uav_optimal_coverage.h
Go to the documentation of this file.
1 #ifndef UAV_OPTIMAL_COVERAGE_H
2 #define UAV_OPTIMAL_COVERAGE_H
3 
4 #include <geometry_msgs/Pose.h>
5 #include <cpswarm_msgs/GetWaypoint.h>
6 #include <position.h>
7 
8 using namespace std;
9 using namespace ros;
10 
14 typedef enum {
19 
24 {
25 public:
30  uav_optimal_coverage (double altitude);
31 
36 
42 
46  void stop ();
47 
48 private:
53 
57  geometry_msgs::Point waypoint;
58 
62  cpswarm_msgs::GetWaypoint get_wp;
63 
68 
69 };
70 
71 #endif // UAV_OPTIMAL_COVERAGE_H
72 
geometry_msgs::Point waypoint
Current waypoint to navigate to.
ServiceClient wp_getter
Service client to get the current waypoint to navigate to.
unsigned int step
cpswarm_msgs::GetWaypoint get_wp
Service message to get the current waypoint.
behavior_state_t
An enumeration for the state of the behavior algorithm.
A class that allows to cover a given area optimally with a swarm of cyber physical systems (CPSs)...
position pos
A helper object for position related tasks.


uav_optimal_coverage
Author(s): Micha Sende
autogenerated on Sat Feb 6 2021 03:11:39