Classes | Typedefs | Enumerations | Functions | Variables
tuw Namespace Reference

Classes

class  Command
 
class  Figure
 
class  GridMap
 
class  LayeredFigure
 
class  LayeredMaps
 
class  Line2D
 
class  LineSegment2D
 
class  LineSegment2DDetector
 
class  LineSegment2DDetectorParameter
 
class  Point2D
 
class  Polar2D
 
class  Pose2D
 
class  WorldScopedMaps
 

Typedefs

using CommandConstPtr = std::shared_ptr< Command const >
 
using CommandPtr = std::shared_ptr< Command >
 Prototype. More...
 
using FigureConstPtr = std::shared_ptr< Figure const >
 
using FigurePtr = std::shared_ptr< Figure >
 Prototype. More...
 
using LayeredFigureConstPtr = std::shared_ptr< const LayeredFigure >
 
using LayeredFigurePtr = std::shared_ptr< LayeredFigure >
 
using LayeredMapsCostPtr = std::shared_ptr< const LayeredMaps >
 
using LayeredMapsPtr = std::shared_ptr< LayeredMaps >
 
using Line2DConstPtr = std::shared_ptr< Line2D const >
 
using Line2DPtr = std::shared_ptr< Line2D >
 Prototype. More...
 
using LineSegment2DConstPtr = std::shared_ptr< LineSegment2D const >
 
using LineSegment2DDetectorConstPtr = std::shared_ptr< LineSegment2DDetector const >
 
using LineSegment2DDetectorParameterConstPtr = std::shared_ptr< LineSegment2DDetectorParameter const >
 
using LineSegment2DDetectorParameterPtr = std::shared_ptr< LineSegment2DDetectorParameter >
 Prototype. More...
 
using LineSegment2DDetectorPtr = std::shared_ptr< LineSegment2DDetector >
 Prototype. More...
 
using LineSegment2DPtr = std::shared_ptr< LineSegment2D >
 Prototype. More...
 
using Point2DConstPtr = std::shared_ptr< Point2D const >
 
using Point2DPtr = std::shared_ptr< Point2D >
 
using Polar2DConstPtr = std::shared_ptr< Polar2D const >
 
using Polar2DPtr = std::shared_ptr< Polar2D >
 Prototype. More...
 
using Pose2DConstPtr = std::shared_ptr< Pose2D const >
 
using Pose2DPtr = std::shared_ptr< Pose2D >
 
typedef cv::Matx< double, 3, 3 > Tf2D
 
using WorldScopedMapsConstPtr = std::shared_ptr< WorldScopedMaps const >
 
using WorldScopedMapsPtr = std::shared_ptr< WorldScopedMaps >
 Prototype. More...
 

Enumerations

enum  DistributionType { NORMAL_DISTRIBUTION = 0, UNIFORM_DISTRIBUTION = 1, GRID_DISTRIBUTION = 2 }
 

Functions

double angle_difference (double alpha0, double angle1)
 
double angle_normalize (double angle, double min_angle=-M_PI, double max_angle=+M_PI)
 
cv::Vec< double, 3 > append (const cv::Vec< double, 2 > &src, double value=1.0)
 
cv::Vec< double, 4 > append (const cv::Vec< double, 3 > &src, double value=1.0)
 
template<typename Quaternion >
void EulerPitchToQuaternion (double pitch, Quaternion &q)
 
template<typename Quaternion >
void EulerToQuaternion (double roll, const Quaternion &q)
 
template<typename Quaternion >
void EulerToQuaternion (double pitch, double roll, double yaw, const Quaternion &q)
 
template<typename Quaternion >
void EulerYawToQuaternion (double yaw, Quaternion &q)
 
std::string format (const cv::Mat_< int8_t > &m)
 
std::string format (const cv::Mat_< int > &m)
 
std::string format (const cv::Mat_< float > &m)
 
std::string format (const cv::Mat_< double > &m)
 
