transforms.cpp File Reference

#include <stereo_wall_detection/geometry/angles.h>
#include <stereo_wall_detection/geometry/transforms.h>
#include <stereo_wall_detection/geometry/nearest.h>
#include <Eigen/SVD>
#include "QR"
#include "Householder"
#include "Jacobi"
#include "src/Core/util/DisableMSVCWarnings.h"
#include "src/misc/Solve.h"
#include "src/SVD/JacobiSVD.h"
#include "src/SVD/UpperBidiagonalization.h"
#include "src/Core/util/EnableMSVCWarnings.h"
Include dependency graph for transforms.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  cloud_geometry
namespace  cloud_geometry::transforms

Functions

void cloud_geometry::transforms::convertAxisAngleToRotationMatrix (const geometry_msgs::Point32 &axis, double angle, Eigen::Matrix3d &rotation)
 Convert an axis-angle representation to a 3x3 rotation matrix.
void cloud_geometry::transforms::getPlaneToPlaneTransformation (const std::vector< double > &plane_a, const geometry_msgs::Point32 &plane_b, float tx, float ty, float tz, Eigen::Matrix4d &transformation)
 Obtain a 4x4 rigid transformation matrix (with translation).
void cloud_geometry::transforms::getPlaneToPlaneTransformation (const std::vector< double > &plane_a, const std::vector< double > &plane_b, float tx, float ty, float tz, Eigen::Matrix4d &transformation)
 Obtain a 4x4 rigid transformation matrix (with translation).
bool cloud_geometry::transforms::getPointsRigidTransformation (const sensor_msgs::PointCloud &pc_a, const std::vector< int > &indices_a, const sensor_msgs::PointCloud &pc_b, const std::vector< int > &indices_b, Eigen::Matrix4d &transformation)
 Computes the rigid transformation between two point clouds.
bool cloud_geometry::transforms::getPointsRigidTransformation (const sensor_msgs::PointCloud &pc_a, const sensor_msgs::PointCloud &pc_b, Eigen::Matrix4d &transformation)
 Computes the rigid transformation between two point clouds.
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines


stereo_wall_detection
Author(s): Radu Bogdan Rusu
autogenerated on Fri Jan 11 09:37:21 2013