"The minimum corner of the box must be less than or equal to maximum corner"' failed. SDF model
I am trying to import a simple pillow into Gazebo. I have 2 files: a pillow.world file which contains my pillow and the ground plane, and a pillow.sdf file which contains only my pillow collada mesh.
The model inside my world file is the exact same as the model inside my sdf file.
When I run in the terminal:
gazebo pillow.world
the pillow loads up successfully:
yet when I run my sdf file by first running:
gazebo
then in a separate/new terminal, running:
gz model -f pillow.sdf -m my_mesh
The following error occurs:
enter code hereNode::Advertise(): Error advertising a topic. Did you forget to start the discovery service?
gzclient: /build/ogre-1.9-B6QkmW/ogre-1.9-1.9.0+dfsg1/OgreMain/include/OgreAxisAlignedBox.h:252: void Ogre::AxisAlignedBox::setExtents(const Ogre::Vector3&, const Ogre::Vector3&): Assertion (min.x <= max.x && min.y <= max.y && min.z <= max.z) && "The minimum corner of the box must be less than or equal to maximum corner"' failed. escalating to SIGKILL on server
here is my pillow.world file:
<?xml version="1.0"?>
<sdf version="1.4">
<world name="default">
<include>
<uri>model://ground_plane</uri>
</include>
<include>
<uri>model://sun</uri>
</include>
<model name="my_mesh">
<pose>0 0 0.0 0 0 0</pose>
<static>true</static>
<link name="body">
<inertial>
<mass>1.0</mass>
<inertia> <!-- inertias are tricky to compute -->
<!-- http://gazebosim.org/tutorials?tut=inertia&cat=build_robot -->
<ixx>0.00000</ixx> <!-- for a box: ixx = 0.083 * mass * (y*y + z*z) -->
<ixy>000000</ixy> <!-- for a box: ixy = 0 -->
<ixz>0.000000</ixz> <!-- for a box: ixz = 0 -->
<iyy>0.000000</iyy> <!-- for a box: iyy = 0.083 * mass * (x*x + z*z) -->
<iyz>0.000000</iyz> <!-- for a box: iyz = 0 -->
<izz>0.000000</izz> <!-- for a box: izz = 0.083 * mass * (x*x + y*y) -->
</inertia>
</inertial>
<collision name="collision">
<geometry>
<box>
<size>1 1 1</size>
</box>
</geometry>
</collision>
<visual name="visual">
<geometry>
<mesh><uri>file://my_mesh.dae</uri></mesh>
</geometry>
</visual>
</link>
</model>
</world>
</sdf>
and here is my pillow.sdf file:
<?xml version='1.0'?>
<sdf version="1.4">
<model name="my_mesh">
<pose>0 0 0.5 0 0 0</pose>
<static>true</static>
<link name="body">
<inertial>
<mass>1.0</mass>
<inertia> <!-- inertias are tricky to compute -->
<!-- http://gazebosim.org/tutorials?tut=inertia&cat=build_robot -->
<ixx>0.00000</ixx> <!-- for a box: ixx = 0.083 * mass * (y*y + z*z) -->
<ixy>000000</ixy> <!-- for a box: ixy = 0 -->
<ixz>0.000000</ixz> <!-- for a box: ixz = 0 -->
<iyy>0.000000</iyy> <!-- for a box: iyy = 0.083 * mass * (x*x + z*z) -->
<iyz>0.000000</iyz> <!-- for a box: iyz = 0 -->
<izz>0.000000</izz> <!-- for a box: izz = 0.083 * mass * (x*x + y*y) -->
</inertia>
</inertial>
<collision name="collision">
<geometry>
<box>
<size>1 1 1</size>
</box>
</geometry>
</collision>
<visual name="visual">
<geometry>
<mesh><uri>file://my_mesh.dae</uri></mesh>
</geometry>
</visual>
</link>
</model>
</sdf>