image_hack.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 import roslib; roslib.load_manifest('slider_gui')
00003 import rospy
00004 import time
00005 from sensor_msgs.msg import Image
00006 def callback(data):
00007     time.sleep(0.001);
00008 
00009 def listener():
00010     rospy.init_node('image_hack', anonymous=True)
00011     rospy.Subscriber("/head_mount_kinect/rgb/image_raw", Image, callback)
00012     rospy.spin()
00013 
00014 if __name__ == '__main__':
00015     listener()


slider_gui
Author(s): Dirk Thomas
autogenerated on Thu Jun 6 2019 20:32:11