std::string format (const cv::Matx33d &m)
 
template<typename Quaternion >
void QuaternionToEuler (const Quaternion &q, double &roll, double &pitch, double &yaw)
 
template<typename Quaternion >
void QuaternionToPitch (const Quaternion &q, double &pitch)
 
template<typename Quaternion >
void QuaternionToRoll (const Quaternion &q, double &roll)
 
template<typename Quaternion >
void QuaternionToYaw (const Quaternion &q, double &yaw)
 

Variables

static std::map< DistributionType, std::string > DistributionTypeName
 

Typedef Documentation

using tuw::CommandConstPtr = typedef std::shared_ptr< Command const>

Definition at line 11 of file command.h.

using tuw::CommandPtr = typedef std::shared_ptr< Command >

Prototype.

Definition at line 10 of file command.h.

using tuw::FigureConstPtr = typedef std::shared_ptr< Figure const>

Definition at line 12 of file figure.h.

using tuw::FigurePtr = typedef std::shared_ptr< Figure >

Prototype.

Definition at line 11 of file figure.h.

using tuw::LayeredFigureConstPtr = typedef std::shared_ptr< const LayeredFigure >

Definition at line 47 of file layered_figure.h.

using tuw::LayeredFigurePtr = typedef std::shared_ptr< LayeredFigure >

Definition at line 46 of file layered_figure.h.

using tuw::LayeredMapsCostPtr = typedef std::shared_ptr< const LayeredMaps >

Definition at line 44 of file layered_maps.h.

using tuw::LayeredMapsPtr = typedef std::shared_ptr< LayeredMaps >

Definition at line 43 of file layered_maps.h.

using tuw::Line2DConstPtr = typedef std::shared_ptr< Line2D const>

Definition at line 10 of file line2d.h.

using tuw::Line2DPtr = typedef std::shared_ptr< Line2D >

Prototype.

Definition at line 9 of file line2d.h.

using tuw::LineSegment2DConstPtr = typedef std::shared_ptr< LineSegment2D const>

Definition at line 10 of file linesegment2d.h.

using tuw::LineSegment2DDetectorConstPtr = typedef std::shared_ptr< LineSegment2DDetector const>

Definition at line 33 of file linesegment2d_detector.h.

Definition at line 11 of file linesegment2d_detector.h.

Prototype.

Definition at line 10 of file linesegment2d_detector.h.

using tuw::LineSegment2DDetectorPtr = typedef std::shared_ptr< LineSegment2DDetector >

Prototype.

Definition at line 32 of file linesegment2d_detector.h.

using tuw::LineSegment2DPtr = typedef std::shared_ptr< LineSegment2D >

Prototype.

Definition at line 9 of file linesegment2d.h.

using tuw::Point2DConstPtr = typedef std::shared_ptr< Point2D const>

Definition at line 14 of file point2d.h.

using tuw::Point2DPtr = typedef std::shared_ptr< Point2D >

Definition at line 13 of file point2d.h.

using tuw::Polar2DConstPtr = typedef std::shared_ptr< Polar2D const>

Definition at line 10 of file polar2d.h.

using tuw::Polar2DPtr = typedef std::shared_ptr< Polar2D >

Prototype.

Definition at line 9 of file polar2d.h.

using tuw::Pose2DConstPtr = typedef std::shared_ptr< Pose2D const>

Definition at line 11 of file pose2d.h.

using tuw::Pose2DPtr = typedef std::shared_ptr< Pose2D >

Definition at line 10 of file pose2d.h.

typedef cv::Matx<double, 3, 3> tuw::Tf2D

Definition at line 10 of file utils.h.

using tuw::WorldScopedMapsConstPtr = typedef std::shared_ptr< WorldScopedMaps const>

Definition at line 12 of file world_scoped_maps.h.

using tuw::WorldScopedMapsPtr = typedef std::shared_ptr< WorldScopedMaps >

Prototype.

Definition at line 11 of file world_scoped_maps.h.

