Point Cloud Library (PCL)  1.3.1
Classes | Typedefs | Enumerations | Functions
pcl::visualization Namespace Reference

Classes

class  CloudViewer
 Simple point cloud visualization class. More...
class  CloudActor
class  Camera
 Camera class holds a set of camera parameters together with the window pos/size. More...
class  FPSCallback
class  FloatImageUtils
 Provide some gerneral functionalities regarding 2d float arrays, e.g., for visualization purposes More...
class  RenWinInteract
class  PCLHistogramVisualizer
 PCL histogram visualizer main class. More...
class  ImageViewer
class  PCLVisualizerInteractor
 The PCLVisualizer interactor. More...
class  PCLVisualizerInteractorStyle
 PCL Visualizer interactory style class. More...
class  PCLHistogramVisualizerInteractorStyle
 PCL histogram visualizer interactory style class. More...
class  KeyboardEvent
 /brief Class representing key hit/release events More...
class  MouseEvent
class  PCLVisualizer
 PCL Visualizer main class. More...
class  PointCloudGeometryHandler
 Base handler class for PointCloud geometry. More...
class  PointCloudGeometryHandlerXYZ
 XYZ handler class for PointCloud geometry. More...
class  PointCloudGeometryHandlerSurfaceNormal
 Surface normal handler class for PointCloud geometry. More...
class  PointCloudGeometryHandlerCustom
 Custom handler class for PointCloud geometry. More...
class  PointCloudGeometryHandler< sensor_msgs::PointCloud2 >
 Base handler class for PointCloud geometry. More...
class  PointCloudGeometryHandlerXYZ< sensor_msgs::PointCloud2 >
 XYZ handler class for PointCloud geometry. More...
class  PointCloudGeometryHandlerSurfaceNormal< sensor_msgs::PointCloud2 >
 Surface normal handler class for PointCloud geometry. More...
class  PointCloudGeometryHandlerCustom< sensor_msgs::PointCloud2 >
 Custom handler class for PointCloud geometry. More...
class  PointCloudColorHandler
 Base Handler class for PointCloud colors. More...
class  PointCloudColorHandlerRandom
 Handler for random PointCloud colors (i.e., R, G, B will be randomly chosen) More...
class  PointCloudColorHandlerCustom
 Handler for predefined user colors. More...
class  PointCloudColorHandlerRGBField
 RGB handler class for colors. More...
class  PointCloudColorHandlerGenericField
 Generic field handler class for colors. More...
class  PointCloudColorHandler< sensor_msgs::PointCloud2 >
 Base Handler class for PointCloud colors. More...
class  PointCloudColorHandlerRandom< sensor_msgs::PointCloud2 >
 Handler for random PointCloud colors (i.e., R, G, B will be randomly chosen) More...
class  PointCloudColorHandlerCustom< sensor_msgs::PointCloud2 >
 Handler for predefined user colors. More...
class  PointCloudColorHandlerRGBField< sensor_msgs::PointCloud2 >
 RGB handler class for colors. More...
class  PointCloudColorHandlerGenericField< sensor_msgs::PointCloud2 >
 Generic field handler class for colors. More...
class  PointPickingCallback
class  PointPickingEvent
 /brief Class representing 3D point picking events. More...
class  RangeImageVisualizer
 Range image visualizer class. More...
class  Window

Typedefs

typedef std::map< std::string,
CloudActor
CloudActorMap
typedef boost::shared_ptr
< CloudActorMap
CloudActorMapPtr
typedef std::map< std::string,
vtkSmartPointer< vtkProp > > 
ShapeActorMap
typedef boost::shared_ptr
< ShapeActorMap
ShapeActorMapPtr
typedef std::map< int,
vtkSmartPointer< vtkProp > > 
CoordinateActorMap
typedef std::map< std::string,
RenWinInteract
RenWinInteractMap
typedef Eigen::Array< unsigned
char, 3, 1 > 
Vector3ub

Enumerations

enum  RenderingProperties {
  PCL_VISUALIZER_POINT_SIZE, PCL_VISUALIZER_OPACITY, PCL_VISUALIZER_LINE_WIDTH, PCL_VISUALIZER_FONT_SIZE,
  PCL_VISUALIZER_COLOR, PCL_VISUALIZER_REPRESENTATION
}
enum  RenderingRepresentationProperties { PCL_VISUALIZER_REPRESENTATION_POINTS, PCL_VISUALIZER_REPRESENTATION_WIREFRAME, PCL_VISUALIZER_REPRESENTATION_SURFACE }

