Robot not visible in Gazebo after spawned successfully
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