#include <vector>
#include <Eigen/Core>
#include <Eigen/Dense>
#include <geometry_msgs/PointStamped.h>
Go to the source code of this file.
Namespaces | |
robot_calibration | |
Calibration code lives under this namespace. | |
Functions | |
Eigen::Vector3d | robot_calibration::getCentroid (Eigen::MatrixXd points) |
Get the centroid of a point cloud. More... | |
Eigen::MatrixXd | robot_calibration::getMatrix (const std::vector< geometry_msgs::PointStamped > &points) |
Get an Eigen::MatrixXd from a vector of PointStamped. More... | |
bool | robot_calibration::getPlane (Eigen::MatrixXd points, Eigen::Vector3d &normal, double &d) |
Find the plane parameters for a point cloud. More... | |