Go to the documentation of this file.
   38 #ifndef PCL_ROS_PRINCIPAL_CURVATURES_H_ 
   39 #define PCL_ROS_PRINCIPAL_CURVATURES_H_ 
   41 #define EIGEN_YES_I_KNOW_SPARSE_MODULE_IS_NOT_STABLE_YET true 
   42 #include <pcl/features/principal_curvatures.h> 
   57       pcl::PrincipalCurvaturesEstimation<pcl::PointXYZ, pcl::Normal, pcl::PrincipalCurvatures> 
impl_;
 
   80       EIGEN_MAKE_ALIGNED_OPERATOR_NEW
 
   84 #endif  //#ifndef PCL_ROS_PRINCIPAL_CURVATURES_H_ 
  
void computePublish(const PointCloudInConstPtr &cloud, const PointCloudNConstPtr &normals, const PointCloudInConstPtr &surface, const IndicesPtr &indices)
Compute the feature and publish it.
pcl::PointCloud< pcl::PrincipalCurvatures > PointCloudOut
bool childInit(ros::NodeHandle &nh)
Child initialization routine. Internal method.
pcl::PrincipalCurvaturesEstimation< pcl::PointXYZ, pcl::Normal, pcl::PrincipalCurvatures > impl_
boost::shared_ptr< const PointCloudN > PointCloudNConstPtr
pcl::IndicesPtr IndicesPtr
int max_queue_size_
The maximum queue size (default: 3).
ros::Publisher pub_output_
The output PointCloud publisher.
PrincipalCurvaturesEstimation estimates the directions (eigenvectors) and magnitudes (eigenvalues) of...
void emptyPublish(const PointCloudInConstPtr &cloud)
Publish an empty point cloud of the feature output type.
boost::shared_ptr< const PointCloudIn > PointCloudInConstPtr
pcl_ros
Author(s): Open Perception, Julius Kammerl 
, William Woodall 
autogenerated on Fri Jul 12 2024 02:54:40