-
Notifications
You must be signed in to change notification settings - Fork 79
Open
Description
Original issue: ros/robot_model#6 .
Both the C++ and the Python of the parser throw a warning when a URDF with an non-empty inertial element in its root link is parsed.
For example, the simple one link model:
<robot name="oneLink">
<link name="link1">
<inertial>
<mass value="1" />
<inertia ixx="0.01" ixy="0.0" ixz="0.0" iyy="0.01" iyz="0.0" izz="0.01" />
</inertial>
</link>
</robot>creates a warning when parsed, and this is the reason why most URDFs files existing actually use a "fake" massless root link, for example:
<robot name="oneLink">
<link name="base_link" />
<joint name="base_fixed_joint" type="fixed">
<parent link="base_link" />
<child link="link1" />
</joint>
<link name="link1">
<inertial>
<mass value="1" />
<inertia ixx="0.01" ixy="0.0" ixz="0.0" iyy="0.01" iyz="0.0" izz="0.01" />
</inertial>
</link>
</robot>prashanthr05
Metadata
Metadata
Assignees
Labels
No labels