Go to the source code of this file.
Functions | |
C_RESULT | close_teleop (void) |
void | cmdVelCallback (const geometry_msgs::TwistConstPtr &msg) |
bool | flatTrimCallback (std_srvs::Empty::Request &request, std_srvs::Empty::Response &response) |
void | landCallback (const std_msgs::Empty &msg) |
float | max (float a, float b) |
float | min (float a, float b) |
C_RESULT | open_teleop (void) |
void | resetCallback (const std_msgs::Empty &msg) |
bool | setCamChannelCallback (ardrone_autonomy::CamSelect::Request &request, ardrone_autonomy::CamSelect::Response &response) |
bool | setFlightAnimationCallback (ardrone_autonomy::FlightAnim::Request &request, ardrone_autonomy::FlightAnim::Response &response) |
bool | setLedAnimationCallback (ardrone_autonomy::LedAnim::Request &request, ardrone_autonomy::LedAnim::Response &response) |
bool | setRecordCallback (ardrone_autonomy::RecordEnable::Request &request, ardrone_autonomy::RecordEnable::Response &response) |
void | takeoffCallback (const std_msgs::Empty &msg) |
bool | toggleCamCallback (std_srvs::Empty::Request &request, std_srvs::Empty::Response &response) |
C_RESULT | update_teleop (void) |
Variables | |
int | cam_state = DEFAULT_CAM_STATE |
geometry_msgs::Twist | cmd_vel |
int32_t | detect_disable_placeholder = 0 |
int32_t | detect_dtype = CAD_TYPE_MULTIPLE_DETECTION_MODE |
int32_t | detect_enable_placeholder = 1 |
int32_t | detect_enemy_color = ARDRONE_DETECTION_COLOR_ORANGE_YELLOW |
int32_t | detect_hori_type = TAG_TYPE_MASK(TAG_TYPE_SHELL_TAG_V2) |
int32_t | detect_indoor_hull = 0 |
int32_t | detect_vert_type = TAG_TYPE_MASK(TAG_TYPE_BLACK_ROUNDEL) |
const LED_ANIMATION_IDS | ledAnimMap [14] |
bool | needs_land = false |
bool | needs_reset = false |
bool | needs_takeoff = false |
float | old_front_back = -10.0 |
float | old_left_right = -10.0 |
float | old_turn = -10.0 |
float | old_up_down = -10.0 |
int | set_navdata_demo_value = DEFAULT_NAVDATA_DEMO |
input_device_t | teleop |
C_RESULT close_teleop | ( | void | ) |
Definition at line 226 of file teleop_twist.cpp.
void cmdVelCallback | ( | const geometry_msgs::TwistConstPtr & | msg | ) |
Definition at line 111 of file teleop_twist.cpp.
bool flatTrimCallback | ( | std_srvs::Empty::Request & | request, |
std_srvs::Empty::Response & | response | ||
) |
Definition at line 103 of file teleop_twist.cpp.
void landCallback | ( | const std_msgs::Empty & | msg | ) |
Definition at line 126 of file teleop_twist.cpp.
float max | ( | float | a, |
float | b | ||
) | [inline] |
Definition at line 5 of file teleop_twist.cpp.
float min | ( | float | a, |
float | b | ||
) | [inline] |
Definition at line 6 of file teleop_twist.cpp.
C_RESULT open_teleop | ( | void | ) |
Definition at line 147 of file teleop_twist.cpp.
void resetCallback | ( | const std_msgs::Empty & | msg | ) |
Definition at line 133 of file teleop_twist.cpp.
bool setCamChannelCallback | ( | ardrone_autonomy::CamSelect::Request & | request, |
ardrone_autonomy::CamSelect::Response & | response | ||
) |
Definition at line 33 of file teleop_twist.cpp.
bool setFlightAnimationCallback | ( | ardrone_autonomy::FlightAnim::Request & | request, |
ardrone_autonomy::FlightAnim::Response & | response | ||
) |
Definition at line 90 of file teleop_twist.cpp.
bool setLedAnimationCallback | ( | ardrone_autonomy::LedAnim::Request & | request, |
ardrone_autonomy::LedAnim::Response & | response | ||
) |
Definition at line 80 of file teleop_twist.cpp.
bool setRecordCallback | ( | ardrone_autonomy::RecordEnable::Request & | request, |
ardrone_autonomy::RecordEnable::Response & | response | ||
) |
Definition at line 53 of file teleop_twist.cpp.
void takeoffCallback | ( | const std_msgs::Empty & | msg | ) |
Definition at line 140 of file teleop_twist.cpp.
bool toggleCamCallback | ( | std_srvs::Empty::Request & | request, |
std_srvs::Empty::Response & | response | ||
) |
Definition at line 43 of file teleop_twist.cpp.
C_RESULT update_teleop | ( | void | ) |
Definition at line 152 of file teleop_twist.cpp.
int cam_state = DEFAULT_CAM_STATE |
Definition at line 17 of file teleop_twist.cpp.
geometry_msgs::Twist cmd_vel |
Definition at line 11 of file teleop_twist.cpp.
int32_t detect_disable_placeholder = 0 |
Definition at line 24 of file teleop_twist.cpp.
int32_t detect_dtype = CAD_TYPE_MULTIPLE_DETECTION_MODE |
Definition at line 20 of file teleop_twist.cpp.
int32_t detect_enable_placeholder = 1 |
Definition at line 25 of file teleop_twist.cpp.
int32_t detect_enemy_color = ARDRONE_DETECTION_COLOR_ORANGE_YELLOW |
Definition at line 19 of file teleop_twist.cpp.
int32_t detect_hori_type = TAG_TYPE_MASK(TAG_TYPE_SHELL_TAG_V2) |
Definition at line 21 of file teleop_twist.cpp.
int32_t detect_indoor_hull = 0 |
Definition at line 23 of file teleop_twist.cpp.
int32_t detect_vert_type = TAG_TYPE_MASK(TAG_TYPE_BLACK_ROUNDEL) |
Definition at line 22 of file teleop_twist.cpp.
const LED_ANIMATION_IDS ledAnimMap[14] |
{ BLINK_GREEN_RED, BLINK_GREEN, BLINK_RED, BLINK_ORANGE, SNAKE_GREEN_RED, FIRE, STANDARD, RED, GREEN, RED_SNAKE,BLANK, LEFT_GREEN_RIGHT_RED, LEFT_RED_RIGHT_GREEN, BLINK_STANDARD}
Definition at line 27 of file teleop_twist.cpp.
bool needs_land = false |
Definition at line 9 of file teleop_twist.cpp.
bool needs_reset = false |
Definition at line 10 of file teleop_twist.cpp.
bool needs_takeoff = false |
Definition at line 8 of file teleop_twist.cpp.
float old_front_back = -10.0 |
Definition at line 13 of file teleop_twist.cpp.
float old_left_right = -10.0 |
Definition at line 12 of file teleop_twist.cpp.
float old_turn = -10.0 |
Definition at line 15 of file teleop_twist.cpp.
float old_up_down = -10.0 |
Definition at line 14 of file teleop_twist.cpp.
Definition at line 18 of file teleop_twist.cpp.
input_device_t teleop |
{ "Teleop", open_teleop, update_teleop, close_teleop }
Definition at line 231 of file teleop_twist.cpp.