System status plugin. Required for most applications. More...

Public Member Functions | |
| const std::string | get_name () const |
| Plugin name (CamelCase) | |
| const message_map | get_rx_handlers () |
| Return map with message rx handlers. | |
| void | initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| Plugin initializer. | |
| SystemStatusPlugin () | |
Private Member Functions | |
| void | handle_heartbeat (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_statustext (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | handle_sys_status (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | heartbeat_cb (const ros::TimerEvent &event) |
| void | process_statustext_apm_quirk (uint8_t severity, std::string &text) |
| void | process_statustext_normal (uint8_t severity, std::string &text) |
| bool | set_mode_cb (mavros::SetMode::Request &req, mavros::SetMode::Response &res) |
| bool | set_rate_cb (mavros::StreamRate::Request &req, mavros::StreamRate::Response &res) |
| void | timeout_cb (const ros::TimerEvent &event) |
Private Attributes | |
| BatteryStatusDiag | batt_diag |
| ros::Publisher | batt_pub |
| HeartbeatStatus | hb_diag |
| ros::Timer | heartbeat_timer |
| HwStatus | hwst_diag |
| MemInfo | mem_diag |
| ros::ServiceServer | mode_srv |
| ros::ServiceServer | rate_srv |
| ros::Publisher | state_pub |
| SystemStatusDiag | sys_diag |
| ros::Timer | timeout_timer |
| UAS * | uas |
System status plugin. Required for most applications.
Definition at line 328 of file sys_status.cpp.