Basic Image AlgorithmS Library  2.8.0
 All Classes Namespaces Functions Variables Typedefs Enumerations Enumerator Friends Groups Pages
Public Types | Public Member Functions | Protected Member Functions | Protected Attributes | Related Functions | List of all members
BIAS::Vector< T > Class Template Reference

class for column vectors with arbitrary size More...

#include <Base/Math/GenerateGauss.hh>

+ Inheritance diagram for BIAS::Vector< T >:
+ Collaboration diagram for BIAS::Vector< T >:

Public Types

typedef const T * const_iterator
 
typedef const T & const_reference
 
typedef T element_type
 
typedef T * iterator
 
typedef T * pointer
 
typedef T & reference
 
typedef Subscript size_type
 
typedef T value_type
 

Public Member Functions

iterator begin ()
 
const iterator begin () const
 
void clear ()
 stl conform interface JW More...
 
Subscript dim () const
 
double Dist (const Vector< T > &vec) const
 Return the euclidean distance of 2 vectors. More...
 
double DistLinf (const Vector< T > &vec) const
 Return the L infinity distance of 2 vectors. More...
 
void ElementwiseProduct (const Vector< T > &arg, Vector< T > &dest) const
 multiply this with arg elementwise and store the result in dest More...
 
Vector< T > ElementwiseProduct (const Vector< T > &arg) const
 multiply this with arg elementwise and return the result More...
 
iterator end ()
 
const iterator end () const
 
void Fill (const T &scalar)
 fills complete Vector with scalar value More...
 
T * GetData () const
 get the pointer to the data array of the vector (for faster direct memory access) More...
 
T * GetDataLast () const
 Get the pointer to last element of the data array. More...
 
double GetMean (void) const
 
int GetNumElements () const
 conformance interface JW More...
 
void GetSTLVec (std::vector< T > &vec) const
 
std::vector< T > GetSTLVec () const
 
bool IsZero () const
 
void KroneckerProduct (const Vector< T > &arg, Vector< T > &dst) const
 kronecker product More...
 
Subscript lbound () const
 
double Length () const
 returns the Euclidean Length of the Vector More...
 
bool Load (const std::string &filename)
 method to load directly from a given filename. More...
 
void Multiply (const T &scalar, Vector< T > &res) const
 multiply components with scalar storing result in res More...
 
void MultiplyIP (const T &scalar)
 in place multiplication with scalar More...
 
Vector< T > & newsize (Subscript N)
 
NormL1 () const
 Return the L1 norm: |a| + |b| + |c| + ... More...
 
double NormL2 () const
 Return the L2 norm: sqrt(a^1 + a^2 + ...) More...
 
bool operator!= (const Vector< T > &vec) const
 
reference operator() (Subscript i)
 
const_reference operator() (Subscript i) const
 
void operator*= (T scalar)
 
void operator+= (const Vector< T > &vec)
 
void operator-= (const Vector< T > &vec)
 
void operator/= (T scalar)
 
Vector< T > & operator= (const TNT::Vector< T > &vec)
 assignment operators calling corresponding operator from base class "TNT::Vector" if appropriate More...
 
Vector< T > & operator= (const Vector< T > &vec)
 assignment operator calling corresponding operator from base class "TNT::Vector" if appropriate More...
 
bool operator== (const Vector< T > &vec) const
 
reference operator[] (Subscript i)
 
const_reference operator[] (Subscript i) const
 
Matrix< T > OuterProduct (const Vector< T > &v) const
 outer product, constructs a matrix. More...
 
bool Save (const std::string &filename) const
 method to save directly to a given filename. More...
 
ScalarProduct (const Vector< T > &argvec) const
 scalar product (inner product) of two vectors returning a scalr More...
 
void ScalarProduct (const Vector< T > &argvec, T &result) const
 scalar product (inner product) of two vectors returning a scalar, storing the result in result More...
 
void Set (const T &scalar)
 
void SetZero ()
 equivalent to matrix call More...
 
unsigned int Size () const
 length of the vector More...
 
Subscript size () const
 
void Sub (const Vector< T > &arg, Vector< T > &dest) const
 Substraction of vector, storing results in destination vector. More...
 
