37 while not rospy.has_param(
'/robot_description'):
39 rospy.loginfo(
"waiting for robot_description")
40 urdf_str = rospy.get_param(
'/robot_description')
41 robot_urdf = URDF.from_xml_string(urdf_str)
42 robot = URDF.from_xml_string(urdf_str)
43 robot_root = robot.get_root()
45 if robot_root
is not None and robot_root !=
"world":
47 while not rospy.is_shutdown():
49 br.sendTransform((0.0, 0.0, 0.0), (0.0, 0.0, 0.0, 1.0),
50 rospy.Time.now(), robot_root,
"world")
53 if __name__ ==
'__main__':
54 rospy.init_node(
'virtual_joint_broadcaster', anonymous=
True)
58 except rospy.ROSInterruptException:
def publish_world_to_base_transform()