Namespaces | Defines | Functions
cloud_accumulator.cc File Reference
#include "cloud_accumulator.h"
#include <limits>
#include <pcl_ros/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl_conversions/pcl_conversions.h>
#include <pcl/point_cloud.h>
#include <pcl/visualization/pcl_visualizer.h>
#include <pcl/common/transforms.h>
#include <pcl/filters/passthrough.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/io/pcd_io.h>
#include <boost/lexical_cast.hpp>
Include dependency graph for cloud_accumulator.cc:

Go to the source code of this file.

Namespaces

namespace  rc

Defines

#define PCL_NO_PRECOMPILE

Functions

pointcloud_t::Ptr rc::distanceFiltered (double min, double max, const pointcloud_t::ConstPtr input)
 Filter cloud along the optical axis (Z) Filter if min < max, otherwise copy (deep, not only the pointer)
geometry_msgs::TransformStamped rc::myPoseStampedMsgToTF (const geometry_msgs::PoseStamped &msg)
Eigen::Affine3f rc::toAffine (const geometry_msgs::TransformStamped &tf_stamped)
void rc::voxelGridFilter (double size, pointcloud_t::Ptr input, pointcloud_t::Ptr &output)
 Filter if size >= 0, otherwise just copy the pointer.

Define Documentation

Definition at line 1 of file cloud_accumulator.cc.



rc_cloud_accumulator
Author(s): Felix Endres
autogenerated on Thu Jun 6 2019 19:56:20