Namespaces | Functions
eigen_geometry.h File Reference
#include <vector>
#include <Eigen/Core>
#include <Eigen/Dense>
#include <geometry_msgs/PointStamped.h>
Include dependency graph for eigen_geometry.h:
This graph shows which files directly or indirectly include this file:

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...
 


robot_calibration
Author(s): Michael Ferguson
autogenerated on Wed May 24 2023 02:30:23