<p>Hi Ricarda,<br>
Couple of questions:  which world file are you using?  Is it possible to share your model?<br>
If you start up the world paused, does the model spawn where you expect it to be?<br>
John</p>
<p><blockquote type="cite">On Aug 24, 2010 7:15 AM,  <<a href="mailto:steffens@informatik.uni-bonn.de" target="_blank">steffens@informatik.uni-bonn.de</a>> wrote:<br><br>Hi everybody,<br>
<br>
I made an URDF model of our robot, which works quite well in rviz, and now<br>
I want to use it to create a simulation of our robot in gazebo.<br>
As I could not load the entire robot model I did it one part after another.<br>
The problem is that parts of the robot or sometimes the entire robot fall<br>
from the sky after spawning the model.<br>
I checked the accuracy of every value and possible collisions and tried to<br>
solve the problem with trial-and-error but I could not find a mistake or<br>
solve the problem.<br>
<br>
I suppose that there is a problem with the links which have no further<br>
function of its own.<br>
As apparently it is not possible to use those links ( <link name="link1"<br>
/> ) within gazebo I filled the attribute values with zeros:<br>
                <link name="link2"><br>
                        <inertial><br>
                                <mass value="0.01" /><br>
                                <origin xyz="0 0 0" /><br>
                                <inertia ixx="1.0" ixy="0.0" ixz="0.0"<br>
                                                        iyy="1.0" iyz="0.0" izz="1.0" /><br>
                        </inertial><br>
                        <visual><br>
                                <origin xyz="0 0 0" rpy="0 0 0" /><br>
                                <geometry><br>
                                        <box size="0 0 0" /><br>
                                </geometry><br>
<br>
                                <material name="red" /><br>
                        </visual><br>
                        <collision><br>
                                <origin xyz="0 0 0" rpy="0 0 0" /><br>
                                <geometry><br>
                                        <box size="0 0 0" /><br>
                                </geometry><br>
                        </collision><br>
                </link><br>
<br>
I also did some trial-and-error here but it did not work out, too.<br>
So does anybody have a clue of what to do here?<br>
<br>
Thanks,<br>
Ricarda<br>
<br>
_______________________________________________<br>
ros-users mailing list<br>
<a href="mailto:ros-users@code.ros.org" target="_blank">ros-users@code.ros.org</a><br>
<a href="https://code.ros.org/mailman/listinfo/ros-users" target="_blank">https://code.ros.org/mailman/listinfo/ros-users</a><br>
</blockquote></p>