PX4-Autopilot package not found: sitld_gazebo

asked 2023-03-04 14:58:48 -0500

While following this tutorial: https://docs.px4.io/main/en/ros/mavro..., I finally have to run --> roslaunch offboard_py start_offb.launch.

My lunch file, start_offb.launch has this line: <include file="$(find PX4-Autopilot)/launch/mavros_posix_sitl.launch">, which is a directory in /home/francisco/catkin_ws/src/PX4-Autopilot which is in fact ROS path [11] bellow.

I already checked ROS PATHS and the directory is there but every time it gives me the error:

" *Resource not found: PX4-Autopilot ROS path [0]=/opt/ros/melodic/share/ros ROS path [1]=/home/francisco/catkin_ws/src/mavlink ROS path [2]=/home/francisco/catkin_ws/src/mavros/libmavconn ROS path [3]=/home/francisco/catkin_ws/src/mavros_auto_mission ROS path [4]=/home/francisco/catkin_ws/src/mavros/mavros_msgs ROS path [5]=/home/francisco/catkin_ws/src/mavros/mavros ROS path [6]=/home/francisco/catkin_ws/src/mavros/mavros_extras ROS path [7]=/home/francisco/catkin_ws/src/offboard_py ROS path [8]=/home/francisco/catkin_ws/src/PX4-Autopilot ROS path [9]=/home/francisco/catkin_ws/src/mavros/test_mavros ROS path [10]=/opt/ros/melodic/share ROS path [11]=/home/francisco/catkin_ws/src/PX4-Autopilot ROS path [12]=/home/francisco/catkin_ws/src/PX4-Autopilot/Tools/sitl_gazebo The traceback for the exception was written to the log file"

I have already put this lines in my bashrc (source ~/catkin_ws/src/PX4-Autopilot/Tools/setup_gazebo.bash ~/catkin_ws/src/PX4-Autopilot ~/catkin_ws/src/PX4-Autopilot/build/px4_sitl_default export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:~/catkin_ws/src/PX4-Autopilot export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:~/catkin_ws/src/PX4-Autopilot/Tools/sitl_gazebo export GAZEBO_PLUGIN_PATH=$GAZEBO_PLUGIN_PATH:/usr/lib/x86_64-linux-gnu/gazebo-9/plugins).

Already re-built the catkin both with catkin_make and catkin build and am now out of options to fix this problem.

What is missing from my part?

Thank you very very much in advance

edit retag flag offensive close merge delete