RC IO plugin. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
Return map with message rx handlers. | |
void | initialize (UAS &uas_) |
Plugin initializer. | |
RCIOPlugin () | |
Private Member Functions | |
void | connection_cb (bool connected) |
void | handle_rc_channels (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
void | handle_rc_channels_raw (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
void | handle_servo_output_raw (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
void | override_cb (const mavros_msgs::OverrideRCIn::ConstPtr req) |
void | rc_channels_override (const boost::array< uint16_t, 8 > &channels) |
Private Attributes | |
bool | has_rc_channels_msg |
std::recursive_mutex | mutex |
ros::Subscriber | override_sub |
std::vector< uint16_t > | raw_rc_in |
std::vector< uint16_t > | raw_rc_out |
ros::Publisher | rc_in_pub |
ros::NodeHandle | rc_nh |
ros::Publisher | rc_out_pub |
UAS * | uas |