void SubIP (const Vector< T > &argmat)
 in place subtracting More...
 
Vector< T > SubVec (int length, int offset=0) const
 returns the subvector with elements between offset and offset+length-1 More...
 
 Vector ()
 
 Vector (const int rows)
 
 Vector (const int rows, const std::string &s)
 
 Vector (int rows, const T &value)
 assignment with a constant value for all elements (=set) More...
 
 Vector (int rows, const T *v)
 
 Vector (const Vector< T > &v)
 
 Vector (const TNT::Vector< T > &v)
 
 Vector (const Vector2< T > &v)
 
 Vector (const Vector3< T > &v)
 
 Vector (const Vector4< T > &v)
 
 Vector (const std::vector< T > &v)
 
virtual ~Vector ()
 

Protected Member Functions

void copy (const T *v)
 
void destroy ()
 
void initialize (Subscript N)
 
void set (const T &val)
 

Protected Attributes

Subscript n_
 
T * v_
 
T * vm1_
 

Related Functions

(Note that these are not member functions.)

template<class T >
Vector< T > operator* (const Vector< T > &v, const T &scalar)
 
template<class T >
Vector< T > operator* (const T &scalar, const Vector< T > &v)
 
template<class T >
operator* (const Vector< T > &v, const Vector< T > &argvec)
 
template<class T >
Vector< T > operator* (const Matrix< T > &mat, const Vector2< T > &vec)
 
template<class T >
std::ostream & operator<< (std::ostream &os, const BIAS::Vector< T > &vec)
 

Detailed Description

template<class T>
class BIAS::Vector< T >

class for column vectors with arbitrary size

class Vector is the vector class that should be used by common BIAS algorithms and data structures. It is derived from TNT::Vector to inherit the basic operations and algorithm. Special implementations should be done here and NOT in TNT:Vector because the true 'base' Matrix class "TNT::Vector" should be interchangeable and aside from this maintained by NIST.

changed from BIAS to BIAS 11/05/2002 (jw)

The Vector is in row-major order (=n rows, 1 column)

Author
Jan Woetzel
Examples:
ExampleConvolution.cpp.

Definition at line 30 of file GenerateGauss.hh.

Member Typedef Documentation

template<class T>
typedef const T* TNT::Vector< T >::const_iterator
inherited

Definition at line 67 of file vec.h.

template<class T>
typedef const T& TNT::Vector< T >::const_reference
inherited

Definition at line 68 of file vec.h.

template<class T>
typedef T TNT::Vector< T >::element_type
inherited

Definition at line 63 of file vec.h.

template<class T>
typedef T* TNT::Vector< T >::iterator
inherited

Definition at line 65 of file vec.h.

template<class T>
typedef T* TNT::Vector< T >::pointer
inherited

Definition at line 64 of file vec.h.

template<class T>
typedef T& TNT::Vector< T >::reference
inherited

Definition at line 66 of file vec.h.

template<class T>
typedef Subscript TNT::Vector< T >::size_type
inherited

Definition at line 61 of file vec.h.

template<class T>
typedef T BIAS::Vector< T >::value_type

Definition at line 73 of file Vector.hh.

Constructor & Destructor Documentation

template<class T >
BIAS::Vector< T >::~Vector ( )
virtual

Definition at line 45 of file Vector.cpp.

template<class T>
BIAS::Vector< T >::Vector ( )
inline

Definition at line 77 of file Vector.hh.

template<class T>
BIAS::Vector< T >::Vector ( const int  rows)
inlineexplicit

Definition at line 79 of file Vector.hh.

template<class T >
BIAS::Vector< T >::Vector ( const int  rows,
const std::string &  s 
)
explicit

Definition at line 49 of file Vector.cpp.

template<class T>
BIAS::Vector< T >::Vector ( int  rows,
const T &  value 
)
inline

assignment with a constant value for all elements (=set)

Author
Jan Woetzel

Definition at line 91 of file Vector.hh.

template<class T>
BIAS::Vector< T >::Vector ( int  rows,
const T *  v 
)
inline

Definition at line 93 of file Vector.hh.

template<class T>
BIAS::Vector< T >::Vector ( const Vector< T > &  v)
inline

