#include <simple_object_capture/common.h>#include <pcl/registration/icp.h>#include <pcl/registration/registration.h>#include <pcl/registration/transformation_estimation.h>#include <pcl/registration/transformation_estimation_point_to_plane.h>#include <pcl/registration/transformation_estimation_point_to_plane_lls.h>#include <pcl/point_types.h>#include <pcl/io/pcd_io.h>#include <pcl/features/normal_3d.h>#include <pcl/features/integral_image_normal.h>#include <pcl/sample_consensus/method_types.h>#include <pcl/sample_consensus/model_types.h>#include <pcl/segmentation/sac_segmentation.h>#include <pcl/surface/mls.h>#include <pcl/filters/radius_outlier_removal.h>#include <rosbag/bag.h>#include <rosbag/query.h>#include <rosbag/view.h>#include <string>#include <sstream>#include <fstream>#include <sensor_msgs/CameraInfo.h>#include <sensor_msgs/Image.h>#include <geometry_msgs/PoseStamped.h>#include <image_geometry/pinhole_camera_model.h>#include <sensor_msgs/image_encodings.h>#include <boost/filesystem.hpp>
Go to the source code of this file.
Typedefs | |
| typedef pcl::registration::TransformationEstimationPointToPlaneLLS < pcl::PointXYZRGBNormal, pcl::PointXYZRGBNormal > | PointToPlane |
Functions | |
| template<class T > | |
| std::vector< typename T::ConstPtr > | getAllMsgs (const rosbag::Bag &bag, const std::string &topic) |
| int | main (int argc, char **argv) |
| template<class P > | |
| void | pcdWrite (typename pcl::PointCloud< P >::Ptr cloud, const std::string &name, int count, const boost::filesystem::path &folder="") |
| typedef pcl::registration::TransformationEstimationPointToPlaneLLS<pcl::PointXYZRGBNormal, pcl::PointXYZRGBNormal> PointToPlane |
Definition at line 32 of file register_box.cpp.
| std::vector<typename T::ConstPtr> getAllMsgs | ( | const rosbag::Bag & | bag, |
| const std::string & | topic | ||
| ) |
Definition at line 37 of file register_box.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 81 of file register_box.cpp.
| void pcdWrite | ( | typename pcl::PointCloud< P >::Ptr | cloud, |
| const std::string & | name, | ||
| int | count, | ||
| const boost::filesystem::path & | folder = "" |
||
| ) |
Definition at line 52 of file register_box.cpp.