Classes | |
struct | Axis |
struct | Button |
Public Member Functions | |
sensor_msgs::Joy::_axes_type::value_type | getAxis (const sensor_msgs::JoyConstPtr &joy, Axis axis) |
sensor_msgs::Joy::_buttons_type::value_type | getButton (const sensor_msgs::JoyConstPtr &joy, int button) |
void | joyAttitudeCallback (const sensor_msgs::JoyConstPtr &joy) |
void | joyTwistCallback (const sensor_msgs::JoyConstPtr &joy) |
void | stop () |
Teleop () | |
~Teleop () | |
Private Attributes | |
hector_uav_msgs::AttitudeCommand | attitude_ |
ros::Publisher | attitude_publisher_ |
struct { | |
Axis x | |
Axis y | |
Axis yaw | |
Axis z | |
} | axes_ |
struct { | |
Button slow | |
} | buttons_ |
ros::Subscriber | joy_subscriber_ |
ros::NodeHandle | node_handle_ |
double | slow_factor_ |
hector_uav_msgs::ThrustCommand | thrust_ |
ros::Publisher | thrust_publisher_ |
geometry_msgs::Twist | velocity_ |
ros::Publisher | velocity_publisher_ |
hector_uav_msgs::YawrateCommand | yawrate_ |
ros::Publisher | yawrate_publisher_ |
Definition at line 40 of file quadrotor_teleop.cpp.
hector_quadrotor::Teleop::Teleop | ( | ) | [inline] |
Definition at line 79 of file quadrotor_teleop.cpp.
hector_quadrotor::Teleop::~Teleop | ( | ) | [inline] |
Definition at line 117 of file quadrotor_teleop.cpp.
sensor_msgs::Joy::_axes_type::value_type hector_quadrotor::Teleop::getAxis | ( | const sensor_msgs::JoyConstPtr & | joy, |
Axis | axis | ||
) | [inline] |
Definition at line 155 of file quadrotor_teleop.cpp.
sensor_msgs::Joy::_buttons_type::value_type hector_quadrotor::Teleop::getButton | ( | const sensor_msgs::JoyConstPtr & | joy, |
int | button | ||
) | [inline] |
Definition at line 170 of file quadrotor_teleop.cpp.
void hector_quadrotor::Teleop::joyAttitudeCallback | ( | const sensor_msgs::JoyConstPtr & | joy | ) | [inline] |
Definition at line 138 of file quadrotor_teleop.cpp.
void hector_quadrotor::Teleop::joyTwistCallback | ( | const sensor_msgs::JoyConstPtr & | joy | ) | [inline] |
Definition at line 122 of file quadrotor_teleop.cpp.
void hector_quadrotor::Teleop::stop | ( | ) | [inline] |
Definition at line 179 of file quadrotor_teleop.cpp.
hector_uav_msgs::AttitudeCommand hector_quadrotor::Teleop::attitude_ [private] |
Definition at line 48 of file quadrotor_teleop.cpp.
Definition at line 46 of file quadrotor_teleop.cpp.
struct { ... } hector_quadrotor::Teleop::axes_ [private] |
struct { ... } hector_quadrotor::Teleop::buttons_ [private] |
Definition at line 44 of file quadrotor_teleop.cpp.
Definition at line 43 of file quadrotor_teleop.cpp.
Definition at line 73 of file quadrotor_teleop.cpp.
double hector_quadrotor::Teleop::slow_factor_ [private] |
Definition at line 76 of file quadrotor_teleop.cpp.
hector_uav_msgs::ThrustCommand hector_quadrotor::Teleop::thrust_ [private] |
Definition at line 49 of file quadrotor_teleop.cpp.
Definition at line 46 of file quadrotor_teleop.cpp.
geometry_msgs::Twist hector_quadrotor::Teleop::velocity_ [private] |
Definition at line 47 of file quadrotor_teleop.cpp.
Definition at line 46 of file quadrotor_teleop.cpp.
Definition at line 65 of file quadrotor_teleop.cpp.
Definition at line 66 of file quadrotor_teleop.cpp.
Definition at line 68 of file quadrotor_teleop.cpp.
hector_uav_msgs::YawrateCommand hector_quadrotor::Teleop::yawrate_ [private] |
Definition at line 50 of file quadrotor_teleop.cpp.
Definition at line 46 of file quadrotor_teleop.cpp.
Definition at line 67 of file quadrotor_teleop.cpp.