Public Member Functions | Static Public Attributes | Private Attributes | List of all members
KDL::TreeIkSolverVel_wdls Class Reference

#include <treeiksolvervel_wdls.hpp>

Inheritance diagram for KDL::TreeIkSolverVel_wdls:
Inheritance graph
[legend]

Public Member Functions

virtual double CartToJnt (const JntArray &q_in, const Twists &v_in, JntArray &qdot_out)
 
double getLambda () const
 
const Eigen::MatrixXd & getWeightJS () const
 
const Eigen::MatrixXd & getWeightTS () const
 
void setLambda (const double &lambda)
 
void setWeightJS (const Eigen::MatrixXd &Mq)
 
void setWeightTS (const Eigen::MatrixXd &Mx)
 
 TreeIkSolverVel_wdls (const Tree &tree, const std::vector< std::string > &endpoints)
 Child SVD failed. More...
 
virtual ~TreeIkSolverVel_wdls ()
 
- Public Member Functions inherited from KDL::TreeIkSolverVel
virtual ~TreeIkSolverVel ()
 

Static Public Attributes

static const int E_SVD_FAILED = -100
 

Private Attributes

Eigen::MatrixXd J
 
Eigen::MatrixXd J_Wq
 
Jacobians jacobians
 
TreeJntToJacSolver jnttojacsolver
 
double lambda
 
Eigen::VectorXd qdot
 
Eigen::VectorXd S
 
Eigen::VectorXd t
 
Eigen::VectorXd tmp
 
Tree tree
 
Eigen::MatrixXd U
 
Eigen::MatrixXd V
 
Eigen::MatrixXd Wq
 
Eigen::MatrixXd Wq_V
 
Eigen::MatrixXd Wy
 
Eigen::MatrixXd Wy_J_Wq
 
Eigen::VectorXd Wy_t
 
Eigen::MatrixXd Wy_U
 

Detailed Description

Definition at line 17 of file treeiksolvervel_wdls.hpp.

Constructor & Destructor Documentation

◆ TreeIkSolverVel_wdls()

KDL::TreeIkSolverVel_wdls::TreeIkSolverVel_wdls ( const Tree tree,
const std::vector< std::string > &  endpoints 
)

Child SVD failed.

Definition at line 12 of file treeiksolvervel_wdls.cpp.

◆ ~TreeIkSolverVel_wdls()

KDL::TreeIkSolverVel_wdls::~TreeIkSolverVel_wdls ( )
virtual

Definition at line 33 of file treeiksolvervel_wdls.cpp.

Member Function Documentation

◆ CartToJnt()

double KDL::TreeIkSolverVel_wdls::CartToJnt ( const JntArray q_in,
const Twists v_in,
JntArray qdot_out 
)
virtual

Calculate inverse velocity kinematics, from joint positions and cartesian velocities to joint velocities.

Parameters
q_ininput joint positions
v_ininput cartesian velocity
qdot_outoutput joint velocities
Returns
if < 0 something went wrong distance to goal otherwise (weighted norm of v_in)

Implements KDL::TreeIkSolverVel.

Definition at line 48 of file treeiksolvervel_wdls.cpp.

◆ getLambda()

double KDL::TreeIkSolverVel_wdls::getLambda ( ) const
inline

Definition at line 78 of file treeiksolvervel_wdls.hpp.

◆ getWeightJS()

const Eigen::MatrixXd& KDL::TreeIkSolverVel_wdls::getWeightJS ( ) const
inline

Definition at line 49 of file treeiksolvervel_wdls.hpp.

◆ getWeightTS()

const Eigen::MatrixXd& KDL::TreeIkSolverVel_wdls::getWeightTS ( ) const
inline

Definition at line 75 of file treeiksolvervel_wdls.hpp.

◆ setLambda()

void KDL::TreeIkSolverVel_wdls::setLambda ( const double &  lambda)

Definition at line 44 of file treeiksolvervel_wdls.cpp.

◆ setWeightJS()

void KDL::TreeIkSolverVel_wdls::setWeightJS ( const Eigen::MatrixXd &  Mq)

Definition at line 36 of file treeiksolvervel_wdls.cpp.

◆ setWeightTS()

void KDL::TreeIkSolverVel_wdls::setWeightTS ( const Eigen::MatrixXd &  Mx)

Definition at line 40 of file treeiksolvervel_wdls.cpp.

Member Data Documentation

◆ E_SVD_FAILED

const int KDL::TreeIkSolverVel_wdls::E_SVD_FAILED = -100
static

Definition at line 19 of file treeiksolvervel_wdls.hpp.

◆ J

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::J
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ J_Wq

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::J_Wq
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ jacobians

Jacobians KDL::TreeIkSolverVel_wdls::jacobians
private

Definition at line 83 of file treeiksolvervel_wdls.hpp.

◆ jnttojacsolver

TreeJntToJacSolver KDL::TreeIkSolverVel_wdls::jnttojacsolver
private

Definition at line 82 of file treeiksolvervel_wdls.hpp.

◆ lambda

double KDL::TreeIkSolverVel_wdls::lambda
private

Definition at line 87 of file treeiksolvervel_wdls.hpp.

◆ qdot

Eigen::VectorXd KDL::TreeIkSolverVel_wdls::qdot
private

Definition at line 86 of file treeiksolvervel_wdls.hpp.

◆ S

Eigen::VectorXd KDL::TreeIkSolverVel_wdls::S
private

Definition at line 86 of file treeiksolvervel_wdls.hpp.

◆ t

Eigen::VectorXd KDL::TreeIkSolverVel_wdls::t
private

Definition at line 86 of file treeiksolvervel_wdls.hpp.

◆ tmp

Eigen::VectorXd KDL::TreeIkSolverVel_wdls::tmp
private

Definition at line 86 of file treeiksolvervel_wdls.hpp.

◆ tree

Tree KDL::TreeIkSolverVel_wdls::tree
private

Definition at line 81 of file treeiksolvervel_wdls.hpp.

◆ U

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::U
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ V

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::V
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ Wq

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::Wq
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ Wq_V

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::Wq_V
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ Wy

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::Wy
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ Wy_J_Wq

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::Wy_J_Wq
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.

◆ Wy_t

Eigen::VectorXd KDL::TreeIkSolverVel_wdls::Wy_t
private

Definition at line 86 of file treeiksolvervel_wdls.hpp.

◆ Wy_U

Eigen::MatrixXd KDL::TreeIkSolverVel_wdls::Wy_U
private

Definition at line 85 of file treeiksolvervel_wdls.hpp.


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


orocos_kdl
Author(s):
autogenerated on Thu Apr 13 2023 02:19:15