Definition at line 95 of file Vector.hh.

template<class T>
BIAS::Vector< T >::Vector ( const TNT::Vector< T > &  v)
inline
Author
JMF

Definition at line 98 of file Vector.hh.

template<class T>
BIAS::Vector< T >::Vector ( const Vector2< T > &  v)
Author
fw

Definition at line 55 of file Vector.cpp.

template<class T>
BIAS::Vector< T >::Vector ( const Vector3< T > &  v)
Author
fw

Definition at line 61 of file Vector.cpp.

template<class T>
BIAS::Vector< T >::Vector ( const Vector4< T > &  v)
Author
fw

Definition at line 67 of file Vector.cpp.

template<class T>
BIAS::Vector< T >::Vector ( const std::vector< T > &  v)
explicit

Definition at line 73 of file Vector.cpp.

References BIAS::Vector< T >::Size().

Member Function Documentation

template<class T>
iterator TNT::Vector< T >::begin ( )
inlineinherited
template<class T>
const iterator TNT::Vector< T >::begin ( ) const
inlineinherited

Definition at line 166 of file vec.h.

template<class T>
void BIAS::Vector< T >::clear ( )
inline

stl conform interface JW

Definition at line 166 of file Vector.hh.

template<class T>
void TNT::Vector< T >::copy ( const T *  v)
inlineprotectedinherited

Definition at line 92 of file vec.h.

Referenced by TNT::Vector< Subscript >::operator=(), and TNT::Vector< Subscript >::Vector().

template<class T>
void TNT::Vector< T >::destroy ( )
inlineprotectedinherited
template<class T>
Subscript TNT::Vector< T >::dim ( ) const
inlineinherited
template<class T>
double BIAS::Vector< T >::Dist ( const Vector< T > &  vec) const
inline

Return the euclidean distance of 2 vectors.

Author
Birger Streckel
Date
08/2002

Definition at line 435 of file Vector.hh.

References BIAS::Vector< T >::GetDataLast(), and TNT::Vector< T >::size().

template<class T>
double BIAS::Vector< T >::DistLinf ( const Vector< T > &  vec) const
inline

Return the L infinity distance of 2 vectors.

Author
djung
Date
2009/07 untested

Definition at line 459 of file Vector.hh.

References BIAS::Vector< T >::GetDataLast(), and TNT::Vector< T >::size().

template<class T>
void BIAS::Vector< T >::ElementwiseProduct ( const Vector< T > &  arg,
Vector< T > &  dest 
) const
inline

multiply this with arg elementwise and store the result in dest

Author
woelk 12/2004

Definition at line 491 of file Vector.hh.

References TNT::Vector< T >::newsize(), and BIAS::Vector< T >::Size().

Referenced by BIAS::CondensHisto::GetMaxVariance(), BIAS::CondensHisto::GetMeanVariance(), BIAS::Condensation::GetVariance(), and BIAS::Condensation::GetWeightedVariance().

template<class T>
Vector< T > BIAS::Vector< T >::ElementwiseProduct ( const Vector< T > &  arg) const
inline

multiply this with arg elementwise and return the result

Author
woelk 12/2004

Definition at line 502 of file Vector.hh.

template<class T>
iterator TNT::Vector< T >::end ( )
inlineinherited

Definition at line 165 of file vec.h.

template<class T>
const iterator TNT::Vector< T >::end ( ) const
inlineinherited

Definition at line 167 of file vec.h.

template<class T>
void BIAS::Vector< T >::Fill ( const T &  scalar)
template<class T>
T* BIAS::Vector< T >::GetData ( ) const
inline
template<class T>
T* BIAS::Vector< T >::GetDataLast ( ) const
inline

Get the pointer to last element of the data array.

Author
Ingo Thomsen
Date
04/11/2002
Returns
pointer to last element

Definition at line 226 of file Vector.hh.

Referenced by BIAS::Vector< T >::Dist(), and BIAS::Vector< T >::DistLinf().

template<class T >
double BIAS::Vector< T >::GetMean ( void  ) const
Author
Ove Schimmer, www.sequid.com
Date
2008-07-17

