1 #ifndef UAV_OPTIMAL_COVERAGE_H 2 #define UAV_OPTIMAL_COVERAGE_H 4 #include <geometry_msgs/Pose.h> 5 #include <cpswarm_msgs/GetWaypoint.h> 71 #endif // UAV_OPTIMAL_COVERAGE_H geometry_msgs::Point waypoint
Current waypoint to navigate to.
ServiceClient wp_getter
Service client to get the current waypoint to navigate to.
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.