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 |
all_cloud_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
always_subscribe_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
callICP(pcl::PointCloud< pcl::PointXYZRGB >::Ptr reference, pcl::PointCloud< pcl::PointXYZRGB >::Ptr target, Eigen::Affine3f &output_transform) | jsk_pcl_ros::IncrementalModelRegistration | 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 |
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 |
diagnostic_updater_ | jsk_topic_tools::DiagnosticNodelet | protected |
DiagnosticNodelet(const std::string &name) | jsk_topic_tools::DiagnosticNodelet | |
ever_subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
frame_id_ | jsk_pcl_ros::IncrementalModelRegistration | 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 |
IncrementalModelRegistration() | jsk_pcl_ros::IncrementalModelRegistration | inline |
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 |
mutex_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
name_ | jsk_topic_tools::DiagnosticNodelet | protected |
newsampleCallback(const sensor_msgs::PointCloud2::ConstPtr &cloud_msg, const pcl_msgs::PointIndices::ConstPtr &indices_msg, const geometry_msgs::PoseStamped::ConstPtr &pose_msg) | jsk_pcl_ros::IncrementalModelRegistration | protectedvirtual |
nh_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
Nodelet() | nodelet::Nodelet | |
on_init_post_process_called_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
onInit() | jsk_pcl_ros::IncrementalModelRegistration | protectedvirtual |
onInitPostProcess() | jsk_topic_tools::ConnectionBasedNodelet | protectedvirtual |
origin_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
pnh_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
Ptr typedef | jsk_topic_tools::DiagnosticNodelet | |
pub_cloud_non_registered_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
pub_registered_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
publishers_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
samples_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
start_registration_srv_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
startRegistration(std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) | jsk_pcl_ros::IncrementalModelRegistration | protectedvirtual |
sub_cloud_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
sub_indices_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
sub_pose_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
subscribe() | jsk_pcl_ros::IncrementalModelRegistration | inlineprotectedvirtual |
subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
sync_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
SyncPolicy typedef | jsk_pcl_ros::IncrementalModelRegistration | |
timer_warn_never_subscribed_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
timer_warn_on_init_post_process_called_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
transformPointCloudRepsectedToPose(pcl::PointCloud< pcl::PointXYZRGB >::Ptr input, pcl::PointCloud< pcl::PointXYZRGB >::Ptr output, const geometry_msgs::PoseStamped::ConstPtr &pose_msg) | jsk_pcl_ros::IncrementalModelRegistration | protectedvirtual |
unsubscribe() | jsk_pcl_ros::IncrementalModelRegistration | inlineprotectedvirtual |
updateDiagnostic(diagnostic_updater::DiagnosticStatusWrapper &stat) | jsk_pcl_ros::IncrementalModelRegistration | inlineprotectedvirtual |
verbose_connection_ | jsk_topic_tools::ConnectionBasedNodelet | protected |
viewer_ | jsk_pcl_ros::IncrementalModelRegistration | protected |
vital_checker_ | jsk_topic_tools::DiagnosticNodelet | 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 |