#include <joy.h>
Public Member Functions | |
| Joy () | |
Private Types | |
| typedef sensor_msgs::Joy::_buttons_type | ButtonType |
Private Member Functions | |
| void | JoyCallback (const sensor_msgs::JoyConstPtr &msg) |
| void | Publish () |
| void | StopMav () |
Private Attributes | |
| Axes | axes_ |
| Buttons | buttons_ |
| mav_msgs::RollPitchYawrateThrust | control_msg_ |
| ros::Publisher | ctrl_pub_ |
| sensor_msgs::Joy | current_joy_ |
| double | current_yaw_vel_ |
| bool | is_fixed_wing_ |
| ros::Subscriber | joy_sub_ |
| Max | max_ |
| std::string | namespace_ |
| ros::NodeHandle | nh_ |
| geometry_msgs::PoseStamped | pose_ |
| double | v_yaw_step_ |
typedef sensor_msgs::Joy::_buttons_type Joy::ButtonType [private] |
| void Joy::JoyCallback | ( | const sensor_msgs::JoyConstPtr & | msg | ) | [private] |
| void Joy::Publish | ( | ) | [private] |
| void Joy::StopMav | ( | ) | [private] |
Axes Joy::axes_ [private] |
Buttons Joy::buttons_ [private] |
mav_msgs::RollPitchYawrateThrust Joy::control_msg_ [private] |
ros::Publisher Joy::ctrl_pub_ [private] |
sensor_msgs::Joy Joy::current_joy_ [private] |
double Joy::current_yaw_vel_ [private] |
bool Joy::is_fixed_wing_ [private] |
ros::Subscriber Joy::joy_sub_ [private] |
std::string Joy::namespace_ [private] |
ros::NodeHandle Joy::nh_ [private] |
geometry_msgs::PoseStamped Joy::pose_ [private] |
double Joy::v_yaw_step_ [private] |