Classes | |
class | CloudAccumulator |
Demonstration for how to create a registered point cloud map using the rc_visard. More... | |
class | CloudVisualizer |
Displays one cloud using the PCLVisualizer. More... | |
Functions | |
pointcloud_t::Ptr | 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 | myPoseStampedMsgToTF (const geometry_msgs::PoseStamped &msg) |
Eigen::Affine3f | toAffine (const geometry_msgs::TransformStamped &tf_stamped) |
void | voxelGridFilter (double size, pointcloud_t::Ptr input, pointcloud_t::Ptr &output) |
Filter if size >= 0, otherwise just copy the pointer. More... | |
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)
Definition at line 62 of file cloud_accumulator.cc.
|
inline |
Definition at line 20 of file cloud_accumulator.cc.
|
inline |
Definition at line 34 of file cloud_accumulator.cc.
void rc::voxelGridFilter | ( | double | size, |
pointcloud_t::Ptr | input, | ||
pointcloud_t::Ptr & | output | ||
) |
Filter if size >= 0, otherwise just copy the pointer.
Definition at line 48 of file cloud_accumulator.cc.