Todo List
File common/include/pcl/common/file_io.h
move this to pcl::console
Member pcl::assignNormalWeights (const PointCloud< NormalT > &, int, const std::vector< int > &k_indices, const std::vector< float > &k_sqr_distances)
Currently, this function equalizes all weights to 1
Member pcl::createMapping (const std::vector< pcl::PCLPointField > &msg_fields, MsgFieldMap &field_map)
One could construct a pathological case where the struct has a field where the serialized data has padding
Member pcl::EuclideanClusterExtraction< PointT >::getSearchMethod () const
fix this for a generic search tree
Member pcl::extractEuclideanClusters (const PointCloud< PointT > &cloud, const std::vector< int > &indices, const boost::shared_ptr< search::Search< PointT > > &tree, float tolerance, std::vector< PointIndices > &clusters, unsigned int min_pts_per_cluster=1, unsigned int max_pts_per_cluster=(std::numeric_limits< int >::max)())
: fix the return value, make sure the exit is not needed anymore
Class pcl::geometry::MeshBase< DerivedT, MeshTraitsT, MeshTagT >
Add documentation
Class pcl::geometry::MeshIO< MeshT >
  • Only writes the topology (not the mesh data).
  • Supports only ascii.
  • Does not consider the mesh traits (e.g. manifold or not)
Class pcl::ihs::InHandScanner
Add Documentation
Class pcl::ihs::OfflineIntegration
Add Documentation
Member pcl::LINEMOD::detectTemplates (const std::vector< QuantizableModality * > &modalities, std::vector< LINEMODDetection > &detections) const
Ask Stefan why this line was used instead of the one above
Member pcl::LINEMOD::detectTemplatesSemiScaleInvariant (const std::vector< QuantizableModality * > &modalities, std::vector< LINEMODDetection > &detections, float min_scale=0.6944444f, float max_scale=1.44f, float scale_multiplier=1.2f) const
Ask Stefan why this line was used instead of the one above
Member pcl::PointXYZRGBAtoXYZHSV (PointXYZRGBA &in, PointXYZHSV &out)
include the A parameter but how?
Member pcl::PPFRegistration< PointSource, PointTarget >::clusterPoses (PoseWithVotesList &poses, PoseWithVotesList &result)
some kind of threshold for determining whether a cluster has enough votes or not... now just taking the first three clusters
Class pcl::registration::CorrespondenceRejectorFeatures
explain this better.
Member pcl::SampleConsensusModel< PointT >::setRadiusLimits (const double &min_radius, const double &max_radius)
change this to set limits on the entire model
Member pcl::SampleConsensusModelSphere< PointT >::projectPoints (const std::vector< int > &inliers, const Eigen::VectorXf &model_coefficients, PointCloud &projected_points, bool copy_data_fields=true)
implement this.
Member pcl::search::OrganizedNeighbor< PointT >::nearestKSearch (const PointT &p_q, int k, std::vector< int > &k_indices, std::vector< float > &k_sqr_distances) const
still need to implements this functionality
Member pcl::seededHueSegmentation (const PointCloud< PointXYZRGB > &cloud, const boost::shared_ptr< search::Search< PointXYZRGBL > > &tree, float tolerance, PointIndices &indices_in, PointIndices &indices_out, float delta_hue=0.0)

look how to make this templated!

Member pcl::seededHueSegmentation (const PointCloud< PointXYZRGB > &cloud, const boost::shared_ptr< search::Search< PointXYZRGB > > &tree, float tolerance, PointIndices &indices_in, PointIndices &indices_out, float delta_hue=0.0)

look how to make this templated!

Member pcl::SurfaceNormalModality< PointInT >::computeAndQuantizeSurfaceNormals2 ()

Should also need camera model, or at least focal lengths? Replace distance_threshold with mask?

Magic number 1150 is focal length? This is something like f in SXGA mode, but in VGA is more like 530.

Member pcl::toPCLPointCloud2 (const pcl::PointCloud< PointT > &cloud, pcl::PCLPointCloud2 &msg)
msg.is_bigendian = ?;
Member pcl::visualization::PointCloudColorHandlerHSVField< PointT >::getColor (vtkSmartPointer< vtkDataArray > &scalars) const
do this with the point_types_conversion in common, first template it!
Member TEST_F (OutofcoreTest, Outofcore_ConstructorBadPaths)
Shouldn't these throw an exception for bad path?


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:38:49