Wrapper class for a face's 3D position and its timestamp. More...
#include <FaceWrapper.h>
Public Member Functions | |
FaceWrapper (const geometry_msgs::Point_< std::allocator< void > > &position, const ros::Time &time) | |
constructor | |
geometry_msgs::Point | GetPosition () |
returns the position | |
ros::Time | GetTime () |
returns the timestamp | |
~FaceWrapper () | |
standard destructor | |
Private Attributes | |
geometry_msgs::Point | position |
3D position of a face | |
ros::Time | time |
timestamp of a face |
Wrapper class for a face's 3D position and its timestamp.
The FaceWrapper is used in the FaceFind::facesQueue which is a deque of this class.
Definition at line 15 of file FaceWrapper.h.
FaceWrapper::FaceWrapper | ( | const geometry_msgs::Point_< std::allocator< void > > & | position, |
const ros::Time & | time | ||
) |
constructor
position | the new face's position |
time | the new face's timestamp |
Definition at line 5 of file FaceWrapper.cpp.
standard destructor
Definition at line 14 of file FaceWrapper.cpp.
returns the position
Definition at line 17 of file FaceWrapper.cpp.
returns the timestamp
Definition at line 20 of file FaceWrapper.cpp.
geometry_msgs::Point FaceWrapper::position [private] |
3D position of a face
The coordinate frame is the same as in the face_detector
node (usually wide_stereo_optical_frame
)
Definition at line 23 of file FaceWrapper.h.
ros::Time FaceWrapper::time [private] |
timestamp of a face
Used for discarding deprecated face positions
Definition at line 29 of file FaceWrapper.h.