tools.h
Go to the documentation of this file.
00001 #include <visualization_msgs/Marker.h>
00002 #include <Eigen/Core>
00003 #include <pcl/point_cloud.h>
00004 #include <pcl/point_types.h>
00005 #include <geometry_msgs/PoseStamped.h> 
00006 #include <tf/transform_datatypes.h>
00007 
00008 typedef pcl::PointXYZ myPointType;
00009 typedef pcl::PointCloud<myPointType> myCloudType;
00010 
00011 visualization_msgs::Marker visualize_filter_box(float xmin,float xmax,
00012                                                 float ymin,float ymax,
00013                                                 float zmin,float zmax, 
00014                                                 std_msgs::Header header);
00015 
00016 bool computeMainAxis(const myCloudType& pc, Eigen::Vector3f& mean, Eigen::Vector3f& main_axis, float eval_ratio_threshold);
00017 void box_filter(myCloudType::Ptr pc, float xmin,float xmax,float ymin,float ymax,float zmin,float zmax);
00018 geometry_msgs::PoseStamped getPoseStamped(const Eigen::Vector3f& pos, const tf::Quaternion& gripperRotation);
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


door_manipulation_tools
Author(s): Felix Endres
autogenerated on Wed Dec 26 2012 16:02:19