Definition at line 200 of file Vector.cpp.

template<class T>
int BIAS::Vector< T >::GetNumElements ( ) const
inline

conformance interface JW

Definition at line 147 of file Vector.hh.

Referenced by BIAS::glfShaderProgram::SetUniform().

template<class T>
void BIAS::Vector< T >::GetSTLVec ( std::vector< T > &  vec) const
Author
woelk 11/2007 (c) www.vision-n.de

Definition at line 180 of file Vector.cpp.

template<class T>
std::vector< T > BIAS::Vector< T >::GetSTLVec ( ) const

Definition at line 191 of file Vector.cpp.

template<class T>
void TNT::Vector< T >::initialize ( Subscript  N)
inlineprotectedinherited
template<class T >
bool BIAS::Vector< T >::IsZero ( ) const
Returns
true if all elements are equal zero JW

Definition at line 127 of file Vector.cpp.

Referenced by BIAS::TriangleMesh::TestContraction().

template<class T>
void BIAS::Vector< T >::KroneckerProduct ( const Vector< T > &  arg,
Vector< T > &  dst 
) const

kronecker product

Author
woelk 08/2004

Definition at line 111 of file Vector.cpp.

References TNT::Vector< T >::newsize(), and TNT::Vector< T >::size().

Referenced by BIAS::Triangulation::GetCovarianceProjective().

template<class T>
Subscript TNT::Vector< T >::lbound ( ) const
inlineinherited

Definition at line 70 of file vec.h.

Referenced by TNT::QR_factor(), TNT::QR_solve(), and TNT::R_solve().

template<class T>
double BIAS::Vector< T >::Length ( ) const
inline

returns the Euclidean Length of the Vector

Definition at line 139 of file Vector.hh.

template<class T >
bool BIAS::Vector< T >::Load ( const std::string &  filename)

method to load directly from a given filename.

internally using stream operator

Author
Jan Woetzel 09/2005
Returns
false in case of error, true in case of success

Definition at line 151 of file Vector.cpp.

template<class T>
void BIAS::Vector< T >::Multiply ( const T &  scalar,
Vector< T > &  res 
) const
inline

multiply components with scalar storing result in res

Author
Ingo Thomsen tested(03/11/2002)

Definition at line 377 of file Vector.hh.

Referenced by BIAS::Vector< T >::operator*().

template<class T>
void BIAS::Vector< T >::MultiplyIP ( const T &  scalar)
inline

in place multiplication with scalar

Author
Ingo Thomsen untested

Definition at line 202 of file Vector.hh.

Referenced by BIAS::Condensation::CalculateMean_().

template<class T>
Vector<T>& TNT::Vector< T >::newsize ( Subscript  N)
inlineinherited
Examples:
EvaluateAlignment.cpp, ExampleAlignment.cpp, ExampleLeastSquares.cpp, and ExampleUncertaintyTransform.cpp.

Definition at line 220 of file vec.h.

