5 #include <geometry_msgs/Pose.h> 71 geometry_msgs::Pose get_pose ();
89 void operator= (
const target& t);
int id
The ID of this target. Negative IDs are invalid.
Time stamp
Time stamp of latest update of the target.
Duration timeout
The time in seconds after which a target transitions into the state TARGET_LOST when no target update...
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
target_state_t state
State of the target.
geometry_msgs::Pose pose
Position of the target.
A target that is monitored by the CPSs.
Rate * rate
The loop rate object for running the behavior control loops at a specific frequency.
target_state_t
An enumeration for the state of a target.
NodeHandle nh
A node handle for the main ROS node.
geometry_msgs::Pose pose
Current position of the CPS.