Problem with simulation drone in gazebo with ardupilot

HI There
I have Problem with make simulatuon fly drone with gazebo and ardupilot i open Gazebo gz sim -v4 -r iris_runway.sdf gazebo its work gazebo is show drone but drone is not flay after run gazebo i am running sim_vehicle.py -v ArduCopter --map --console
white console propably mavlink or maxproxy is show for exampe how mouch is left battery when i am write STABILIZE> mode guided
GUIDED> arm throttle
GUIDED> takeoff 5 drone is not start mottors and after input takeoff 15 he is on ground can you explain me everything how to make propably simulation drone in gazebo

Hello @nick81, please see the instructions here: Using SITL with Gazebo — Dev documentation.

The correct command for running SITL with Gazebo for the iris model is:

sim_vehicle.py -v ArduCopter -f gazebo-iris --model JSON --map --console

Thx for answear i did do like on documentation still dont work i put correct command running still like you sendme and is problem show log No JSON sensor message received, resending srvos white consle where show before log ist dont work nonne log can you explain like do that propebly

when i unput sim_vehicle.py -v ArduCopter -f gazebo-iris --model JSON --map --console in cosnol ist one log link1 down when i put like i tell you befofre it is running sim_vehicle.py -v ArduCopter --map --console after that show logs fo exable level batteries

i have got Gazebo Sim, version 9.1.0 ionic?

Hello @nick81, the issue is that we have not yet ported the ardupilot_gazebo plugin to support Ionic. As you can see in the project’s CMakeLists.txt, only Garden and Harmonic are currently configured. I’ll draft a PR to update this.

Edit

See: Gazebo: support Gazebo Ionic by srmainwaring · Pull Request #134 · ArduPilot/ardupilot_gazebo · GitHub and Gazebo: ros2: support Gazebo Ionic by srmainwaring · Pull Request #137 · ArduPilot/ardupilot_gazebo · GitHub. Ionic will be supported for the main and ros2 branches once these are merged. You will need to ensure that export GZ_VERSION=ionic is set in the shell before building (or add to .zprofile).