Classes | Enumerations | Functions
prbt_manipulator Namespace Reference

Classes

struct  CheckValue
 
class  IKFastKinematicsPlugin
 
class  IKSolver
 
struct  LimitObeyingSol
 

Enumerations

enum  IkParameterizationType {
  IKP_None = 0, IKP_Transform6D = 0x67000001, IKP_Rotation3D = 0x34000002, IKP_Translation3D = 0x33000003,
  IKP_Direction3D = 0x23000004, IKP_Ray4D = 0x46000005, IKP_Lookat3D = 0x23000006, IKP_TranslationDirection5D = 0x56000007,
  IKP_TranslationXY2D = 0x22000008, IKP_TranslationXYOrientation3D = 0x33000009, IKP_TranslationLocalGlobal6D = 0x3600000a, IKP_TranslationXAxisAngle4D = 0x4400000b,
  IKP_TranslationYAxisAngle4D = 0x4400000c, IKP_TranslationZAxisAngle4D = 0x4400000d, IKP_TranslationXAxisAngleZNorm4D = 0x4400000e, IKP_TranslationYAxisAngleXNorm4D = 0x4400000f,
  IKP_TranslationZAxisAngleYNorm4D = 0x44000010, IKP_NumberOfParameterizations = 16, IKP_VelocityDataBit, IKP_Transform6DVelocity = IKP_Transform6D | IKP_VelocityDataBit,
  IKP_Rotation3DVelocity = IKP_Rotation3D | IKP_VelocityDataBit, IKP_Translation3DVelocity = IKP_Translation3D | IKP_VelocityDataBit, IKP_Direction3DVelocity = IKP_Direction3D | IKP_VelocityDataBit, IKP_Ray4DVelocity = IKP_Ray4D | IKP_VelocityDataBit,
  IKP_Lookat3DVelocity = IKP_Lookat3D | IKP_VelocityDataBit, IKP_TranslationDirection5DVelocity = IKP_TranslationDirection5D | IKP_VelocityDataBit, IKP_TranslationXY2DVelocity = IKP_TranslationXY2D | IKP_VelocityDataBit, IKP_TranslationXYOrientation3DVelocity = IKP_TranslationXYOrientation3D | IKP_VelocityDataBit,
  IKP_TranslationLocalGlobal6DVelocity = IKP_TranslationLocalGlobal6D | IKP_VelocityDataBit, IKP_TranslationXAxisAngle4DVelocity = IKP_TranslationXAxisAngle4D | IKP_VelocityDataBit, IKP_TranslationYAxisAngle4DVelocity = IKP_TranslationYAxisAngle4D | IKP_VelocityDataBit, IKP_TranslationZAxisAngle4DVelocity = IKP_TranslationZAxisAngle4D | IKP_VelocityDataBit,
  IKP_TranslationXAxisAngleZNorm4DVelocity = IKP_TranslationXAxisAngleZNorm4D | IKP_VelocityDataBit, IKP_TranslationYAxisAngleXNorm4DVelocity = IKP_TranslationYAxisAngleXNorm4D | IKP_VelocityDataBit, IKP_TranslationZAxisAngleYNorm4DVelocity = IKP_TranslationZAxisAngleYNorm4D | IKP_VelocityDataBit, IKP_UniqueIdMask = 0x0000ffff,
  IKP_CustomDataBit = 0x00010000
}
 The types of inverse kinematics parameterizations supported. More...
 

Functions

IKFAST_API void ComputeFk (const IkReal *j, IkReal *eetrans, IkReal *eerot)
 
IKFAST_API bool ComputeIk (const IkReal *eetrans, const IkReal *eerot, const IkReal *pfree, IkSolutionListBase< IkReal > &solutions)
 
IKFAST_API bool ComputeIk2 (const IkReal *eetrans, const IkReal *eerot, const IkReal *pfree, IkSolutionListBase< IkReal > &solutions, void *pOpenRAVEManip)
 
IKFAST_API int * GetFreeParameters ()
 
IKFAST_API const char * GetIkFastVersion ()
 
IKFAST_API int GetIkRealSize ()
 
IKFAST_API int GetIkType ()
 
IKFAST_API const char * GetKinematicsHash ()
 
IKFAST_API int GetNumFreeParameters ()
 
IKFAST_API int GetNumJoints ()
 
float IKabs (float f)
 
double IKabs (double f)
 
float IKacos (float f)
 
double IKacos (double f)
 
