moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Classes | |
class | PR2ArmIK |
class | PR2ArmIKSolver |
class | PR2ArmKinematicsPlugin |
Functions | |
double | distance (const urdf::Pose &transform) |
bool | solveQuadratic (double a, double b, double c, double *x1, double *x2) |
bool | solveCosineEqn (double a, double b, double c, double &soln1, double &soln2) |
bool | getKDLChain (const urdf::ModelInterface &model, const std::string &root_name, const std::string &tip_name, KDL::Chain &kdl_chain) |
Eigen::Isometry3f | kdlToEigenMatrix (const KDL::Frame &p) |
double | computeEuclideanDistance (const std::vector< double > &array_1, const KDL::JntArray &array_2) |
void | getKDLChainInfo (const KDL::Chain &chain, moveit_msgs::msg::KinematicSolverInfo &chain_info) |
MOVEIT_CLASS_FORWARD (PR2ArmIKSolver) | |
MOVEIT_CLASS_FORWARD (PR2ArmKinematicsPlugin) | |
double pr2_arm_kinematics::computeEuclideanDistance | ( | const std::vector< double > & | array_1, |
const KDL::JntArray & | array_2 | ||
) |
Definition at line 245 of file pr2_arm_kinematics_plugin.cpp.
|
inline |
bool pr2_arm_kinematics::getKDLChain | ( | const urdf::ModelInterface & | model, |
const std::string & | root_name, | ||
const std::string & | tip_name, | ||
KDL::Chain & | kdl_chain | ||
) |
Definition at line 212 of file pr2_arm_kinematics_plugin.cpp.
void pr2_arm_kinematics::getKDLChainInfo | ( | const KDL::Chain & | chain, |
moveit_msgs::msg::KinematicSolverInfo & | chain_info | ||
) |
Definition at line 255 of file pr2_arm_kinematics_plugin.cpp.
Eigen::Isometry3f pr2_arm_kinematics::kdlToEigenMatrix | ( | const KDL::Frame & | p | ) |
Definition at line 231 of file pr2_arm_kinematics_plugin.cpp.
pr2_arm_kinematics::MOVEIT_CLASS_FORWARD | ( | PR2ArmIKSolver | ) |
pr2_arm_kinematics::MOVEIT_CLASS_FORWARD | ( | PR2ArmKinematicsPlugin | ) |
|
inline |
|
inline |