#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>
Go to the source code of this file.
Namespaces | |
rc | |
Macros | |
#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) More... | |
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. More... | |
#define PCL_NO_PRECOMPILE |
Definition at line 1 of file cloud_accumulator.cc.