, including all inherited members.
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] |
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] |
Config typedef | jsk_pcl_ros::EdgeDepthRefinement | |
configCallback(Config &config, uint32_t level) | jsk_pcl_ros::EdgeDepthRefinement | [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] |
duplication_angle_threshold_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
duplication_distance_threshold_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
ever_subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | [protected] |
findMinMaxIndex(const int width, const int height, const std::vector< int > &indices) | jsk_pcl_ros::EdgeDepthRefinement | [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 | |
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] |
isSubscribed() | jsk_topic_tools::ConnectionBasedNodelet | [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] |
nh_ | jsk_topic_tools::ConnectionBasedNodelet | [protected] |
Nodelet() | nodelet::Nodelet | |
on_init_post_process_called_ | jsk_topic_tools::ConnectionBasedNodelet | [protected] |
onInit() | jsk_pcl_ros::EdgeDepthRefinement | [protected, virtual] |
onInitPostProcess() | jsk_topic_tools::ConnectionBasedNodelet | [protected, virtual] |
outlier_distance_threshold_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
pnh_ | jsk_topic_tools::ConnectionBasedNodelet | [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] |
publishers_ | jsk_topic_tools::ConnectionBasedNodelet | [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] |
subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | [protected] |
sync_ | jsk_pcl_ros::EdgeDepthRefinement | [protected] |
SyncPolicy typedef | jsk_pcl_ros::EdgeDepthRefinement | |
timer_warn_never_subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | [protected] |
timer_warn_on_init_post_process_called_ | jsk_topic_tools::ConnectionBasedNodelet | [protected] |
unsubscribe() | jsk_pcl_ros::EdgeDepthRefinement | [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] |