teleop_twist.h
Go to the documentation of this file.
1 
25 #ifndef ARDRONE_AUTONOMY_TELEOP_TWIST_H
26 #define ARDRONE_AUTONOMY_TELEOP_TWIST_H
27 
29 #include <geometry_msgs/Twist.h>
30 #include <std_msgs/Empty.h>
31 #include <std_srvs/Empty.h>
32 #include <ardrone_autonomy/CamSelect.h>
33 #include <ardrone_autonomy/LedAnim.h>
34 #include <ardrone_autonomy/FlightAnim.h>
35 #include <ardrone_autonomy/RecordEnable.h>
36 
37 #define _EPS 1.0e-6
38 
39 extern input_device_t teleop;
40 
41 void CmdVelCallback(const geometry_msgs::TwistConstPtr &msg);
42 void LandCallback(const std_msgs::Empty &msg);
43 void ResetCallback(const std_msgs::Empty &msg);
44 void TakeoffCallback(const std_msgs::Empty &msg);
45 
46 // void toggleCamCallback(const std_msgs::Empty &msg);
48  ardrone_autonomy::CamSelect::Request& request,
49  ardrone_autonomy::CamSelect::Response& response);
50 
52  std_srvs::Empty::Request& request,
53  std_srvs::Empty::Response& response);
54 
56  ardrone_autonomy::LedAnim::Request& request,
57  ardrone_autonomy::LedAnim::Response& response);
58 
59 bool FlatTrimCallback(
60  std_srvs::Empty::Request& request,
61  std_srvs::Empty::Response& response);
62 
64  ardrone_autonomy::FlightAnim::Request& request,
65  ardrone_autonomy::FlightAnim::Response& response);
66 
68  ardrone_autonomy::RecordEnable::Request &request,
69  ardrone_autonomy::RecordEnable::Response& response);
70 
71 // All global drone configs that should be sent on init
72 
73 #define DEFAULT_CAM_STATE 0
74 #define DEFAULT_NAVDATA_DEMO 0
75 
76 extern int cam_state;
77 extern int set_navdata_demo_value;
78 extern int32_t detect_enemy_color;
79 extern int32_t detect_groundstripes_color;
80 extern int32_t detect_indoor_hull; // 1: Indoor Hull
81 extern int32_t detect_dtype;
82 extern int32_t detect_hori_type;
83 extern int32_t detect_vert_type;
84 extern int32_t detect_disable_placeholder;
85 extern int32_t detect_enable_placeholder;
86 
87 #endif // ARDRONE_AUTONOMY_TELEOP_TWIST_H
bool SetCamChannelCallback(ardrone_autonomy::CamSelect::Request &request, ardrone_autonomy::CamSelect::Response &response)
int cam_state
void CmdVelCallback(const geometry_msgs::TwistConstPtr &msg)
bool SetLedAnimationCallback(ardrone_autonomy::LedAnim::Request &request, ardrone_autonomy::LedAnim::Response &response)
int32_t detect_disable_placeholder
bool ToggleCamCallback(std_srvs::Empty::Request &request, std_srvs::Empty::Response &response)
void LandCallback(const std_msgs::Empty &msg)
bool SetRecordCallback(ardrone_autonomy::RecordEnable::Request &request, ardrone_autonomy::RecordEnable::Response &response)
bool FlatTrimCallback(std_srvs::Empty::Request &request, std_srvs::Empty::Response &response)
int32_t detect_vert_type
void ResetCallback(const std_msgs::Empty &msg)
int32_t detect_dtype
bool SetFlightAnimationCallback(ardrone_autonomy::FlightAnim::Request &request, ardrone_autonomy::FlightAnim::Response &response)
int32_t detect_hori_type
int set_navdata_demo_value
void TakeoffCallback(const std_msgs::Empty &msg)
int32_t detect_enemy_color
int32_t detect_groundstripes_color
input_device_t teleop
int32_t detect_indoor_hull
int32_t detect_enable_placeholder


ardrone_autonomy
Author(s): Mani Monajjemi, Mani Monajjemi
autogenerated on Mon Jun 10 2019 12:39:49