Referenced by BIAS::GenSynthMatches::_AddParameter(), BIAS::Binomial< InputStorageType, OutputStorageType >::_CalculateKernel(), BIAS::Param::AddParamVecDbl(), BIAS::Param::AddParamVecInt(), BIAS::LDA::AnalyzeData(), BIAS::CheckJacobian(), BIAS::PCA::ComputeMean(), BIAS::ContourDetectorBSpline< StorageType >::CPntsToQ_(), TNT::eigenproblem_special_quadratic_matrix_solve(), TNT::eigenvalue_solve(), BIAS::Vector< T >::ElementwiseProduct(), BIAS::CamPoseCalib::Estimate(), BIAS::GenerateGauss::Gauss1D(), General_singular_value_decomposition(), BIAS::SVD::GetLeftNullvector(), BIAS::FFT::GetMagnitude(), BIAS::CondensHisto::GetMaxValue(), BIAS::CondensHisto::GetMaxVariance(), BIAS::Random::GetMeanAndCovariance(), BIAS::CondensHisto::GetMeanVariance(), BIAS::SVD::GetNullvector(), BIAS::PMatrixLinear::GetPEstSystemInHom(), BIAS::FFT::GetPhase(), BIAS::ContourDetectorBSpline< StorageType >::GetPointAndParamVec_(), BIAS::Random::GetQuasiUniformDistributed(), BIAS::Condensation::GetVariance(), BIAS::Condensation::GetWeightedVariance(), BIAS::SparseMatrix::InvertAndSolve(), BIAS::Vector< T >::KroneckerProduct(), BIAS::LevenbergMarquardtBase::LM_Compute(), BIAS::LevenbergMarquardtBase::LM_ComputeWithoutJacobian(), BIAS::Matrix< T >::Mult(), BIAS::SparseMatrix::Multiply(), BIAS::Matrix< T >::MultLeft(), BIAS::MxArrToBIASVector(), TNT::Fortran_Sparse_Vector< T >::newsize(), TNT::Fortran_Sparse_Col_Matrix< T >::newsize(), BIAS::GenSynthMatches::operator=(), TNT::operator>>(), Packed_symmetric_eigenvalue_solve(), BIAS::Covariance3Dto2D::Project(), BIAS::Covariance3Dto2DHomg::Project(), TNT::QR_factor(), BIAS::GenSynthMatches::Read(), BIAS::SparseMatrix::Solve(), BIAS::LeastSquaresSVD::Solve(), BIAS::Vector< T >::Sub(), BIAS::TextureTransformDisparity::TextureTransformDisparity(), BIAS::TextureTransformDisplacement::TextureTransformDisplacement(), BIAS::TextureTransformEuclidian::TextureTransformEuclidian(), BIAS::TextureTransformRotation::TextureTransformRotation(), BIAS::TextureTransformSimilar::TextureTransformSimilar(), BIAS::MonteCarloTransform::Transform(), BIAS::CovQuaternion2AxisAngle::Transform_(), BIAS::CovEuler2Quaternion::Transform_(), BIAS::Cov3Dto2DPoseCertain::Transform_(), BIAS::Covariance3Dto2D::Transform_(), BIAS::CovTransformPose::Transform_(), BIAS::CamPoseCalib::TransformVec(), Upper_symmetric_eigenvalue_solve(), BIAS::Matrix< T >::Vec(), BIAS::Tracker< StorageType, CalculationType >::Vector2FilterMask_(), and BIAS::LeastSquaresSVD::WeightedSolve().

template<class T >
T BIAS::Vector< T >::NormL1 ( ) const
inline

Return the L1 norm: |a| + |b| + |c| + ...

Author
Ingo Thomsen
Date
04/11/2002

Definition at line 405 of file Vector.hh.

template<class T >
double BIAS::Vector< T >::NormL2 ( ) const
inline
template<class T>
bool BIAS::Vector< T >::operator!= ( const Vector< T > &  vec) const
inline

Definition at line 134 of file Vector.hh.

template<class T>
reference TNT::Vector< T >::operator() ( Subscript  i)
inlineinherited

Definition at line 268 of file vec.h.

template<class T>
const_reference TNT::Vector< T >::operator() ( Subscript  i) const
inlineinherited

Definition at line 277 of file vec.h.

template<class T>
void BIAS::Vector< T >::operator*= ( scalar)
inline

Definition at line 322 of file Vector.hh.

template<class T>
void BIAS::Vector< T >::operator+= ( const Vector< T > &  vec)
inline

Definition at line 298 of file Vector.hh.

References BIAS::Vector< T >::GetData(), and TNT::Vector< T >::size().

template<class T>
void BIAS::Vector< T >::operator-= ( const Vector< T > &  vec)
inline

Definition at line 310 of file Vector.hh.

References BIAS::Vector< T >::GetData(), and TNT::Vector< T >::size().

template<class T>
void BIAS::Vector< T >::operator/= ( scalar)
inline
Author
woelk 12/2004

Definition at line 333 of file Vector.hh.

template<class T>
Vector< T > & BIAS::Vector< T >::operator= ( const TNT::Vector< T > &  vec)

assignment operators calling corresponding operator from base class "TNT::Vector" if appropriate

Author
Jan Woetzel (02/25/2002)

Definition at line 85 of file Vector.cpp.

References TNT::Vector< T >::operator=().

