Deprecated List

Member hebi::robot_model::RobotModel::addJoint  (HebiJointType joint_type)

Replaced by addJoint(JointType) accepting C++ enum

Member hebi::robot_model::RobotModel::getFK  (HebiFrameType frame_type, const Eigen::VectorXd &positions, Matrix4dVector &frames) const

Replaced by getFK accepting C++ enum

Member hebi::robot_model::RobotModel::getForwardKinematics  (HebiFrameType frame_type, const Eigen::VectorXd &positions, Matrix4dVector &frames) const

Replaced by getForwardKinematics accepting C++ enum

Member hebi::robot_model::RobotModel::getFrameCount  (HebiFrameType frame_type) const

Replaced by getFrameCount(FrameType) accepting C++ enum

Member hebi::robot_model::RobotModel::getJ  (HebiFrameType frame_type, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const

Replaced by getJ accepting C++ enum

Member hebi::robot_model::RobotModel::getJacobians  (HebiFrameType frame_type, const Eigen::VectorXd &positions, MatrixXdVector &jacobians) const

Replaced by getJacobians accepting C++ enum