#include "shape_tracker/ShapeTracker.h"#include <pcl_conversions/pcl_conversions.h>#include <shape_reconstruction/RangeImagePlanar.hpp>#include "pcl_ros/point_cloud.h"#include "pcl/filters/approximate_voxel_grid.h"#include "opencv2/imgproc/imgproc.hpp"Go to the source code of this file.
Defines | |
| #define | BB_FILTER_BEFORE_ICP |
Functions | |
| void | calculate_ICP_COV (pcl::PointCloud< pcl::PointXYZ > &data_pi, pcl::PointCloud< pcl::PointXYZ > &model_qi, Eigen::Matrix4f &transform, Eigen::MatrixXd &ICP_COV) |
| void | Image8u2IndicesOfOrganizedPC (const cv::Mat &image_8u, pcl::PointIndices::Ptr indices_ptr) |
| void | IndicesOfOrganizedPC2Image8u (pcl::PointIndices::Ptr indices_ptr, cv::Mat &image_8u) |
| void | OrganizedPC2DepthMap2 (const pcl::PointCloud< pcl::PointXYZ >::Ptr organized_pc, cv::Mat &depth_map_mat) |
| #define BB_FILTER_BEFORE_ICP |
Definition at line 16 of file ShapeTracker.cpp.
| void calculate_ICP_COV | ( | pcl::PointCloud< pcl::PointXYZ > & | data_pi, |
| pcl::PointCloud< pcl::PointXYZ > & | model_qi, | ||
| Eigen::Matrix4f & | transform, | ||
| Eigen::MatrixXd & | ICP_COV | ||
| ) |
Definition at line 440 of file ShapeTracker.cpp.
| void Image8u2IndicesOfOrganizedPC | ( | const cv::Mat & | image_8u, |
| pcl::PointIndices::Ptr | indices_ptr | ||
| ) |
Definition at line 19 of file ShapeTracker.cpp.
| void IndicesOfOrganizedPC2Image8u | ( | pcl::PointIndices::Ptr | indices_ptr, |
| cv::Mat & | image_8u | ||
| ) |
Definition at line 35 of file ShapeTracker.cpp.
| void OrganizedPC2DepthMap2 | ( | const pcl::PointCloud< pcl::PointXYZ >::Ptr | organized_pc, |
| cv::Mat & | depth_map_mat | ||
| ) |
Definition at line 168 of file ShapeTracker.cpp.