Namespaces | Functions
data_functions.h File Reference
#include <robot_calibration_msgs/CalibrationData.h>
Include dependency graph for data_functions.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  robot_calibration
 

Calibration code lives under this namespace.


Functions

geometry_msgs::PointStamped robot_calibration::computeAverage (std::vector< geometry_msgs::PointStamped > points)
 Compute the average point based on a vector of points.
double robot_calibration::computeAverage (std::vector< double > values)
 Compute the average value based on a vector of doubles.
geometry_msgs::PointStamped robot_calibration::computeDifference (geometry_msgs::PointStamped &p1, geometry_msgs::PointStamped &p2)
 Compute the difference in between two points. Note that points must be in the same frame.
double robot_calibration::getDistance (geometry_msgs::PointStamped &p1, geometry_msgs::PointStamped &p2)
 Compute the distance in Euclidean space between two points. Note that points must be in the same frame.
std::vector
< geometry_msgs::PointStamped > 
robot_calibration::getErrorPoints (ChainModel *chain1, ChainModel *chain2, CalibrationOffsetParser *offsets, robot_calibration_msgs::CalibrationData &data)
 Returns a vector of points representing the differences between two projections using different chains but the same calibration offsets.
std::vector< double > robot_calibration::getErrors (ChainModel *chain1, ChainModel *chain2, CalibrationOffsetParser *offsets, robot_calibration_msgs::CalibrationData &data)
 Returns the distance between each point in a given sample.
void robot_calibration::printComparePoints (ChainModel *chain1, ChainModel *chain2, CalibrationOffsetParser *before, CalibrationOffsetParser *after, robot_calibration_msgs::CalibrationData &data)
void robot_calibration::printComparePointsInternal (ChainModel *chain1, ChainModel *chain2, CalibrationOffsetParser *offsets, robot_calibration_msgs::CalibrationData &data)
void robot_calibration::printSimpleDistanceError (ChainModel *chain1, ChainModel *chain2, CalibrationOffsetParser *before, CalibrationOffsetParser *after, robot_calibration_msgs::CalibrationData &data)


robot_calibration
Author(s): Michael Ferguson
autogenerated on Sat May 20 2017 02:35:31