thien94 / vision_to_mavros

A collection of ROS and non-ROS (Python) code that converts data from vision-based system (external localization system like fiducial tags, VIO, SLAM, or depth image) to corresponding mavros topics or MAVLink messages that can be consumed by a flight control stack (with working and tested examples for ArduPilot).
https://ardupilot.org/dev/docs/ros-vio-tracking-camera.html
GNU General Public License v3.0
241 stars 146 forks source link

cannot run set origin.py script #47

Open Illusion-1404 opened 3 years ago

Illusion-1404 commented 3 years ago

I am getting this strange error , even though yaml is installed for python 2.7

Traceback (most recent call last): File "/home/octo/catkin_ws/src/vision_to_mavros/scripts/set_origin.py", line 9, in import rospy File "/opt/ros/melodic/lib/python2.7/dist-packages/rospy/init.py", line 47, in from std_msgs.msg import Header File "/opt/ros/melodic/lib/python2.7/dist-packages/std_msgs/msg/init.py", line 1, in from ._Bool import * File "/opt/ros/melodic/lib/python2.7/dist-packages/std_msgs/msg/_Bool.py", line 6, in import genpy File "/opt/ros/melodic/lib/python2.7/dist-packages/genpy/init.py", line 34, in from . message import Message, SerializationError, DeserializationError, MessageException, struct_I File "/opt/ros/melodic/lib/python2.7/dist-packages/genpy/message.py", line 48, in import yaml ModuleNotFoundError: No module named 'yaml'

thien94 commented 3 years ago

You could try: