50 #include <px4_platform_common/module_params.h> 206 void fill_thrust(
float *thrust_body_array, uint8_t vehicle_type,
float thrust);
293 (ParamFloat<px4::params::BAT_CRIT_THR>) _param_bat_crit_thr,
294 (ParamFloat<px4::params::BAT_EMERGEN_THR>) _param_bat_emergen_thr,
295 (ParamFloat<px4::params::BAT_LOW_THR>) _param_bat_low_thr,
296 (ParamInt<px4::params::COM_FLIGHT_UUID>) _param_com_flight_uuid,
297 (ParamFloat<px4::params::SENS_FLOW_MAXHGT>) _param_sens_flow_maxhgt,
298 (ParamFloat<px4::params::SENS_FLOW_MAXR>) _param_sens_flow_maxr,
299 (ParamFloat<px4::params::SENS_FLOW_MINHGT>) _param_sens_flow_minhgt,
300 (ParamInt<px4::params::SENS_FLOW_ROT>) _param_sens_flow_rot
void fill_thrust(float *thrust_body_array, uint8_t vehicle_type, float thrust)
MAVLink remote file server. Support FTP like commands using MAVLINK_MSG_ID_FILE_TRANSFER_PROTOCOL mes...
void handle_message_vision_position_estimate(mavlink_message_t *msg)
MavlinkMissionManager _mission_manager
switch_pos_t decode_switch_pos(uint16_t buttons, unsigned sw)
Decode a switch position from a bitfield.
uORB::Subscription _vehicle_status_sub
void handle_message_set_mode(mavlink_message_t *msg)
uint8_t _mom_switch_pos[MOM_SWITCH_COUNT]
uORB::Publication< cellular_status_s > _cellular_status_pub
uint16_t _mom_switch_state
void handle_message_statustext(mavlink_message_t *msg)
void handle_message_cellular_status(mavlink_message_t *msg)
void handle_message_manual_control(mavlink_message_t *msg)
void update_params()
Updates the battery, optical flow, and flight ID subscribed parameters.
uORB::Subscription _actuator_armed_sub
uORB::Publication< vehicle_global_position_s > _global_pos_pub
uORB::Publication< vehicle_gps_position_s > _gps_pub
~MavlinkReceiver()=default
uORB::Publication< airspeed_s > _airspeed_pub
void send_flight_information()
map_projection_reference_s _hil_local_proj_ref
uORB::Publication< debug_key_value_s > _debug_key_value_pub
void handle_message_rc_channels_override(mavlink_message_t *msg)
bool evaluate_target_ok(int command, int target_system, int target_component)
Implementation of the MAVLink mission protocol.
Mavlink parameters manager definition.
uORB::Publication< debug_value_s > _debug_value_pub
void handle_message_command_ack(mavlink_message_t *msg)
mavlink_status_t _status
receiver status, used for mavlink_parse_char()
void acknowledge(uint8_t sysid, uint8_t compid, uint16_t command, uint8_t result)
void handle_message_named_value_float(mavlink_message_t *msg)
uORB::Publication< follow_target_s > _follow_target_pub
void handle_message_gps_global_origin(mavlink_message_t *msg)
uORB::Publication< vehicle_rates_setpoint_s > _rates_sp_pub
void handle_message(mavlink_message_t *msg)
DEFINE_PARAMETERS((ParamFloat< px4::params::BAT_CRIT_THR >) _param_bat_crit_thr,(ParamFloat< px4::params::BAT_EMERGEN_THR >) _param_bat_emergen_thr,(ParamFloat< px4::params::BAT_LOW_THR >) _param_bat_low_thr,(ParamInt< px4::params::COM_FLIGHT_UUID >) _param_com_flight_uuid,(ParamFloat< px4::params::SENS_FLOW_MAXHGT >) _param_sens_flow_maxhgt,(ParamFloat< px4::params::SENS_FLOW_MAXR >) _param_sens_flow_maxr,(ParamFloat< px4::params::SENS_FLOW_MINHGT >) _param_sens_flow_minhgt,(ParamInt< px4::params::SENS_FLOW_ROT >) _param_sens_flow_rot)
uORB::PublicationQueued< vehicle_command_s > _cmd_pub
void handle_message_set_attitude_target(mavlink_message_t *msg)
void handle_message_onboard_computer_status(mavlink_message_t *msg)
uORB::Publication< vehicle_odometry_s > _mocap_odometry_pub
uORB::PublicationMulti< sensor_baro_s > _baro_pub
uORB::PublicationQueued< gps_inject_data_s > _gps_inject_data_pub
uORB::Publication< vehicle_attitude_setpoint_s > _fw_virtual_att_sp_pub
uORB::Publication< vehicle_land_detected_s > _land_detector_pub
void handle_message_set_actuator_control_target(mavlink_message_t *msg)
void handle_message_battery_status(mavlink_message_t *msg)
uORB::PublicationMulti< distance_sensor_s > _distance_sensor_pub
uORB::Publication< vehicle_odometry_s > _visual_odometry_pub
void handle_message_debug(mavlink_message_t *msg)
uORB::PublicationMulti< input_rc_s > _rc_pub
static constexpr unsigned int MOM_SWITCH_COUNT
void get_message_interval(int msgId)
uORB::PublicationMulti< manual_control_setpoint_s > _manual_pub
static char msg[NUM_MSG][CONFIG_USART1_TXBUFSIZE]
void Run()
Receive data from UART/UDP.
uORB::PublicationMulti< sensor_accel_s > _accel_pub
uORB::Publication< actuator_controls_s > _actuator_controls_pubs[4]
hrt_abstime _last_utm_global_pos_com
uORB::Publication< vehicle_attitude_setpoint_s > _mc_virtual_att_sp_pub
void handle_message_hil_optical_flow(mavlink_message_t *msg)
#define ORB_ID(_name)
Generates a pointer to the uORB metadata structure for a given topic.
static void * start_helper(void *context)
uORB::PublicationMulti< ping_s > _ping_pub
void handle_message_adsb_vehicle(mavlink_message_t *msg)
void handle_message_distance_sensor(mavlink_message_t *msg)
Mavlink time synchroniser definition.
void send_storage_information(int storage_id)
int decode_switch_pos_n(uint16_t buttons, unsigned sw)
Decode a switch position from a bitfield and state.
uORB::Publication< position_setpoint_triplet_s > _pos_sp_triplet_pub
uORB::PublicationMulti< sensor_mag_s > _mag_pub
bool _hil_local_proj_inited
void handle_message_hil_gps(mavlink_message_t *msg)
void handle_message_command_int(mavlink_message_t *msg)
uORB::PublicationMulti< sensor_gyro_s > _gyro_pub
MavlinkReceiver(Mavlink *parent)
void handle_message_logging_ack(mavlink_message_t *msg)
uORB::Subscription _parameter_update_sub
uORB::PublicationQueued< vehicle_command_ack_s > _cmd_ack_pub
void handle_message_radio_status(mavlink_message_t *msg)
uORB::Publication< vehicle_local_position_s > _local_pos_pub
uORB::Publication< debug_vect_s > _debug_vect_pub
uORB::Publication< vehicle_attitude_s > _attitude_pub
void handle_message_set_position_target_global_int(mavlink_message_t *msg)
void handle_message_command_both(mavlink_message_t *msg, const T &cmd_mavlink, const vehicle_command_s &vehicle_command)
Common method to handle both mavlink command types.
uORB::PublicationQueued< transponder_report_s > _transponder_report_pub
uORB::Publication< landing_target_pose_s > _landing_target_pose_pub
void handle_message_hil_sensor(mavlink_message_t *msg)
uORB::Publication< log_message_s > _log_message_pub
__BEGIN_DECLS typedef uint64_t hrt_abstime
Absolute time, in microsecond units.
void handle_message_debug_vect(mavlink_message_t *msg)
uORB::Publication< vehicle_trajectory_waypoint_s > _trajectory_waypoint_pub
uORB::Publication< offboard_control_mode_s > _offboard_control_mode_pub
uORB::Publication< optical_flow_s > _flow_pub
uORB::Subscription _vehicle_attitude_sub
void handle_message_optical_flow_rad(mavlink_message_t *msg)
void handle_message_hil_state_quaternion(mavlink_message_t *msg)
void handle_message_play_tune(mavlink_message_t *msg)
int set_message_interval(int msgId, float interval, int data_rate=-1)
Set the interval at which the given message stream is published.
uORB::PublicationMulti< distance_sensor_s > _flow_distance_sensor_pub
MavlinkTimesync _mavlink_timesync
MavlinkParametersManager _parameters_manager
void handle_message_odometry(mavlink_message_t *msg)
void handle_message_debug_float_array(mavlink_message_t *msg)
uORB::Publication< collision_report_s > _collision_report_pub
uORB::Publication< vehicle_attitude_setpoint_s > _att_sp_pub
static void receive_start(pthread_t *thread, Mavlink *parent)
Start the receiver thread.
void handle_message_collision(mavlink_message_t *msg)
uORB::Publication< debug_array_s > _debug_array_pub
void handle_message_att_pos_mocap(mavlink_message_t *msg)
void handle_message_set_position_target_local_ned(mavlink_message_t *msg)
uORB::PublicationMulti< radio_status_s > _radio_status_pub
void handle_message_follow_target(mavlink_message_t *msg)
uORB::Publication< battery_status_s > _battery_pub
MavlinkLogHandler _mavlink_log_handler
uORB::Publication< obstacle_distance_s > _obstacle_distance_pub
void handle_message_heartbeat(mavlink_message_t *msg)
void handle_message_landing_target(mavlink_message_t *msg)
MavlinkReceiver operator=(const MavlinkReceiver &)=delete
void handle_message_utm_global_position(mavlink_message_t *msg)
void handle_message_ping(mavlink_message_t *msg)
uORB::Publication< onboard_computer_status_s > _onboard_computer_status_pub
uORB::Subscription _control_mode_sub
void handle_message_command_long(mavlink_message_t *msg)
uORB::Subscription _vehicle_local_position_sub
void handle_message_gps_rtcm_data(mavlink_message_t *msg)
void handle_message_serial_control(mavlink_message_t *msg)
void handle_message_obstacle_distance(mavlink_message_t *msg)
uint64_t _global_ref_timestamp
void handle_message_trajectory_representation_waypoints(mavlink_message_t *msg)