Public Member Functions | Protected Attributes | List of all members
RobotDynamics::Math::Point3d Class Reference

#include <Point3.hpp>

Inheritance diagram for RobotDynamics::Math::Point3d:
Inheritance graph
[legend]

Public Member Functions

void absoluteValue ()
 Set each element to the absolute value. More...
 
void clampMax (const double max)
 clamp any values that are greater than make to max More...
 
void clampMin (const double min)
 clamp any values that are less than min to min More...
 
void clampMinMax (const double min, const double max)
 clamp any values greater than max to max, and any value less than min to min More...
 
Vector3d cross (const Vector3d &v)
 Cross product between a point and vector. More...
 
EIGEN_STRONG_INLINE double * data ()
 
double distance (const Point3d &point) const
 
double distanceL1 (const Point3d &point) const
 L1 norm of two points. More...
 
double distanceLinf (const Point3d &point) const
 
double distanceSquared (const Point3d &point) const
 Square of the distance between two ponts, $ x^2 + y^2 + z^2 $. More...
 
EIGEN_STRONG_INLINE bool epsilonEquals (const Point3d &point, const double epsilon) const
 
bool operator!= (const Point3d &rhs)
 
template<typename T >
void operator*= (const T scale)
 
void operator+= (const Vector3d &v)
 
void operator-= (const Vector3d &v)
 
template<typename T >
void operator/= (const T scale)
 
Point3doperator= (const Point3d &other)
 
bool operator== (const Point3d &rhs)
 
 Point3d (const double x, const double y, const double z)
 
 Point3d (const Point3d &point)
 
 Point3d (const Vector3d &vector)
 
EIGEN_STRONG_INLINE Point3d ()
 
EIGEN_STRONG_INLINE void set (const std::vector< double > &vector)
 
EIGEN_STRONG_INLINE void set (const Point3d &point)
 
void set (const Math::Vector3d &v)
 
void set (const double x, const double y, const double z)
 
EIGEN_STRONG_INLINE void setToZero ()
 
void transform (const Math::SpatialTransform &X)
 Performs in place point transform. Given a point, $p$, this performs $ p = -X.E X.r + X.E p $. More...
 
Point3d transform_copy (const Math::SpatialTransform &X)
 
EIGEN_STRONG_INLINE Math::Vector3d vec () const
 
EIGEN_STRONG_INLINE double & x ()
 
EIGEN_STRONG_INLINE double x () const
 
EIGEN_STRONG_INLINE double & y ()
 
EIGEN_STRONG_INLINE double y () const
 
EIGEN_STRONG_INLINE double & z ()
 
EIGEN_STRONG_INLINE double z () const
 
virtual ~Point3d ()
 

Protected Attributes

double point [3]
 

Detailed Description

Definition at line 28 of file Point3.hpp.

Constructor & Destructor Documentation

RobotDynamics::Math::Point3d::Point3d ( const double  x,
const double  y,
const double  z 
)
inline

Definition at line 31 of file Point3.hpp.

RobotDynamics::Math::Point3d::Point3d ( const Point3d point)
inline

Definition at line 38 of file Point3.hpp.

RobotDynamics::Math::Point3d::Point3d ( const Vector3d vector)
inlineexplicit

Definition at line 43 of file Point3.hpp.

EIGEN_STRONG_INLINE RobotDynamics::Math::Point3d::Point3d ( )
inline

Definition at line 47 of file Point3.hpp.

virtual RobotDynamics::Math::Point3d::~Point3d ( )
inlinevirtual

Definition at line 51 of file Point3.hpp.

Member Function Documentation

void RobotDynamics::Math::Point3d::absoluteValue ( )
inline

Set each element to the absolute value.

Definition at line 167 of file Point3.hpp.

void RobotDynamics::Math::Point3d::clampMax ( const double  max)
inline

clamp any values that are greater than make to max

Parameters
max

Definition at line 135 of file Point3.hpp.

void RobotDynamics::Math::Point3d::clampMin ( const double  min)
inline

clamp any values that are less than min to min

Parameters
min

Definition at line 113 of file Point3.hpp.

void RobotDynamics::Math::Point3d::clampMinMax ( const double  min,
const double  max 
)
inline

clamp any values greater than max to max, and any value less than min to min

Parameters
min
max

Definition at line 158 of file Point3.hpp.

Vector3d RobotDynamics::Math::Point3d::cross ( const Vector3d v)
inline

Cross product between a point and vector.

Parameters
v
Returns

Definition at line 213 of file Point3.hpp.

EIGEN_STRONG_INLINE double* RobotDynamics::Math::Point3d::data ( )
inline

Definition at line 264 of file Point3.hpp.

double RobotDynamics::Math::Point3d::distance ( const Point3d point) const
inline

