3DR Radio plugin. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
Return map with message rx handlers. | |
void | initialize (UAS &uas_) |
Plugin initializer. | |
TDRRadioPlugin () | |
Private Member Functions | |
void | connection_cb (bool connected) |
void | diag_run (diagnostic_updater::DiagnosticStatusWrapper &stat) |
template<typename msgT > | |
void | handle_message (msgT &rst, uint8_t sysid, uint8_t compid) |
void | handle_radio_status (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
Private Attributes | |
bool | diag_added |
std::recursive_mutex | diag_mutex |
bool | has_radio_status |
mavros_msgs::RadioStatus::Ptr | last_status |
int | low_rssi |
ros::NodeHandle | nh |
ros::Publisher | status_pub |
UAS * | uas |
3DR Radio plugin.
Definition at line 26 of file 3dr_radio.cpp.