This is the complete list of members for hebi::robot_model::RobotModel, including all inherited members.
actuator_masses_ | hebi::robot_model::RobotModel | privatestatic |
ActuatorType enum name | hebi::robot_model::RobotModel | |
addActuator(ActuatorType actuator_type) | hebi::robot_model::RobotModel | |
addBracket(BracketType bracket_type) | hebi::robot_model::RobotModel | |
addJoint(HebiJointType joint_type, bool combine) | hebi::robot_model::RobotModel | |
addLink(LinkType link_type, double extension, double twist) | hebi::robot_model::RobotModel | |
addObjectives(HebiIKPtr ik, const T &objective) const | hebi::robot_model::RobotModel | inlineprivate |
addObjectives(HebiIKPtr ik, const T &objective, Args...args) const | hebi::robot_model::RobotModel | inlineprivate |
addRigidBody(const Eigen::Matrix4d &com, const Eigen::VectorXd &inertia, double mass, const Eigen::Matrix4d &output, bool combine) | hebi::robot_model::RobotModel | |
BracketType enum name | hebi::robot_model::RobotModel | |
getBaseFrame() const | hebi::robot_model::RobotModel | |
getDoFCount() const | hebi::robot_model::RobotModel | |
getEndEffector(const Eigen::VectorXd &positions, Eigen::Matrix4d &transform) const | hebi::robot_model::RobotModel | |
getFK(HebiFrameType, const Eigen::VectorXd &positions, Matrix4dVector &frames) const | hebi::robot_model::RobotModel | |
getForwardKinematics(HebiFrameType, const Eigen::VectorXd &positions, Matrix4dVector &frames) const | hebi::robot_model::RobotModel | |
getFrameCount(HebiFrameType frame_type) const | hebi::robot_model::RobotModel | |
getJ(HebiFrameType, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const | hebi::robot_model::RobotModel | |
getJacobianEndEffector(const Eigen::VectorXd &positions, Eigen::MatrixXd &jacobian) const | hebi::robot_model::RobotModel | |
getJacobians(HebiFrameType, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const | hebi::robot_model::RobotModel | |
getJEndEffector(const Eigen::VectorXd &positions, Eigen::MatrixXd &jacobian) const | hebi::robot_model::RobotModel | |
getMasses(Eigen::VectorXd &masses) const | hebi::robot_model::RobotModel | |
internal_ | hebi::robot_model::RobotModel | private |
LinkType enum name | hebi::robot_model::RobotModel | |
Objective | hebi::robot_model::RobotModel | private |
RobotModel() | hebi::robot_model::RobotModel | |
setBaseFrame(const Eigen::Matrix4d &base_frame) | hebi::robot_model::RobotModel | |
setRodXAxisInertia(Eigen::VectorXd &inertia, double mass, double length) | hebi::robot_model::RobotModel | privatestatic |
setRotX(Eigen::Matrix4d &matrix, double radians) | hebi::robot_model::RobotModel | privatestatic |
setSphereInertia(Eigen::VectorXd &inertia, double mass, double radius) | hebi::robot_model::RobotModel | privatestatic |
setTranslate(Eigen::Matrix4d &matrix, double x, double y, double z) | hebi::robot_model::RobotModel | privatestatic |
solveIK(const Eigen::VectorXd &initial_positions, Eigen::VectorXd &result, Args...objectives) const | hebi::robot_model::RobotModel | inline |
solveInverseKinematics(const Eigen::VectorXd &initial_positions, Eigen::VectorXd &result, Args...args) const | hebi::robot_model::RobotModel | inline |
tryAdd(HebiRobotModelElementPtr element, bool combine) | hebi::robot_model::RobotModel | private |
~RobotModel() noexcept | hebi::robot_model::RobotModel |