#include "tools.h"
#include <iostream>
#include <pcl/filters/passthrough.h>
#include <Eigen/SVD>
#include <cmath>
Go to the source code of this file.
Functions |
void | box_filter (myCloudType::Ptr pc, float xmin, float xmax, float ymin, float ymax, float zmin, float zmax) |
bool | computeMainAxis (const myCloudType &pc, Eigen::Vector3f &mean, Eigen::Vector3f &main_axis, float eval_ratio_threshold) |
geometry_msgs::PoseStamped | getPoseStamped (const Eigen::Vector3f &pos, const tf::Quaternion &rotation) |
visualization_msgs::Marker | visualize_filter_box (float xmin, float xmax, float ymin, float ymax, float zmin, float zmax, std_msgs::Header header) |
Function Documentation