ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

There was no robot in the gazebo.

asked 2018-10-16 00:06:07 -0500

saito gravatar image

updated 2018-10-17 02:14:28 -0500

gvdhoorn gravatar image

Hello. I am a ROS beginner. I am doing SLAM of turtlebot 3 (waffle) in the ubuntu 16.04, ros (kinetic) personal computer environment. There was no problem until the previous time, but an error will occur on such a screen. Why?

motoi@motoi-Endeavor-NY2500S:~$ export TURTLEBOT3_MODEL=waffle
motoi@motoi-Endeavor-NY2500S:~$ roslaunch turtlebot3_gazebo turtlebot3_world.launch

Traceback (most recent call last):
  File "/opt/ros/kinetic/lib/gazebo_ros/spawn_model", line 32, in <module>
    import tf.transformations as tft
  File "/opt/ros/kinetic/lib/python2.7/dist-packages/tf/__init__.py", line 28, in <module>
    from tf2_ros import TransformException as Exception, ConnectivityException, LookupException, ExtrapolationException
ImportError: cannot import name TransformException
[spawn_urdf-3] process has died [pid 27848, exit code 1, cmd /opt/ros/kinetic/lib/gazebo_ros/spawn_model -urdf >-model turtlebot3_waffle -x -2.0 -y -0.5 -z 0.0 -param robot_description __name:=spawn_urdf> __log:=/home/motoi/.ros/log/d4409256-d1d7-11e8-9c06-58fb846c94cc/spawn_urdf-3.log].
log file: /home/motoi/.ros/log/d4409256-d1d7-11e8-9c06-58fb846c94cc/spawn_urdf-3*.log
edit retag flag offensive close merge delete

Comments

Can you show us your launch file(s) and the command(s) you run that gives you this error please ?

Delb gravatar image Delb  ( 2018-10-16 01:05:10 -0500 )edit

export TURTLEBOT3_MODEL=waffle roslaunch turtlebot3_gazebo turtlebot3_world.launch OK?thank you.

saito gravatar image saito  ( 2018-10-16 02:23:26 -0500 )edit

Have you modified something ? If not you might be missing some packages try sudo apt-get install ros-kinetic-turtlebot3 and sudo apt-get install ros-kinetic-turtlebot3-gazebo

Delb gravatar image Delb  ( 2018-10-16 02:54:49 -0500 )edit

thank you.But that alone did not solve it. What I did is delete the navigation package that I used to install costmap _ 2 d. Perhaps it may have erased something important.

saito gravatar image saito  ( 2018-10-16 22:22:20 -0500 )edit

Did you reinstalled it afterwards ? Your issue comes from the gazebo_ros package maybe try sudo apt-get install ros-kinetic-gazebo-ros. If it doesn't work try using roslaunch turtlebot3_gazebo turtlebot3_world.launch gui:=false, because the gazebo GUI creates errors sometimes.

Delb gravatar image Delb  ( 2018-10-17 01:04:54 -0500 )edit

Did. I carried out what I was told, but I will not hesitate.oh.......

saito gravatar image saito  ( 2018-10-17 01:32:28 -0500 )edit
saito gravatar image saito  ( 2018-10-17 01:39:53 -0500 )edit

You might be missing some tf packages, try install tf, tf2 and tf2-ros. Also you should copy/paste the error into your question, images (even more in a link) aren't searchable.

Delb gravatar image Delb  ( 2018-10-17 01:50:23 -0500 )edit

1 Answer

Sort by ยป oldest newest most voted
0

answered 2018-10-24 02:09:59 -0500

saito gravatar image

Resolved ros and solved it.

edit flag offensive delete link more

Comments

resolved? how did you resolve?

eliocon gravatar image eliocon  ( 2021-06-22 10:37:04 -0500 )edit

Question Tools

1 follower

Stats

Asked: 2018-10-16 00:06:07 -0500

Seen: 1,244 times

Last updated: Oct 24 '18