Go to the documentation of this file.00001 #ifndef _SURFACE_PERCEPTION_SURFACE_H_
00002 #define _SURFACE_PERCEPTION_SURFACE_H_
00003
00004 #include "geometry_msgs/PoseStamped.h"
00005 #include "geometry_msgs/Vector3.h"
00006 #include "pcl/ModelCoefficients.h"
00007
00008 namespace surface_perception {
00010 struct Surface {
00011 public:
00016 geometry_msgs::PoseStamped pose_stamped;
00017
00019 geometry_msgs::Vector3 dimensions;
00020
00024 pcl::ModelCoefficients::Ptr coefficients;
00025 };
00026 }
00027
00028 #endif // _SURFACE_PERCEPTION_SURFACE_H_