Todo List
File common/include/pcl/common/file_io.h
move this to pcl::console
Member pcl::createMapping (const std::vector< sensor_msgs::PointField > &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
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::toROSMsg (const pcl::PointCloud< PointT > &cloud, sensor_msgs::PointCloud2 &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!


pcl
Author(s): Open Perception
autogenerated on Mon Oct 6 2014 03:19:14