ardupilot_gazebo
ardupilot_gazebo copied to clipboard
Plugins and models for vehicle simulation in Gazebo Sim with ArduPilot SITL controllers
## Feature request I am currently working on a multi-drone formation algorithm. I will convert the algorithm results into coordinates to make the drone perform formation transformation, which includes three-dimensional...
## Feature request ### Issue The gimbal models use the visual meshes for collisions. This causes significant performance slowdown in complex worlds. For example: https://discuss.ardupilot.org/t/gazebo-harmonic-slow-real-time-factor-on-baylands-world/125284/1 ### Suggested solution Replace the...
## Bug report **Issue details** When launching `gz sim` with docker containers running `sim_vehicle.py`, docker containers report `no link`. Notes: - Multi vehicle sim on host machine (launching sim_vehicle.py in...
## Summary Fixes ArduPilotPlugin linking failure on macOS arm64 with protobuf 33.0 and abseil 20250814.1. Resolves #149 ## Problem On macOS arm64 (Apple Silicon), ArduPilotPlugin failed to link with undefined...
## Environment - **OS**: macOS Sequoia 24.5.0 (Darwin) - **Architecture**: arm64 (Apple Silicon) - **Gazebo Version**: Ionic (gz-sim9 9.4.0_3) - **Protobuf Version**: 33.0 (Homebrew) - **Abseil Version**: 20250814.1 (Homebrew) -...
I was playing around with Gazebo for the first time today and was just trying to get the Iris' gstreamer camera feed. I found that I needed to tweak the...
## Description This PR introduces a gazebo plugin of an electro-mechanical model of a motor. This plugin enhances the motor control in a model. * The electro-mechanical model of a...
## Bug report **Issue details** The iris model provided by this package doesn't seem to have optimal collision handling as it starts to slide for me on maps like Baylands...
## Bug report **Issue details** When i tried to enable streaming with "gz topic -t /world/gimbal/model/mount/model/gimbal/link/pitch_link/sensor/camera/image/enable_streaming -m gz.msgs.Boolean -p "data: 1"" for the gimbal.sdf i saw a gstreamer error message...
## Bug report **Issue details** I followed the odometry section of [ROS 2 interfaces](https://ardupilot.org/dev/docs/ros2-interfaces.html#odometry) and the [Cartographer SLAM with ROS 2 in SITL](https://ardupilot.org/dev/docs/ros2-cartographer-slam.html#cartographer-slam-with-ros-2-in-sitl) to get the simulation with external odometry....