PX4 / PX4-SITL_gazebo-classic

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.
http://dev.px4.io/simulation-gazebo.html
370 stars 786 forks source link

cannot find mavlink_sitl_gazebo #554

Closed atieh-sahraei closed 4 years ago

atieh-sahraei commented 4 years ago

Hi, My Setup information is as follow: Mavros: [Installed by, install_geographiclib_datasets.sh] ROS: [melodic] Gazebo: [9] Ubuntu: [18.04] and the installation did not have any issue and when running " make px4_sitl_default gazebo" the gazebo runs without error. I also set the paths. However, recently when I want to run the sitl with mavros "roslaunch px4 mavros_posix_sitl.launch" I get the following error: (It is strange because the day before I could run the launch file but now it gives error) I am following this tutorial: [(https://gaas.gitbook.io/guide/software-realization-build-your-own-autonomous-drone/build-your-own-autonomous-drone-e01-offboard-control-and-gazebo-simulation)]

Resource not found: The following package was not found in : mavlink_sitl_gazebo ROS path [0]=/opt/ros/melodic/share/ros ROS path [1]=/home/name/catkin_ws/src/mavros/test_mavros ROS path [2]=/home/name/catkin_ws/src/Firmware ROS path [3]=/home/name/catkin_ws/src/mavros/mavros_extras ROS path [4]=/home/name/catkin_ws/src/mavros/mavros ROS path [5]=/home/name/catkin_ws/src/mavros/mavros_msgs ROS path [6]=/home/name/catkin_ws/src/mavros/libmavconn ROS path [7]=/home/name/catkin_ws/src/beginner_tutorials ROS path [8]=/opt/ros/melodic/share The traceback for the exception was written to the log file

This is the launch file: `<?xml version="1.0"?>

`
Jaeyoung-Lim commented 4 years ago

It seems like your GAZEBO_PLUGIN_PATH is not set correctly

adbidwai commented 4 years ago

Your package is not found in the path of ROS packages. It seems have not sourced your current workspace in your terminal. Build your packages again and source your workspace again after building it.

HuaYuXiao commented 1 month ago

It seems like your GAZEBO_PLUGIN_PATH is not set correctly

You should check your ~/.bashrc, and make sure GAZEBO_PLUGIN_PATH is set correctly.