1 #ifndef UAV_RANDOM_DIRECTION_H     2 #define UAV_RANDOM_DIRECTION_H     5 #include <cpswarm_msgs/GetSector.h>     6 #include <cpswarm_msgs/GetPoints.h>    60     bool new_direction ();
    98 #endif // UAV_RANDOM_DIRECTION_H 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. 
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.