Enumeration Type Documentation

Enumerator
NORMAL_DISTRIBUTION 
UNIFORM_DISTRIBUTION 
GRID_DISTRIBUTION 

Definition at line 16 of file tuw_geometry.h.

Function Documentation

double tuw::angle_difference ( double  alpha0,
double  angle1 
)
inline

computes the angle difference between two angles by taking into account the circular space

Parameters
alpha0
angle1
Returns
difference

Definition at line 59 of file utils.h.

double tuw::angle_normalize ( double  angle,
double  min_angle = -M_PI,
double  max_angle = +M_PI 
)
inline

normalizes an angle between min_angle and max_angle but max_angle - min_angle >= 2PI

Parameters
angleto normalize
min_angle
max_angle
Returns
normalize angle

Definition at line 43 of file utils.h.

cv::Vec<double, 3> tuw::append ( const cv::Vec< double, 2 > &  src,
double  value = 1.0 
)
inline

creates a new vector by adding a single component usable to homogeneous vectors

Parameters
srcto normalize
value
Returns
extended vector

Definition at line 19 of file utils.h.

cv::Vec<double, 4> tuw::append ( const cv::Vec< double, 3 > &  src,
double  value = 1.0 
)
inline

creates a new vector by adding a single component usable to homogeneous vectors

Parameters
srcto normalize
value
Returns
extended vector

Definition at line 31 of file utils.h.

template<typename Quaternion >
void tuw::EulerPitchToQuaternion ( double  pitch,
Quaternion &  q 
)

Euler Pitch to Quaternion roation arount Y

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 69 of file utils.h.

template<typename Quaternion >
void tuw::EulerToQuaternion ( double  roll,
const Quaternion &  q 
)

Euler Roll to Quaternion roation arount X

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 86 of file utils.h.

template<typename Quaternion >
void tuw::EulerToQuaternion ( double  pitch,
double  roll,
double  yaw,
const Quaternion &  q 
)

Euler to Quaternion

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 118 of file utils.h.

template<typename Quaternion >
void tuw::EulerYawToQuaternion ( double  yaw,
Quaternion &  q 
)

Euler Yaw to Quaternion rotation around Z

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 102 of file utils.h.

std::string tuw::format ( const cv::Mat_< int8_t > &  m)

Definition at line 11 of file utils.cpp.

std::string tuw::format ( const cv::Mat_< int > &  m)

Definition at line 22 of file utils.cpp.

std::string tuw::format ( const cv::Mat_< float > &  m)

Definition at line 33 of file utils.cpp.

std::string tuw::format ( const cv::Mat_< double > &  m)

Definition at line 45 of file utils.cpp.

std::string tuw::format ( const cv::Matx33d &  m)

Definition at line 57 of file utils.cpp.

template<typename Quaternion >
void tuw::QuaternionToEuler ( const Quaternion &  q,
double &  roll,
double &  pitch,
double &  yaw 
)

Quaternion to euler angles

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 179 of file utils.h.

template<typename Quaternion >
void tuw::QuaternionToPitch ( const Quaternion &  q,
double &  pitch 
)

Quaternion to an euler pitch angle

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 151 of file utils.h.

template<typename Quaternion >
void tuw::QuaternionToRoll ( const Quaternion &  q,
double &  roll 
)

Quaternion to an euler roll angle

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 139 of file utils.h.

template<typename Quaternion >
void tuw::QuaternionToYaw ( const Quaternion &  q,
double &  yaw 
)

Quaternion to an euler yaw angle

See also
https://en.wikipedia.org/wiki/Conversion_between_quaternions_and_Euler_angles

Definition at line 166 of file utils.h.

Variable Documentation

std::map<DistributionType, std::string> tuw::DistributionTypeName
static

Definition at line 21 of file tuw_geometry.h.



tuw_geometry
Author(s): Markus Bader
autogenerated on Mon Jun 10 2019 15:33:09