40 while not rospy.has_param(
'/robot_description'):
42 rospy.loginfo(
"waiting for robot_description")
43 urdf_str = rospy.get_param(
'/robot_description')
44 robot_urdf = URDF.from_xml_string(urdf_str)
45 robot = URDF.from_xml_string(urdf_str)
46 robot_root = robot.get_root()
48 if robot_root
is not None and robot_root !=
"world":
50 while not rospy.is_shutdown():
52 br.sendTransform((0.0, 0.0, 0.0), (0.0, 0.0, 0.0, 1.0),
53 rospy.Time.now(), robot_root,
"world")
56 if __name__ ==
'__main__':
57 rospy.init_node(
'virtual_joint_broadcaster', anonymous=
True)
61 except rospy.ROSInterruptException:
def publish_world_to_base_transform()