Ardupilot Gazebo not starting - Fuel world download failed because Fetch failed

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.

Hi @copter_pro, when Gazebo fails to find a world or model file it is almost always an issue with the path to the world and model SDF. Iā€™d recommend checking the resource path GZ_SIM_RESOURCE_PATH in the terminal used to run the simulation.

Note that using sudo to run any of the simulation commands is not correct usage, and may have a number of unintended and unwanted side effects. Aside from the security issue, it can alter permissions that may prevent other processes from running correctly.

If the simulation does not start running as a non-sudo user, this indicates an issue with the installation, and that should be corrected.

Problem was that I used sudo. Question resolved.

1 Like