10 #ifndef _KINEMATICS6M180_H_ 11 #define _KINEMATICS6M180_H_ 113 bool setAngOff(
const std::vector<double> aAngOff);
115 bool setAngStop(
const std::vector<double> aAngStop);
121 bool enc2rad(std::vector<double>& aAngles,
const std::vector<int> aEncoders);
127 bool rad2enc(std::vector<int>& aEncoders,
const std::vector<double> aAngles);
133 bool directKinematics(std::vector<double>& aPosition,
const std::vector<double> aAngles);
141 bool inverseKinematics(std::vector<double>& aAngles,
const std::vector<double> aPosition,
const std::vector<double> aStartingAngles);
147 #endif //_KINEMATICS6M180_H_ bool enc2rad(std::vector< double > &aAngles, const std::vector< int > aEncoders)
std::vector< int > mEncodersPerCycle
Encoders per cycle vector.
int mNumberOfSegments
Number of segments of the robot.
void IK_b1b2costh3_6M180(angles_calc &a, const position &p) const
helper functions
bool directKinematics(std::vector< double > &aPosition, const std::vector< double > aAngles)
std::vector< int > getDir()
get direction
std::vector< int > mRotationDirection
Rotation direction vector [1|-1].
bool setAngOff(const std::vector< double > aAngOff)
set angle offset
Implements the kinematics for the Katana6M180.
std::vector< double > mSegmentLength
Effector segment lengths vector [m].
std::vector< int > getEncOff()
get encoder offset
static const int cNrOfPossibleSolutions
std::vector< int > getEpc()
get encoders per cycle
std::vector< angles_calc > angles_container
std::vector< double > getLinkLength()
get link length
Base Class for the kinematics implementations.
std::vector< double > getAngRange()
get angle range
~Kinematics6M180()
Destructor.
void thetacomp(angles_calc &a, const position &p_m) const
std::vector< double > mAngleStop
Angle stop vector [rad].
bool PositionTest6M180(const angles_calc &a, const position &p) const
bool setAngStop(const std::vector< double > aAngStop)
set angle stop
std::vector< double > getAngMin()
get angle min
std::vector< double > getAngMax()
get angle max
bool rad2enc(std::vector< int > &aEncoders, const std::vector< double > aAngles)
FloatVector FloatVector * a
std::vector< double > getAngStop()
get angle stop
bool setLinkLength(const std::vector< double > aLengths)
set link length
std::vector< int > mEncoderOffset
Encoder offset vector.
int mNumberOfMotors
Number of motors of the robot.
std::vector< double > mAngleOffset
Angle offset vector [rad].
bool AnglePositionTest(const angles_calc &a) const
structs, type and constants used in inverse kinematics calculation
bool initialize()
initialization routine
bool mIsInitialized
Initialized flag.
Kinematics6M180()
Constructor.
std::vector< double > getAngOff()
get angle offset
bool angledef(angles_calc &a) const
bool inverseKinematics(std::vector< double > &aAngles, const std::vector< double > aPosition, const std::vector< double > aStartingAngles)