float IKasin (float f)
 
double IKasin (double f)
 
float IKatan2 (float fy, float fx)
 
double IKatan2 (double fy, double fx)
 
float IKatan2Simple (float fy, float fx)
 
double IKatan2Simple (double fy, double fx)
 
template<typename T >
CheckValue< T > IKatan2WithCheck (T fy, T fx, T epsilon)
 
float IKcos (float f)
 
double IKcos (double f)
 
 IKFAST_COMPILE_ASSERT (IKFAST_VERSION==0x1000004a)
 
float IKfmod (float x, float y)
 
double IKfmod (double x, double y)
 
float IKlog (float f)
 
double IKlog (double f)
 
template<typename T >
CheckValue< T > IKPowWithIntegerCheck (T f, int n)
 
float IKsign (float f)
 
double IKsign (double f)
 
float IKsin (float f)
 
double IKsin (double f)
 
float IKsqr (float f)
 
double IKsqr (double f)
 
float IKsqrt (float f)
 
double IKsqrt (double f)
 
float IKtan (float f)
 
double IKtan (double f)
 

Enumeration Type Documentation

The types of inverse kinematics parameterizations supported.

The minimum degree of freedoms required is set in the upper 4 bits of each type. The number of values used to represent the parameterization ( >= dof ) is the next 4 bits. The lower bits contain a unique id of the type.

Enumerator
IKP_None 
IKP_Transform6D 

end effector reaches desired 6D transformation

IKP_Rotation3D 

end effector reaches desired 3D rotation

IKP_Translation3D 

end effector origin reaches desired 3D translation

IKP_Direction3D 

direction on end effector coordinate system reaches desired direction

IKP_Ray4D 

ray on end effector coordinate system reaches desired global ray

IKP_Lookat3D 

direction on end effector coordinate system points to desired 3D position

IKP_TranslationDirection5D 

end effector origin and direction reaches desired 3D translation and

IKP_TranslationXY2D 

2D translation along XY plane

direction. Can be thought of as Ray IK where the origin of the ray must coincide.

IKP_TranslationXYOrientation3D 

2D translation along XY plane and 1D rotation around Z axis. The

IKP_TranslationLocalGlobal6D 

local point on end effector origin reaches desired 3D global point

offset of the rotation is measured starting at +X, so at +X is it 0, at +Y it is pi/2.

IKP_TranslationXAxisAngle4D 

end effector origin reaches desired 3D translation, manipulator

IKP_TranslationYAxisAngle4D 

direction makes a specific angle with x-axis like a cone, angle is from 0-pi. Axes defined in the manipulator base link's coordinate system) end effector origin reaches desired 3D translation, manipulator

IKP_TranslationZAxisAngle4D 

direction makes a specific angle with y-axis like a cone, angle is from 0-pi. Axes defined in the manipulator base link's coordinate system) end effector origin reaches desired 3D translation, manipulator

IKP_TranslationXAxisAngleZNorm4D 

direction makes a specific angle with z-axis like a cone, angle is from 0-pi. Axes are defined in the manipulator base link's coordinate system. end effector origin reaches desired 3D translation, manipulator

IKP_TranslationYAxisAngleXNorm4D 

