Classes | Namespaces | Variables
asctec_hl_interface_adapter.cpp File Reference
#include <algorithm>
#include <cmath>
#include <ros/ros.h>
#include <nodelet/nodelet.h>
#include <pluginlib/class_list_macros.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <diagnostic_updater/update_functions.h>
#include <dynamic_reconfigure/server.h>
#include <starmac_robots_asctec/AscTecAdapterConfig.h>
#include <string>
#include <angles/angles.h>
#include "asctec_hl_comm/mav_status.h"
#include "asctec_hl_comm/mav_ctrl.h"
#include "std_msgs/Bool.h"
#include "flyer_controller/control_mode_output.h"
#include "starmac_robots_asctec/pid.h"
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/Imu.h>
#include <tf/tf.h>
#include <tf/transform_datatypes.h>
#include "starmac_robots_asctec/misc.h"
Include dependency graph for asctec_hl_interface_adapter.cpp:

Go to the source code of this file.

Classes

class  starmac_robots_asctec::AscTecHLInterfaceAdapterNodelet

Namespaces

namespace  starmac_robots_asctec

Variables

static double MAX_PITCH_CMD = M_PI_2
static double MAX_ROLL_CMD = M_PI_2
static double MAX_THRUST_CMD = 32
static double MAX_YAW_RATE_CMD = 2.0 * M_PI
static double PITCH_SCALE = M_PI / 180.0
static double ROLL_SCALE = M_PI / 180.0
static double THRUST_SCALE = 1.0 / 32.0
static double YAW_SCALE = M_PI / 180.0

Variable Documentation

double MAX_PITCH_CMD = M_PI_2 [static]

Definition at line 68 of file asctec_hl_interface_adapter.cpp.

double MAX_ROLL_CMD = M_PI_2 [static]

Definition at line 67 of file asctec_hl_interface_adapter.cpp.

double MAX_THRUST_CMD = 32 [static]

Definition at line 70 of file asctec_hl_interface_adapter.cpp.

double MAX_YAW_RATE_CMD = 2.0 * M_PI [static]

Definition at line 69 of file asctec_hl_interface_adapter.cpp.

double PITCH_SCALE = M_PI / 180.0 [static]

Definition at line 66 of file asctec_hl_interface_adapter.cpp.

double ROLL_SCALE = M_PI / 180.0 [static]

Definition at line 65 of file asctec_hl_interface_adapter.cpp.

double THRUST_SCALE = 1.0 / 32.0 [static]

Definition at line 77 of file asctec_hl_interface_adapter.cpp.

double YAW_SCALE = M_PI / 180.0 [static]

Definition at line 75 of file asctec_hl_interface_adapter.cpp.



starmac_robots_asctec
Author(s): Patrick Bouffard
autogenerated on Sun Jan 5 2014 11:38:03