Using roslaunch to start Gazebo, I got core dump error.
Using roslaunch to start Gazebo, I got below error and no showing model..
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.Aborted (core dumped)
How to solve it? and what is the problem? If anyone knows how to solve the problem, please reply...
My xacro file.
<?xml version="1.0" encoding="utf-8" ?>
<robot name="robot">
<material name="grey">
<color rgba="0.2 0.2 0.2 1.0" />
</material>
<!--======================= Links =========================-->
<!-- Body Base -->
<link name="Body_Base">
<visual>
<origin rpy="0 0 -1" xyz="0 0 0" />
<geometry>
<mesh filename="package://rb_description/meshes/visual/_1_base.dae" />
</geometry>
<material name="grey" />
</visual>
<collision>
<origin rpy="0 0 -1" xyz="0 0 0" />
<geometry>
<mesh filename="package://rb_description/meshes/collision/_1_base.stl" scale="0.001 0.001 0.001" />
</geometry>
</collision>
<inertial>
<mass value="1" />
<inertia ixx="0.1" iyy="0.1" izz="0.1" ixy="0.0" ixz="0.0" iyz="0.0" />
</inertial>
</link>
<!-- Body Module 1 -->
<link name="Body_Module_1">
<visual>
<origin rpy="0 0 -1" xyz="0 0 0" />
<geometry>
<mesh filename="package://rb_description/meshes/visual/_2_module_1.dae" />
</geometry>
<material name="grey" />
</visual>
<collision>
<origin rpy="0 0 -1" xyz="0 0 0" />
<geometry>
<mesh filename="package://rb_description/meshes/collision/_2_module_1.stl" scale="0.001 0.001 0.001" />
</geometry>
</collision>
<inertial>
<mass value="1" />
<inertia ixx="0.1" iyy="0.1" izz="0.1" ixy="0.0" ixz="0.0" iyz="0.0" />
</inertial>
</link>
<!-- Body Module 2 -->
<link name="Body_Module_2">
<visual>
<origin rpy="0 0 -1" xyz="0 0 -0.1" />
<geometry>
<mesh filename="package://rb_description/meshes/visual/_3_module_2.dae" />
</geometry>
<material name="grey" />
</visual>
<visual>
<origin rpy="0 0 -1" xyz="0 0 -0.1" />
<geometry>
<mesh filename="package://rb_description/meshes/visual/_4_pipe_1.dae" />
</geometry>
<material name="grey" />
</visual>
<visual>
<origin rpy="0 0 -1" xyz="0 0 -0.1" />
<geometry>
<mesh filename="package://rb_description/meshes/visual/_5_module_3.dae" />
</geometry>
<material name="grey" />
</visual>
<collision>
<origin rpy="0 0 -1" xyz="0 0 -0.1" />
<geometry>
<mesh filename="package://rb_description/meshes/collision/_3_module_2.stl" scale="0.001 0.001 0.001" />
</geometry>
</collision>
<collision>
<origin rpy="0 0 -1" xyz="0 0 -0.1" />
<geometry>
<mesh filename="package://rb_description/meshes/collision/_4_pipe_1.stl" scale="0.001 0.001 0.001" />
</geometry>
</collision>
<collision>
<origin rpy="0 0 -1" xyz="0 0 -0.1" />
<geometry>
<mesh filename="package://rb_description/meshes/collision/_5_module_3.stl" scale="0.001 0.001 0.001" />
</geometry>
</collision>
<inertial>
<mass value="1" />
<inertia ixx="0.1" iyy="0.1" izz="0.1" ixy="0.0" ixz="0.0" iyz="0.0" />
</inertial>
</link>
<!-- Body Module 3 -->
<link name="Body_Module_3">
<visual>
<origin rpy="0 0 -1" xyz="0 0 -0.5" />
<geometry>
<mesh filename="package://rb_description/meshes/visual/_6_module_dummy.dae" />
</geometry ...