There was no robot in the gazebo.
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
Can you show us your launch file(s) and the command(s) you run that gives you this error please ?
export TURTLEBOT3_MODEL=waffle roslaunch turtlebot3_gazebo turtlebot3_world.launch
OK?thank you.Have you modified something ? If not you might be missing some packages try
sudo apt-get install ros-kinetic-turtlebot3
andsudo apt-get install ros-kinetic-turtlebot3-gazebo
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.
Did you reinstalled it afterwards ? Your issue comes from the
gazebo_ros
package maybe trysudo apt-get install ros-kinetic-gazebo-ros
. If it doesn't work try usingroslaunch turtlebot3_gazebo turtlebot3_world.launch gui:=false
, because thegazebo GUI
creates errors sometimes.Did. I carried out what I was told, but I will not hesitate.oh.......
link text
You might be missing some
tf
packages, try installtf
,tf2
andtf2-ros
. Also you should copy/paste the error into your question, images (even more in a link) aren't searchable.