24 #include <Eigen/Dense> 26 #include <pcl/point_types.h> 27 #include <pcl/point_cloud.h> 66 Eigen::Vector3d
computeMedian(std::vector<Eigen::Vector3d> points);
75 pcl::PointXYZ
computeMedian(std::vector<pcl::PointXYZ> points);
89 pcl::PointXYZ
findPoint3D(pcl::PointCloud<pcl::PointXYZ>::Ptr cloud, pcl::PointXYZ current_point,
int row,
int column,
int image_height,
int image_width);
pcl::PointXYZ findPoint3D(pcl::PointCloud< pcl::PointXYZ >::Ptr cloud, pcl::PointXYZ current_point, int row, int column, int image_height, int image_width)
Finds the corresponding 3D point to the given 2D point.
Eigen::Vector3d parseStringVector(std::string input_string, std::string delim)
Parses the given string and returns the 3D-double-vector described by it.
Eigen::Vector3d computeMedian(std::vector< Eigen::Vector3d > points)
Computes the median of the given points.
rgb hsv2rgb(hsv in)
Converts the given hsv-color to rgb.
Eigen::Vector2i parseStringVector2i(std::string input_string, std::string delim)
Parses the given string and returns the 2D-int-vector described by it.