#include "ardrone_sdk.h"#include <geometry_msgs/Twist.h>#include <std_msgs/Empty.h>#include <std_srvs/Empty.h>#include <ardrone_autonomy/CamSelect.h>#include <ardrone_autonomy/LedAnim.h>#include <ardrone_autonomy/FlightAnim.h>#include <ardrone_autonomy/RecordEnable.h>

Go to the source code of this file.
| Defines | |
| #define | _EPS 1.0e-6 | 
| #define | DEFAULT_CAM_STATE 0 | 
| #define | DEFAULT_NAVDATA_DEMO 0 | 
| Functions | |
| 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) | 
| 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) | 
| Variables | |
| int | cam_state | 
| int32_t | detect_disable_placeholder | 
| int32_t | detect_dtype | 
| int32_t | detect_enable_placeholder | 
| int32_t | detect_enemy_color | 
| int32_t | detect_groundstripes_color | 
| int32_t | detect_hori_type | 
| int32_t | detect_indoor_hull | 
| int32_t | detect_vert_type | 
| int | set_navdata_demo_value | 
| input_device_t | teleop | 
| #define _EPS 1.0e-6 | 
Definition at line 13 of file teleop_twist.h.
| #define DEFAULT_CAM_STATE 0 | 
Definition at line 32 of file teleop_twist.h.
| #define DEFAULT_NAVDATA_DEMO 0 | 
Definition at line 33 of file teleop_twist.h.
| 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.
| 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.
| int cam_state | 
Definition at line 17 of file teleop_twist.cpp.
| int32_t detect_disable_placeholder | 
Definition at line 24 of file teleop_twist.cpp.
| int32_t detect_dtype | 
Definition at line 20 of file teleop_twist.cpp.
| int32_t detect_enable_placeholder | 
Definition at line 25 of file teleop_twist.cpp.
| int32_t detect_enemy_color | 
Definition at line 19 of file teleop_twist.cpp.
| int32_t detect_groundstripes_color | 
| int32_t detect_hori_type | 
Definition at line 21 of file teleop_twist.cpp.
| int32_t detect_indoor_hull | 
Definition at line 23 of file teleop_twist.cpp.
| int32_t detect_vert_type | 
Definition at line 22 of file teleop_twist.cpp.
Definition at line 18 of file teleop_twist.cpp.
| input_device_t teleop | 
Definition at line 144 of file ardrone_sdk.cpp.