px4-firmware/msg
Konrad 007ed11bbe Mission+RTL: Refactoring mission and RTL to keep them separate. RTL does all its mission related computation in its own class.
Dataman: Add write function to dataman cache.

RTL and mission have a new common base class mission_base. Both inherit from them and mission, RTL mission, and rtl reverse mission inherit from them and implement their desired functionalities. This simplifies the logic in mission as well as make the logic in rtl mission reverse and mission more readable.
Rtl mission reverse now functional again for VTOL flying back the mission and transitioning to MC at the home position.
Dataman cache has new write functionality to write to dataman while updating write item in its cache if necessary.
Dataman cache is now only updated when the respective module is active. Leads to a higher computation time once on activation, but decreases unnecessary cache updates when inactive.
2023-09-29 14:25:03 +02:00
..
ActionRequest.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ActuatorArmed.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ActuatorControlsStatus.msg VTOL: remove virtual actuator_controls and instead use virtual torque/thrust topics 2023-03-16 11:55:45 +01:00
ActuatorMotors.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ActuatorOutputs.msg Improve logging for Modal IO ESC (#21188) 2023-03-06 09:51:22 -05:00
ActuatorServos.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ActuatorServosTrim.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ActuatorTest.msg msg: set all ORB_QUEUE_LENGTH to actual rounded value 2023-09-08 15:28:16 -04:00
AdcReport.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Airspeed.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
AirspeedValidated.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
AirspeedWind.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
AutotuneAttitudeControlStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
BatteryStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ButtonEvent.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
CMakeLists.txt dataman: add DatamanClient with sync functions 2023-07-24 13:10:31 +02:00
CameraCapture.msg Use gimbal attitude for the camera feedback when available 2022-11-14 09:26:14 -05:00
CameraStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
CameraTrigger.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
CellularStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
CollisionConstraints.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
CollisionReport.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ControlAllocatorStatus.msg Control_allocator_status.msg: remove allocated_ fields 2022-11-02 14:56:13 +01:00
Cpuload.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
DatamanRequest.msg dataman: remove locking mechanism 2023-07-24 13:10:31 +02:00
DatamanResponse.msg dataman: remove locking mechanism 2023-07-24 13:10:31 +02:00
DebugArray.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
DebugKeyValue.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
DebugValue.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
DebugVect.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
DifferentialPressure.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
DistanceSensor.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Ekf2Timestamps.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
EscReport.msg Improve logging for Modal IO ESC (#21188) 2023-03-06 09:51:22 -05:00
EscStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
EstimatorAidSource1d.msg ekf2: remove aid src status fusion_enabled flag 2023-09-26 10:30:16 -04:00
EstimatorAidSource2d.msg ekf2: remove aid src status fusion_enabled flag 2023-09-26 10:30:16 -04:00
EstimatorAidSource3d.msg ekf2: remove aid src status fusion_enabled flag 2023-09-26 10:30:16 -04:00
EstimatorBias.msg ekf2: EV overhaul yaw and position fusion (#20501) 2022-12-20 10:23:56 -05:00
EstimatorBias3d.msg ekf2: EV overhaul yaw and position fusion (#20501) 2022-12-20 10:23:56 -05:00
EstimatorEventFlags.msg Fix magnetometer typo 2023-01-30 10:24:16 +01:00
EstimatorGpsStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
EstimatorInnovations.msg ekf2: new gravity observation (#21038) 2023-02-07 13:28:58 -05:00
EstimatorSelectorStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
EstimatorSensorBias.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
EstimatorStates.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
EstimatorStatus.msg ekf2: log mag inclination and strength for tuning 2023-07-24 10:16:37 -04:00
EstimatorStatusFlags.msg EKF2: improve resilience against incorrect mag data 2023-08-17 09:55:15 -04:00
Event.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
FailsafeFlags.msg mode_requirements: add manual control for manual modes 2023-03-08 09:32:56 +01:00
FailureDetectorStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
FollowTarget.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
FollowTargetEstimator.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
FollowTargetStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GeneratorStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GeofenceResult.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalControls.msg Gimbal: remove shutter and retraction handling 2023-03-23 06:59:02 +01:00
GimbalDeviceAttitudeStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalDeviceInformation.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalDeviceSetAttitude.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalManagerInformation.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalManagerSetAttitude.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalManagerSetManualControl.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GimbalManagerStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GpioConfig.msg Driver: Refactor MCP23009 GPIO expander into uORB driver 2023-06-19 07:58:21 +02:00
GpioIn.msg Driver: Refactor MCP23009 GPIO expander into uORB driver 2023-06-19 07:58:21 +02:00
GpioOut.msg Driver: Refactor MCP23009 GPIO expander into uORB driver 2023-06-19 07:58:21 +02:00
GpioRequest.msg Driver: Refactor MCP23009 GPIO expander into uORB driver 2023-06-19 07:58:21 +02:00
GpsDump.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
GpsInjectData.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Gripper.msg params/uorb docs: rename mixer to control allocation (#20447) 2022-10-24 13:22:26 +02:00
HealthReport.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
HeaterStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
HomePosition.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
HoverThrustEstimate.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
InputRc.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
InternalCombustionEngineStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
IridiumsbdStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
IrlockReport.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
LandingGear.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
LandingGearWheel.msg Fixed-wing: split out control of steering wheel into seperate message LandingGearWheel 2022-11-22 13:46:25 -05:00
LandingTargetInnovations.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
LandingTargetPose.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
LaunchDetectionStatus.msg FW Launch Detection: refactor state machine and pubish launch_detection_status message 2022-11-25 18:45:36 +01:00
LedControl.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
LogMessage.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
LoggerStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
MagWorkerData.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
MagnetometerBiasEstimate.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ManualControlSetpoint.msg Rework flaps/spoilers logic 2023-03-06 22:43:41 +01:00
ManualControlSwitches.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
MavlinkLog.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
MavlinkTunnel.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Mission.msg Mission+RTL: Refactoring mission and RTL to keep them separate. RTL does all its mission related computation in its own class. 2023-09-29 14:25:03 +02:00
MissionResult.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ModeCompleted.msg navigator: add ModeCompleted signalling topic 2023-02-07 19:11:52 -05:00
MountOrientation.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
NavigatorMissionItem.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
NormalizedUnsignedSetpoint.msg Rework flaps/spoilers logic 2023-03-06 22:43:41 +01:00
NpfgStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ObstacleDistance.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
OffboardControlMode.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
OnboardComputerStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
OrbTest.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
OrbTestLarge.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
OrbTestMedium.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
OrbitStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
ParameterUpdate.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Ping.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PositionControllerLandingStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PositionControllerStatus.msg PositionControllerStatus.msg: add comments 2023-01-26 17:04:43 +01:00
PositionSetpoint.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PositionSetpointTriplet.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PowerButtonState.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PowerMonitor.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PpsCapture.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
PwmInput.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Px4ioStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
QshellReq.msg Qurt qshell implementation (#20736) 2022-12-09 16:49:41 -05:00
QshellRetval.msg Qurt qshell implementation (#20736) 2022-12-09 16:49:41 -05:00
RadioStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
RateCtrlStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
RcChannels.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
RcParameterMap.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
Rpm.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
RtlTimeEstimate.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SatelliteInfo.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorAccel.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorAccelFifo.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorBaro.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorCombined.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorCorrection.msg Add magnetometer thermal compensation. 2023-06-07 12:07:29 -04:00
SensorGnssRelative.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorGps.msg SensorGps.msg: switch to double precision for lat/lon/alt 2023-07-13 07:50:09 +02:00
SensorGyro.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorGyroFft.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorGyroFifo.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorHygrometer.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorMag.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorOpticalFlow.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorPreflightMag.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorSelection.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorUwb.msg drivers: rework NXP UWB driver (#21124) 2023-07-12 11:44:23 -04:00
SensorsStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SensorsStatusImu.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
SystemPower.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TakeoffStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TaskStackInfo.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TecsStatus.msg TECS: revert altitude controller to old logic 2023-04-06 20:12:52 +02:00
TelemetryStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TiltrotorExtraControls.msg Remove INDEX_COLLECTIVE_TILT from actuator_controls and instead use new topic tiltrotor_extra_controls 2023-03-06 22:43:41 +01:00
TimesyncStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TrajectoryBezier.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TrajectorySetpoint.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TrajectoryWaypoint.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TransponderReport.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
TuneControl.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
UavcanParameterRequest.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
UavcanParameterValue.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
UlogStream.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
UlogStreamAck.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleAcceleration.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleAirData.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleAngularAccelerationSetpoint.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleAngularVelocity.msg merge vehicle_angular_acceleration into vehicle_angular_velocity (#20531) 2022-11-14 11:03:59 -05:00
VehicleAttitude.msg drivers: initial VectorNav (VN-100, VN-200, VN-300) support 2023-01-20 19:09:30 -05:00
VehicleAttitudeSetpoint.msg Rework flaps/spoilers logic 2023-03-06 22:43:41 +01:00
VehicleCommand.msg delete unused mavlink_px4.py & fix typos in VehicleCommand (#21332) 2023-04-20 07:50:58 +02:00
VehicleCommandAck.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleConstraints.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleControlMode.msg VehicleControlMode: add flag_control_allocation_enabled 2023-08-21 20:53:51 -04:00
VehicleGlobalPosition.msg drivers: initial VectorNav (VN-100, VN-200, VN-300) support 2023-01-20 19:09:30 -05:00
VehicleImu.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleImuStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleLandDetected.msg LandDetector: log rotational_movement 2022-11-01 18:35:54 +01:00
VehicleLocalPosition.msg ekf2: add unaided_yaw for more resilient yaw control 2023-08-30 09:56:19 +02:00
VehicleLocalPositionSetpoint.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleMagnetometer.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleOdometry.msg ekf2: EV overhaul yaw and position fusion (#20501) 2022-12-20 10:23:56 -05:00
VehicleOpticalFlow.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleOpticalFlowVel.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleRatesSetpoint.msg FW separate reset integrals for messages (#20502) 2022-11-01 06:06:27 +01:00
VehicleRoi.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleStatus.msg commander: collapse ArmStateMachine and simplify 2023-07-28 17:12:01 -04:00
VehicleThrustSetpoint.msg VTOL: remove virtual actuator_controls and instead use virtual torque/thrust topics 2023-03-16 11:55:45 +01:00
VehicleTorqueSetpoint.msg VTOL: remove virtual actuator_controls and instead use virtual torque/thrust topics 2023-03-16 11:55:45 +01:00
VehicleTrajectoryBezier.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VehicleTrajectoryWaypoint.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
VtolVehicleStatus.msg VTOL/Commander: rename transition_failsafe to vtol_fixed_wing_system_failure 2023-01-13 19:02:21 +03:00
Wind.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00
YawEstimatorStatus.msg msg ROS2 compatibility, microdds_client improvements (timesync, reduced code size, added topics, etc), fastrtps purge 2022-10-19 19:36:47 -04:00