addDescendantJointModel(const JointModel *joint) | moveit::core::JointModel | |
addDescendantLinkModel(const LinkModel *link) | moveit::core::JointModel | |
addMimicRequest(const JointModel *joint) | moveit::core::JointModel | |
Bounds typedef | moveit::core::JointModel | |
child_link_model_ | moveit::core::JointModel | protected |
computeTransform(const double *joint_values, Eigen::Isometry3d &transf) const override | moveit::core::FloatingJointModel | virtual |
computeVariableBoundsMsg() | moveit::core::JointModel | protected |
computeVariablePositions(const Eigen::Isometry3d &transf, double *joint_values) const override | moveit::core::FloatingJointModel | virtual |
descendant_joint_models_ | moveit::core::JointModel | protected |
descendant_link_models_ | moveit::core::JointModel | protected |
distance(const double *values1, const double *values2) const override | moveit::core::FloatingJointModel | virtual |
distance_factor_ | moveit::core::JointModel | protected |
distanceRotation(const double *values1, const double *values2) const | moveit::core::FloatingJointModel | |
distanceTranslation(const double *values1, const double *values2) const | moveit::core::FloatingJointModel | |
enforcePositionBounds(double *values, const Bounds &other_bounds) const override | moveit::core::FloatingJointModel | virtual |
moveit::core::JointModel::enforcePositionBounds(double *values) const | moveit::core::JointModel | inline |
enforceVelocityBounds(double *values) const | moveit::core::JointModel | inline |
enforceVelocityBounds(double *values, const Bounds &other_bounds) const | moveit::core::JointModel | virtual |
FIXED enum value | moveit::core::JointModel | |
FLOATING enum value | moveit::core::JointModel | |
FloatingJointModel(const std::string &name, size_t joint_index, size_t first_variable_index) | moveit::core::FloatingJointModel | |
getAngularDistanceWeight() const | moveit::core::FloatingJointModel | inline |
getChildLinkModel() const | moveit::core::JointModel | inline |
getDescendantJointModels() const | moveit::core::JointModel | inline |
getDescendantLinkModels() const | moveit::core::JointModel | inline |
getDistanceFactor() const | moveit::core::JointModel | inline |
getFirstVariableIndex() const | moveit::core::JointModel | inline |
getJointIndex() const | moveit::core::JointModel | inline |
getLocalVariableIndex(const std::string &variable) const | moveit::core::JointModel | |
getLocalVariableNames() const | moveit::core::JointModel | inline |
getMaximumExtent(const Bounds &other_bounds) const override | moveit::core::FloatingJointModel | virtual |
moveit::core::JointModel::getMaximumExtent() const | moveit::core::JointModel | inline |
getMimic() const | moveit::core::JointModel | inline |
getMimicFactor() const | moveit::core::JointModel | inline |
getMimicOffset() const | moveit::core::JointModel | inline |
getMimicRequests() const | moveit::core::JointModel | inline |
getName() const | moveit::core::JointModel | inline |
getNonFixedDescendantJointModels() const | moveit::core::JointModel | inline |
getParentLinkModel() const | moveit::core::JointModel | inline |
getStateSpaceDimension() const override | moveit::core::FloatingJointModel | virtual |
getType() const | moveit::core::JointModel | inline |
getTypeName() const | moveit::core::JointModel | |
getVariableBounds(const std::string &variable) const | moveit::core::JointModel | |
getVariableBounds() const | moveit::core::JointModel | inline |
getVariableBoundsMsg() const | moveit::core::JointModel | inline |
getVariableCount() const | moveit::core::JointModel | inline |
getVariableDefaultPositions(double *values, const Bounds &other_bounds) const override | moveit::core::FloatingJointModel | virtual |
moveit::core::JointModel::getVariableDefaultPositions(double *values) const | moveit::core::JointModel | inline |
getVariableNames() const | moveit::core::JointModel | inline |
getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, double *values, const Bounds &other_bounds) const override | moveit::core::FloatingJointModel | virtual |
moveit::core::JointModel::getVariableRandomPositions(random_numbers::RandomNumberGenerator &rng, double *values) const | moveit::core::JointModel | inline |
getVariableRandomPositionsNearBy(random_numbers::RandomNumberGenerator &rng, double *values, const Bounds &other_bounds, const double *near, const double distance) const override | moveit::core::FloatingJointModel | virtual |
moveit::core::JointModel::getVariableRandomPositionsNearBy(random_numbers::RandomNumberGenerator &rng, double *values, const double *near, const double distance) const | moveit::core::JointModel | inline |
harmonizePosition(double *values, const Bounds &other_bounds) const | moveit::core::JointModel | virtual |
harmonizePosition(double *values) const | moveit::core::JointModel | inline |
hasVariable(const std::string &variable) const | moveit::core::JointModel | inline |
interpolate(const double *from, const double *to, const double t, double *state) const override | moveit::core::FloatingJointModel | virtual |
isPassive() const | moveit::core::JointModel | inline |
JointModel(const std::string &name, size_t joint_index, size_t first_variable_index) | moveit::core::JointModel | |
JointType enum name | moveit::core::JointModel | |
local_variable_names_ | moveit::core::JointModel | protected |
mimic_ | moveit::core::JointModel | protected |
mimic_factor_ | moveit::core::JointModel | protected |
mimic_offset_ | moveit::core::JointModel | protected |
mimic_requests_ | moveit::core::JointModel | protected |
non_fixed_descendant_joint_models_ | moveit::core::JointModel | protected |
normalizeRotation(double *values) const | moveit::core::FloatingJointModel | |
parent_link_model_ | moveit::core::JointModel | protected |
passive_ | moveit::core::JointModel | protected |
PLANAR enum value | moveit::core::JointModel | |
PRISMATIC enum value | moveit::core::JointModel | |
REVOLUTE enum value | moveit::core::JointModel | |
satisfiesAccelerationBounds(const double *values, double margin=0.0) const | moveit::core::JointModel | inline |
satisfiesAccelerationBounds(const double *values, const Bounds &other_bounds, double margin) const | moveit::core::JointModel | virtual |
satisfiesJerkBounds(const double *values, double margin=0.0) const | moveit::core::JointModel | inline |
satisfiesJerkBounds(const double *values, const Bounds &other_bounds, double margin) const | moveit::core::JointModel | virtual |
satisfiesPositionBounds(const double *values, const Bounds &other_bounds, double margin) const override | moveit::core::FloatingJointModel | virtual |
moveit::core::JointModel::satisfiesPositionBounds(const double *values, double margin=0.0) const | moveit::core::JointModel | inline |
satisfiesVelocityBounds(const double *values, double margin=0.0) const | moveit::core::JointModel | inline |
satisfiesVelocityBounds(const double *values, const Bounds &other_bounds, double margin) const | moveit::core::JointModel | virtual |
setAngularDistanceWeight(double weight) | moveit::core::FloatingJointModel | inline |
setChildLinkModel(const LinkModel *link) | moveit::core::JointModel | inline |
setDistanceFactor(double factor) | moveit::core::JointModel | inline |
setMimic(const JointModel *mimic, double factor, double offset) | moveit::core::JointModel | |
setParentLinkModel(const LinkModel *link) | moveit::core::JointModel | inline |
setPassive(bool flag) | moveit::core::JointModel | inline |
setVariableBounds(const std::string &variable, const VariableBounds &bounds) | moveit::core::JointModel | |
setVariableBounds(const std::vector< moveit_msgs::msg::JointLimits > &jlim) | moveit::core::JointModel | |
type_ | moveit::core::JointModel | protected |
UNKNOWN enum value | moveit::core::JointModel | |
variable_bounds_ | moveit::core::JointModel | protected |
variable_bounds_msg_ | moveit::core::JointModel | protected |
variable_index_map_ | moveit::core::JointModel | protected |
variable_names_ | moveit::core::JointModel | protected |
~JointModel() | moveit::core::JointModel | virtual |