run_sensors.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 # Echos all PR2 sensors to stress gazebo
00004 
00005 PKG = 'pr2_pickup_object_demo'
00006 
00007 import roslib; roslib.load_manifest(PKG)
00008 
00009 from sensor_msgs.msg import LaserScan, Image, PointCloud
00010 import rospy
00011 
00012 def empty_cb(msg):
00013     pass
00014 
00015 if __name__ == '__main__':
00016     rospy.init_node('gazebo_sink')
00017 
00018     wide_sub = rospy.Subscriber('wide_stereo/left/image_raw', Image, empty_cb)
00019     l_fa_sub = rospy.Subscriber('l_forearm_cam/image_raw', Image, empty_cb)
00020     r_fa_sub = rospy.Subscriber('r_forearm_cam/image_raw', Image, empty_cb)
00021     narrow_sub = rospy.Subscriber('narrow_stereo/left/image_raw', Image, empty_cb)
00022     cloud_sub = rospy.Subscriber('narrow_stereo/points', PointCloud, empty_cb)
00023 
00024     tilt_sub = rospy.Subscriber('tilt_scan', LaserScan, empty_cb)
00025     base_sub = rospy.Subscriber('base_scan', LaserScan, empty_cb)
00026 
00027     rospy.spin()


pr2_pickup_object_demo
Author(s): Kevin Watts
autogenerated on Mon Jan 6 2014 12:10:54