ArduPilot / ardupilot_gazebo

Plugins and models for vehicle simulation in Gazebo Sim with ArduPilot SITL controllers
GNU Lesser General Public License v3.0
81 stars 76 forks source link

Add multi-agent heterogenous demo with zephyr and iris in one environment #89

Open Ryanf55 opened 4 months ago

Ryanf55 commented 4 months ago

Feature request

Is your feature request related to a problem? Please describe.

I want to simulate a mixed fleet of vehicle types in Gazebo, but it's not clear how to do that.

Describe the solution you'd like

https://discuss.ardupilot.org/t/multi-vehicle-zephyr-and-iris-ardupilot-gazebo-simulation-going-to-different-points-in-gazebo-simulation-for-the-same-lat-lon-alt/90686

Add the iris and the zephyr models to the same environment, as requested above. Then, demonstrate how to run SITL where you can have two mavproxy sessions, one for each vehicle, and have both vehicles flying at the same time (perhaps hover the iris, and then have the plane do a loiter circle around).

Describe alternatives you've considered

Platform [ ] All [ ] AntennaTracker [x] Copter [x] Plane [ ] Rover [ ] Submarine

Additional context

srmainwaring commented 4 months ago

@Ryanf55 - this is already supported and used in the ship landing demos where a quadcopter and truck or quadcopter and ship are both controller in Gazebo using ArduPilot. There are a couple of threads in discourse with discussions:

Ryanf55 commented 4 months ago

Thanks for the references. I'm happy to do the work for it with the content you attached.

What do you think about adding a node that makes the copter with gimbal chase the plane and film it with the gimbal?

srmainwaring commented 3 months ago

What do you think about adding a node that makes the copter with gimbal chase the plane and film it with the gimbal?

This would be better handled in https://github.com/ArduPilot/ardupilot_gz where we can use Python launch files to manage multiple vehicles (and override the port settings in the additional vehicles).