Gazebo Garden incorrect protocol magic

When i try to use sitl based on this guide Using SITL with Gazebo — Dev documentation
i get the error in the gazebo terminal ‘[Wrn] [ArduPilotPlugin.cc:1386] Incorrect protocol magic 0 should be 18458’

Hi @Erush - that’s unusual and points to some sort of message corruption between the SITL-JSON code on the ardupilot side and the Gazebo plugin.

Can you pls supply some more details about your set up:

  • OS - platform and version (lsb_release -a on Ubuntu).
  • Gazebo version (gz sim --version).
  • Ardupilot version branch and commit.

I had a similar problem.
In my case adding --model JSON to sim_vehicle.py -v ArduCopter -f gazebo-iris –model JSON seems to be a solution.