Public Member Functions | Private Attributes
FaceWrapper Class Reference

Wrapper class for a face's 3D position and its timestamp. More...

#include <FaceWrapper.h>

List of all members.

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

Detailed Description

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.


Constructor & Destructor Documentation

FaceWrapper::FaceWrapper ( const geometry_msgs::Point_< std::allocator< void > > &  position,
const ros::Time time 
)

constructor

Parameters:
positionthe new face's position
timethe new face's timestamp

Definition at line 5 of file FaceWrapper.cpp.

standard destructor

Definition at line 14 of file FaceWrapper.cpp.


Member Function Documentation

returns the position

Definition at line 17 of file FaceWrapper.cpp.

returns the timestamp

Definition at line 20 of file FaceWrapper.cpp.


Member Data Documentation

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.

timestamp of a face

Used for discarding deprecated face positions

Definition at line 29 of file FaceWrapper.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends Defines


face_finder
Author(s): Nikolaus Mayer, Christian Schilling
autogenerated on Wed Dec 26 2012 16:22:45