33 from sensor_msgs.msg
import JointState
37 rospy.init_node(
'fake_mir_joint_publisher')
38 prefix = rospy.get_param(
'~prefix',
'')
39 pub = rospy.Publisher(
'joint_states', JointState, queue_size=10)
41 while not rospy.is_shutdown():
43 js.header.stamp = rospy.Time.now()
45 prefix +
'left_wheel_joint',
46 prefix +
'right_wheel_joint',
47 prefix +
'fl_caster_rotation_joint',
48 prefix +
'fl_caster_wheel_joint',
49 prefix +
'fr_caster_rotation_joint',
50 prefix +
'fr_caster_wheel_joint',
51 prefix +
'bl_caster_rotation_joint',
52 prefix +
'bl_caster_wheel_joint',
53 prefix +
'br_caster_rotation_joint',
54 prefix +
'br_caster_wheel_joint',
56 js.position = [0.0
for _
in js.name]
57 js.velocity = [0.0
for _
in js.name]
58 js.effort = [0.0
for _
in js.name]
63 if __name__ ==
'__main__':
66 except rospy.ROSInterruptException: