Add package dropping for simulating drone delivery #724
Add this suggestion to a batch that can be applied as a single commit.
This suggestion is invalid because no changes were made to the code.
Suggestions cannot be applied while the pull request is closed.
Suggestions cannot be applied while viewing a subset of changes.
Only one suggestion per line can be applied in a batch.
Add this suggestion to a batch that can be applied as a single commit.
Applying suggestions on deleted lines is not supported.
You must change the existing code in this line in order to create a valid suggestion.
Outdated suggestions cannot be applied.
This suggestion has been applied or marked resolved.
Suggestions cannot be applied from pending reviews.
Suggestions cannot be applied on multi-line comments.
Suggestions cannot be applied while the pull request is queued to merge.
Suggestion cannot be applied right now. Please check back later.
Problem Description
As PX4 vehicles are now being used for package deliveries, this PR adds a package dropping model to simulate a scenario, where a vehicle drops a package that is attached to a parachute.
standard_vtol_drop
model was added, when one of the aux pins are set over a threshold, releases a package with a parachute.gazebo_drop_plugin
. Any model can be specified through the plugin that the vehicle wants to dropparachute_package
model has been added for the parachute attached package.Testing
This was tested with a mavsdk application sending
MAV_CMD_DO_SET_ACTUATOR
commands.The example MAVSDK app can be found in PX4/PX4-Autopilot#16758
To run the model,
Additional Context