Ubuntu 24.04.1
Gazebo Harmonic 8.6.0
I have installed Gazebo Harmonic according to:
https://gazebosim.org/docs/harmonic/install_ubuntu/
Then I install Ardupilot SITL plugin with:
https://ardupilot.org/dev/docs/sitl-with-gazebo.html
I make test run using (it is not working without sudo):
sudo gz sim -v4 -r iris_runway.sdf`
and receive this error message:
[Wrn] [gz.cc:102] Fuel world download failed because Fetch failed. Other errors
Unable to find or download file
There already was post about this issue, but advices from it did not help.
Title: Ardupilot_gazebo not working
Author: jax2000
Site: community.gazebosim
I tried to pass model directly:
sudo gz sim /home/sasha/gz_ws/src/ardupilot_gazebo/worlds/iris_runway.sdf
but it fails with
[Err] [Server.cc:204] Error Code 14: [/sdf/world[@name="iris_runway"]/include[0]/uri:/home/sasha/gz_ws/src/ardupilot_gazebo/worlds/iris_runway.sdf:L114]: Msg: Unable to find uri[model://runway]
If I launch from models folder, window opens but error is that Ardupilot plugin not loaded.