mapping.h
Go to the documentation of this file.
1 
6 #ifndef MAPPING_H
7 #define MAPPING_H
8 
9 #define PCL_NO_PRECOMPILE
10 
11 #include <pcl/point_cloud.h>
12 #include <pcl/point_types.h>
13 
14 #include <Eigen/Core>
15 #include <Eigen/Dense>
16 #include <vector>
17 
18 #include "toposens_msgs/TsPoint.h"
19 #include "toposens_msgs/TsScan.h"
20 
21 using namespace Eigen;
22 
23 namespace toposens_pointcloud
24 {
26 typedef pcl::PointCloud<pcl::PointXYZINormal> XYZINCloud;
27 
32 class Mapping
33 {
34 public:
35  Mapping() = default;
36 
44  void doTransform(pcl::PointXYZINormal &pt, Vector3f translation, Vector4f quaternion);
45 
54  pcl::PointXYZINormal convertToXYZINormal(toposens_msgs::TsPoint i);
55 };
56 
57 } // namespace toposens_pointcloud
58 
59 #endif
void doTransform(const T &data_in, T &data_out, const geometry_msgs::TransformStamped &transform)
pcl::PointCloud< pcl::PointXYZINormal > XYZINCloud
Definition: mapping.h:26
Library for mapping/converting pcl::PointXYZINormal and toposens_msgs::TsPoint messages.
Definition: mapping.h:32


toposens_pointcloud
Author(s): Adi Singh, Sebastian Dengler, Christopher Lang, Inshal Uddin
autogenerated on Mon Feb 28 2022 23:57:49