template<class T>
Vector<T>& BIAS::Vector< T >::operator= ( const Vector< T > &  vec)
inline

assignment operator calling corresponding operator from base class "TNT::Vector" if appropriate

Author
grest

Definition at line 120 of file Vector.hh.

template<class T>
bool BIAS::Vector< T >::operator== ( const Vector< T > &  vec) const
inline

Definition at line 344 of file Vector.hh.

References BIAS::Vector< T >::GetData(), and TNT::Vector< T >::size().

template<class T>
reference TNT::Vector< T >::operator[] ( Subscript  i)
inlineinherited

Definition at line 286 of file vec.h.

template<class T>
const_reference TNT::Vector< T >::operator[] ( Subscript  i) const
inlineinherited

Definition at line 295 of file vec.h.

template<class T>
Matrix< T > BIAS::Vector< T >::OuterProduct ( const Vector< T > &  v) const

outer product, constructs a matrix.

Often written as v * v^T for col vectors

Author
Daniel Grest, Oct 2002 tested

Definition at line 99 of file Vector.cpp.

References TNT::Vector< T >::size().

Referenced by BIAS::ContourDetectorBSpline< StorageType >::Fit_(), BIAS::GenerateGauss::Gauss2D(), BIAS::QRFrac(), BIAS::TrackerBaseHomography< StorageType >::Track_(), BIAS::MonteCarloTransform::Transform(), and BIAS::UnscentedTransform::Transform().

template<class T >
bool BIAS::Vector< T >::Save ( const std::string &  filename) const

method to save directly to a given filename.

internally using stream operator

Author
Jan Woetzel 09/2009
Returns
false in case of error, true in case of success

Definition at line 166 of file Vector.cpp.

template<class T>
T BIAS::Vector< T >::ScalarProduct ( const Vector< T > &  argvec) const
inline
template<class T>
void BIAS::Vector< T >::ScalarProduct ( const Vector< T > &  argvec,
T &  result 
) const
inline

scalar product (inner product) of two vectors returning a scalar, storing the result in result

Author
Ingo Thomsen tested(03/11/2002)

Definition at line 363 of file Vector.hh.

References TNT::Vector< T >::size().

template<class T>
void TNT::Vector< T >::set ( const T &  val)
inlineprotectedinherited

Definition at line 118 of file vec.h.

Referenced by TNT::Vector< Subscript >::operator=(), and TNT::Vector< Subscript >::Vector().

template<class T>
void BIAS::Vector< T >::Set ( const T &  scalar)
inline
template<class T>
void BIAS::Vector< T >::SetZero ( )
inline
template<class T>
unsigned int BIAS::Vector< T >::Size ( ) const
inline

length of the vector

Definition at line 143 of file Vector.hh.

