#include "geometry_msgs/Pose.h"
#include "geometry_msgs/Vector3.h"
#include "pcl/ModelCoefficients.h"
#include "pcl/PointIndices.h"
#include "pcl/point_cloud.h"
#include "pcl/point_types.h"
#include "surface_perception/surface.h"
Go to the source code of this file.
Namespaces | |
namespace | surface_perception |
Functions | |
bool | surface_perception::FitBox (const pcl::PointCloud< pcl::PointXYZRGB >::Ptr &input, const pcl::PointIndicesPtr &indices, const pcl::ModelCoefficients::Ptr &model, geometry_msgs::Pose *pose, geometry_msgs::Vector3 *dimensions) |
Fits an oriented bounding box around a given point cloud representing an object or a surface. | |
bool | surface_perception::FitBoxOnSurface (const pcl::PointCloud< pcl::PointXYZRGB >::Ptr &input, const pcl::PointIndicesPtr &indices, const Surface &surface, geometry_msgs::Pose *pose, geometry_msgs::Vector3 *dimensions) |
Fits an oriented bounding box around a given point cloud representing an object resting on a surface. | |
Eigen::Matrix3f | surface_perception::StandardizeBoxOrientation (const Eigen::Matrix3f &rotation_matrix, double x_dim, double y_dim, double *updated_x_dim, double *updated_y_dim) |
Returns a standardized orientation for a box. |