Gazebo | Ignition | Community
Ask Your Question
0

Robot not visible in Gazebo after spawned successfully

asked 2020-05-29 14:08:24 -0600

saran pn gravatar image

The Command I used to spawn the robot

roslaunch my_robot_urdf spawn_urdf.launch

Terminal Response for the above command:

process[spawn_robot_urdf-1]: started with pid [4685] the rosdep view is empty: call 'sudo rosdep init' and 'rosdep update' SpawnModel script started [spawn_robot_urdf-1] process has finished cleanly log file: /home/user/.ros/log/419a060e-a1dc-11ea-a6c2-0ef9f7b9d029/spawn_robot_urdf-1*.log all processes on machine have died, roslaunch will exit shutting down processing monitor... ... shutting down processing monitor complete done

Gazebo Response: Gazebo says that my Robot has been inserted, but I am not able to see anything.

My urdf file is below:

<robot name="Nimbus v6 Assy joined solid model.SLDPRT"> <link name="Nimbus v6 Assy joined solid model.SLDPRT"> <inertial> <origin xyz="0.001048 0.26572 0.029429" rpy="0 0 0"/> <mass value="64.446"/> <inertia ixx="7.0001" ixy="-0.00034769" ixz="-4.4285E-05" iyy="3.9061" iyz="0.31137" izz="9.5932"/> </inertial> <visual> <origin xyz="0 0 0" rpy="1.5707963267949 0 0"/> <geometry> <mesh filename="/simulation_ws/src/my_robot_urdf/launch/Nimbus v6 Assy joined solid model.SLDPRT.STL"/> </geometry> <material name=""> <color rgba="1 1 1 1"/> </material> </visual> <collision> <origin xyz="0 0 0" rpy="1.5707963267949 0 0"/> <geometry> <mesh filename="/simulation_ws/src/my_robot_urdf/launch/Nimbus v6 Assy joined solid model.SLDPRT.STL"/> </geometry> </collision> </link> </robot>

Can anyone please let me know what I am supposed to do for this ??

NOTE: I am using Ubuntu 16.04 + ROS Kinetic + Gazebo 7

edit retag flag offensive close merge delete

1 Answer

Sort by ยป oldest newest most voted
0

answered 2020-06-01 09:40:41 -0600

ahcorde gravatar image

Hello,

In a quick read of your URDF this line looks wrong:

<mesh filename="/simulation_ws/src/my_robot_urdf/launch/Nimbus v6 Assy joined solid model.SLDPRT.STL"/>

for two reasons:

  • You need to write the absolute path which means you need to add something else to your path /home/<your username>/simulation_ws/src/my_robot_urdf/launch/Nim...
  • Spaces in a path are not a good idea. Use _ or -.
edit flag offensive delete link more

Question Tools

1 follower

Stats

Asked: 2020-05-29 14:06:22 -0600

Seen: 500 times

Last updated: Jun 01 '20