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