00001 00007 #ifndef FACE_WRAPPER_H 00008 #define FACE_WRAPPER_H 00009 00010 00011 #include <people_msgs/PositionMeasurement.h> 00012 #include <ros/ros.h> 00013 #include <geometry_msgs/Point32.h> 00014 00015 class FaceWrapper 00016 { 00017 private : 00018 00023 geometry_msgs::Point position; 00024 00029 ros::Time time; 00030 00031 public : 00032 00037 FaceWrapper(const geometry_msgs::Point_<std::allocator<void> >& position, const ros::Time& time); 00038 00040 ~FaceWrapper(); 00041 00043 geometry_msgs::Point GetPosition(); 00044 00046 ros::Time GetTime(); 00047 }; 00048 00049 #endif