Go to the documentation of this file.00001
00002
00003 import rospy
00004 from sensor_msgs.msg import JointState
00005
00006 def talker():
00007 pub = rospy.Publisher('/joint_states', JointState, queue_size=1)
00008 rospy.init_node('dummy_head')
00009 while not rospy.is_shutdown():
00010 msg = JointState()
00011 msg.name = []
00012 msg.name.append('head_axis_joint')
00013 msg.position = []
00014 msg.position.append(0)
00015
00016 pub.publish(msg)
00017 rospy.sleep(0.1)
00018 if __name__ == '__main__':
00019 try:
00020 talker()
00021 except rospy.ROSInterruptException: pass
00022