px4-firmware/msg
David Sidrane 4349f49610 PX4 System:Expunge the nuttx adc structure from the system
This PR is preliminary ground work for FMUv5.

   PX4 does not use the NuttX adc driver. But used the same format
   for the data returned by the nuttx ADC driver.

   There was a fixme:in src/platforms/px4_adc.h "this needs to be
   a px4_adc_msg_s type" With this PR the need for
   src/platforms/px4_adc.h goes away as the driver drv_adc.h now
   describes the px4_adc_msg_t.
2017-07-17 22:28:29 +02:00
..
ros uorb autogeneration 2016-05-14 11:27:07 +02:00
templates uORB generation use constexpr (#7348) 2017-06-03 18:02:42 -04:00
CMakeLists.txt delete vehicle_global_velocity_setpoint 2017-06-26 11:31:25 -04:00
actuator_armed.msg UAVCAN: disable ESCs when in VTOL fixed-wing 2017-04-23 14:59:24 +02:00
actuator_controls.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
actuator_direct.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
actuator_outputs.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
adc_report.msg PX4 System:Expunge the nuttx adc structure from the system 2017-07-17 22:28:29 +02:00
airspeed.msg preflight check airspeed use differential_pressure 2017-07-08 21:54:04 +02:00
att_pos_mocap.msg Mocap timestamp cleanup (#5021) 2016-07-11 12:46:29 +02:00
battery_status.msg Battery: Implement an emergency warn level 2017-02-27 09:03:20 +01:00
camera_capture.msg msg : add camera feedback message 2017-05-12 22:11:17 +02:00
camera_trigger.msg camera_trigger : completely refactor state handling 2017-05-12 22:11:17 +02:00
collision_report.msg MAVLink Streams: added collision stream 2016-11-19 14:46:20 +01:00
commander_state.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
control_state.msg msg: add gyro biases to control state message 2017-01-19 19:24:52 +01:00
cpuload.msg Include memory in CPU load message 2016-08-15 14:53:26 +02:00
debug_key_value.msg Move debug_key_value to generated topics 2015-05-27 15:21:31 -07:00
differential_pressure.msg airspeed sensors apply offset separately 2017-07-06 10:05:07 -04:00
distance_sensor.msg distance sensor message: added type for radar sensors 2016-12-27 15:35:55 +01:00
ekf2_innovations.msg added beta innovations to ekf_innovations 2016-11-15 23:58:05 +01:00
ekf2_replay.msg msg: ekf: switch to uin32_t for deltas, should be more than enough 2017-07-16 14:08:37 +02:00
ekf2_timestamps.msg replay: update & add some comments 2017-03-04 22:47:54 +08:00
esc_report.msg Move esc_status to generated topics 2015-05-27 15:21:31 -07:00
esc_status.msg Add TAP to vendor list 2016-06-24 00:08:24 +02:00
estimator_status.msg estimator_status.msg: fix documentation of innovation_check_flags 2017-06-29 16:06:06 +02:00
fence.msg Move fence to generated topics 2015-05-27 15:21:31 -07:00
fence_vertex.msg Move fence to generated topics 2015-05-27 15:21:31 -07:00
filtered_bottom_flow.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
follow_target.msg adding lpf based on confidence of linear movement 2016-05-16 15:12:50 -07:00
fw_pos_ctrl_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
geofence_result.msg mission require valid landing after DO_LAND_START 2017-04-20 14:41:01 -04:00
gps_dump.msg gps file dump: re-implement with an uORB topic & write to the log file (#4987) 2016-07-06 09:32:37 +02:00
gps_inject_data.msg RTCM: use MAVLINK_MSG_ID_GPS_RTCM_DATA mavlink message (supports fragmentation) 2016-06-02 09:26:03 +02:00
hil_sensor.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
home_position.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
input_rc.msg input_rc.msg: remove timestamp_publication, use timestamp instead 2016-09-19 13:02:31 +02:00
led_control.msg lib/led: add BREATHE mode (but not implemented yet) 2017-03-12 00:08:35 +01:00
log_message.msg logging: publish a message for PX4_{WARN,ERR} & store them to the ulog file 2016-08-24 21:24:35 +02:00
manual_control_setpoint.msg Switch assignment: added manual and stabilized switch for a default stabilized switch scheme, let FW go into Acro 2017-02-18 08:03:19 +01:00
mavlink_log.msg logger: subscribe to mavlink_log messages and write them to the log 2016-06-02 07:32:49 +02:00
mc_att_ctrl_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
mission.msg orb macros: cleanup some unused code (#4576) 2016-05-19 11:08:37 +02:00
mission_result.msg mission require valid landing after DO_LAND_START 2017-04-20 14:41:01 -04:00
mount_orientation.msg update mavlink to master, rename MOUNT_STATUS 2016-11-28 21:01:22 +01:00
multirotor_motor_limits.msg msg: improve multirotor_motor_limits reporting 2016-12-13 16:14:15 +01:00
offboard_control_mode.msg Offboard control (#5816) 2016-11-07 12:09:41 +01:00
optical_flow.msg msg: Clarify sign conventions for optical flow message 2016-12-30 10:39:10 +01:00
output_pwm.msg PWM out driver: Move to generated uORB topic 2015-08-20 10:46:59 +02:00
parameter_update.msg param: implement rate-limited autosave 2017-04-06 11:49:03 +02:00
position_setpoint.msg Add body/NED frame for offboard velocity control 2016-12-15 10:17:03 +01:00
position_setpoint_triplet.msg uORB combine VTOL FW and MC virtual topics (#7008) 2017-04-09 13:17:20 -04:00
pwm_input.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
qshell_req.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
rc_channels.msg Switch assignment: added manual and stabilized switch for a default stabilized switch scheme, let FW go into Acro 2017-02-18 08:03:19 +01:00
rc_parameter_map.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
safety.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
satellite_info.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
sensor_accel.msg Sensor messages device IDs: These remain unsigned 2017-01-19 19:24:52 +01:00
sensor_baro.msg Sensor messages device IDs: These remain unsigned 2017-01-19 19:24:52 +01:00
sensor_combined.msg msg: ekf: switch to uin32_t for deltas, should be more than enough 2017-07-16 14:08:37 +02:00
sensor_correction.msg msg: Add mapping from uORB index to compensation parameter index 2017-02-01 08:40:23 +01:00
sensor_gyro.msg Sensor messages device IDs: These remain unsigned 2017-01-19 19:24:52 +01:00
sensor_mag.msg sensor_mag.msg: add is_external flag & set it in the mag drivers 2017-06-14 19:53:07 +02:00
sensor_preflight.msg msg: Add topic for pre-flight sensor checks 2016-11-19 15:12:08 +01:00
sensor_selection.msg msg: create uORB topic for sensor selection data 2017-05-03 08:37:14 +02:00
servorail_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
subsystem_info.msg uORB: Moved subsystem_info to generated topics 2015-05-27 15:21:32 -07:00
system_power.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
task_stack_info.msg load_mon: rename low_stack -> task_stack_info & always publish it 2017-02-04 12:15:59 +01:00
tecs_status.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
telemetry_status.msg Iridium driver and support 2016-12-14 08:20:01 +01:00
test_motor.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
time_offset.msg uORB: Moved time_offset topic to generated topics 2015-05-27 15:21:33 -07:00
transponder_report.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
uavcan_parameter_request.msg Added MAVLink/UAVCAN parameter bridge; implemented UAVCAN ESC enumeration 2015-10-13 21:50:23 +11:00
uavcan_parameter_value.msg Added MAVLink/UAVCAN parameter bridge; implemented UAVCAN ESC enumeration 2015-10-13 21:50:23 +11:00
ulog_stream.msg mavlink ulog: add target sys & component ids (update to changed mavlink message) 2016-10-19 13:13:47 +02:00
ulog_stream_ack.msg ulog_stream_ack.msg: lower timeout & increase max retries 2016-11-14 10:27:57 +01:00
vehicle_attitude.msg mavlink_receiver : Add external estimator interface 2017-02-15 21:47:51 +01:00
vehicle_attitude_setpoint.msg uORB combine VTOL FW and MC virtual topics (#7008) 2017-04-09 13:17:20 -04:00
vehicle_command.msg remove partial CMD_OVERRIDE_GOTO implementation (#7356) 2017-06-08 22:03:50 -04:00
vehicle_command_ack.msg vehicle_command topic: use uorb queuing with length 3 2016-09-07 18:47:12 +02:00
vehicle_control_mode.msg Vehicle control state: Add support for global yaw 2017-02-22 09:21:20 +01:00
vehicle_force_setpoint.msg enable force setpoint message for multiplatform 2015-02-28 18:25:35 +01:00
vehicle_global_position.msg msg: Add vertical derivative to vehicle position messages 2017-06-19 09:09:52 +02:00
vehicle_gps_position.msg gps_position: convert uint64 timestamp_time -> int32 timestamp_time_relative 2016-06-24 00:22:01 +02:00
vehicle_land_detected.msg land_detector: battery level status to adjust maximum altitude possible 2017-02-27 22:54:19 +01:00
vehicle_local_position.msg msg: Add vertical derivative to vehicle position messages 2017-06-19 09:09:52 +02:00
vehicle_local_position_setpoint.msg uorb autogeneration 2016-05-14 11:27:07 +02:00
vehicle_rates_setpoint.msg uORB combine VTOL FW and MC virtual topics (#7008) 2017-04-09 13:17:20 -04:00
vehicle_roi.msg vmount: add mount and ROI implementation 2016-09-06 11:33:18 +02:00
vehicle_status.msg minor: uppercase typo and unused header 2016-12-20 09:46:36 +01:00
vehicle_status_flags.msg Add new message vehicle_status_flags for the commander status_flags 2017-02-04 21:13:59 +01:00
vtol_vehicle_status.msg VTOL vehicle status: Adjust defines to match VTOL controller enum 2016-12-25 18:15:51 +01:00
wind_estimate.msg uorb autogeneration 2016-05-14 11:27:07 +02:00