object.h
Go to the documentation of this file.
00001 #ifndef _SURFACE_PERCEPTION_OBJECT_H_
00002 #define _SURFACE_PERCEPTION_OBJECT_H_
00003 
00004 #include "geometry_msgs/PoseStamped.h"
00005 #include "geometry_msgs/Vector3.h"
00006 #include "pcl/PointIndices.h"
00007 #include "pcl/point_cloud.h"
00008 #include "pcl/point_types.h"
00009 
00010 namespace surface_perception {
00012 struct Object {
00013  public:
00020   geometry_msgs::PoseStamped pose_stamped;
00021 
00025   geometry_msgs::Vector3 dimensions;
00026 
00028   pcl::PointCloud<pcl::PointXYZRGB>::Ptr cloud;
00029 
00031   pcl::PointIndices::Ptr indices;
00032 };
00033 }  // namespace surface_perception
00034 #endif  // _SURFACE_PERCEPTION_OBJECT_H_


surface_perception
Author(s): Yu-Tang Peng
autogenerated on Thu Jun 6 2019 17:36:21