You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
Hi, I just followed introduction to tf2 and onturtle_tf2_demo.launch I got this traceback:
Traceback (most recent call last):
File "/opt/ros/noetic/lib/turtle_tf2/turtle_tf2_broadcaster.py", line 35, in <module>
import rospy
File "/opt/ros/noetic/lib/python3/dist-packages/rospy/__init__.py", line 47, in <module>
from std_msgs.msg import Header
File "/opt/ros/noetic/lib/python3/dist-packages/std_msgs/msg/__init__.py", line 1, in <module>
from ._Bool import *
File "/opt/ros/noetic/lib/python3/dist-packages/std_msgs/msg/_Bool.py", line 6, in <module>
import genpy
File "/opt/ros/noetic/lib/python3/dist-packages/genpy/__init__.py", line 34, in <module>
from . message import Message, SerializationError, DeserializationError, MessageException, struct_I
File "/opt/ros/noetic/lib/python3/dist-packages/genpy/message.py", line 48, in <module>
import yaml
ModuleNotFoundError: No module named 'yaml'
Traceback (most recent call last):
File "/opt/ros/noetic/lib/turtle_tf2/turtle_tf2_broadcaster.py", line 35, in <module>
import rospy
File "/opt/ros/noetic/lib/python3/dist-packages/rospy/__init__.py", line 47, in <module>
from std_msgs.msg import Header
File "/opt/ros/noetic/lib/python3/dist-packages/std_msgs/msg/__init__.py", line 1, in <module>
from ._Bool import *
File "/opt/ros/noetic/lib/python3/dist-packages/std_msgs/msg/_Bool.py", line 6, in <module>
import genpy
File "/opt/ros/noetic/lib/python3/dist-packages/genpy/__init__.py", line 34, in <module>
from . message import Message, SerializationError, DeserializationError, MessageException, struct_I
File "/opt/ros/noetic/lib/python3/dist-packages/genpy/message.py", line 48, in <module>
import yaml
ModuleNotFoundError: No module named 'yaml'
Traceback (most recent call last):
File "/opt/ros/noetic/lib/turtle_tf2/turtle_tf2_listener.py", line 34, in <module>
import rospy
File "/opt/ros/noetic/lib/python3/dist-packages/rospy/__init__.py", line 47, in <module>
from std_msgs.msg import Header
File "/opt/ros/noetic/lib/python3/dist-packages/std_msgs/msg/__init__.py", line 1, in <module>
from ._Bool import *
File "/opt/ros/noetic/lib/python3/dist-packages/std_msgs/msg/_Bool.py", line 6, in <module>
import genpy
File "/opt/ros/noetic/lib/python3/dist-packages/genpy/__init__.py", line 34, in <module>
from . message import Message, SerializationError, DeserializationError, MessageException, struct_I
File "/opt/ros/noetic/lib/python3/dist-packages/genpy/message.py", line 48, in <module>
import yaml
ModuleNotFoundError: No module named 'yaml'
I found out that changing #!/usr/bin/env python to #!/usr/bin/env python3 in turtle_tf2_listener.py and turtle_tf2_broadcaster.py fixed the thing. I'm on Ubuntu 20.04 with Ros Noetic btw.
The text was updated successfully, but these errors were encountered:
Hi, I just followed introduction to tf2 and on
turtle_tf2_demo.launch
I got this traceback:I found out that changing
#!/usr/bin/env python
to#!/usr/bin/env python3
inturtle_tf2_listener.py
andturtle_tf2_broadcaster.py
fixed the thing. I'm on Ubuntu 20.04 with Ros Noetic btw.The text was updated successfully, but these errors were encountered: