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::RobotModel [protected]
active_joint_model_vector_moveit::core::RobotModel [protected]
active_joint_model_vector_const_moveit::core::RobotModel [protected]
active_joint_models_bounds_moveit::core::RobotModel [protected]
addJointModelGroup(const srdf::Model::Group &group)moveit::core::RobotModel [protected]
buildGroups(const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
buildGroupsInfo_EndEffectors(const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
buildGroupsInfo_Subgroups(const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
buildGroupStates(const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
buildJointInfo()moveit::core::RobotModel [protected]
buildMimic(const urdf::ModelInterface &urdf_model)moveit::core::RobotModel [protected]
buildModel(const urdf::ModelInterface &urdf_model, const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
buildRecursive(LinkModel *parent, const urdf::Link *link, const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
common_joint_roots_moveit::core::RobotModel [protected]
computeCommonRoot(const JointModel *a, const JointModel *b) const moveit::core::RobotModel [protected]
computeCommonRoots()moveit::core::RobotModel [protected]
computeDescendants()moveit::core::RobotModel [protected]
computeFixedTransforms(const LinkModel *link, const Eigen::Affine3d &transform, LinkTransformMap &associated_transforms)moveit::core::RobotModel [protected]
constructJointModel(const urdf::Joint *urdf_joint_model, const urdf::Link *child_link, const srdf::Model &srdf_model)moveit::core::RobotModel [protected]
constructLinkModel(const urdf::Link *urdf_link)moveit::core::RobotModel [protected]
constructShape(const urdf::Geometry *geom)moveit::core::RobotModel [protected]
continuous_joint_model_vector_moveit::core::RobotModel [protected]
distance(const double *state1, const double *state2) const moveit::core::RobotModel
end_effectors_moveit::core::RobotModel [protected]
end_effectors_map_moveit::core::RobotModel [protected]
enforcePositionBounds(double *state) const moveit::core::RobotModel [inline]
enforcePositionBounds(double *state, const JointBoundsVector &active_joint_bounds) const moveit::core::RobotModel
getActiveJointModels() const moveit::core::RobotModel [inline]
getActiveJointModels()moveit::core::RobotModel [inline]
getActiveJointModelsBounds() const moveit::core::RobotModel [inline]
getCommonRoot(const JointModel *a, const JointModel *b) const moveit::core::RobotModel [inline]
getContinuousJointModels() const moveit::core::RobotModel [inline]
getEndEffector(const std::string &name) const moveit::core::RobotModel
getEndEffector(const std::string &name)moveit::core::RobotModel
getEndEffectors() const moveit::core::RobotModel [inline]
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::RobotModel [inline]
getJointModelGroup(const std::string &name) const moveit::core::RobotModel
getJointModelGroup(const std::string &name)moveit::core::RobotModel
getJointModelGroupNames() const moveit::core::RobotModel [inline]
getJointModelGroups() const moveit::core::RobotModel [inline]
getJointModelGroups()moveit::core::RobotModel [inline]
getJointModelNames() const moveit::core::RobotModel [inline]
getJointModels() const moveit::core::RobotModel [inline]
getJointModels()moveit::core::RobotModel [inline]
getJointOfVariable(int variable_index) const moveit::core::RobotModel [inline]
getJointOfVariable(const std::string &variable) const moveit::core::RobotModel [inline]
getLinkGeometryCount() const moveit::core::RobotModel [inline]
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::RobotModel [inline]
getLinkModelNames() const moveit::core::RobotModel [inline]
getLinkModelNamesWithCollisionGeometry() const moveit::core::RobotModel [inline]
getLinkModels() const moveit::core::RobotModel [inline]
getLinkModels()moveit::core::RobotModel [inline]
getLinkModelsWithCollisionGeometry() const moveit::core::RobotModel [inline]
getMaximumExtent() const moveit::core::RobotModel [inline]
getMaximumExtent(const JointBoundsVector &active_joint_bounds) const moveit::core::RobotModel
getMimicJointModels() const moveit::core::RobotModel [inline]
getMissingVariableNames(const std::vector< std::string > &variables, std::vector< std::string > &missing_variables) const moveit::core::RobotModel
getModelFrame() const moveit::core::RobotModel [inline]
getMultiDOFJointModels() const moveit::core::RobotModel [inline]
getName() const moveit::core::RobotModel [inline]
getRootJoint() const moveit::core::RobotModel
getRootJointName() const moveit::core::RobotModel [inline]
getRootLink() const moveit::core::RobotModel
getRootLinkName() const moveit::core::RobotModel [inline]
getSingleDOFJointModels() const moveit::core::RobotModel [inline]
getSRDF() const moveit::core::RobotModel [inline]
getURDF() const moveit::core::RobotModel [inline]
getVariableBounds(const std::string &variable) const moveit::core::RobotModel [inline]
getVariableCount() const moveit::core::RobotModel [inline]
getVariableDefaultPositions(double *values) const moveit::core::RobotModel
getVariableDefaultPositions(std::vector< double > &values) const moveit::core::RobotModel [inline]
getVariableDefaultPositions(std::map< std::string, double > &values) const moveit::core::RobotModel
getVariableIndex(const std::string &variable) const moveit::core::RobotModel
getVariableNames() const moveit::core::RobotModel [inline]
getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, double *values) const moveit::core::RobotModel
getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, std::vector< double > &values) const moveit::core::RobotModel [inline]
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::RobotModel [inline]
joint_model_group_map_moveit::core::RobotModel [protected]
joint_model_group_names_moveit::core::RobotModel [protected]
joint_model_groups_moveit::core::RobotModel [protected]
joint_model_groups_const_moveit::core::RobotModel [protected]
joint_model_map_moveit::core::RobotModel [protected]
joint_model_names_vector_moveit::core::RobotModel [protected]
joint_model_vector_moveit::core::RobotModel [protected]
joint_model_vector_const_moveit::core::RobotModel [protected]
joint_variables_index_map_moveit::core::RobotModel [protected]
joints_of_variable_moveit::core::RobotModel [protected]
link_geometry_count_moveit::core::RobotModel [protected]
link_model_map_moveit::core::RobotModel [protected]
link_model_names_vector_moveit::core::RobotModel [protected]
link_model_names_with_collision_geometry_vector_moveit::core::RobotModel [protected]
link_model_vector_moveit::core::RobotModel [protected]
link_model_vector_const_moveit::core::RobotModel [protected]
link_models_with_collision_geometry_vector_moveit::core::RobotModel [protected]
mimic_joints_moveit::core::RobotModel [protected]
model_frame_moveit::core::RobotModel [protected]
model_name_moveit::core::RobotModel [protected]
multi_dof_joints_moveit::core::RobotModel [protected]
printModelInfo(std::ostream &out) const moveit::core::RobotModel
RobotModel(const boost::shared_ptr< const urdf::ModelInterface > &urdf_model, const boost::shared_ptr< const srdf::Model > &srdf_model)moveit::core::RobotModel
root_joint_moveit::core::RobotModel [protected]
root_link_moveit::core::RobotModel [protected]
satisfiesPositionBounds(const double *state, double margin=0.0) const moveit::core::RobotModel [inline]
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::RobotModel [protected]
srdf_moveit::core::RobotModel [protected]
updateMimicJoints(double *values) const moveit::core::RobotModel [protected]
urdf_moveit::core::RobotModel [protected]
variable_count_moveit::core::RobotModel [protected]
variable_names_moveit::core::RobotModel [protected]
~RobotModel()moveit::core::RobotModel


moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Mon Jul 24 2017 02:20:45