, including all inherited members.
algorithm_ | jsk_pcl_ros::ICPRegistration | [protected] |
align(const sensor_msgs::PointCloud2::ConstPtr &msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
align(const sensor_msgs::PointCloud2::ConstPtr &msg, const sensor_msgs::PointCloud2::ConstPtr &reference_msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
align_box_ | jsk_pcl_ros::ICPRegistration | [protected] |
alignPointcloud(pcl::PointCloud< PointT >::Ptr &cloud, pcl::PointCloud< PointT >::Ptr &reference, const Eigen::Affine3f &offset, pcl::PointCloud< PointT >::Ptr &output_cloud, Eigen::Affine3d &output_transform) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignPointcloudWithICP(pcl::PointCloud< PointT >::Ptr &cloud, pcl::PointCloud< PointT >::Ptr &reference, const Eigen::Affine3f &offset, pcl::PointCloud< PointT >::Ptr &output_cloud, Eigen::Affine3d &output_transform) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignPointcloudWithNDT(pcl::PointCloud< PointT >::Ptr &cloud, pcl::PointCloud< PointT >::Ptr &reference, const Eigen::Affine3f &offset, pcl::PointCloud< PointT >::Ptr &output_cloud, Eigen::Affine3d &output_transform) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignPointcloudWithReferences(pcl::PointCloud< PointT >::Ptr &cloud, const Eigen::Affine3f &offset, const std_msgs::Header &header) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignService(jsk_recognition_msgs::ICPAlign::Request &req, jsk_recognition_msgs::ICPAlign::Response &res) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignWithBox(const sensor_msgs::PointCloud2::ConstPtr &msg, const jsk_recognition_msgs::BoundingBox::ConstPtr &box_msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignWithBoxService(jsk_recognition_msgs::ICPAlignWithBox::Request &req, jsk_recognition_msgs::ICPAlignWithBox::Response &res) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
alignWithOffset(const sensor_msgs::PointCloud2::ConstPtr &msg, const geometry_msgs::PoseStamped::ConstPtr &pose_msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
camera_info_msg_ | jsk_pcl_ros::ICPRegistration | [protected] |
cameraInfoCallback(const sensor_msgs::CameraInfo::ConstPtr &msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
Config typedef | jsk_pcl_ros::ICPRegistration | |
configCallback(Config &config, uint32_t level) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
correspondence_algorithm_ | jsk_pcl_ros::ICPRegistration | [protected] |
correspondence_distance_ | jsk_pcl_ros::ICPRegistration | [protected] |
correspondence_randomness_ | jsk_pcl_ros::ICPRegistration | [protected] |
done_init_ | jsk_pcl_ros::ICPRegistration | [protected] |
euclidean_fittness_epsilon_ | jsk_pcl_ros::ICPRegistration | [protected] |
ICPRegistration() | jsk_pcl_ros::ICPRegistration | [inline] |
max_iteration_ | jsk_pcl_ros::ICPRegistration | [protected] |
maximum_optimizer_iterations_ | jsk_pcl_ros::ICPRegistration | [protected] |
mutex_ | jsk_pcl_ros::ICPRegistration | [protected] |
ndt_outlier_ratio_ | jsk_pcl_ros::ICPRegistration | [protected] |
ndt_resolution_ | jsk_pcl_ros::ICPRegistration | [protected] |
ndt_step_size_ | jsk_pcl_ros::ICPRegistration | [protected] |
OffsetSyncPolicy typedef | jsk_pcl_ros::ICPRegistration | |
onInit() | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
PointT typedef | jsk_pcl_ros::ICPRegistration | |
pub_average_time_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_debug_flipped_cloud_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_debug_result_cloud_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_debug_source_cloud_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_debug_target_cloud_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_icp_result | jsk_pcl_ros::ICPRegistration | [protected] |
pub_latest_time_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_result_cloud_ | jsk_pcl_ros::ICPRegistration | [protected] |
pub_result_pose_ | jsk_pcl_ros::ICPRegistration | [protected] |
publishDebugCloud(ros::Publisher &pub, const pcl::PointCloud< PointT > &cloud) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
ransac_iterations_ | jsk_pcl_ros::ICPRegistration | [protected] |
ransac_outlier_threshold_ | jsk_pcl_ros::ICPRegistration | [protected] |
reference_cloud_list_ | jsk_pcl_ros::ICPRegistration | [protected] |
referenceAddCallback(const sensor_msgs::PointCloud2::ConstPtr &msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
referenceArrayCallback(const jsk_recognition_msgs::PointsArray::ConstPtr &msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
referenceCallback(const sensor_msgs::PointCloud2::ConstPtr &msg) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
ReferenceSyncPolicy typedef | jsk_pcl_ros::ICPRegistration | |
rotation_epsilon_ | jsk_pcl_ros::ICPRegistration | [protected] |
scorePointcloudAlignment(pcl::PointCloud< PointT >::Ptr &cloud, pcl::PointCloud< PointT >::Ptr &reference, const Eigen::Affine3f &offset, Eigen::Affine3f &offset_result, pcl::PointCloud< PointT >::Ptr transformed_cloud, Eigen::Affine3d &transform_result) | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
srv_ | jsk_pcl_ros::ICPRegistration | [protected] |
srv_icp_align_ | jsk_pcl_ros::ICPRegistration | [protected] |
srv_icp_align_with_box_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_box_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_camera_info_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_input_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_offset_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_reference_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_reference_add | jsk_pcl_ros::ICPRegistration | [protected] |
sub_reference_array_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_sync_input_ | jsk_pcl_ros::ICPRegistration | [protected] |
sub_sync_reference_ | jsk_pcl_ros::ICPRegistration | [protected] |
subscribe() | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
sync_ | jsk_pcl_ros::ICPRegistration | [protected] |
sync_offset_ | jsk_pcl_ros::ICPRegistration | [protected] |
sync_reference_ | jsk_pcl_ros::ICPRegistration | [protected] |
synchronize_reference_ | jsk_pcl_ros::ICPRegistration | [protected] |
SyncPolicy typedef | jsk_pcl_ros::ICPRegistration | |
tf_listener_ | jsk_pcl_ros::ICPRegistration | [protected] |
timer_ | jsk_pcl_ros::ICPRegistration | [protected] |
transform_3dof_ | jsk_pcl_ros::ICPRegistration | [protected] |
transform_epsilon_ | jsk_pcl_ros::ICPRegistration | [protected] |
unsubscribe() | jsk_pcl_ros::ICPRegistration | [protected, virtual] |
use_flipped_initial_pose_ | jsk_pcl_ros::ICPRegistration | [protected] |
use_normal_ | jsk_pcl_ros::ICPRegistration | [protected] |
use_offset_pose_ | jsk_pcl_ros::ICPRegistration | [protected] |