#include <ros/ros.h>
#include <nodelet/nodelet.h>
#include <pluginlib/class_list_macros.h>
#include <string>
#include <diagnostic_updater/diagnostic_updater.h>
#include "flyer_controller/controller_status.h"
#include "flyer_controller/controller_cmd.h"
#include "std_msgs/Bool.h"
#include "starmac_msgs/OperatorCommands.h"
#include <sensor_msgs/Joy.h>
Go to the source code of this file.
Classes | |
class | flyer_controller::TeleopFlyer |
Namespaces | |
namespace | flyer_controller |
namespace | flyer_controller::TeleopTypes |
Typedefs | |
typedef TeleopStates | flyer_controller::TeleopTypes::TeleopState |
Enumerations | |
enum | flyer_controller::TeleopTypes::TeleopStates { flyer_controller::TeleopTypes::ERROR = 0, flyer_controller::TeleopTypes::OFF = 1, flyer_controller::TeleopTypes::INITIALIZE = 2, flyer_controller::TeleopTypes::STANDBY = 3, flyer_controller::TeleopTypes::OPERATIONAL = 4 } |
Variables | |
const int | flyer_controller::BTN_CANCEL = 6 |
const int | flyer_controller::BTN_ESTOP = 11 |
const int | flyer_controller::BTN_OPERATIONAL_MODE_ATTITUDE = 2 |
const int | flyer_controller::BTN_OPERATIONAL_MODE_HOVER = 3 |
const int | flyer_controller::BTN_STANDBY_GO_OPERATIONAL = 2 |
const int | flyer_controller::BTN_TRIGGER = 0 |