#include <visualization_msgs/Marker.h>
#include <Eigen/Core>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <geometry_msgs/PoseStamped.h>
#include <tf/transform_datatypes.h>
Go to the source code of this file.
Typedefs |
typedef pcl::PointCloud
< myPointType > | myCloudType |
typedef pcl::PointXYZ | myPointType |
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 &gripperRotation) |
visualization_msgs::Marker | visualize_filter_box (float xmin, float xmax, float ymin, float ymax, float zmin, float zmax, std_msgs::Header header) |
Typedef Documentation
Function Documentation