Referenced by BIAS::GenSynthMatches::_CheckParams(), BIAS::GenSynthMatches::_CreateCamMovement(), BIAS::ImageAlignment::Align(), BIAS::BIASVectorToMxArr(), BIAS::FFT::Compute(), BIAS::SOCP::Compute(), BIAS::LDA::ComputeAnonymousReduction(), BIAS::TrackerBaseInterface< StorageType >::ComputeMaskSum(), BIAS::UnscentedTransform::ComputeSigmaPoints_(), BIAS::Convolution< InputStorageType, OutputStorageType >::ConvFloatHori_(), BIAS::Convolution< InputStorageType, OutputStorageType >::ConvFloatVert_(), BIAS::Convolution< InputStorageType, OutputStorageType >::ConvIntHori_(), BIAS::Convolution< InputStorageType, OutputStorageType >::ConvIntVert_(), BIAS::Vector< T >::ElementwiseProduct(), BIAS::TrackerBaseInterface< StorageType >::Filter_BySeparableMask(), BIAS::TrackerBaseInterface< StorageType >::FilterLowpass_BySeparableMask(), BIAS::CamPoseCalib::GetCov(), BIAS::FFT::GetMagnitude(), BIAS::FFT::GetPhase(), BIAS::Random::GetQuasiNormalDistributed(), BIAS::Random::GetQuasiUniformDistributed(), BIAS::MonteCarloTransform::GetSamples_(), BIAS::TrackerBaseInterface< StorageType >::Init(), BIAS::ContourDetectorBSpline< StorageType >::Init(), BIAS::TextureTransformAffine::InterpretParameters(), BIAS::SparseMatrix::InvertAndSolve(), BIAS::EParametrization::Normalize(), Packed_symmetric_eigenvalue_solve(), BIAS::TextureTransform::ParameterJacobianBackward(), BIAS::TextureTransform::ParameterJacobianForward(), BIAS::PMatrixBase::Parametrization2R_(), BIAS::Parametrization::ParamsToEMatrix(), BIAS::Powell(), BIAS::PowellExtended(), BIAS::Covariance3Dto2D::Project(), BIAS::Covariance3Dto2DHomg::Project(), BIAS::Tensor3D< T >::SetFromVector(), BIAS::TextureTransformAffine::SetParameters(), BIAS::TextureTransformDisparity::SetParameters(), BIAS::TextureTransformDisplacement::SetParameters(), BIAS::TextureTransformRotation::SetParameters(), BIAS::TextureTransformEuclidian::SetParameters(), BIAS::TextureTransformSimilar::SetParameters(), BIAS::wxVectorPanel::SetVector(), BIAS::SparseMatrix::Solve(), SquaredMahalanobisDistance(), BIAS::ContourDetectorBSpline< StorageType >::TestInit_(), BIAS::MonteCarloTransform::Transform(), BIAS::UnscentedTransform::Transform(), BIAS::Covariance3Dto2D::Transform_(), BIAS::Covariance3Dto2DHomg::Transform_(), BIAS::CamPoseCalib::TransformVec(), BIAS::Vector< T >::Vector(), and BIAS::Tracker< StorageType, CalculationType >::Vector2FilterMask_().

template<class T>
Subscript TNT::Vector< T >::size ( ) const
inlineinherited
Examples:
ExampleGenerateGauss.cpp, and ExampleHdr.cpp.

Definition at line 262 of file vec.h.

Referenced by BIAS::GenSynthMatches::_CheckParams(), BIAS::ImageAlignment::Align(), BIAS::LDA::AnalyzeData(), BIAS::CamPoseCalib::ApplyCoVariances_(), BIAS::ImageAlignment::AutoAlign(), BIAS::TrackerBaseAffine2< StorageType >::BilinearRegion1_(), BIAS::IntegralHistogram::CalcSimilarity(), BIAS::CheckJacobian(), BIAS::LDA::ComputeAnonymousReduction(), BIAS::ComputeJacobian(), BIAS::PCA::ComputeMean(), BIAS::LDA::ComputeMeans(), BIAS::LDA::ComputeReductionMatrix(), BIAS::PCA::ComputeScatter(), BIAS::IntegralHistogram::CopyNoCheck(), BIAS::Vector< T >::Dist(), BIAS::Vector< T >::DistLinf(), BIAS::Parametrization::EMatrixToParams(), BIAS::CamPoseCalib::Estimate(), BIAS::TriangleMesh::GetBiggestConnectedSegment(), BIAS::FMatrixEstimation::GetDetPolynomial(), BIAS::Random::GetMeanAndCovariance(), BIAS::GenSynthMatchesRig::GetParameters_(), BIAS::SVD::GetSingularValue(), BIAS::Matrix< T >::GetSubMatrix(), BIAS::HomgPoint3D::HomgPoint3D(), BIAS::Kalman::Init(), BIAS::IteratedExtendedKalman::Init(), BIAS::Vector< T >::KroneckerProduct(), Lapack_LLS_QR_linear_solve(), Lapack_LU_linear_solve(), Lapack_WLLS_solve(), BIAS::Matrix< EP_TYPE >::Matrix(), BIAS::Matrix< T >::Mult(), BIAS::Matrix< T >::MultLeft(), BIAS::Vector< T >::operator*(), BIAS::Vector3< T >::operator+(), BIAS::Vector< T >::operator+=(), BIAS::Vector< T >::operator-=(), BIAS::Vector3< HOMGPOINT2D_TYPE >::operator=(), BIAS::Vector< T >::operator==(), TNT::operator>>(), BIAS::Vector< T >::OuterProduct(), BIAS::Parametrization::ParamsToEMatrix(), TNT::QR_factor(), BIAS::ContourDetectorBSpline< StorageType >::QToCPnts_(), BIAS::Vector< T >::ScalarProduct(), BIAS::RParametrization::Set(), BIAS::Vector3< T >::Set(), BIAS::HomgPoint2D::Set(), BIAS::Matrix< T >::Set(), BIAS::Matrix< T >::SetCol(), BIAS::PoseParametrization::SetCQ(), BIAS::EParametrization::SetEQ(), BIAS::HomgPlane3D::SetFromVector(), BIAS::Matrix3x3< T >::SetFromVector(), BIAS::ExtendedKalman::SetInitial(), BIAS::Matrix< T >::SetRow(), BIAS::IteratedExtendedKalman::SetState(), BIAS::Matrix< T >::SetTranspose(), BIAS::CamPoseCalib::SetWeightsByError_(), BIAS::GaussHelmert::Solve(), BIAS::LeastSquaresSVD::Solve(), BIAS::SVD::Solve(), BIAS::CamPoseCalib::SolveLM_(), BIAS::SVD::Sqrt(), BIAS::SVD::SqrtT(), BIAS::ImageAlignment::StrictPyramidAlign(), BIAS::Vector< T >::SubIP(), BIAS::ContourDetectorBSpline< StorageType >::TestInit_(), BIAS::UnscentedTransform::Transform(), BIAS::ProjectionParametersBase::Transform_(), BIAS::Kalman::Update(), BIAS::ExtendedKalman::Update(), BIAS::IteratedExtendedKalman::Update(), BIAS::Vector2< T >::Vector2(), BIAS::Vector3< T >::Vector3(), BIAS::Vector4< T >::Vector4(), and BIAS::LeastSquaresSVD::WeightedSolve().

