..
ros
uorb autogeneration
9 years ago
templates
This commit fixes the way baud rate is generated from the program argument in
7 years ago
tools
uORB delete unused vehicle_force_setpoint
7 years ago
CMakeLists.txt
msg: add new tune_control messege
7 years ago
actuator_armed.msg
mavlink: implement MAV_CMD_REQUEST_FLIGHT_INFORMATION
8 years ago
actuator_controls.msg
uorb autogeneration
9 years ago
actuator_direct.msg
uorb autogeneration
9 years ago
actuator_outputs.msg
uorb autogeneration
9 years ago
adc_report.msg
PX4 System:Expunge the nuttx adc structure from the system
8 years ago
airspeed.msg
preflight check airspeed use differential_pressure
8 years ago
att_pos_mocap.msg
Mocap timestamp cleanup ( #5021 )
9 years ago
battery_status.msg
Added Power Brick related battery_status.msg fields
8 years ago
camera_capture.msg
msg : add camera feedback message
8 years ago
camera_trigger.msg
camera_trigger : completely refactor state handling
8 years ago
collision_report.msg
MAVLink Streams: added collision stream
8 years ago
commander_state.msg
msgs : add support for precision landing
7 years ago
cpuload.msg
Include memory in CPU load message
9 years ago
debug_key_value.msg
Use char* for names of debug messages
8 years ago
debug_value.msg
Wrong indentation
8 years ago
debug_vect.msg
Use char* for names of debug messages
8 years ago
differential_pressure.msg
multi diff pres sensor publication and logging
8 years ago
distance_sensor.msg
add constants for distance orientation convention
7 years ago
ekf2_innovations.msg
msgs : add support for precision landing
7 years ago
ekf2_timestamps.msg
replay: update & add some comments
8 years ago
esc_report.msg
Move esc_status to generated topics
10 years ago
esc_status.msg
Add TAP to vendor list
9 years ago
estimator_status.msg
ekf2: added beta test ratio to estimator_status
7 years ago
follow_target.msg
adding lpf based on confidence of linear movement
9 years ago
fw_pos_ctrl_status.msg
uorb autogeneration
9 years ago
geofence_result.msg
mission require valid landing after DO_LAND_START
8 years ago
gps_dump.msg
gps file dump: re-implement with an uORB topic & write to the log file ( #4987 )
9 years ago
gps_inject_data.msg
RTCM: use MAVLINK_MSG_ID_GPS_RTCM_DATA mavlink message (supports fragmentation)
9 years ago
home_position.msg
home_position delete unused direction_{x, y, z}
7 years ago
input_rc.msg
input_rc.msg: remove timestamp_publication, use timestamp instead
9 years ago
irlock_report.msg
msgs : add support for precision landing
7 years ago
landing_target_innovations.msg
msgs : add support for precision landing
7 years ago
landing_target_pose.msg
msgs : add support for precision landing
7 years ago
led_control.msg
libled: allow infinite flashing mode
7 years ago
log_message.msg
logging: publish a message for PX4_{WARN,ERR} & store them to the ulog file
9 years ago
manual_control_setpoint.msg
Switch assignment: added manual and stabilized switch for a default stabilized switch scheme, let FW go into Acro
8 years ago
mavlink_log.msg
logger: subscribe to mavlink_log messages and write them to the log
9 years ago
mission.msg
Mission merge offboard + onboard and simplify
7 years ago
mission_result.msg
fix MISSION_ITEM REACHED message broadcast ( #8332 )
7 years ago
mount_orientation.msg
update mavlink to master, rename MOUNT_STATUS
8 years ago
multirotor_motor_limits.msg
multirotor_motor_limits only publish for MC
8 years ago
offboard_control_mode.msg
Offboard control ( #5816 )
8 years ago
optical_flow.msg
msg: Clarify sign conventions for optical flow message
8 years ago
parameter_update.msg
Param interface: Publish instance count
7 years ago
position_setpoint.msg
navigator move parameters out of MissionBlock
7 years ago
position_setpoint_triplet.msg
uORB combine VTOL FW and MC virtual topics ( #7008 )
8 years ago
power_button_state.msg
fix power button shutdown: use an orb topic instead of a work queue call
8 years ago
pwm_input.msg
uorb autogeneration
9 years ago
qshell_req.msg
uorb autogeneration
9 years ago
rate_ctrl_status.msg
rate controller status include rates
7 years ago
rc_channels.msg
Switch assignment: added manual and stabilized switch for a default stabilized switch scheme, let FW go into Acro
8 years ago
rc_parameter_map.msg
uorb autogeneration
9 years ago
safety.msg
Safety: Add field for override inputs
7 years ago
satellite_info.msg
uorb autogeneration
9 years ago
sensor_accel.msg
Sensor messages device IDs: These remain unsigned
8 years ago
sensor_baro.msg
Sensor messages device IDs: These remain unsigned
8 years ago
sensor_bias.msg
delete control_state and cleanup vehicle_attitude ( #7882 )
7 years ago
sensor_combined.msg
msg: ekf: switch to uin32_t for deltas, should be more than enough
8 years ago
sensor_correction.msg
msg: Add mapping from uORB index to compensation parameter index
8 years ago
sensor_gyro.msg
Sensor messages device IDs: These remain unsigned
8 years ago
sensor_mag.msg
vehicle_command commands are uint16, not uint32
8 years ago
sensor_preflight.msg
msg: publish magnetometer inconsistency level
7 years ago
sensor_selection.msg
msg: create uORB topic for sensor selection data
8 years ago
servorail_status.msg
uorb autogeneration
9 years ago
subsystem_info.msg
uORB: Moved subsystem_info to generated topics
10 years ago
system_power.msg
Fixed typo usb_vaild -> usb_valid
7 years ago
task_stack_info.msg
load_mon: rename low_stack -> task_stack_info & always publish it
8 years ago
tecs_status.msg
TECS: Use version in ECL library
7 years ago
telemetry_status.msg
Iridium driver and support
8 years ago
test_motor.msg
uorb autogeneration
9 years ago
time_offset.msg
uORB: Moved time_offset topic to generated topics
10 years ago
transponder_report.msg
Navigator: Add the ability to do a low-altitude RTL to avoid traffic
7 years ago
tune_control.msg
tune_control: add silence to tune_control msg
7 years ago
uavcan_parameter_request.msg
Added MAVLink/UAVCAN parameter bridge; implemented UAVCAN ESC enumeration
9 years ago
uavcan_parameter_value.msg
Added MAVLink/UAVCAN parameter bridge; implemented UAVCAN ESC enumeration
9 years ago
ulog_stream.msg
mavlink ulog: add target sys & component ids (update to changed mavlink message)
8 years ago
ulog_stream_ack.msg
ulog_stream_ack.msg: lower timeout & increase max retries
8 years ago
vehicle_attitude.msg
delete control_state and cleanup vehicle_attitude ( #7882 )
7 years ago
vehicle_attitude_setpoint.msg
mc_pos_control: multiple small fixes in position controller we acumulated over time during our PX4 deployment and want to contribute back
7 years ago
vehicle_command.msg
New ROI commands implementation
7 years ago
vehicle_command_ack.msg
vehicle_command commands are uint16, not uint32
8 years ago
vehicle_control_mode.msg
Vehicle control state: Add support for global yaw
8 years ago
vehicle_global_position.msg
delete control_state and cleanup vehicle_attitude ( #7882 )
7 years ago
vehicle_gps_position.msg
gps_position: convert uint64 timestamp_time -> int32 timestamp_time_relative
9 years ago
vehicle_land_detected.msg
landdetector: add additional landdetection state
8 years ago
vehicle_local_position.msg
msg: Add estimator required control limits to vehicle_local_positiion
7 years ago
vehicle_local_position_setpoint.msg
uorb autogeneration
9 years ago
vehicle_rates_setpoint.msg
uORB combine VTOL FW and MC virtual topics ( #7008 )
8 years ago
vehicle_roi.msg
New ROI commands implementation
7 years ago
vehicle_status.msg
msgs : add support for precision landing
7 years ago
vehicle_status_flags.msg
commander log full status flags
7 years ago
vtol_vehicle_status.msg
vtol_att avoid unnecessary work and delete unused
7 years ago
wind_estimate.msg
delete control_state and cleanup vehicle_attitude ( #7882 )
7 years ago