, including all inherited members.
Config typedef | jsk_pcl_ros::EdgeDepthRefinement | |
configCallback(Config &config, uint32_t level) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
duplication_angle_threshold_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
duplication_distance_threshold_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
findMinMaxIndex(const int width, const int height, const std::vector< int > &indices) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
integrateDuplicatedIndices(const pcl::PointCloud< PointT >::Ptr &cloud, const std::set< int > &duplicated_set, const std::vector< pcl::PointIndices::Ptr > all_inliers, pcl::PointIndices::Ptr &output_indices) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
lineFromCoefficients(const pcl::ModelCoefficients::Ptr coefficients) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
min_inliers_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
mutex_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
onInit() | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
outlier_distance_threshold_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
PointT typedef | jsk_pcl_ros::EdgeDepthRefinement | |
pub_coefficients_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
pub_edges_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
pub_indices_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
pub_outlier_removed_coefficients_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
pub_outlier_removed_edges_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
pub_outlier_removed_indices_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
publishIndices(ros::Publisher &pub, ros::Publisher &pub_coefficients, ros::Publisher &pub_edges, const std::vector< pcl::PointIndices::Ptr > inliers, const std::vector< pcl::ModelCoefficients::Ptr > coefficients, const std_msgs::Header &header) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
refine(const sensor_msgs::PointCloud2ConstPtr &point, const jsk_recognition_msgs::ClusterPointIndicesConstPtr &indices) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
removeDuplicatedEdges(const pcl::PointCloud< PointT >::Ptr &cloud, const std::vector< pcl::PointIndices::Ptr > inliers, const std::vector< pcl::ModelCoefficients::Ptr > coefficients, std::vector< pcl::PointIndices::Ptr > &output_inliers, std::vector< pcl::ModelCoefficients::Ptr > &output_coefficients) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
removeOutliers(const pcl::PointCloud< PointT >::Ptr &cloud, const std::vector< PCLIndicesMsg > &indices, std::vector< pcl::PointIndices::Ptr > &output_inliers, std::vector< pcl::ModelCoefficients::Ptr > &output_coefficients) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
removeOutliersByLine(const pcl::PointCloud< PointT >::Ptr &cloud, const std::vector< int > &indices, pcl::PointIndices &inliers, pcl::ModelCoefficients &coefficients) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
segmentFromIndices(const pcl::PointCloud< PointT >::Ptr &cloud, const std::vector< int > &indices, const jsk_recognition_utils::Line::Ptr &line) | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
srv_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
sub_indices_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
sub_input_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
subscribe() | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
sync_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
SyncPolicy typedef | jsk_pcl_ros::EdgeDepthRefinement | |
unsubscribe() | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |