Gazebo does not resolve model paths correctly

Hello everyone!

I encountered an issue while running Gazebo. The paths to the models are not being properly resolved. Here’s my nano ~/.bashrc file:

bash

export GZ_SIM_SYSTEM_PLUGIN_PATH=$HOME/gz_ws/src/ardupilot_gazebo/build:${GZ_SIM_SYSTEM_PLUGIN_PATH}

export PATH=/opt/gcc-arm-none-eabi-10-2020-q4-major/bin:$PATH
export PATH=/home/aleksey.kravtsov/ardupilot/Tools/autotest:$PATH
export PATH=/usr/lib/ccache:$PATH

export GAZEBO_MODEL_PATH=$HOME/gz_ws/src/ardupilot_gazebo/models
export GZ_SIM_RESOURCE_PATH=$HOME/gz_ws/src/ardupilot_gazebo/models:$HOME/gz_ws/src/ardupilot_gazebo/worlds:$GZ>

And here’s the error I’m getting:

less

[GUI] [Err] [SceneManager.cc:426] Failed to load geometry for visual: base_visual
[GUI] [Err] [SystemPaths.cc:534] File [/home/aleksey.kravtsov/ardupilot_gazebo/models/gimbal_small_3d/meshes/yaw_arm.dae] resolved to path [/home/aleksey.kravtsov/ardupilot_gazebo/models/gimbal_small_3d/meshes/yaw_arm.dae] but the path does not exist
[GUI] [Err] [MeshManager.cc:211] Unable to find file [/home/aleksey.kravtsov/ardupilot_gazebo/models/gimbal_small_3d/meshes/yaw_arm.dae]
[GUI] [Wrn] [Util.cc:859] Failed to load mesh from [/home/aleksey.kravtsov/ardupilot_gazebo/models/gimbal_small_3d/meshes/yaw_arm.dae].

I don’t understand why the path to the world file and plugins is resolved correctly, but the paths to the models are not.

This env variable is for Gazebo classic and is not required:

export GAZEBO_MODEL_PATH=$HOME/gz_ws/src/ardupilot_gazebo/models

Because of command line tool name conflicts (gz), having both Gazebo Classic (gazebo) and Gazebo Harmonic (gz-sim) installed concurrently is not supported.

This variable looks like it contains a typo at the end of the line (or maybe a miscopy?)

export GZ_SIM_RESOURCE_PATH=$HOME/gz_ws/src/ardupilot_gazebo/models:$HOME/gz_ws/src/ardupilot_gazebo/worlds:$GZ>

Does the simulation find the plugins and models if the current contents of GZ_SIM_SYSTEM_PLUGIN_PATH and GZ_SIM_RESOURCE_PATH are not concatenated?