Public Types | Public Member Functions | Protected Attributes | Related Functions | List of all members
Eigen::UniformScaling< _Scalar > Class Template Reference

Represents a generic uniform scaling transformation. More...

#include <ForwardDeclarations.h>

Public Types

typedef _Scalar Scalar
 

Public Member Functions

template<typename NewScalarType >
UniformScaling< NewScalarType > cast () const
 
const Scalarfactor () const
 
Scalarfactor ()
 
UniformScaling inverse () const
 
bool isApprox (const UniformScaling &other, const typename NumTraits< Scalar >::Real &prec=NumTraits< Scalar >::dummy_precision()) const
 
UniformScaling operator* (const UniformScaling &other) const
 
template<int Dim>
Transform< Scalar, Dim, Affineoperator* (const Translation< Scalar, Dim > &t) const
 
template<int Dim, int Mode, int Options>
internal::uniformscaling_times_affine_returntype< Scalar, Dim, Mode >::type operator* (const Transform< Scalar, Dim, Mode, Options > &t) const
 
template<typename Derived >
Eigen::internal::plain_matrix_type< Derived >::type operator* (const MatrixBase< Derived > &other) const
 
template<typename Derived , int Dim>
Matrix< Scalar, Dim, Dim > operator* (const RotationBase< Derived, Dim > &r) const
 
 UniformScaling ()
 
 UniformScaling (const Scalar &s)
 
template<typename OtherScalarType >
 UniformScaling (const UniformScaling< OtherScalarType > &other)
 

Protected Attributes

Scalar m_factor
 

Related Functions

(Note that these are not member functions.)

template<typename Derived , typename Scalar >
 operator* (const MatrixBase< Derived > &matrix, const UniformScaling< Scalar > &s)
 

Detailed Description

template<typename _Scalar>
class Eigen::UniformScaling< _Scalar >

Represents a generic uniform scaling transformation.

Template Parameters
_Scalarthe scalar type, i.e., the type of the coefficients.

This class represent a uniform scaling transformation. It is the return type of Scaling(Scalar), and most of the time this is the only way it is used. In particular, this class is not aimed to be used to store a scaling transformation, but rather to make easier the constructions and updates of Transform objects.

To represent an axis aligned scaling, use the DiagonalMatrix class.

See also
Scaling(), class DiagonalMatrix, MatrixBase::asDiagonal(), class Translation, class Transform

Definition at line 297 of file ForwardDeclarations.h.

Member Typedef Documentation

◆ Scalar

template<typename _Scalar>
typedef _Scalar Eigen::UniformScaling< _Scalar >::Scalar

the scalar type of the coefficients

Definition at line 53 of file Eigen/src/Geometry/Scaling.h.

Constructor & Destructor Documentation

◆ UniformScaling() [1/3]

template<typename _Scalar>
Eigen::UniformScaling< _Scalar >::UniformScaling ( )
inline

Default constructor without initialization.

Definition at line 62 of file Eigen/src/Geometry/Scaling.h.

◆ UniformScaling() [2/3]

template<typename _Scalar>
Eigen::UniformScaling< _Scalar >::UniformScaling ( const Scalar s)
inlineexplicit

Constructs and initialize a uniform scaling transformation

Definition at line 64 of file Eigen/src/Geometry/Scaling.h.

◆ UniformScaling() [3/3]

template<typename _Scalar>
template<typename OtherScalarType >
Eigen::UniformScaling< _Scalar >::UniformScaling ( const UniformScaling< OtherScalarType > &  other)
inlineexplicit

Copy constructor with scalar type conversion

Definition at line 113 of file Eigen/src/Geometry/Scaling.h.

Member Function Documentation

◆ cast()

template<typename _Scalar>
template<typename NewScalarType >
UniformScaling<NewScalarType> Eigen::UniformScaling< _Scalar >::cast ( ) const
inline
Returns
*this with scalar type casted to NewScalarType

Note that if NewScalarType is equal to the current scalar type of *this then this function smartly returns a const reference to *this.

Definition at line 108 of file Eigen/src/Geometry/Scaling.h.

◆ factor() [1/2]

template<typename _Scalar>
const Scalar& Eigen::UniformScaling< _Scalar >::factor ( ) const
inline

Definition at line 66 of file Eigen/src/Geometry/Scaling.h.

◆ factor() [2/2]

template<typename _Scalar>
Scalar& Eigen::UniformScaling< _Scalar >::factor ( )
inline

Definition at line 67 of file Eigen/src/Geometry/Scaling.h.

◆ inverse()

template<typename _Scalar>
UniformScaling Eigen::UniformScaling< _Scalar >::inverse ( ) const
inline
Returns
the inverse scaling

Definition at line 99 of file Eigen/src/Geometry/Scaling.h.

◆ isApprox()

template<typename _Scalar>
bool Eigen::UniformScaling< _Scalar >::isApprox ( const UniformScaling< _Scalar > &  other,
const typename NumTraits< Scalar >::Real prec = NumTraits<Scalar>::dummy_precision() 
) const
inline
Returns
true if *this is approximately equal to other, within the precision determined by prec.
See also
MatrixBase::isApprox()

Definition at line 120 of file Eigen/src/Geometry/Scaling.h.

◆ operator*() [1/5]

template<typename _Scalar>
UniformScaling Eigen::UniformScaling< _Scalar >::operator* ( const UniformScaling< _Scalar > &  other) const
inline

Concatenates two uniform scaling

Definition at line 70 of file Eigen/src/Geometry/Scaling.h.

◆ operator*() [2/5]

template<typename Scalar >
template<int Dim>
Transform< Scalar, Dim, Affine > Eigen::UniformScaling< Scalar >::operator* ( const Translation< Scalar, Dim > &  t) const
inline

Concatenates a uniform scaling and a translation

Definition at line 176 of file Eigen/src/Geometry/Scaling.h.

◆ operator*() [3/5]

template<typename _Scalar>
template<int Dim, int Mode, int Options>
internal::uniformscaling_times_affine_returntype<Scalar,Dim,Mode>::type Eigen::UniformScaling< _Scalar >::operator* ( const Transform< Scalar, Dim, Mode, Options > &  t) const
inline

Concatenates a uniform scaling and an affine transformation

Definition at line 81 of file Eigen/src/Geometry/Scaling.h.

◆ operator*() [4/5]

template<typename _Scalar>
template<typename Derived >
Eigen::internal::plain_matrix_type<Derived>::type Eigen::UniformScaling< _Scalar >::operator* ( const MatrixBase< Derived > &  other) const
inline

Concatenates a uniform scaling and a linear transformation matrix

Definition at line 91 of file Eigen/src/Geometry/Scaling.h.

◆ operator*() [5/5]

template<typename _Scalar>
template<typename Derived , int Dim>
Matrix<Scalar,Dim,Dim> Eigen::UniformScaling< _Scalar >::operator* ( const RotationBase< Derived, Dim > &  r) const
inline

Definition at line 95 of file Eigen/src/Geometry/Scaling.h.

Member Data Documentation

◆ m_factor

template<typename _Scalar>
Scalar Eigen::UniformScaling< _Scalar >::m_factor
protected

Definition at line 57 of file Eigen/src/Geometry/Scaling.h.


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


gtsam
Author(s):
autogenerated on Tue Jul 4 2023 02:44:19