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 |
applyRecursiveRANSAC(const pcl::PointCloud< PointT >::Ptr &input, const pcl::PointCloud< pcl::Normal >::Ptr &normal, const Eigen::Vector3f &imu_vector, std::vector< pcl::PointIndices::Ptr > &output_inliers, std::vector< pcl::ModelCoefficients::Ptr > &output_coefficients, std::vector< jsk_recognition_utils::ConvexPolygon::Ptr > &output_polygons) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
camera_publishers_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
cameraConnectionBaseCallback() | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
cameraConnectionCallback(const image_transport::SingleSubscriberPublisher &pub) | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
cameraInfoConnectionCallback(const ros::SingleSubscriberPublisher &pub) | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
Config typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
configCallback(Config &config, uint32_t level) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
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 | protectedvirtual |
eps_angle_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
ever_subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
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 | protectedvirtual |
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 | |
isSubscribed() | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
max_iterations_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
min_inliers_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
min_points_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
min_trial_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
mutex_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
nh_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
Nodelet() | nodelet::Nodelet | |
normal_distance_weight_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
NormalImuSynchronizer typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
on_init_post_process_called_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
onInit() | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
onInitPostProcess() | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
outlier_threshold_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
pnh_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
PointT typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
pub_coefficients_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
pub_inliers_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
pub_polygons_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
publishers_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
publishResult(const std_msgs::Header &header, const std::vector< pcl::PointIndices::Ptr > &inliers, const std::vector< pcl::ModelCoefficients::Ptr > &coefficients, const std::vector< jsk_recognition_utils::ConvexPolygon::Ptr > &convexes) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
segment(const sensor_msgs::PointCloud2::ConstPtr &msg) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
segment(const sensor_msgs::PointCloud2::ConstPtr &msg, const sensor_msgs::PointCloud2::ConstPtr &msg_nromal) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
segmentWithClusters(const sensor_msgs::PointCloud2::ConstPtr &msg, const jsk_recognition_msgs::ClusterPointIndices::ConstPtr &clusters) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
segmentWithImu(const sensor_msgs::PointCloud2::ConstPtr &msg, const sensor_msgs::Imu::ConstPtr &imu) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
segmentWithImu(const sensor_msgs::PointCloud2::ConstPtr &msg, const sensor_msgs::PointCloud2::ConstPtr &msg_nromal, const sensor_msgs::Imu::ConstPtr &imu) | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
srv_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sub_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sub_clusters_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sub_imu_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sub_input_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sub_normal_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
subscribe() | jsk_pcl_ros::MultiPlaneSACSegmentation | protectedvirtual |
subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
sync_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sync_cluster_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sync_imu_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
sync_normal_imu_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
SyncClusterPolicy typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
SyncImuPolicy typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
SyncNormalImuPolicy typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
SyncPolicy typedef | jsk_pcl_ros::MultiPlaneSACSegmentation | |
tf_listener_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
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::MultiPlaneSACSegmentation | protectedvirtual |
use_clusters_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
use_imu_parallel_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
use_imu_perpendicular_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
use_normal_ | jsk_pcl_ros::MultiPlaneSACSegmentation | protected |
verbose_connection_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
warnNeverSubscribedCallback(const ros::WallTimerEvent &event) | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
warnOnInitPostProcessCalledCallback(const ros::WallTimerEvent &event) | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
~Nodelet() | nodelet::Nodelet | virtual |