This is the complete list of members for hebi::robot_model::RobotModel, including all inherited members.
| addActuator(robot_model::ActuatorType actuator_type) | hebi::robot_model::RobotModel | |
| addBracket(robot_model::BracketType bracket_type) | hebi::robot_model::RobotModel | |
| addEndEffector(EndEffectorType end_effector_type) | hebi::robot_model::RobotModel | |
| addJoint(JointType joint_type) | hebi::robot_model::RobotModel | |
| addJoint(HebiJointType joint_type) | hebi::robot_model::RobotModel | inline |
| addLink(robot_model::LinkType link_type, double extension, double twist, LinkInputType input_type=LinkInputType::RightAngle, LinkOutputType output_type=LinkOutputType::RightAngle) | 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) | 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(FrameType, const Eigen::VectorXd &positions, Matrix4dVector &frames) const | hebi::robot_model::RobotModel | |
| getFK(HebiFrameType frame_type, const Eigen::VectorXd &positions, Matrix4dVector &frames) const | hebi::robot_model::RobotModel | inline |
| getForwardKinematics(FrameType, const Eigen::VectorXd &positions, Matrix4dVector &frames) const | hebi::robot_model::RobotModel | |
| getForwardKinematics(HebiFrameType frame_type, const Eigen::VectorXd &positions, Matrix4dVector &frames) const | hebi::robot_model::RobotModel | inline |
| getFrameCount(FrameType frame_type) const | hebi::robot_model::RobotModel | |
| getFrameCount(HebiFrameType frame_type) const | hebi::robot_model::RobotModel | inline |
| getJ(FrameType, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const | hebi::robot_model::RobotModel | |
| getJ(HebiFrameType frame_type, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const | hebi::robot_model::RobotModel | inline |
| getJacobianEndEffector(const Eigen::VectorXd &positions, Eigen::MatrixXd &jacobian) const | hebi::robot_model::RobotModel | |
| getJacobians(FrameType, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const | hebi::robot_model::RobotModel | |
| getJacobians(HebiFrameType frame_type, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const | hebi::robot_model::RobotModel | inline |
| getJEndEffector(const Eigen::VectorXd &positions, Eigen::MatrixXd &jacobian) const | hebi::robot_model::RobotModel | |
| getMasses(Eigen::VectorXd &masses) const | hebi::robot_model::RobotModel | |
| getMetadata(std::vector< MetadataBase > &metadata) const | hebi::robot_model::RobotModel | |
| internal_ | hebi::robot_model::RobotModel | private |
| loadHRDF(const std::string &file) | hebi::robot_model::RobotModel | static |
| Objective | hebi::robot_model::RobotModel | private |
| RobotModel(HebiRobotModelPtr) | hebi::robot_model::RobotModel | private |
| RobotModel() | hebi::robot_model::RobotModel | |
| setBaseFrame(const Eigen::Matrix4d &base_frame) | hebi::robot_model::RobotModel | |
| 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) | hebi::robot_model::RobotModel | private |
| ~RobotModel() noexcept | hebi::robot_model::RobotModel |