Functions

PCL_EXPORTS void getRandomColors (double &r, double &g, double &b, double min=0.2, double max=2.8)
 Get (good) random values for R/G/B.
PCL_EXPORTS void getCorrespondingPointCloud (vtkPolyData *src, const pcl::PointCloud< pcl::PointXYZ > &tgt, std::vector< int > &indices)
 Obtain a list of corresponding indices, for a set of vtk points, from a pcl::PointCloud.
PCL_EXPORTS bool savePointData (vtkPolyData *data, const std::string &out_file, const boost::shared_ptr< CloudActorMap > &actors)
 Saves the vtk-formatted Point Cloud data into a set of files, based on whether the data comes from previously loaded PCD files.
template<typename PointT >
vtkSmartPointer< vtkDataSet > createPolygon (const typename pcl::PointCloud< PointT >::ConstPtr &cloud)
 Create a 3d poly line from a set of points.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createLine (const Eigen::Vector4f &pt1, const Eigen::Vector4f &pt2)
 Create a line shape from two points.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createSphere (const Eigen::Vector4f &center, double radius, int res=10)
 Create a sphere shape from a point and a radius.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createCylinder (const pcl::ModelCoefficients &coefficients, int numsides=30)
 Create a cylinder shape from a set of model coefficients.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createSphere (const pcl::ModelCoefficients &coefficients, int res=10)
 Create a sphere shape from a set of model coefficients.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createLine (const pcl::ModelCoefficients &coefficients)
 Create a line shape from a set of model coefficients.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createPlane (const pcl::ModelCoefficients &coefficients)
 Create a planar shape from a set of model coefficients.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
create2DCircle (const pcl::ModelCoefficients &coefficients, double z=0.0)
 Create a 2d circle shape from a set of model coefficients.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createCone (const pcl::ModelCoefficients &coefficients)
 Create a cone shape from a set of model coefficients.
PCL_EXPORTS vtkSmartPointer
< vtkDataSet > 
createCube (const pcl::ModelCoefficients &coefficients)
 Creaet a cube shape from a set of model coefficients.
PCL_EXPORTS void allocVtkUnstructuredGrid (vtkSmartPointer< vtkUnstructuredGrid > &polydata)
 Allocate a new unstructured grid smartpointer.

Typedef Documentation

typedef std::map<std::string, CloudActor> pcl::visualization::CloudActorMap

Definition at line 89 of file actor_map.h.

Definition at line 90 of file actor_map.h.

typedef std::map<int, vtkSmartPointer<vtkProp> > pcl::visualization::CoordinateActorMap

Definition at line 95 of file actor_map.h.

typedef std::map<std::string, RenWinInteract> pcl::visualization::RenWinInteractMap

Definition at line 84 of file ren_win_interact_map.h.

typedef std::map<std::string, vtkSmartPointer<vtkProp> > pcl::visualization::ShapeActorMap

Definition at line 92 of file actor_map.h.

Definition at line 93 of file actor_map.h.

typedef Eigen::Array<unsigned char, 3, 1> pcl::visualization::Vector3ub

Definition at line 57 of file image_viewer.h.


Enumeration Type Documentation

Enumerator:
PCL_VISUALIZER_POINT_SIZE 
PCL_VISUALIZER_OPACITY 
PCL_VISUALIZER_LINE_WIDTH 
PCL_VISUALIZER_FONT_SIZE 
PCL_VISUALIZER_COLOR 
PCL_VISUALIZER_REPRESENTATION 

Definition at line 58 of file common.h.

Enumerator:
PCL_VISUALIZER_REPRESENTATION_POINTS 
PCL_VISUALIZER_REPRESENTATION_WIREFRAME 
PCL_VISUALIZER_REPRESENTATION_SURFACE 

Definition at line 68 of file common.h.


Function Documentation

PCL_EXPORTS void pcl::visualization::allocVtkUnstructuredGrid ( vtkSmartPointer< vtkUnstructuredGrid > &  polydata)

Allocate a new unstructured grid smartpointer.

Internal

PCL_EXPORTS void pcl::visualization::getRandomColors ( double &  r,
double &  g,
double &  b,
double  min = 0.2,
double  max = 2.8 
)

Get (good) random values for R/G/B.

Parameters:
rthe resultant R color value
gthe resultant G color value
bthe resultant B color value
minminimum value for the colors
maxmaximum value for the colors
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines