Go to the documentation of this file. 1 #ifndef PYTHON_PYPOINT_MATCHER_HELPER_H
2 #define PYTHON_PYPOINT_MATCHER_HELPER_H
4 #include <pybind11/pybind11.h>
5 #include <pybind11/eigen.h>
6 #include <pybind11/stl.h>
7 #include <pybind11/stl_bind.h>
11 namespace py = pybind11;
71 PYBIND11_MAKE_OPAQUE(std::vector<std::string>)
72 PYBIND11_MAKE_OPAQUE(std::map<
std::string, std::map<std::string, std::string>>)
73 PYBIND11_MAKE_OPAQUE(
std::map<
std::
string,
unsigned>)
75 PYBIND11_MAKE_OPAQUE(
std::map<
std::
string,
std::
string>)
76 PYBIND11_MAKE_OPAQUE(
std::map<
std::
string,
std::vector<
std::
string>>)
77 PYBIND11_MAKE_OPAQUE(
std::vector<
Label>)
83 #endif //PYTHON_PYPOINT_MATCHER_HELPER_H
PM::Transformations Transformations
PM::DataPointsFilter DataPointsFilter
std::vector< Vector, Eigen::aligned_allocator< Vector > > VectorVector
A vector of vector over ScalarType, not a matrix.
PM::ICPSequence ICPSequence
Matrix OutlierWeights
Weights of the associations between the points in Matches and the points in the reference.
ErrorMinimizer::ErrorElements ErrorElements
PM::Parameters Parameters
PM::DataPoints DataPoints
float ScalarType
The scalar type.
PM::DataPointsFilters DataPointsFilters
PM::QuaternionVector QuaternionVector
Eigen::Array< float, Eigen::Dynamic, Eigen::Dynamic > Array
A dense array over ScalarType.
Generator::AffineTransform AffineTransform
PM::Quaternion Quaternion
The logger interface, used to output warnings and informations.
std::vector< Quaternion, Eigen::aligned_allocator< Quaternion > > QuaternionVector
A vector of quaternions over ScalarType.
PointMatcherSupport::Parametrizable::ParametersDoc ParametersDoc
PM::VectorVector VectorVector
Eigen::Matrix< std::int64_t, Eigen::Dynamic, Eigen::Dynamic > Int64Matrix
A dense signed 64-bits matrix.
PM::PointCloudGenerator Generator
PM::TransformationChecker TransformationChecker
A structure holding data ready for minimization. The data are "normalized", for instance there are no...
std::vector< ParameterDoc > ParametersDoc
The documentation of all parameters.
PM::OutlierWeights OutlierWeights
PM::Int64Matrix Int64Matrix
Eigen::Matrix< float, Eigen::Dynamic, Eigen::Dynamic > Matrix
A dense matrix over ScalarType.
PM::TransformationCheckers TransformationCheckers
PM::ErrorMinimizer ErrorMinimizer
DataPoints::Labels Labels
PM::Transformation Transformation
Eigen::Matrix< int, Eigen::Dynamic, Eigen::Dynamic > IntMatrix
A dense integer matrix.
Parametrizable::InvalidParameter InvalidParameter
An exception thrown when one tries to fetch the value of an unexisting parameter.
Eigen::Matrix< float, Eigen::Dynamic, 1 > Vector
A vector over ScalarType.
Parametrizable::ParameterDoc ParameterDoc
pms::Parametrizable Parametrizable
PM::OutlierFilters OutlierFilters
std::string Parameter
alias
The superclass of classes that are constructed using generic parameters. This class provides the para...
PM::TransformationParameters TransformationParameters
The documentation of a parameter.
PM::ICPChainBase ICPChaineBase
An error minimizer will compute a transformation matrix such as to minimize the error between the rea...
Functions and classes that are not dependant on scalar type are defined in this namespace.
PM::ScalarType ScalarType
PM::OutlierFilter OutlierFilter
Parametrizable::Parameter Parameter
Generator::StaticCoordVector StaticCoordVector
Eigen::Quaternion< float > Quaternion
A quaternion over ScalarType.
std::map< std::string, Parameter > Parameters
Parameters stored as a map of string->string.
A factor for subclasses of Interface.
Matrix TransformationParameters
A matrix holding the parameters a transformation.
The name for a certain number of dim.