Functions | Variables
passthrough_filter.cpp File Reference
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_types.h>
#include <pcl/io/pcd_io.h>
#include <pcl/console/print.h>
#include <pcl/console/parse.h>
#include <pcl/console/time.h>
#include <pcl/filters/passthrough.h>
Include dependency graph for passthrough_filter.cpp:

Go to the source code of this file.

Functions

void compute (const sensor_msgs::PointCloud2::ConstPtr &input, sensor_msgs::PointCloud2 &output, std::string field_name, float min, float max, bool inside, bool keep_organized)
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

std::string default_field_name = "z"
bool default_inside = true
bool default_keep_organized = true
float default_max = 1.0f
float default_min = 0.0f

Function Documentation

void compute ( const sensor_msgs::PointCloud2::ConstPtr &  input,
sensor_msgs::PointCloud2 &  output,
std::string  field_name,
float  min,
float  max,
bool  inside,
bool  keep_organized 
)

Definition at line 89 of file passthrough_filter.cpp.

bool loadCloud ( const std::string &  filename,
sensor_msgs::PointCloud2 &  cloud 
)

Definition at line 74 of file passthrough_filter.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 125 of file passthrough_filter.cpp.

void printHelp ( int  ,
char **  argv 
)

Definition at line 59 of file passthrough_filter.cpp.

void saveCloud ( const std::string &  filename,
const sensor_msgs::PointCloud2 &  output 
)

Definition at line 110 of file passthrough_filter.cpp.


Variable Documentation

std::string default_field_name = "z"

Definition at line 56 of file passthrough_filter.cpp.

bool default_inside = true

Definition at line 54 of file passthrough_filter.cpp.

Definition at line 55 of file passthrough_filter.cpp.

float default_max = 1.0f

Definition at line 53 of file passthrough_filter.cpp.

float default_min = 0.0f

Definition at line 52 of file passthrough_filter.cpp.



pcl
Author(s): Open Perception
autogenerated on Mon Oct 6 2014 03:19:13