GridMapPclLoader.cpp
Go to the documentation of this file.
1 /*
2  * GridMapPclLoader.cpp
3  *
4  * Created on: Aug 26, 2019
5  * Author: Edo Jelavic
6  * Institute: ETH Zurich, Robotic Systems Lab
7  */
8 
9 #include <chrono>
10 
11 #ifdef GRID_MAP_PCL_OPENMP_FOUND
12 #include <omp.h>
13 #endif
14 
15 #include <pcl/common/io.h>
16 #include <ros/console.h>
17 
19 
21 #include "grid_map_pcl/helpers.hpp"
22 
23 namespace grid_map {
24 
26  return workingGridMap_;
27 }
28 
29 void GridMapPclLoader::loadCloudFromPcdFile(const std::string& filename) {
30  Pointcloud::Ptr inputCloud(new pcl::PointCloud<pcl::PointXYZ>);
31  inputCloud = grid_map_pcl::loadPointcloudFromPcd(filename);
32  setInputCloud(inputCloud);
33 }
34 
35 void GridMapPclLoader::setInputCloud(Pointcloud::ConstPtr inputCloud) {
36  setRawInputCloud(inputCloud);
37  setWorkingCloud(inputCloud);
38 }
39 
40 void GridMapPclLoader::setRawInputCloud(Pointcloud::ConstPtr rawInputCloud) {
41  rawInputCloud_.reset();
42  Pointcloud::Ptr temp(new Pointcloud());
43  pcl::copyPointCloud(*rawInputCloud, *temp);
44  rawInputCloud_ = temp;
45 }
46 
47 void GridMapPclLoader::setWorkingCloud(Pointcloud::ConstPtr workingCloud) {
48  workingCloud_.reset();
49  Pointcloud::Ptr temp(new Pointcloud());
50  pcl::copyPointCloud(*workingCloud, *temp);
51  workingCloud_ = temp;
52 }
53 
55  // Preprocess: Remove outliers, downsample cloud, transform cloud
56  ROS_INFO_STREAM("Preprocessing of the pointcloud started");
57 
60  setWorkingCloud(filteredCloud);
61  }
62 
65  setWorkingCloud(downsampledCloud);
66  }
67 
69  setWorkingCloud(transformedCloud);
70  ROS_INFO_STREAM("Preprocessing and filtering finished");
71 }
72 
75  const double resolution = params_.get().gridMap_.resolution_;
76  if (resolution < 1e-4) {
77  throw std::runtime_error("Desired grid map resolution is zero");
78  }
79 
80  // find point cloud dimensions
81  // min and max coordinate in x,y and z direction
82  pcl::PointXYZ minBound;
83  pcl::PointXYZ maxBound;
84  pcl::getMinMax3D(*workingCloud_, minBound, maxBound);
85 
86  // from min and max points we can compute the length
87  grid_map::Length length = grid_map::Length(maxBound.x - minBound.x, maxBound.y - minBound.y);
88 
89  // we put the center of the grid map to be in the middle of the point cloud
90  grid_map::Position position = grid_map::Position((maxBound.x + minBound.x) / 2.0, (maxBound.y + minBound.y) / 2.0);
91  workingGridMap_.setGeometry(length, resolution, position);
92 
93  ROS_INFO_STREAM("Grid map dimensions: " << workingGridMap_.getLength()(0) << " x " << workingGridMap_.getLength()(1));
94  ROS_INFO_STREAM("Grid map resolution: " << workingGridMap_.getResolution());
95  ROS_INFO_STREAM("Grid map num cells: " << workingGridMap_.getSize()(0) << " x " << workingGridMap_.getSize()(1));
96  ROS_INFO_STREAM("Initialized map geometry");
97 }
98 
99 void GridMapPclLoader::addLayerFromInputCloud(const std::string& layer) {
100  ROS_INFO_STREAM("Started adding layer: " << layer);
101  // Preprocess: allocate memory in the internal data structure
103  ROS_INFO("Finished preprocessing");
104  workingGridMap_.add(layer);
105  grid_map::Matrix& gridMapData = workingGridMap_.get(layer);
106  unsigned int linearGridMapSize = workingGridMap_.getSize().prod();
107 
108  // Iterate through grid map and calculate the corresponding height based on the point cloud
109 #ifndef GRID_MAP_PCL_OPENMP_FOUND
110  ROS_WARN_STREAM("OpemMP not found, defaulting to single threaded implementation");
111 #else
112  omp_set_num_threads(params_.get().numThreads_);
113 #pragma omp parallel for schedule(dynamic, 10)
114 #endif
115  for (unsigned int linearIndex = 0; linearIndex < linearGridMapSize; ++linearIndex) {
116  processGridMapCell(linearIndex, &gridMapData);
117  }
118  ROS_INFO_STREAM("Finished adding layer: " << layer);
119 }
120 
121 void GridMapPclLoader::processGridMapCell(const unsigned int linearGridMapIndex, grid_map::Matrix* gridMapData) {
122  // Get grid map index from linear index and check if enough points lie within the cell
123  const grid_map::Index index(grid_map::getIndexFromLinearIndex(linearGridMapIndex, workingGridMap_.getSize()));
124 
125  Pointcloud::Ptr pointsInsideCellBorder(new Pointcloud());
126  pointsInsideCellBorder = getPointcloudInsideGridMapCellBorder(index);
127  const bool isTooFewPointsInCell = pointsInsideCellBorder->size() < params_.get().gridMap_.minCloudPointsPerCell_;
128  if (isTooFewPointsInCell) {
129  ROS_WARN_STREAM_THROTTLE(10.0, "Less than " << params_.get().gridMap_.minCloudPointsPerCell_ << " points in a cell. Skipping.");
130  return;
131  }
132  if (pointsInsideCellBorder->size() > params_.get().gridMap_.maxCloudPointsPerCell_) {
133  ROS_WARN_STREAM_THROTTLE(10.0, "More than " << params_.get().gridMap_.maxCloudPointsPerCell_ << " points in a cell. Skipping.");
134  return;
135  }
136  auto& clusterHeights = clusterHeightsWithingGridMapCell_[index(0)][index(1)];
137  calculateElevationFromPointsInsideGridMapCell(pointsInsideCellBorder, clusterHeights);
138  if (clusterHeights.empty()) {
139  (*gridMapData)(index(0), index(1)) = std::nan("1");
140  } else {
141  (*gridMapData)(index(0), index(1)) = params_.get().clusterExtraction_.useMaxHeightAsCellElevation_
142  ? *(std::max_element(clusterHeights.begin(), clusterHeights.end()))
143  : *(std::min_element(clusterHeights.begin(), clusterHeights.end()));
144  }
145 }
146 
147 void GridMapPclLoader::calculateElevationFromPointsInsideGridMapCell(Pointcloud::ConstPtr cloud, std::vector<float>& heights) const {
148  heights.clear();
149  // Extract point cloud cluster from point cloud and return if none is found.
150  std::vector<Pointcloud::Ptr> clusterClouds = pointcloudProcessor_.extractClusterCloudsFromPointcloud(cloud);
151  const bool isNoClustersFound = clusterClouds.empty();
152  if (isNoClustersFound) {
153  ROS_WARN_STREAM_THROTTLE(10.0, "No clusters found in the grid map cell");
154  return;
155  }
156 
157  // Extract mean z value of cluster vector and return smallest height value
158  heights.reserve(clusterClouds.size());
159 
160  std::transform(clusterClouds.begin(), clusterClouds.end(), std::back_inserter(heights),
161  [this](Pointcloud::ConstPtr cloud) -> double { return grid_map_pcl::calculateMeanOfPointPositions(cloud).z(); });
162 }
163 
164 GridMapPclLoader::Pointcloud::Ptr GridMapPclLoader::getPointcloudInsideGridMapCellBorder(const grid_map::Index& index) const {
165  return pointcloudWithinGridMapCell_[index.x()][index.y()];
166 }
167 
168 void GridMapPclLoader::loadParameters(const std::string& filename) {
169  params_.loadParameters(filename);
171 }
172 
174  params_.parameters_ = std::move(parameters);
175 }
176 
177 void GridMapPclLoader::savePointCloudAsPcdFile(const std::string& filename) const {
179 }
180 
184 }
185 
187  const unsigned int dimX = workingGridMap_.getSize().x() + 1;
188  const unsigned int dimY = workingGridMap_.getSize().y() + 1;
189 
190  // resize vectors
191  pointcloudWithinGridMapCell_.resize(dimX);
193 
194  // allocate pointClouds
195  for (unsigned int i = 0; i < dimX; ++i) {
196  pointcloudWithinGridMapCell_[i].resize(dimY);
197  clusterHeightsWithingGridMapCell_[i].resize(dimY);
198  for (unsigned int j = 0; j < dimY; ++j) {
199  pointcloudWithinGridMapCell_[i][j].reset(new Pointcloud());
200  clusterHeightsWithingGridMapCell_[i][j].clear();
201  }
202  }
203 }
204 
206  // For each point in input point cloud, find which grid map
207  // cell does it belong to. Then copy that point in the
208  // right cell in the matrix of point clouds data structure.
209  // This allows for faster access in the clustering stage.
210  for (unsigned int i = 0; i < workingCloud_->points.size(); ++i) {
211  const Point& point = workingCloud_->points[i];
212  const double x = point.x;
213  const double y = point.y;
214  grid_map::Index index;
216  pointcloudWithinGridMapCell_[index.x()][index.y()]->push_back(point);
217  }
218 }
219 } // namespace grid_map
void loadParameters(const std::string &filename)
void setGeometry(const Length &length, const double resolution, const Position &position=Position::Zero())
#define ROS_WARN_STREAM_THROTTLE(period, args)
Pointcloud::Ptr applyRigidBodyTransformation(Pointcloud::ConstPtr inputCloud) const
bool loadParameters(const std::string &filename)
void processGridMapCell(const unsigned int linearGridMapIndex, grid_map::Matrix *gridMapData)
void setWorkingCloud(Pointcloud::ConstPtr workingCloud)
const Matrix & get(const std::string &layer) const
const Size & getSize() const
void setRawInputCloud(Pointcloud::ConstPtr rawInputCloud)
std::vector< std::vector< Pointcloud::Ptr > > pointcloudWithinGridMapCell_
Eigen::Vector3d calculateMeanOfPointPositions(Pointcloud::ConstPtr inputCloud)
Definition: helpers.cpp:140
void loadCloudFromPcdFile(const std::string &filename)
double getResolution() const
void loadParameters(const std::string &filename)
std::vector< Pointcloud::Ptr > extractClusterCloudsFromPointcloud(Pointcloud::ConstPtr inputCloud) const
grid_map::GridMap workingGridMap_
Eigen::Vector2d Position
const grid_map::GridMap & getGridMap() const
::pcl::PointCloud< Point > Pointcloud
void addLayerFromInputCloud(const std::string &layer)
#define ROS_INFO(...)
Pointcloud::Ptr downsampleInputCloud(Pointcloud::ConstPtr inputCloud) const
Eigen::Array2i Index
void setInputCloud(Pointcloud::ConstPtr inputCloud)
grid_map_pcl::PointcloudProcessor pointcloudProcessor_
Eigen::MatrixXf Matrix
Pointcloud::Ptr loadPointcloudFromPcd(const std::string &filename)
Definition: helpers.cpp:150
#define ROS_WARN_STREAM(args)
Eigen::Array2d Length
static void savePointCloudAsPcdFile(const std::string &filename, const Pointcloud &cloud)
void add(const std::string &layer, const double value=NAN)
Pointcloud::Ptr getPointcloudInsideGridMapCellBorder(const grid_map::Index &index) const
std::vector< std::vector< std::vector< float > > > clusterHeightsWithingGridMapCell_
#define ROS_INFO_STREAM(args)
void setParameters(const grid_map_pcl::PclLoaderParameters::Parameters parameters)
void calculateElevationFromPointsInsideGridMapCell(Pointcloud::ConstPtr cloud, std::vector< float > &heights) const
TFSIMD_FORCE_INLINE tfScalar length(const Quaternion &q)
void savePointCloudAsPcdFile(const std::string &filename) const
bool getIndex(const Position &position, Index &index) const
Index getIndexFromLinearIndex(size_t linearIndex, const Size &bufferSize, bool rowMajor=false)
const Length & getLength() const
grid_map_pcl::PclLoaderParameters params_
Pointcloud::Ptr removeOutliersFromInputCloud(Pointcloud::ConstPtr inputCloud) const


grid_map_pcl
Author(s): Dominic Jud , Edo Jelavic
autogenerated on Wed Jul 5 2023 02:23:51