|
PX4 simulation stack
|
#include "ros/ros.h"#include <mavros_msgs/RCOut.h>#include <mavros_msgs/OverrideRCIn.h>#include <boost/array.hpp>
Go to the source code of this file.
Functions | |
| void | rc_out_Callback (const mavros_msgs::RCOut::ConstPtr &msg) |
| void | Setting (ros::NodeHandle &n) |
| int | main (int argc, char **argv) |
Variables | |
| ros::Publisher | rc_override_pub |
| ros::Subscriber | rc_out_sub |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 56 of file rc_converter.cpp.
| void rc_out_Callback | ( | const mavros_msgs::RCOut::ConstPtr & | msg | ) |
Definition at line 14 of file rc_converter.cpp.
| void Setting | ( | ros::NodeHandle & | n | ) |
Definition at line 49 of file rc_converter.cpp.
| ros::Subscriber rc_out_sub |
Definition at line 9 of file rc_converter.cpp.
| ros::Publisher rc_override_pub |
Definition at line 8 of file rc_converter.cpp.
1.8.11