jsk_pcl_ros::EdgebasedCubeFinder Member List
This is the complete list of members for jsk_pcl_ros::EdgebasedCubeFinder, including all inherited members.
A_PERPENDICULAR enum valuejsk_pcl_ros::EdgebasedCubeFinder
advertise(ros::NodeHandle &nh, std::string topic, int queue_size)jsk_topic_tools::ConnectionBasedNodelet [protected]
advertiseCamera(ros::NodeHandle &nh, image_transport::ImageTransport &it, const std::string &topic, int queue_size)jsk_topic_tools::ConnectionBasedNodelet [protected]
advertiseCamera(ros::NodeHandle &nh, const std::string &topic, int queue_size)jsk_topic_tools::ConnectionBasedNodelet [protected]
advertiseImage(ros::NodeHandle &nh, image_transport::ImageTransport &it, const std::string &topic, int queue_size)jsk_topic_tools::ConnectionBasedNodelet [protected]
advertiseImage(ros::NodeHandle &nh, const std::string &topic, int queue_size)jsk_topic_tools::ConnectionBasedNodelet [protected]
always_subscribe_jsk_topic_tools::ConnectionBasedNodelet [protected]
B_PERPENDICULAR enum valuejsk_pcl_ros::EdgebasedCubeFinder
C_PERPENDICULAR enum valuejsk_pcl_ros::EdgebasedCubeFinder
camera_publishers_jsk_topic_tools::ConnectionBasedNodelet [protected]
cameraConnectionBaseCallback()jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
cameraConnectionCallback(const image_transport::SingleSubscriberPublisher &pub)jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
cameraInfoConnectionCallback(const ros::SingleSubscriberPublisher &pub)jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
combinateCoefficients(const std::vector< pcl::ModelCoefficients::Ptr > &coefficients)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
combinateIndices(const std::vector< pcl::PointIndices::Ptr > &indices)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
Config typedefjsk_pcl_ros::EdgebasedCubeFinder
configCallback(Config &config, uint32_t level)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
connection_mutex_jsk_topic_tools::ConnectionBasedNodelet [protected]
connection_status_jsk_topic_tools::ConnectionBasedNodelet [protected]
ConnectionBasedNodelet()jsk_topic_tools::ConnectionBasedNodelet
connectionCallback(const ros::SingleSubscriberPublisher &pub)jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
convex_area_threshold_jsk_pcl_ros::EdgebasedCubeFinder [protected]
convex_edge_threshold_jsk_pcl_ros::EdgebasedCubeFinder [protected]
convexFromPairs(const pcl::PointCloud< PointT >::Ptr cloud, const CoefficientsPair &coefficients_pair, const IndicesPair &indices_pair)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
countInliers(const pcl::PointCloud< PointT >::Ptr cloud, const jsk_recognition_utils::ConvexPolygon::Ptr convex)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
cubeFromIndicesAndCoefficients(const pcl::PointCloud< PointT >::Ptr cloud, const IndicesCoefficientsTriple &indices_coefficients_triple, pcl::PointCloud< EdgebasedCubeFinder::PointT >::Ptr points_on_edge)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
EdgeRelation enum namejsk_pcl_ros::EdgebasedCubeFinder
estimate(const sensor_msgs::PointCloud2::ConstPtr &input_cloud, const jsk_recognition_msgs::ParallelEdgeArray::ConstPtr &input_edges)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
estimate2(const sensor_msgs::PointCloud2::ConstPtr &input_cloud, const jsk_recognition_msgs::ParallelEdgeArray::ConstPtr &input_edges)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
estimateConvexPolygon(const pcl::PointCloud< PointT >::Ptr cloud, const pcl::PointIndices::Ptr indices, pcl::ModelCoefficients::Ptr coefficients, pcl::PointIndices::Ptr inliers)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
estimateParallelPlane(const jsk_recognition_utils::ConvexPolygon::Ptr convex, const pcl::PointCloud< PointT >::Ptr filtered_cloud, pcl::PointIndices::Ptr output_inliers, pcl::ModelCoefficients::Ptr output_coefficients)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
estimatePerpendicularPlane(const jsk_recognition_utils::ConvexPolygon::Ptr convex, const CoefficientsPair &edge_coefficients, const pcl::PointCloud< PointT >::Ptr filtered_cloud, pcl::PointIndices::Ptr output_inliers, pcl::ModelCoefficients::Ptr output_coefficients)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
ever_subscribed_jsk_topic_tools::ConnectionBasedNodelet [protected]
extractPointCloud(const pcl::PointCloud< PointT >::Ptr cloud, const pcl::PointIndices::Ptr indices)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
filterBasedOnConvex(const pcl::PointCloud< PointT >::Ptr cloud, const std::vector< jsk_recognition_utils::ConvexPolygon::Ptr > &convexes, std::vector< int > &output_indices)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
filterPairsBasedOnParallelEdgeDistances(const std::vector< IndicesPair > &pairs, const std::vector< CoefficientsPair > &coefficients_pair, std::vector< IndicesPair > &filtered_indices_pairs, std::vector< CoefficientsPair > &filtered_coefficients_pairs)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
filterPerpendicularEdgeTriples(const std::vector< IndicesCoefficientsTriple > &triples)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
getMTCallbackQueue() const nodelet::Nodelet [protected]
getMTNodeHandle() const nodelet::Nodelet [protected]
getMTPrivateNodeHandle() const nodelet::Nodelet [protected]
getMyArgv() const nodelet::Nodelet [protected]
getName() const nodelet::Nodelet [protected]
getNodeHandle() const nodelet::Nodelet [protected]
getPrivateNodeHandle() const nodelet::Nodelet [protected]
getRemappingArgs() const nodelet::Nodelet [protected]
getSTCallbackQueue() const nodelet::Nodelet [protected]
getSuffixedName(const std::string &suffix) const nodelet::Nodelet [protected]
image_publishers_jsk_topic_tools::ConnectionBasedNodelet [protected]
imageConnectionCallback(const image_transport::SingleSubscriberPublisher &pub)jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
init(const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)nodelet::Nodelet
isPerpendicularVector(const Eigen::Vector3f &a, const Eigen::Vector3f &b)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
isSubscribed()jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
midLineFromCoefficientsPair(const CoefficientsPair &pair)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
min_inliers_jsk_pcl_ros::EdgebasedCubeFinder [protected]
minMaxPointOnLine(const jsk_recognition_utils::Line &line, const pcl::PointCloud< PointT >::Ptr cloud)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
mutex_jsk_pcl_ros::EdgebasedCubeFinder [protected]
nh_jsk_topic_tools::ConnectionBasedNodelet [protected]
Nodelet()nodelet::Nodelet
NOT_PERPENDICULAR enum valuejsk_pcl_ros::EdgebasedCubeFinder
on_init_post_process_called_jsk_topic_tools::ConnectionBasedNodelet [protected]
onInit()jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
onInitPostProcess()jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
outlier_threshold_jsk_pcl_ros::EdgebasedCubeFinder [protected]
parallel_edge_distance_max_threshold_jsk_pcl_ros::EdgebasedCubeFinder [protected]
parallel_edge_distance_min_threshold_jsk_pcl_ros::EdgebasedCubeFinder [protected]
perpendicularEdgeTriple(const jsk_recognition_utils::Line &edge_a, const jsk_recognition_utils::Line &edge_b, const jsk_recognition_utils::Line &edge_c)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
pnh_jsk_topic_tools::ConnectionBasedNodelet [protected]
PointT typedefjsk_pcl_ros::EdgebasedCubeFinder
preparePointCloudForRANSAC(const jsk_recognition_utils::ConvexPolygon::Ptr convex, const CoefficientsPair &edge_coefficients_pair, const pcl::PointCloud< PointT >::Ptr cloud)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
pub_jsk_pcl_ros::EdgebasedCubeFinder [protected]
pub_debug_clusers_jsk_pcl_ros::EdgebasedCubeFinder [protected]
pub_debug_filtered_cloud_jsk_pcl_ros::EdgebasedCubeFinder [protected]
pub_debug_marker_jsk_pcl_ros::EdgebasedCubeFinder [protected]
pub_debug_polygons_jsk_pcl_ros::EdgebasedCubeFinder [protected]
pub_pose_array_jsk_pcl_ros::EdgebasedCubeFinder [protected]
publishers_jsk_topic_tools::ConnectionBasedNodelet [protected]
srv_jsk_pcl_ros::EdgebasedCubeFinder [protected]
sub_edges_jsk_pcl_ros::EdgebasedCubeFinder [protected]
sub_input_jsk_pcl_ros::EdgebasedCubeFinder [protected]
subscribe()jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
subscribed_jsk_topic_tools::ConnectionBasedNodelet [protected]
sync_jsk_pcl_ros::EdgebasedCubeFinder [protected]
SyncPolicy typedefjsk_pcl_ros::EdgebasedCubeFinder
timer_warn_never_subscribed_jsk_topic_tools::ConnectionBasedNodelet [protected]
timer_warn_on_init_post_process_called_jsk_topic_tools::ConnectionBasedNodelet [protected]
tripleIndicesAndCoefficients(const std::vector< pcl::PointIndices::Ptr > &indices, const std::vector< pcl::ModelCoefficients::Ptr > &coefficients)jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
unsubscribe()jsk_pcl_ros::EdgebasedCubeFinder [protected, virtual]
verbose_connection_jsk_topic_tools::ConnectionBasedNodelet [protected]
warnNeverSubscribedCallback(const ros::WallTimerEvent &event)jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
warnOnInitPostProcessCalledCallback(const ros::WallTimerEvent &event)jsk_topic_tools::ConnectionBasedNodelet [protected, virtual]
~Nodelet()nodelet::Nodelet [virtual]


jsk_pcl_ros
Author(s): Yohei Kakiuchi
autogenerated on Sun Oct 8 2017 02:43:51