◆ KinematicsLoaderImpl()
kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::KinematicsLoaderImpl |
( |
const std::string & |
robot_description, |
|
|
const std::map< std::string, std::vector< std::string >> & |
possible_kinematics_solvers, |
|
|
const std::map< std::string, std::vector< double >> & |
search_res, |
|
|
const std::map< std::string, std::vector< std::string >> & |
iksolver_to_tip_links |
|
) |
| |
|
inline |
Pimpl Implementation of KinematicsLoader.
- Parameters
-
robot_description | |
possible_kinematics_solvers | |
search_res | |
iksolver_to_tip_links | - a map between each ik solver and a vector of custom-specified tip link(s) |
Definition at line 94 of file kinematics_plugin_loader.cpp.
◆ allocKinematicsSolver()
kinematics::KinematicsBasePtr kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::allocKinematicsSolver |
( |
const moveit::core::JointModelGroup * |
jmg | ) |
|
|
inline |
◆ allocKinematicsSolverWithCache()
kinematics::KinematicsBasePtr kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::allocKinematicsSolverWithCache |
( |
const moveit::core::JointModelGroup * |
jmg | ) |
|
|
inline |
◆ chooseTipFrames()
std::vector<std::string> kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::chooseTipFrames |
( |
const moveit::core::JointModelGroup * |
jmg | ) |
|
|
inline |
Helper function to decide which, and how many, tip frames a planning group has.
- Parameters
-
jmg | - joint model group pointer |
- Returns
- tips - list of valid links in a planning group to plan for
Definition at line 120 of file kinematics_plugin_loader.cpp.
◆ status()
void kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::status |
( |
| ) |
const |
|
inline |
◆ cache_lock_
boost::mutex kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::cache_lock_ |
|
private |
◆ iksolver_to_tip_links_
std::map<std::string, std::vector<std::string> > kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::iksolver_to_tip_links_ |
|
private |
◆ instances_
std::map<const moveit::core::JointModelGroup*, kinematics::KinematicsBasePtr> kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::instances_ |
|
private |
◆ kinematics_loader_
◆ lock_
boost::mutex kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::lock_ |
|
private |
◆ possible_kinematics_solvers_
std::map<std::string, std::vector<std::string> > kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::possible_kinematics_solvers_ |
|
private |
◆ robot_description_
std::string kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::robot_description_ |
|
private |
◆ search_res_
std::map<std::string, std::vector<double> > kinematics_plugin_loader::KinematicsPluginLoader::KinematicsLoaderImpl::search_res_ |
|
private |
The documentation for this class was generated from the following file: