#include <sensor_msgs/PointCloud2.h>
#include <pcl/io/pcd_io.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/console/print.h>
#include <pcl/console/parse.h>
#include <pcl/console/time.h>
Go to the source code of this file.
Functions |
void | compute (const sensor_msgs::PointCloud2::ConstPtr &input, sensor_msgs::PointCloud2 &output, float leaf_x, float leaf_y, float leaf_z, const std::string &field, double fmin, double fmax) |
std::string | default_field ("z") |
bool | loadCloud (const std::string &filename, sensor_msgs::PointCloud2 &cloud) |
int | main (int argc, char **argv) |
void | printHelp (int, char **argv) |
void | saveCloud (const std::string &filename, const sensor_msgs::PointCloud2 &output) |
Variables |
double | default_filter_max = std::numeric_limits<double>::max () |
double | default_filter_min = -std::numeric_limits<double>::max () |
float | default_leaf_size = 0.01f |
Function Documentation
void compute |
( |
const sensor_msgs::PointCloud2::ConstPtr & |
input, |
|
|
sensor_msgs::PointCloud2 & |
output, |
|
|
float |
leaf_x, |
|
|
float |
leaf_y, |
|
|
float |
leaf_z, |
|
|
const std::string & |
field, |
|
|
double |
fmin, |
|
|
double |
fmax |
|
) |
| |
bool loadCloud |
( |
const std::string & |
filename, |
|
|
sensor_msgs::PointCloud2 & |
cloud |
|
) |
| |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
void saveCloud |
( |
const std::string & |
filename, |
|
|
const sensor_msgs::PointCloud2 & |
output |
|
) |
| |
Variable Documentation