uav_random_direction.h
Go to the documentation of this file.
1 #ifndef UAV_RANDOM_DIRECTION_H
2 #define UAV_RANDOM_DIRECTION_H
3 
5 #include <cpswarm_msgs/GetSector.h>
6 #include <cpswarm_msgs/GetPoints.h>
7 #include <position.h>
8 
9 using namespace std;
10 using namespace ros;
11 
15 typedef enum {
20 
25 {
26 public:
31  uav_random_direction (double altitude);
32 
37 
43 
47  void stop ();
48 
49 private:
54  bool select_goal ();
55 
60  bool new_direction ();
61 
66 
71 
76 
80  double direction;
81 
85  geometry_msgs::Pose goal;
86 
91 
95  double margin;
96 };
97 
98 #endif // UAV_RANDOM_DIRECTION_H
99 
behavior_state_t
An enumeration for the state of the behavior algorithm.
random_numbers::RandomNumberGenerator * rng
The random number generator used for selecting a random direction.
double margin
The distance in meter to keep to the environment boundary.
ServiceClient area_client
Service client to get the area polygon.
position pos
A helper object for position related tasks.
double direction
The direction in which the drone is travling. It is measured in radian, clockwise starting from north...
geometry_msgs::Pose goal
The current goal.
unsigned int step
A class that allows to cover a given area with the random direction algorithm. The random direction i...
ServiceClient clear_sector_client
Service client for determining the sector clear of obstacles.


uav_random_direction
Author(s): Micha Sende
autogenerated on Sat Feb 6 2021 03:11:41