Go to the documentation of this file.00001
00002 import roslib; roslib.load_manifest('kurt_base')
00003 import rospy
00004 from sensor_msgs.msg import JointState
00005 def fake_wheel_publisher():
00006 pub = rospy.Publisher('/joint_states', JointState)
00007 rospy.init_node('fake_wheel_publisher')
00008 while not rospy.is_shutdown():
00009 js = JointState()
00010 js.header.stamp = rospy.Time.now()
00011 js.name = ['left_front_wheel_joint', 'left_middle_wheel_joint', 'left_rear_wheel_joint', 'right_front_wheel_joint', 'right_middle_wheel_joint', 'right_rear_wheel_joint']
00012 js.position = [0.0, 0.0, 0.0, 0.0, 0.0, 0.0]
00013 pub.publish(js)
00014 rospy.sleep(0.02)
00015 if __name__ == '__main__':
00016 try:
00017 fake_wheel_publisher()
00018 except rospy.ROSInterruptException: pass