brief Distance between two points, $ \sqrt{x^2 + y^2 + z^2} $

Parameters
point
Returns
Distance

Definition at line 193 of file Point3.hpp.

double RobotDynamics::Math::Point3d::distanceL1 ( const Point3d point) const
inline

L1 norm of two points.

Parameters
point
Returns
L1 norm

Definition at line 203 of file Point3.hpp.

double RobotDynamics::Math::Point3d::distanceLinf ( const Point3d point) const
inline

L-infinity norm

Parameters
point
Returns

Definition at line 223 of file Point3.hpp.

double RobotDynamics::Math::Point3d::distanceSquared ( const Point3d point) const
inline

Square of the distance between two ponts, $ x^2 + y^2 + z^2 $.

Parameters
point
Returns
Distance squared

Definition at line 179 of file Point3.hpp.

EIGEN_STRONG_INLINE bool RobotDynamics::Math::Point3d::epsilonEquals ( const Point3d point,
const double  epsilon 
) const
inline

Compares if two points are within epsilon of each other

Parameters
point
epsilon
Returns
true if they are within epsilon, false otherwise

Definition at line 104 of file Point3.hpp.

bool RobotDynamics::Math::Point3d::operator!= ( const Point3d rhs)
inline

Definition at line 308 of file Point3.hpp.

template<typename T >
void RobotDynamics::Math::Point3d::operator*= ( const T  scale)
inline

Definition at line 281 of file Point3.hpp.

void RobotDynamics::Math::Point3d::operator+= ( const Vector3d v)
inline

Definition at line 313 of file Point3.hpp.

void RobotDynamics::Math::Point3d::operator-= ( const Vector3d v)
inline

Definition at line 320 of file Point3.hpp.

template<typename T >
void RobotDynamics::Math::Point3d::operator/= ( const T  scale)
inline

Definition at line 290 of file Point3.hpp.

Point3d& RobotDynamics::Math::Point3d::operator= ( const Point3d other)
inline

Definition at line 274 of file Point3.hpp.

bool RobotDynamics::Math::Point3d::operator== ( const Point3d rhs)
inline

Definition at line 298 of file Point3.hpp.

EIGEN_STRONG_INLINE void RobotDynamics::Math::Point3d::set ( const std::vector< double > &  vector)
inline

Definition at line 71 of file Point3.hpp.

EIGEN_STRONG_INLINE void RobotDynamics::Math::Point3d::set ( const Point3d point)
inline

Definition at line 76 of file Point3.hpp.

void RobotDynamics::Math::Point3d::set ( const Math::Vector3d v)
inline

Definition at line 81 of file Point3.hpp.

void RobotDynamics::Math::Point3d::set ( const double  x,
const double  y,
const double  z 
)
inline

Definition at line 86 of file Point3.hpp.

EIGEN_STRONG_INLINE void RobotDynamics::Math::Point3d::setToZero ( )
inline

Definition at line 93 of file Point3.hpp.

void RobotDynamics::Math::Point3d::transform ( const Math::SpatialTransform X)
inlinevirtual

Performs in place point transform. Given a point, $p$, this performs $ p = -X.E X.r + X.E p $.

Parameters
X

Implements RobotDynamics::Math::TransformableGeometricObject.

Definition at line 59 of file Point3.hpp.

Point3d RobotDynamics::Math::Point3d::transform_copy ( const Math::SpatialTransform X)
inline

Definition at line 64 of file Point3.hpp.

EIGEN_STRONG_INLINE Math::Vector3d RobotDynamics::Math::Point3d::vec ( ) const
inline

Definition at line 269 of file Point3.hpp.

EIGEN_STRONG_INLINE double& RobotDynamics::Math::Point3d::x ( )
inline

Definition at line 234 of file Point3.hpp.

EIGEN_STRONG_INLINE double RobotDynamics::Math::Point3d::x ( ) const
inline

Definition at line 239 of file Point3.hpp.

EIGEN_STRONG_INLINE double& RobotDynamics::Math::Point3d::y ( )
inline

Definition at line 244 of file Point3.hpp.

EIGEN_STRONG_INLINE double RobotDynamics::Math::Point3d::y ( ) const
inline

Definition at line 249 of file Point3.hpp.

EIGEN_STRONG_INLINE double& RobotDynamics::Math::Point3d::z ( )
inline

Definition at line 254 of file Point3.hpp.

EIGEN_STRONG_INLINE double RobotDynamics::Math::Point3d::z ( ) const
inline

Definition at line 259 of file Point3.hpp.

Member Data Documentation

double RobotDynamics::Math::Point3d::point[3]
protected

Definition at line 328 of file Point3.hpp.


The documentation for this class was generated from the following file:


rdl_dynamics
Author(s):
autogenerated on Tue Apr 20 2021 02:25:28