Closed srmainwaring closed 1 year ago
Enable 32 servos when the parameter SERVO_32_ENABLE is set.
This PR is the companion to https://github.com/ArduPilot/ardupilot/pull/23239 for the ArduPilot gazebo plugin.
<have_32_channels>
Testing with iris_runway.sdf world:
iris_runway.sdf
gz sim -v4 -r iris_runway.sdf
sim_vehicle.py -D -v ArduCopter -f gazebo-iris --model JSON --console
Enable 32 servos in MAVProxy:
Magic number for 32 channel servo packet received:
Update plugin parameter and restart and the connection is restored.
<plugin name="ArduPilotPlugin" filename="libArduPilotPlugin"> <!-- Port settings --> <fdm_addr>127.0.0.1</fdm_addr> <fdm_port_in>9002</fdm_port_in> <connectionTimeoutMaxCount>5</connectionTimeoutMaxCount> <lock_step>1</lock_step> <have_32_channels>1</have_32_channels> ... </plugin>
Magic number for 16 channel servo packet received:
<plugin name="ArduPilotPlugin" filename="libArduPilotPlugin"> <!-- Port settings --> <fdm_addr>127.0.0.1</fdm_addr> <fdm_port_in>9002</fdm_port_in> <connectionTimeoutMaxCount>5</connectionTimeoutMaxCount> <lock_step>1</lock_step> <have_32_channels>0</have_32_channels> ... </plugin>
Tested during review of https://github.com/ArduPilot/SITL_Models/pull/96.
Enable 32 servos when the parameter SERVO_32_ENABLE is set.
This PR is the companion to https://github.com/ArduPilot/ardupilot/pull/23239 for the ArduPilot gazebo plugin.
Details
<have_32_channels>
to enable 32 rather than 16 channels.<have_32_channels>
.Testing
Testing with
iris_runway.sdf
world:Gazebo
SITL
Enable 32 servos
Enable 32 servos in MAVProxy:
Magic number for 32 channel servo packet received:
Update plugin parameter and restart and the connection is restored.
Disable 32 servos
Magic number for 16 channel servo packet received:
Update plugin parameter and restart and the connection is restored.