follower.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 import rospy
00003 from sensor_msgs.msg import Image
00004 
00005 def image_callback(msg):
00006         pass
00007 
00008 rospy.init_node('follower')
00009 image_sub = rospy.Subscriber('camera/rgb/image_raw', Image, image_callback)
00010 rospy.spin()


gapter
Author(s):
autogenerated on Thu Jun 6 2019 22:05:13