moveit::core::RobotModel Member List

This is the complete list of members for moveit::core::RobotModel, including all inherited members.

active_joint_model_start_index_moveit::core::RobotModelprotected
active_joint_model_vector_moveit::core::RobotModelprotected
active_joint_model_vector_const_moveit::core::RobotModelprotected
active_joint_models_bounds_moveit::core::RobotModelprotected
addJointModelGroup(const srdf::Model::Group &group)moveit::core::RobotModelprotected
buildGroups(const srdf::Model &srdf_model)moveit::core::RobotModelprotected
buildGroupsInfo_EndEffectors(const srdf::Model &srdf_model)moveit::core::RobotModelprotected
buildGroupsInfo_Subgroups(const srdf::Model &srdf_model)moveit::core::RobotModelprotected
buildGroupStates(const srdf::Model &srdf_model)moveit::core::RobotModelprotected
buildJointInfo()moveit::core::RobotModelprotected
buildMimic(const urdf::ModelInterface &urdf_model)moveit::core::RobotModelprotected
buildModel(const urdf::ModelInterface &urdf_model, const srdf::Model &srdf_model)moveit::core::RobotModelprotected
buildRecursive(LinkModel *parent, const urdf::Link *link, const srdf::Model &srdf_model)moveit::core::RobotModelprotected
common_joint_roots_moveit::core::RobotModelprotected
computeCommonRoot(const JointModel *a, const JointModel *b) const moveit::core::RobotModelprotected
computeCommonRoots()moveit::core::RobotModelprotected
computeDescendants()moveit::core::RobotModelprotected
computeFixedTransforms(const LinkModel *link, const Eigen::Affine3d &transform, LinkTransformMap &associated_transforms)moveit::core::RobotModelprotected
constructJointModel(const urdf::Joint *urdf_joint_model, const urdf::Link *child_link, const srdf::Model &srdf_model)moveit::core::RobotModelprotected
constructLinkModel(const urdf::Link *urdf_link)moveit::core::RobotModelprotected
constructShape(const urdf::Geometry *geom)moveit::core::RobotModelprotected
continuous_joint_model_vector_moveit::core::RobotModelprotected
distance(const double *state1, const double *state2) const moveit::core::RobotModel
end_effectors_moveit::core::RobotModelprotected
end_effectors_map_moveit::core::RobotModelprotected
enforcePositionBounds(double *state) const moveit::core::RobotModelinline
enforcePositionBounds(double *state, const JointBoundsVector &active_joint_bounds) const moveit::core::RobotModel
getActiveJointModels() const moveit::core::RobotModelinline
getActiveJointModels()moveit::core::RobotModelinline
getActiveJointModelsBounds() const moveit::core::RobotModelinline
getCommonRoot(const JointModel *a, const JointModel *b) const moveit::core::RobotModelinline
getContinuousJointModels() const moveit::core::RobotModelinline
getEndEffector(const std::string &name) const moveit::core::RobotModel
getEndEffector(const std::string &name)moveit::core::RobotModel
getEndEffectors() const moveit::core::RobotModelinline
getJointModel(const std::string &joint) const moveit::core::RobotModel
getJointModel(int index) const moveit::core::RobotModel
getJointModel(const std::string &joint)moveit::core::RobotModel
getJointModelCount() const moveit::core::RobotModelinline
getJointModelGroup(const std::string &name) const moveit::core::RobotModel
getJointModelGroup(const std::string &name)moveit::core::RobotModel
getJointModelGroupNames() const moveit::core::RobotModelinline
getJointModelGroups() const moveit::core::RobotModelinline
getJointModelGroups()moveit::core::RobotModelinline
getJointModelNames() const moveit::core::RobotModelinline
getJointModels() const moveit::core::RobotModelinline
getJointModels()moveit::core::RobotModelinline
getJointOfVariable(int variable_index) const moveit::core::RobotModelinline
getJointOfVariable(const std::string &variable) const moveit::core::RobotModelinline
getLinkGeometryCount() const moveit::core::RobotModelinline
getLinkModel(const std::string &link) const moveit::core::RobotModel
getLinkModel(int index) const moveit::core::RobotModel
getLinkModel(const std::string &link)moveit::core::RobotModel
getLinkModelCount() const moveit::core::RobotModelinline
getLinkModelNames() const moveit::core::RobotModelinline
getLinkModelNamesWithCollisionGeometry() const moveit::core::RobotModelinline
getLinkModels() const moveit::core::RobotModelinline
getLinkModels()moveit::core::RobotModelinline
getLinkModelsWithCollisionGeometry() const moveit::core::RobotModelinline
getMaximumExtent() const moveit::core::RobotModelinline
getMaximumExtent(const JointBoundsVector &active_joint_bounds) const moveit::core::RobotModel
getMimicJointModels() const moveit::core::RobotModelinline
getMissingVariableNames(const std::vector< std::string > &variables, std::vector< std::string > &missing_variables) const moveit::core::RobotModel
getModelFrame() const moveit::core::RobotModelinline
getMultiDOFJointModels() const moveit::core::RobotModelinline
getName() const moveit::core::RobotModelinline
getRigidlyConnectedParentLinkModel(const LinkModel *link)moveit::core::RobotModelstatic
getRootJoint() const moveit::core::RobotModel
getRootJointName() const moveit::core::RobotModelinline
getRootLink() const moveit::core::RobotModel
getRootLinkName() const moveit::core::RobotModelinline
getSingleDOFJointModels() const moveit::core::RobotModelinline
getSRDF() const moveit::core::RobotModelinline
getURDF() const moveit::core::RobotModelinline
getVariableBounds(const std::string &variable) const moveit::core::RobotModelinline
getVariableCount() const moveit::core::RobotModelinline
getVariableDefaultPositions(double *values) const moveit::core::RobotModel
getVariableDefaultPositions(std::vector< double > &values) const moveit::core::RobotModelinline
getVariableDefaultPositions(std::map< std::string, double > &values) const moveit::core::RobotModel
getVariableIndex(const std::string &variable) const moveit::core::RobotModel
getVariableNames() const moveit::core::RobotModelinline
getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, double *values) const moveit::core::RobotModel
getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, std::vector< double > &values) const moveit::core::RobotModelinline
getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, std::map< std::string, double > &values) const moveit::core::RobotModel
hasEndEffector(const std::string &eef) const moveit::core::RobotModel
hasJointModel(const std::string &name) const moveit::core::RobotModel
hasJointModelGroup(const std::string &group) const moveit::core::RobotModel
hasLinkModel(const std::string &name) const moveit::core::RobotModel
interpolate(const double *from, const double *to, double t, double *state) const moveit::core::RobotModel
isEmpty() const moveit::core::RobotModelinline
joint_model_group_map_moveit::core::RobotModelprotected
joint_model_group_names_moveit::core::RobotModelprotected
joint_model_groups_moveit::core::RobotModelprotected
joint_model_groups_const_moveit::core::RobotModelprotected
joint_model_map_moveit::core::RobotModelprotected
joint_model_names_vector_moveit::core::RobotModelprotected
joint_model_vector_moveit::core::RobotModelprotected
joint_model_vector_const_moveit::core::RobotModelprotected
joint_variables_index_map_moveit::core::RobotModelprotected
joints_of_variable_moveit::core::RobotModelprotected
link_geometry_count_moveit::core::RobotModelprotected
link_model_map_moveit::core::RobotModelprotected
link_model_names_vector_moveit::core::RobotModelprotected
link_model_names_with_collision_geometry_vector_moveit::core::RobotModelprotected
link_model_vector_moveit::core::RobotModelprotected
link_model_vector_const_moveit::core::RobotModelprotected
link_models_with_collision_geometry_vector_moveit::core::RobotModelprotected
mimic_joints_moveit::core::RobotModelprotected
model_frame_moveit::core::RobotModelprotected
model_name_moveit::core::RobotModelprotected
multi_dof_joints_moveit::core::RobotModelprotected
printModelInfo(std::ostream &out) const moveit::core::RobotModel
RobotModel(const urdf::ModelInterfaceSharedPtr &urdf_model, const srdf::ModelConstSharedPtr &srdf_model)moveit::core::RobotModel
root_joint_moveit::core::RobotModelprotected
root_link_moveit::core::RobotModelprotected
satisfiesPositionBounds(const double *state, double margin=0.0) const moveit::core::RobotModelinline
satisfiesPositionBounds(const double *state, const JointBoundsVector &active_joint_bounds, double margin=0.0) const moveit::core::RobotModel
setKinematicsAllocators(const std::map< std::string, SolverAllocatorFn > &allocators)moveit::core::RobotModel
single_dof_joints_moveit::core::RobotModelprotected
srdf_moveit::core::RobotModelprotected
updateMimicJoints(double *values) const moveit::core::RobotModelprotected
urdf_moveit::core::RobotModelprotected
variable_count_moveit::core::RobotModelprotected
variable_names_moveit::core::RobotModelprotected
~RobotModel()moveit::core::RobotModel


moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Wed Jul 10 2019 04:03:06