px4-firmware/msg
Claudio Micheli c2a68debd9 add jamming_state to gps sensor module
Signed-off-by: Claudio Micheli <claudio@auterion.com>
2021-01-30 11:26:42 +01:00
..
templates msg: rtps: improve verbosity when the the client is not capable of parsing a specific ID 2021-01-10 22:22:22 +01:00
tools Remove ancient submodules 2021-01-21 10:46:29 +01:00
CMakeLists.txt Add logging of mag calibration data (mag_worker_data) 2021-01-20 09:44:45 -05:00
actuator_armed.msg Mavlink FLIGHT_INFORMATION fix arming time (ms -> us) and add takeoff time 2020-12-16 09:38:05 -05:00
actuator_controls.msg initial control allocation support 2021-01-18 11:25:37 -05:00
actuator_outputs.msg beautify some identation 2018-08-09 13:40:48 +02:00
adc_report.msg ADC: replace ioctl with uorb message (#14087) 2020-03-20 11:23:32 +01:00
airspeed.msg beautify some identation 2018-08-09 13:40:48 +02:00
airspeed_validated.msg Commenting and formating fixes 2020-10-06 09:31:58 +02:00
battery_status.msg format smart battery serial number as string on mavlink 2020-12-28 11:04:54 +01:00
camera_capture.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
camera_trigger.msg camera_capture: change topic namings to make logging, mavlink streaming and geotagging easier 2019-02-10 18:07:44 -05:00
cellular_status.msg Update mavlink with cellular status message fixes 2020-07-09 15:12:02 -04:00
collision_constraints.msg first push on supporting ROS2 Dashing and IDL 4.2 2019-10-04 16:56:03 +01:00
collision_report.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
commander_state.msg msg: add orbit main and navigation state 2018-12-08 22:34:57 +01:00
control_allocator_status.msg fix control_allocator_status: torque_setpoint_achieved and thrust_setpoint_achieved are bool 2021-01-18 11:25:37 -05:00
cpuload.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
debug_array.msg Add support for mavlink message DEBUG_FLOAT_ARRAY 2018-09-27 12:33:12 -04:00
debug_key_value.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
debug_value.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
debug_vect.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
differential_pressure.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
distance_sensor.msg Drivers: Distance Sensors: Add proper device IDs 2021-01-27 17:02:20 -05:00
ekf2_timestamps.msg replay: remove GPS relative timestamps 2020-02-07 08:19:22 +01:00
ekf_gps_drift.msg msg: Create message for GPS drift rates 2018-08-17 10:44:07 +10:00
esc_report.msg msg: extend field definition in msg/esc_report (arming & failure states) 2020-04-03 09:16:43 +02:00
esc_status.msg msg: extend field definition in msg/esc_report (arming & failure states) 2020-04-03 09:16:43 +02:00
estimator_innovations.msg estimator_innovations: remove unimplemented fake vel & pos fields 2020-11-11 20:17:52 -05:00
estimator_optical_flow_vel.msg OpticalFlow: add optical flow velocity logging 2020-10-26 14:10:25 -04:00
estimator_selector_status.msg Multi-EKF support (ekf2) 2020-10-27 10:56:11 -04:00
estimator_sensor_bias.msg estimated IMU bias preflight checks 2021-01-12 09:09:42 +01:00
estimator_states.msg estimator messages add explicit timestamp_sample 2020-09-04 10:48:26 -04:00
estimator_status.msg ekf2: update to new ecl to fix fault status getter 2020-12-10 12:45:41 -05:00
estimator_status_flags.msg msg: estimator_status_flags shorten fields 2021-01-11 11:49:51 -05:00
follow_target.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
generator_status.msg mavlink: handle receiving GENERATOR_STATUS 2020-09-25 11:36:58 -04:00
geofence_result.msg Add Land as Geofence Action 2020-07-09 10:32:10 -04:00
gps_dump.msg GPS_DUMP_COMM: dump all gps instances 2020-12-08 11:45:24 +01:00
gps_inject_data.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
home_position.msg Commander: set home position in air 2020-12-07 10:24:23 -05:00
hover_thrust_estimate.msg mc_hover_thrust_estimator: validity flag and other small improvements/fixes 2020-08-03 10:30:52 -04:00
input_rc.msg rc/dsm: decode improvements 2020-08-02 12:52:16 -04:00
iridiumsbd_status.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
irlock_report.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
landing_gear.msg vehicle constraints: remove landing gear 2018-12-10 16:17:23 +01:00
landing_target_innovations.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
landing_target_pose.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
led_control.msg msg:led_control Extend to support 8 LEDS 2021-01-23 09:30:59 -05:00
log_message.msg log_message increase queue depth 2->4 2021-01-09 11:04:32 -05:00
logger_status.msg logger: record message gaps 2020-07-29 13:36:22 -04:00
mag_worker_data.msg Add logging of mag calibration data (mag_worker_data) 2021-01-20 09:44:45 -05:00
manual_control_setpoint.msg new manual_control_switches msg (split out of manual_control_setpoint) (#16270) 2020-12-11 12:11:35 -05:00
manual_control_switches.msg new manual_control_switches msg (split out of manual_control_setpoint) (#16270) 2020-12-11 12:11:35 -05:00
mavlink_log.msg mavlink: STATUSTEXT directly use mavlink_log subscription 2020-11-17 19:47:06 -05:00
mission.msg beautify some identation 2018-08-09 13:40:48 +02:00
mission_result.msg beautify some identation 2018-08-09 13:40:48 +02:00
mount_orientation.msg beautify some identation 2018-08-09 13:40:48 +02:00
multirotor_motor_limits.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
navigator_mission_item.msg navigator: publish navigator mission item changes for logging 2020-10-13 12:12:03 -04:00
obstacle_distance.msg Collision Prevention: support multiple sensors and frames (#12883) 2019-09-06 08:38:56 +02:00
offboard_control_mode.msg mc_att_ctrl: added yawrate control from offboard. 2019-06-04 08:26:09 +02:00
onboard_computer_status.msg Add units on message comments 2019-10-27 11:47:10 +00:00
optical_flow.msg first push on supporting ROS2 Dashing and IDL 4.2 2019-10-04 16:56:03 +01:00
orb_test.msg uORB: add bitset for faster orb_exists check and remove uORB::Subscription lazy subscribe hack/optimization 2020-03-11 09:06:33 -04:00
orb_test_large.msg uORB: add bitset for faster orb_exists check and remove uORB::Subscription lazy subscribe hack/optimization 2020-03-11 09:06:33 -04:00
orb_test_medium.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
orbit_status.msg Orbit: Add RC controlled yaw mode 2020-07-13 20:26:13 +02:00
parameter_update.msg beautify some identation 2018-08-09 13:40:48 +02:00
ping.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
position_controller_landing_status.msg generic position controller status/feedback message 2018-08-31 14:43:51 -04:00
position_controller_status.msg FW move altitude first order hold (FOH) and loiter to position special cases from navigator to position controller 2020-10-06 16:57:12 -04:00
position_setpoint.msg Navigator: make weather vane work in all auto modes, not just mission (#13761) 2019-12-28 12:13:15 -05:00
position_setpoint_triplet.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
power_button_state.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
power_monitor.msg Added TI ina226 I2C power monitor (#11755) 2019-05-17 13:33:48 -04:00
pwm_input.msg PWM automatic trigger system (ATS) for parachutes (#13726) 2020-01-06 20:14:06 -05:00
px4io_status.msg px4io: servorail_status -> px4io_status and log all flags 2020-07-21 09:56:13 -04:00
qshell_req.msg qshell: rename qshell sequence fields so they can be parsed on fastrtpsgen 2019-09-04 17:04:28 +01:00
qshell_retval.msg qshell: rename qshell sequence fields so they can be parsed on fastrtpsgen 2019-09-04 17:04:28 +01:00
radio_status.msg radio_status: change 'fixed' field name to 'fix' so it does not clash with 'fixed' floating-point notation on the IDL generation 2018-10-08 10:58:45 +02:00
rate_ctrl_status.msg sensors: create vehicle_angular_velocity module (#12596) 2019-08-06 12:55:25 -04:00
rc_channels.msg new manual_control_switches msg (split out of manual_control_setpoint) (#16270) 2020-12-11 12:11:35 -05:00
rc_parameter_map.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
rpm.msg Remove duplicite data from RPM message and enable logging of RPM message 2020-03-30 13:08:53 -04:00
rtl_flight_time.msg Test the vehicle type parameter usage 2021-01-18 16:26:53 +01:00
safety.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
satellite_info.msg Add MavlinkStreamGPSStatus status class stream via GPS_STATUS.hpp and add PRN code to satellite_info.msg. 2020-10-14 08:26:42 +02:00
sensor_accel.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_accel_fifo.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_baro.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_combined.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_correction.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_gps.msg add jamming_state to gps sensor module 2021-01-30 11:26:42 +01:00
sensor_gyro.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_gyro_fft.msg FFT add simple median filter 2020-11-02 12:58:46 -05:00
sensor_gyro_fifo.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_mag.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
sensor_preflight_mag.msg sensors: move mag aggregation to new VehicleMagnetometer WorkItem 2020-08-21 10:12:13 -04:00
sensor_selection.msg sensors: move mag aggregation to new VehicleMagnetometer WorkItem 2020-08-21 10:12:13 -04:00
sensors_status_imu.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
system_power.msg adc: add support for multiple sensor voltage channels 2021-01-15 10:57:20 -05:00
task_stack_info.msg load_mon: update orb_publish to uORB::Publication<> 2019-09-02 20:41:34 -04:00
tecs_status.msg TECS: add EAS_sp to tecs_status.msg and rename other airspeeds to TAS 2021-01-23 09:34:34 -05:00
telemetry_status.msg mavlink: telemetry status only log simple HEARTBEAT validity 2020-10-13 13:37:10 -04:00
test_motor.msg commander: add support for DO_MOTOR_TEST 2019-10-24 09:27:29 +02:00
timesync.msg mavlink: timesync: readd timesync_status uORB to report Mavlink timesync 2020-03-10 12:15:18 +00:00
timesync_status.msg mavlink: timesync: readd timesync_status uORB to report Mavlink timesync 2020-03-10 12:15:18 +00:00
trajectory_bezier.msg Add documenation to uORB message 2020-03-09 09:51:49 +01:00
trajectory_waypoint.msg add point type (mavlink command associated with wp) in Obstacle Avoidance interface 2019-08-05 16:05:40 +02:00
transponder_report.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
tune_control.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
uavcan_parameter_request.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
uavcan_parameter_value.msg add timestamp field to uORB msgs; sync timestamp whenever possible 2018-08-09 13:40:48 +02:00
ulog_stream.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
ulog_stream_ack.msg ulog stream msgs: rename 'sequence' fields as they are protected names in fastrtpsgen 2019-10-14 16:37:17 +01:00
vehicle_acceleration.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_actuator_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_air_data.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_angular_acceleration.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_angular_acceleration_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_angular_velocity.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_attitude.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_attitude_setpoint.msg vehicle_attitude_setpoint: get rid of unused q_d_valid flag 2020-02-27 09:17:52 +01:00
vehicle_command.msg vehicle_command: increase queue depth 4 -> 8 2021-01-26 12:00:18 -05:00
vehicle_command_ack.msg fix: uORB topics lost messages when publications overflow 2020-10-19 08:52:55 +02:00
vehicle_constraints.msg Temporary logging addition to debug CI 2020-12-30 10:25:08 -05:00
vehicle_control_mode.msg vehicle_control_mode: fix invalid comment for flag_armed 2020-01-24 08:42:16 +01:00
vehicle_global_position.msg Multi-EKF support (ekf2) 2020-10-27 10:56:11 -04:00
vehicle_gps_position.msg vehicle_gps_position: add jamming_state 2021-01-30 11:26:42 +01:00
vehicle_imu.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_imu_status.msg sensors: angular_velocity always get gyro rate from vehicle_imu_status 2020-12-16 10:12:27 -05:00
vehicle_land_detected.msg LandDetector: switch land flags to properies instead of one state 2019-10-16 00:47:01 -04:00
vehicle_local_position.msg vehicle_local_position: added bitfield for terrain estimate sensor info 2021-01-17 12:06:59 +01:00
vehicle_local_position_setpoint.msg vehicle_local_position_setpoint: make acceleration and jerk arrays 2019-10-24 14:58:57 +02:00
vehicle_magnetometer.msg Clarification of coordinate systems for sensors_* and vehicle_* messages (#16339) 2020-12-15 09:18:05 +01:00
vehicle_odometry.msg rename vehicle_visual_odometry_aligned -> estimator_visual_odometry_aligned 2020-10-27 12:33:39 -04:00
vehicle_rates_setpoint.msg VTOL rate control architecture improvements (#10819) 2018-11-21 20:32:40 -05:00
vehicle_roi.msg beautify some identation 2018-08-09 13:40:48 +02:00
vehicle_status.msg Mavlink FLIGHT_INFORMATION fix arming time (ms -> us) and add takeoff time 2020-12-16 09:38:05 -05:00
vehicle_status_flags.msg commander: unify offboard timeouts 2020-03-04 09:35:14 +01:00
vehicle_thrust_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_torque_setpoint.msg initial control allocation support 2021-01-18 11:25:37 -05:00
vehicle_trajectory_bezier.msg Add uORB messages for bezier curve trajectories 2020-03-09 09:51:49 +01:00
vehicle_trajectory_waypoint.msg TRAJECTORY message renamed 2018-11-13 12:13:01 -05:00
vtol_vehicle_status.msg beautify some identation 2018-08-09 13:40:48 +02:00
wheel_encoders.msg Changed wheel encoder publication to multi-instance 2019-08-05 02:45:33 -07:00
wind_estimate.msg wind_estimate message: add identifier for source 2020-12-08 11:43:27 -05:00
yaw_estimator_status.msg estimator messages add explicit timestamp_sample 2020-09-04 10:48:26 -04:00