13 if (target.header.stamp >
Time(0)) {
22 if (
pos.
move(target.pose.pose) ==
false)
27 ROS_WARN_ONCE(
"No pose received for target %d, holding position!", target.id);
bool move(geometry_msgs::Pose pose)
cpswarm_msgs::TargetPositionEvent target
The target being tracked by this UAV.
position pos
A helper object for position related tasks.
behavior_state_t step(cpswarm_msgs::TargetPositionEvent target)
Execute one cycle of the tracking algorithm.
#define ROS_WARN_ONCE(...)
cpswarm_msgs::TargetPositionEvent target
The target being tracked.
bool out_of_bounds(geometry_msgs::Pose pose)
uav_simple_tracking(cpswarm_msgs::TargetPositionEvent target, double altitude)
Constructor that initializes the private member variables.
behavior_state_t
An enumeration for the state of the behavior algorithm.