Hello! I have a question about the using the PX4-Autopilot package with the gazebo-classic simulator and ROS2 Foxy. In the github repository of the PX4-Autopilot package under this path “PX4-Autopilot/Tools/simulation/gazebo-classic/sitl_gazebo-classic/include” there are multiple gazebo plugins saved with the “.h” extension instead of the “.so” extension which gazebo plugins are usually saved with. When I run this command “./Tools/simulation/gazebo-classic/sitl_multiple_run.sh -t px4_sitl_rtps -m iris -n 2” to launch a gazebo simulation with two iris drone models, I get the error below which I think is due to the fact that the gazebo plugins used in the sdf file for the iris drone model have the “.so” extension instead of the “.h” extension.
Error:
“[Err] [Plugin.hh:212] Failed to load plugin libgazebo_gps_plugin.so: libgazebo_gps_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_multirotor_base_plugin.so: libgazebo_multirotor_base_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_motor_model.so: libgazebo_motor_model.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_groundtruth_plugin.so: libgazebo_groundtruth_plugin.so: cannot open shared object file: No such file or directory
[Err] [Plugin.hh:212] Failed to load plugin libgazebo_magnetometer_plugin.so: libgazebo_magnetometer_plugin.so: cannot open shared object file: No such file or directory”
I am new to using gazebo with PX4-Autopilot and I was wondering if I need to compile these plugins into “.so” files, and if so how do I it? Or am I doing this wrong and I need to approach it differently? Any help regarding this would be extremely useful.
I am using ubuntu 20.04.6 LTS, ROS2 Foxy and Gazebo-11. Thank you!