Functions
planeExtractor.cpp File Reference
#include <plane_extractor.h>
Include dependency graph for planeExtractor.cpp:

Go to the source code of this file.

Functions

geometry_msgs::Point32 calcCentroid (const pcl::PointCloud< Point > &cloud)
void drawObjectPrisms (const book_stacking_msgs::ObjectInfos &objects, const ros::Publisher &object_pub, const book_stacking_msgs::PlaneInfo &plane, float r, float g, float b)
void drawPlaneMarkers (const std::vector< book_stacking_msgs::PlaneInfo > &planes, const ros::Publisher &plane_pub, float r, float g, float b)
void drawPlaneMarkers (const book_stacking_msgs::PlaneInfos &planes, const ros::Publisher &plane_pub, float r, float g, float b)
book_stacking_msgs::ObjectInfos getObjectsOverPlane (const book_stacking_msgs::PlaneInfo &plane, const pcl::PointCloud< Point > &cloud, double prism_min_height, double prism_max_height)
book_stacking_msgs::PlaneInfos getPlanesByNormals (const pcl::PointCloud< Point > &cloud, unsigned int max_planes, bool cluster_planes, bool use_concave, bool use_omp, double dist_thresh, double max_sac_iterations, double sac_probability, unsigned int min_inliers, double search_radius, double cluster_tolerance)

Function Documentation

geometry_msgs::Point32 calcCentroid ( const pcl::PointCloud< Point > &  cloud)

Definition at line 3 of file planeExtractor.cpp.

void drawObjectPrisms ( const book_stacking_msgs::ObjectInfos &  objects,
const ros::Publisher object_pub,
const book_stacking_msgs::PlaneInfo &  plane,
float  r,
float  g,
float  b 
)

Definition at line 102 of file planeExtractor.cpp.

void drawPlaneMarkers ( const std::vector< book_stacking_msgs::PlaneInfo > &  planes,
const ros::Publisher plane_pub,
float  r,
float  g,
float  b 
)

Definition at line 178 of file planeExtractor.cpp.

void drawPlaneMarkers ( const book_stacking_msgs::PlaneInfos &  planes,
const ros::Publisher plane_pub,
float  r,
float  g,
float  b 
)

Definition at line 184 of file planeExtractor.cpp.

book_stacking_msgs::ObjectInfos getObjectsOverPlane ( const book_stacking_msgs::PlaneInfo &  plane,
const pcl::PointCloud< Point > &  cloud,
double  prism_min_height,
double  prism_max_height 
)

Definition at line 24 of file planeExtractor.cpp.

book_stacking_msgs::PlaneInfos getPlanesByNormals ( const pcl::PointCloud< Point > &  cloud,
unsigned int  max_planes,
bool  cluster_planes,
bool  use_concave,
bool  use_omp,
double  dist_thresh,
double  max_sac_iterations,
double  sac_probability,
unsigned int  min_inliers,
double  search_radius,
double  cluster_tolerance 
)

Definition at line 234 of file planeExtractor.cpp.



book_stacking
Author(s): Akansel
autogenerated on Wed Nov 27 2013 12:25:48