grvc_ual  2.2
An abstraction layer for unmanned aerial vehicles
backend_light.h
1 //----------------------------------------------------------------------------------------------------------------------
2 // GRVC UAL
3 //----------------------------------------------------------------------------------------------------------------------
4 // The MIT License (MIT)
5 //
6 // Copyright (c) 2016 GRVC University of Seville
7 //
8 // Permission is hereby granted, free of charge, to any person obtaining a copy of this software and associated
9 // documentation files (the "Software"), to deal in the Software without restriction, including without limitation the
10 // rights to use, copy, modify, merge, publish, distribute, sublicense, and/or sell copies of the Software, and to
11 // permit persons to whom the Software is furnished to do so, subject to the following conditions:
12 //
13 // The above copyright notice and this permission notice shall be included in all copies or substantial portions of the
14 // Software.
15 //
16 // THE SOFTWARE IS PROVIDED "AS IS", WITHOUT WARRANTY OF ANY KIND, EXPRESS OR IMPLIED, INCLUDING BUT NOT LIMITED TO THE
17 // WARRANTIES OF MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NONINFRINGEMENT. IN NO EVENT SHALL THE AUTHORS
18 // OR COPYRIGHT HOLDERS BE LIABLE FOR ANY CLAIM, DAMAGES OR OTHER LIABILITY, WHETHER IN AN ACTION OF CONTRACT, TORT OR
19 // OTHERWISE, ARISING FROM, OUT OF OR IN CONNECTION WITH THE SOFTWARE OR THE USE OR OTHER DEALINGS IN THE SOFTWARE.
20 //----------------------------------------------------------------------------------------------------------------------
21 #ifndef UAV_ABSTRACTION_LAYER_BACKEND_LIGHT_H
22 #define UAV_ABSTRACTION_LAYER_BACKEND_LIGHT_H
23 
24 #include <thread>
25 #include <Eigen/Core>
26 
27 #include <uav_abstraction_layer/backend.h>
28 #include <ros/ros.h>
29 
30 #include <geometry_msgs/PoseStamped.h>
31 #include <geometry_msgs/TwistStamped.h>
32 #include <geometry_msgs/TransformStamped.h>
33 #include <tf2_ros/static_transform_broadcaster.h>
34 
35 namespace grvc { namespace ual {
36 
37 class BackendLight : public Backend {
38 
39 public:
40  BackendLight();
41 
43  bool isReady() const override;
45  virtual Pose pose() override;
47  virtual Velocity velocity() const override;
49  virtual Odometry odometry() const override;
51  virtual Transform transform() const override;
52 
55  void setPose(const geometry_msgs::PoseStamped& _pose) override;
56 
59  void goToWaypoint(const Waypoint& _wp) override;
60 
63  void goToWaypointGeo(const WaypointGeo& _wp) override;
64 
67  void takeOff(double _height) override;
69  void land() override;
72  void setVelocity(const Velocity& _vel) override;
75  void recoverFromManual() override {}
77  void setHome(bool set_z) override {}
78 
79 private:
80  void initHomeFrame();
81  bool referencePoseReached() const;
82  void move();
83  Velocity calcVel(Pose _target_pose);
84 
85  geometry_msgs::PoseStamped home_pose_;
86  geometry_msgs::PoseStamped ref_pose_;
87  geometry_msgs::PoseStamped cur_pose_;
88  geometry_msgs::PoseStamped cur_pose_noisy_;
89  geometry_msgs::PoseStamped gazebo_pose_;
90  geometry_msgs::TwistStamped ref_vel_;
91  geometry_msgs::TwistStamped cur_vel_;
92 
93  //Gazebo animated link
94  std::string link_name_;
95  ros::Publisher link_state_publisher_;
96 
97  //Noise
98  std::default_random_engine generator_;
99  std::normal_distribution<double>* distribution_;
100 
101  //Control
102  bool flying_ = false;
103  bool control_in_vel_ = false;
104  float max_h_vel_;
105  float max_v_vel_;
106  float max_yaw_vel_;
107  float max_pose_error_;
108  float max_orient_error_;
109 
110  int robot_id_;
111  std::string pose_frame_id_;
112  std::string uav_home_frame_id_;
113  std::string uav_frame_id_;
114  tf2_ros::StaticTransformBroadcaster * static_tf_broadcaster_;
115  std::map <std::string, geometry_msgs::TransformStamped> cached_transforms_;
116  ros::Time last_command_time_;
117 
118  std::thread offboard_thread_;
119 };
120 
121 }} // namespace grvc::ual
122 
123 #endif // UAV_ABSTRACTION_LAYER_BACKEND_LIGHT_H
void goToWaypointGeo(const WaypointGeo &_wp) override
void takeOff(double _height) override
virtual Pose pose() override
Latest pose estimation of the robot.
virtual Odometry odometry() const override
Latest odometry estimation of the robot.
void land() override
Land on the current position.
void recoverFromManual() override
Definition: backend_light.h:75
void goToWaypoint(const Waypoint &_wp) override
void setHome(bool set_z) override
Set home position.
Definition: backend_light.h:77
Definition: backend_light.h:37
Common interface for back-end implementations of ual.
Definition: backend.h:46
bool isReady() const override
Backend is initialized and ready to run tasks?
virtual Velocity velocity() const override
Latest velocity estimation of the robot.
void setVelocity(const Velocity &_vel) override
virtual Transform transform() const override
Latest transform estimation of the robot.
Definition: backend.h:36
void setPose(const geometry_msgs::PoseStamped &_pose) override