direction needs to be orthogonal to z-axis and be rotated at a certain angle starting from the x-axis (defined in the manipulator base link's coordinate system) end effector origin reaches desired 3D translation, manipulator

IKP_TranslationZAxisAngleYNorm4D 

direction needs to be orthogonal to x-axis and be rotated at a certain angle starting from the y-axis (defined in the manipulator base link's coordinate system) end effector origin reaches desired 3D translation, manipulator

IKP_NumberOfParameterizations 

number of parameterizations (does not count IKP_None)

direction needs to be orthogonal to y-axis and be rotated at a certain angle starting from the z-axis (defined in the manipulator base link's coordinate system)

IKP_VelocityDataBit 

bit is set if the data represents the time-derivate velocity of an IkParameterization

IKP_Transform6DVelocity 
IKP_Rotation3DVelocity 
IKP_Translation3DVelocity 
IKP_Direction3DVelocity 
IKP_Ray4DVelocity 
IKP_Lookat3DVelocity 
IKP_TranslationDirection5DVelocity 
IKP_TranslationXY2DVelocity 
IKP_TranslationXYOrientation3DVelocity 
IKP_TranslationLocalGlobal6DVelocity 
IKP_TranslationXAxisAngle4DVelocity 
IKP_TranslationYAxisAngle4DVelocity 
IKP_TranslationZAxisAngle4DVelocity 
IKP_TranslationXAxisAngleZNorm4DVelocity 
IKP_TranslationYAxisAngleXNorm4DVelocity 
IKP_TranslationZAxisAngleYNorm4DVelocity 
IKP_UniqueIdMask 

the mask for the unique ids

IKP_CustomDataBit 

bit is set if the ikparameterization contains custom data, this is only used

Definition at line 72 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

Function Documentation

IKFAST_API void prbt_manipulator::ComputeFk ( const IkReal *  j,
IkReal *  eetrans,
IkReal *  eerot 
)

solves the forward kinematics equations.

Parameters
pfreeis an array specifying the free joints of the chain.

Definition at line 294 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API bool prbt_manipulator::ComputeIk ( const IkReal *  eetrans,
const IkReal *  eerot,
const IkReal *  pfree,
IkSolutionListBase< IkReal > &  solutions 
)

solves the inverse kinematics equations.

Parameters
pfreeis an array specifying the free joints of the chain.

Definition at line 20055 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API bool prbt_manipulator::ComputeIk2 ( const IkReal *  eetrans,
const IkReal *  eerot,
const IkReal *  pfree,
IkSolutionListBase< IkReal > &  solutions,
void *  pOpenRAVEManip 
)

Definition at line 20060 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API int* prbt_manipulator::GetFreeParameters ( )

Definition at line 360 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API const char* prbt_manipulator::GetIkFastVersion ( )

Definition at line 20067 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API int prbt_manipulator::GetIkRealSize ( )

Definition at line 363 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API int prbt_manipulator::GetIkType ( )

Definition at line 365 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API const char* prbt_manipulator::GetKinematicsHash ( )

Definition at line 20065 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API int prbt_manipulator::GetNumFreeParameters ( )

Definition at line 359 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

IKFAST_API int prbt_manipulator::GetNumJoints ( )

Definition at line 361 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKabs ( float  f)
inline

Definition at line 86 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKabs ( double  f)
inline

Definition at line 87 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKacos ( float  f)
inline

Definition at line 149 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKacos ( double  f)
inline

Definition at line 156 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKasin ( float  f)
inline

Definition at line 116 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKasin ( double  f)
inline

Definition at line 123 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKatan2 ( float  fy,
float  fx 
)
inline

Definition at line 174 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKatan2 ( double  fy,
double  fx 
)
inline

Definition at line 187 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKatan2Simple ( float  fy,
float  fx 
)
inline

Definition at line 171 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKatan2Simple ( double  fy,
double  fx 
)
inline

Definition at line 184 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

template<typename T >
CheckValue<T> prbt_manipulator::IKatan2WithCheck ( fy,
fx,
epsilon 
)
inline

Definition at line 206 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKcos ( float  f)
inline

Definition at line 165 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKcos ( double  f)
inline

Definition at line 166 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

prbt_manipulator::IKFAST_COMPILE_ASSERT ( IKFAST_VERSION  = =0x1000004a)
float prbt_manipulator::IKfmod ( float  x,
float  y 
)
inline

Definition at line 132 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKfmod ( double  x,
double  y 
)
inline

Definition at line 141 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKlog ( float  f)
inline

Definition at line 92 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKlog ( double  f)
inline

Definition at line 93 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

template<typename T >
CheckValue<T> prbt_manipulator::IKPowWithIntegerCheck ( f,
int  n 
)
inline

Definition at line 241 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKsign ( float  f)
inline

Definition at line 220 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKsign ( double  f)
inline

Definition at line 230 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKsin ( float  f)
inline

Definition at line 163 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKsin ( double  f)
inline

Definition at line 164 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKsqr ( float  f)
inline

Definition at line 89 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKsqr ( double  f)
inline

Definition at line 90 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKsqrt ( float  f)
inline

Definition at line 169 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKsqrt ( double  f)
inline

Definition at line 170 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

float prbt_manipulator::IKtan ( float  f)
inline

Definition at line 167 of file prbt_manipulator_ikfast_moveit_plugin.cpp.

double prbt_manipulator::IKtan ( double  f)
inline

Definition at line 168 of file prbt_manipulator_ikfast_moveit_plugin.cpp.



prbt_ikfast_manipulator_plugin
Author(s):
autogenerated on Mon May 3 2021 02:19:27