#include "jsk_pcl_ros/hinted_stick_finder.h"#include "jsk_recognition_utils/pcl_conversion_util.h"#include <pcl/sample_consensus/method_types.h>#include <pcl/sample_consensus/model_types.h>#include <pcl/segmentation/sac_segmentation.h>#include <pcl/filters/project_inliers.h>#include <pcl/filters/extract_indices.h>#include <pcl/features/normal_3d_omp.h>#include <visualization_msgs/Marker.h>#include <geometry_msgs/PoseStamped.h>#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
| Namespaces | |
| namespace | jsk_pcl_ros | 
| Defines | |
| #define | BOOST_PARAMETER_MAX_ARITY 7 | 
| Functions | |
| PLUGINLIB_EXPORT_CLASS (jsk_pcl_ros::HintedStickFinder, nodelet::Nodelet) | |
| #define BOOST_PARAMETER_MAX_ARITY 7 | 
Definition at line 35 of file hinted_stick_finder_nodelet.cpp.