00001
00002 import roslib; roslib.load_manifest('uvc_cam')
00003 import rospy
00004 from sensor_msgs.msg import CameraInfo
00005 from sensor_msgs.srv import SetCameraInfo
00006
00007 def talker():
00008 pub = rospy.Publisher('camera_info', String)
00009 rospy.init_node('talker')
00010 while not rospy.is_shutdown():
00011 str = "hello world %s"%rospy.get_time()
00012 rospy.loginfo(str)
00013 pub.publish(String(str))
00014 rospy.sleep(1.0)
00015 if __name__ == '__main__':
00016 try:
00017 talker()
00018 except rospy.ROSInterruptException: pass