HEBI C++ API
3.10.0
|
This is the complete list of members for hebi::robot_model::RobotModel, including all inherited members.
ActuatorType typedef | hebi::robot_model::RobotModel | |
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 | |
addEndEffector(double x, double y, double z) | hebi::robot_model::RobotModel | |
addEndEffector(const Eigen::Matrix4d &com, const Eigen::VectorXd &inertia, double mass, const Eigen::Matrix4d &output) | 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 | |
addRigidBody(const Eigen::Matrix4d &com, const Eigen::VectorXd &inertia, double mass, const Eigen::Matrix4d &output) | hebi::robot_model::RobotModel | |
BracketType typedef | hebi::robot_model::RobotModel | |
createSubtree(size_t element_index) | hebi::robot_model::RobotModel | |
getBaseFrame() const | hebi::robot_model::RobotModel | |
getDoFCount() const | hebi::robot_model::RobotModel | |
getDynamicCompEfforts(const Eigen::VectorXd &angles, const Eigen::VectorXd &cmd_pos, const Eigen::VectorXd &cmd_vel, const Eigen::VectorXd &cmd_accel, Eigen::VectorXd &comp_torque, double dt) 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 |
getGravCompEfforts(const Eigen::VectorXd &angles, const Eigen::Vector3d &gravity, Eigen::VectorXd &comp_torque) const | hebi::robot_model::RobotModel | |
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 | |
getMeshPath(size_t mesh_frame_index) const | hebi::robot_model::RobotModel | |
getMetadata(std::vector< MetadataBase > &metadata) const | hebi::robot_model::RobotModel | |
LinkType typedef | hebi::robot_model::RobotModel | |
loadHRDF(const std::string &file) | hebi::robot_model::RobotModel | static |
loadHRDFString(const std::string &string) | hebi::robot_model::RobotModel | static |
RobotModel() | hebi::robot_model::RobotModel | |
setBaseFrame(const Eigen::Matrix4d &base_frame) | hebi::robot_model::RobotModel | |
solveIK(const Eigen::VectorXd &initial_positions, Eigen::VectorXd &result, const Args &... objectives) const | hebi::robot_model::RobotModel | inline |
solveInverseKinematics(const Eigen::VectorXd &initial_positions, Eigen::VectorXd &result, const Args &... args) const | hebi::robot_model::RobotModel | inline |
~RobotModel() noexcept | hebi::robot_model::RobotModel |