template<class T>
void BIAS::Vector< T >::Sub ( const Vector< T > &  arg,
Vector< T > &  dest 
) const
inline

Substraction of vector, storing results in destination vector.

Author
woelk 07/2006

Definition at line 395 of file Vector.hh.

References TNT::Vector< T >::newsize().

template<class T>
void BIAS::Vector< T >::SubIP ( const Vector< T > &  argmat)
inline

in place subtracting

Author
Ingo Thomsen untested

Definition at line 385 of file Vector.hh.

References TNT::Vector< T >::size().

template<class T >
Vector< T > BIAS::Vector< T >::SubVec ( int  length,
int  offset = 0 
) const

returns the subvector with elements between offset and offset+length-1

Author
Dennis Herzog
Date
2005-07-29

Definition at line 138 of file Vector.cpp.

Friends And Related Function Documentation

template<class T >
Vector< T > operator* ( const Vector< T > &  v,
const T &  scalar 
)
related

Definition at line 75 of file Operators.hh.

References BIAS::Vector< T >::Multiply(), and TNT::Vector< T >::size().

template<class T >
Vector< T > operator* ( const T &  scalar,
const Vector< T > &  v 
)
related

Definition at line 84 of file Operators.hh.

References BIAS::Vector< T >::Multiply(), and TNT::Vector< T >::size().

template<class T >
T operator* ( const Vector< T > &  v,
const Vector< T > &  argvec 
)
related

Definition at line 295 of file Operators.hh.

References BIAS::Vector< T >::ScalarProduct().

template<class T >
Vector< T > operator* ( const Matrix< T > &  mat,
const Vector2< T > &  vec 
)
related

Definition at line 662 of file Operators.hh.

References TNT::Matrix< T >::num_cols(), and TNT::Matrix< T >::num_rows().

template<class T >
std::ostream & operator<< ( std::ostream &  os,
const BIAS::Vector< T > &  vec 
)
related

Output with streams

Author
woelk 10/2004 major corrections by Jan Woetzel/Sun Min 11/2004

Definition at line 535 of file Vector.hh.

Member Data Documentation

template<class T>
Subscript TNT::Vector< T >::n_
protectedinherited
template<class T>
T* TNT::Vector< T >::v_
protectedinherited
template<class T>
T* TNT::Vector< T >::vm1_
protectedinherited

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