ArduPilot / ardupilot_gazebo

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

Add range sensor example #40

Open srmainwaring opened 1 year ago

srmainwaring commented 1 year ago

Feature request

PR #5 provides support for range / proximity sensor integration in the core ArduPilotPlugin, but refers to an example in an external repo.

It would be good to have a simple rover example using the range sensors included here to help users get started.

Describe alternatives you've considered

Continue to reference external repos for examples. Not ideal as not self contained.

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

Additional context

The example referred to is here: https://github.com/srmainwaring/ros_gz_rover

8-DK commented 7 months ago

I have done this modifications on this branch. https://github.com/8-DK/ardupilot_gazebo/tree/FR-40-rangefinder-sensor-integration Please review code, if its ok to merge.

Use following params RNGFND1_TYPE 100 RNGFND1_ORIENT 0 RNGFND2_TYPE 100 RNGFND2_ORIENT 4 RNGFND3_TYPE 100 RNGFND3_ORIENT 25

screen