9 nh.
param(this_node::getName() +
"/queue_size", queue_size, 1);
34 ROS_ERROR(
"Failed to get waypoint, cannot perform coverage!");
39 if (
get_wp.response.valid ==
false) {
40 ROS_INFO(
"Path completely traversed, stop coverage!");
ServiceClient serviceClient(const std::string &service_name, bool persistent=false, const M_string &header_values=M_string())
geometry_msgs::Point waypoint
Current waypoint to navigate to.
uav_optimal_coverage(double altitude)
Constructor that initializes the private member variables.
bool move(geometry_msgs::Pose pose)
bool call(MReq &req, MRes &res)
geometry_msgs::Pose get_pose() const
double get_tolerance() const
bool waitForExistence(ros::Duration timeout=ros::Duration(-1))
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
ServiceClient wp_getter
Service client to get the current waypoint to navigate to.
~uav_optimal_coverage()
Destructor that deletes the private member objects.
behavior_state_t step()
Move the swarm member to a new position.
cpswarm_msgs::GetWaypoint get_wp
Service message to get the current waypoint.
behavior_state_t
An enumeration for the state of the behavior algorithm.
ROSCPP_DECL void spinOnce()
position pos
A helper object for position related tasks.