Hi,<div><br></div><div>smach_viewer is reporting an error when I'm trying to visualize my state machine. It's displaying the state machine correctly and I can see the states changing, but when it gives me the error message below.</div>
<div><br></div><div>state_machines_library is not my package, it's just a subdirectory in my package src directory where I put some state machines. </div><div><br></div><div>Cheers,</div><div><br>Ugo</div><div><br></div>
<div><div>[ERROR] [WallTime: 1306510577.579619] bad callback: <bound method SmachViewerFrame._status_msg_update of <__main__.SmachViewerFrame; proxy of <Swig Object of type 'wxFrame *' at 0x3cb36d0> >></div>
<div>Traceback (most recent call last):</div><div>  File "/code/ros/ros_comm/clients/rospy/src/rospy/topics.py", line 563, in _invoke_callback</div><div>    cb(msg)</div><div>  File "/code/ros/executive_smach_visualization/smach_viewer/smach_viewer.py", line 662, in _status_msg_update</div>
<div>    if container.update_status(msg):</div><div>  File "/code/ros/executive_smach_visualization/smach_viewer/smach_viewer.py", line 148, in update_status</div><div>    roslib.load_manifest(packagename)</div>
<div>  File "/code/ros/ros/core/roslib/src/roslib/launcher.py", line 69, in load_manifest</div><div>    sys.path = _generate_python_path(package_name, [], os.environ) + sys.path</div><div>  File "/code/ros/ros/core/roslib/src/roslib/launcher.py", line 105, in _generate_python_path</div>
<div>    manifest_file = roslib.manifest.manifest_file(pkg, True, env)</div><div>  File "/code/ros/ros/core/roslib/src/roslib/manifest.py", line 117, in manifest_file</div><div>    d = roslib.packages.get_pkg_dir(package, required, ros_root=env[roslib.rosenv.ROS_ROOT])</div>
<div>  File "/code/ros/ros/core/roslib/src/roslib/packages.py", line 213, in get_pkg_dir</div><div>    raise InvalidROSPkgException("Cannot locate installation of package %s: %s. ROS_ROOT[%s] ROS_PACKAGE_PATH[%s]"%(package, rperr.strip(), ros_root, ros_package_path))</div>
<div>InvalidROSPkgException: Cannot locate installation of package state_machines_library: [rospack] couldn't find package [state_machines_library]. ROS_ROOT[/code/ros/ros] ROS_PACKAGE_PATH[/code/Projects/heyu_x10/heyu_X10:/code/ros_overlay/cereal_port:/code/ros_overlay/openni_kinect/openni_kinect:/code/Projects/ethercat/trunk:/code/Projects/ethercat/shadow_robot_ethercat:/code/Projects/ethercat/pr2_sr_hand_gazebo_demo:/code/ros/geometry_visualization:/code/ros/pr2_ethercat_drivers:/code/ros/pr2_power_drivers:/code/ros/pr2_simulator:/code/ros/pr2_gui:/code/ros/visualization_tutorials:/code/ros/geometry_tutorials:/code/ros/common_tutorials:/code/ros/ros_tutorials:/code/ros/documentation:/code/ros/simulator_gazebo:/code/ros/simulator_stage:/code/ros/geometry_experimental:/code/ros/sql_database:/code/ros/tabletop_object_perception:/code/ros/ros_realtime:/code/ros/pr2_tabletop_manipulation_apps:/code/ros/pr2_object_manipulation:/code/ros/pr2_arm_navigation:/code/ros/pr2_kinematics:/code/ros/pr2_navigation:/code/ros/pr2_calibration:/code/ros/web_interface:/code/ros/point_cloud_perception:/code/ros/robot_calibration:/code/ros/object_manipulation:/code/ros/slam_gmapping:/code/ros/navigation:/code/ros/vision_opencv:/code/ros/image_pipeline:/code/ros/image_transport_plugins:/code/ros/pr2_common:/code/ros/pr2_mechanism:/code/ros/control:/code/ros/pr2_controllers:/code/ros/perception_pcl:/code/ros/trajectory_filters:/code/ros/physics_ode:/code/ros/motion_planning_common:/code/ros/motion_planners:/code/ros/kinematics:/code/ros/arm_navigation:/code/ros/diagnostics_monitors:/code/ros/executive_smach_visualization:/code/ros/laser_pipeline:/code/ros/image_common:/code/ros/rx:/code/ros/visualization:/code/ros/visualization_common:/code/ros/executive_smach:/code/ros/robot_model:/code/ros/geometry:/code/ros/driver_common:/code/ros/diagnostics:/code/ros/common:/code/ros/common_msgs:/code/ros/ros_comm:/code/Projects/3_FT_DSTL/Software/ros:/code/Projects/ROS_interfaces/sr-ros-interface/manipulation/shadow_robot:/code/Projects/ROS_interfaces/sr-ros-interface/manipulation/shadow_robot/sr_object_manipulation]</div>
</div><div><br></div><div> <br><div><br>-- <br>Ugo Cupcic | Shadow Robot Company | <a href="mailto:ugo@shadowrobot.com" target="_blank">ugo@shadowrobot.com</a> <br>Software Engineer | 251 Liverpool Road | <br>need a Hand? | London N1 1LX | +44 20 7700 2487 <br>
<a href="http://www.shadowrobot.com/hand/" target="_blank">http://www.shadowrobot.com/hand/</a> @shadowrobot <br><br>
</div></div>