XBotInterface  2.4.1
XBotInterface provides a generic API to model and control a robot.
XBot::ModelInterface Member List

This is the complete list of members for XBot::ModelInterface, including all inherited members.

_ft_id_mapXBot::XBotInterfaceprotected
_ft_mapXBot::XBotInterfaceprotected
_hand_id_mapXBot::XBotInterfaceprotected
_hand_mapXBot::XBotInterfaceprotected
_imu_id_mapXBot::XBotInterfaceprotected
_imu_mapXBot::XBotInterfaceprotected
_is_floating_baseXBot::ModelInterfaceprotected
_joint_id_to_eigen_idXBot::XBotInterfaceprotected
_joint_name_to_eigen_idXBot::XBotInterfaceprotected
_joint_vectorXBot::XBotInterfaceprotected
_XBotModelXBot::XBotInterfaceprotected
arm(int arm_id)XBot::ModelInterface
arm(int arm_id) constXBot::ModelInterface
arms() constXBot::XBotInterface
chain(const std::string &chain_name)XBot::ModelInterface
chain(const std::string &chain_name) constXBot::ModelInterface
checkEffortLimits(const Eigen::VectorXd &tau, std::vector< std::string > &violating_joints) constXBot::XBotInterface
checkEffortLimits(const Eigen::VectorXd &tau) constXBot::XBotInterface
checkJointLimits(const Eigen::VectorXd &q, std::vector< std::string > &violating_joints) constXBot::XBotInterface
checkJointLimits(const Eigen::VectorXd &q) constXBot::XBotInterface
checkVelocityLimits(const Eigen::VectorXd &qdot, std::vector< std::string > &violating_joints) constXBot::XBotInterface
checkVelocityLimits(const Eigen::VectorXd &qdot) constXBot::XBotInterface
computeConstrainedInverseDynamics(const Eigen::MatrixXd &J, const Eigen::VectorXd &weights, Eigen::VectorXd &tau) constXBot::ModelInterface
computeGravityCompensation(Eigen::VectorXd &g) const =0XBot::ModelInterfacepure virtual
computeInverseDynamics(Eigen::VectorXd &tau) const =0XBot::ModelInterfacepure virtual
computeJdotQdot(const std::string &link_name, const KDL::Vector &point, KDL::Twist &jdotqdot) constXBot::ModelInterfacevirtual
computeJdotQdot(const std::string &link_name, const Eigen::Vector3d &point, Eigen::Vector6d &jdotqdot) constXBot::ModelInterface
computeNonlinearTerm(Eigen::VectorXd &n) const =0XBot::ModelInterfacepure virtual
computeRelativeJdotQdot(const std::string &target_link_name, const std::string &base_link_name, KDL::Twist &jdotqdot) const =0XBot::ModelInterfacepure virtual
computeRelativeJdotQdot(const std::string &target_link_name, const std::string &base_link_name, Eigen::Vector6d &jdotqdot) constXBot::ModelInterface
ConstPtr typedefXBot::ModelInterface
eigenToMap(const Eigen::VectorXd &vector, JointNameMap &name_map) constXBot::XBotInterface
eigenToMap(const Eigen::VectorXd &vector, JointIdMap &id_map) constXBot::XBotInterface
enforceEffortLimit(Eigen::VectorXd &tau) constXBot::XBotInterface
enforceJointLimits(JointIdMap &q) constXBot::XBotInterface
enforceJointLimits(JointNameMap &q) constXBot::XBotInterface
enforceJointLimits(Eigen::VectorXd &q) constXBot::XBotInterface
enforceVelocityLimit(Eigen::VectorXd &qdot) constXBot::XBotInterface
getAccelerationTwist(const std::string &link_name, KDL::Twist &acceleration) const =0XBot::ModelInterfacepure virtual
getAccelerationTwist(const std::string &link_name, Eigen::Vector6d &acceleration) constXBot::ModelInterface
getActuatedJointNum() constXBot::ModelInterface
getCentroidalMomentum(Eigen::Vector6d &centroidal_momentum) const =0XBot::ModelInterfacepure virtual
getCentroidalMomentumMatrix(Eigen::MatrixXd &centroidal_momentum_matrix, Eigen::Vector6d &CMMdotQdot) constXBot::ModelInterfacevirtual
getCentroidalMomentumMatrix(Eigen::MatrixXd &centroidal_momentum_matrix) constXBot::ModelInterfacevirtual
XBot::XBotInterface::getChainMap() constXBot::XBotInterface
getChainNames() constXBot::XBotInterface
getChainSelectionMatrix(const std::string &chain_name, Eigen::MatrixXd &S) constXBot::ModelInterface
getCOM(KDL::Vector &com_position) const =0XBot::ModelInterfacepure virtual
getCOM(const std::string &reference_frame, KDL::Vector &com_position) constXBot::ModelInterface
getCOM(Eigen::Vector3d &com_position) constXBot::ModelInterface
getCOM(const std::string &reference_frame, Eigen::Vector3d &com_position) constXBot::ModelInterface
getCOMAcceleration(KDL::Vector &acceleration) const =0XBot::ModelInterfacepure virtual
getCOMAcceleration(Eigen::Vector3d &acceleration) constXBot::ModelInterface
getCOMJacobian(KDL::Jacobian &J, KDL::Vector &dJcomQdot) constXBot::ModelInterfacevirtual
getCOMJacobian(KDL::Jacobian &J) constXBot::ModelInterfacevirtual
getCOMJacobian(Eigen::MatrixXd &J, Eigen::Vector3d &dJcomQdot) constXBot::ModelInterfacevirtual
getCOMJacobian(Eigen::MatrixXd &J) constXBot::ModelInterface
getCOMVelocity(KDL::Vector &velocity) const =0XBot::ModelInterfacepure virtual
getCOMVelocity(Eigen::Vector3d &velocity) constXBot::ModelInterface
getConfigOptions() constXBot::XBotInterface
getDamping(Eigen::VectorXd &D) constXBot::ModelInterface
getDamping(JointIdMap &D) constXBot::ModelInterface
getDamping(JointNameMap &D) constXBot::ModelInterface
XBot::XBotInterface::getDamping(Eigen::VectorXd &D) constXBot::XBotInterface
XBot::XBotInterface::getDamping(JointIdMap &D) constXBot::XBotInterface
XBot::XBotInterface::getDamping(JointNameMap &D) constXBot::XBotInterface
getDofIndex(const std::string &joint_name) constXBot::XBotInterface
getDofIndex(int joint_id) constXBot::XBotInterface
getDofIndex(const std::string &chain_name, std::vector< int > &ids) constXBot::XBotInterface
getEffortLimits(Eigen::VectorXd &tau_max) constXBot::XBotInterface
XBot::XBotInterface::getEffortReference(Eigen::VectorXd &tau) constXBot::XBotInterface
XBot::XBotInterface::getEffortReference(JointIdMap &tau) constXBot::XBotInterface
XBot::XBotInterface::getEffortReference(JointNameMap &tau) constXBot::XBotInterface
getEnabledJointId() constXBot::XBotInterface
getEnabledJointNames() constXBot::XBotInterface
getFloatingBaseLink(std::string &floating_base_link) const =0XBot::ModelInterfacepure virtual
getFloatingBasePose(KDL::Frame &floating_base_pose) constXBot::ModelInterface
getFloatingBasePose(Eigen::Affine3d &floating_base_pose) constXBot::ModelInterface
getFloatingBaseTwist(KDL::Twist &floating_base_twist) constXBot::ModelInterface
getFloatingBaseTwist(Eigen::Vector6d &floating_base_twist) constXBot::ModelInterface
getForceTorque() constXBot::XBotInterface
getForceTorque(const std::string &parent_link_name) constXBot::XBotInterface
getForceTorque(int ft_id) constXBot::XBotInterface
getForceTorqueInternal() constXBot::XBotInterfaceprotected
getGravity(KDL::Vector &gravity) const =0XBot::ModelInterfacepure virtual
getGravity(const std::string &reference_frame, KDL::Vector &gravity) constXBot::ModelInterface
getGravity(Eigen::Vector3d &gravity) constXBot::ModelInterface
getGravity(const std::string &reference_frame, Eigen::Vector3d &gravity) constXBot::ModelInterface
getHand()XBot::XBotInterface
getHand(int hand_id) constXBot::XBotInterface
getImu()XBot::XBotInterface
getImu(const std::string &parent_link_name) constXBot::XBotInterface
getImu(int imu_id) constXBot::XBotInterface
getImuInternal() constXBot::XBotInterfaceprotected
getInertiaInverse(Eigen::MatrixXd &Minv) constXBot::ModelInterfacevirtual
getInertiaInverseTimesMatrix(const Eigen::MatrixXd &Mat, Eigen::MatrixXd &Minv_Mat) constXBot::ModelInterfacevirtual
getInertiaInverseTimesVector(const Eigen::VectorXd &vec, Eigen::VectorXd &minv_vec) constXBot::ModelInterfacevirtual
getInertiaMatrix(Eigen::MatrixXd &M) const =0XBot::ModelInterfacepure virtual
getJacobian(const std::string &link_name, const KDL::Vector &reference_point, KDL::Jacobian &J) const =0XBot::ModelInterfacepure virtual
getJacobian(const std::string &link_name, KDL::Jacobian &J) constXBot::ModelInterface
getJacobian(const std::string &link_name, const std::string &target_frame, KDL::Jacobian &J) constXBot::ModelInterface
getJacobian(const std::string &link_name, Eigen::MatrixXd &J) constXBot::ModelInterface
getJacobian(const std::string &link_name, const std::string &target_frame, Eigen::MatrixXd &J) constXBot::ModelInterface
getJacobian(const std::string &link_name, const Eigen::Vector3d &reference_point, Eigen::MatrixXd &J) constXBot::ModelInterface
getJointAcceleration(Eigen::VectorXd &qddot) constXBot::ModelInterface
getJointAcceleration(JointIdMap &qddot) constXBot::ModelInterface
getJointAcceleration(JointNameMap &qddot) constXBot::ModelInterface
XBot::XBotInterface::getJointAcceleration(Eigen::VectorXd &qddot) constXBot::XBotInterface
XBot::XBotInterface::getJointAcceleration(JointIdMap &qddot) constXBot::XBotInterface
XBot::XBotInterface::getJointAcceleration(JointNameMap &qddot) constXBot::XBotInterface
getJointByDofIndex(int idx) constXBot::XBotInterface
getJointByDofIndexInternal(int dof_index) constXBot::XBotInterfaceprotected
getJointByID(int joint_id) constXBot::XBotInterface
getJointByIdInternal(int joint_id) constXBot::XBotInterfaceprotected
getJointByName(const std::string &joint_name) constXBot::XBotInterface
getJointByNameInternal(const std::string &joint_name) constXBot::XBotInterfaceprotected
getJointEffort(Eigen::VectorXd &tau) constXBot::ModelInterface
getJointEffort(JointIdMap &tau) constXBot::ModelInterface
getJointEffort(JointNameMap &tau) constXBot::ModelInterface
XBot::XBotInterface::getJointEffort(Eigen::VectorXd &tau) constXBot::XBotInterface
XBot::XBotInterface::getJointEffort(JointIdMap &tau) constXBot::XBotInterface
XBot::XBotInterface::getJointEffort(JointNameMap &tau) constXBot::XBotInterface
getJointLimits(Eigen::VectorXd &q_min, Eigen::VectorXd &q_max) constXBot::XBotInterface
getJointNum() constXBot::XBotInterface
getJointPosition(Eigen::VectorXd &q) constXBot::ModelInterface
getJointPosition(JointIdMap &q) constXBot::ModelInterface
getJointPosition(JointNameMap &q) constXBot::ModelInterface
XBot::XBotInterface::getJointPosition(Eigen::VectorXd &q) constXBot::XBotInterface
XBot::XBotInterface::getJointPosition(JointIdMap &q) constXBot::XBotInterface
XBot::XBotInterface::getJointPosition(JointNameMap &q) constXBot::XBotInterface
getJointSelectionMatrix(const std::string &joint_name, Eigen::RowVectorXd &S) constXBot::ModelInterface
getJointSelectionMatrix(int joint_id, Eigen::RowVectorXd &S) constXBot::ModelInterface
getJointVelocity(Eigen::VectorXd &qdot) constXBot::ModelInterface
getJointVelocity(JointIdMap &qdot) constXBot::ModelInterface
getJointVelocity(JointNameMap &qdot) constXBot::ModelInterface
XBot::XBotInterface::getJointVelocity(Eigen::VectorXd &qdot) constXBot::XBotInterface
XBot::XBotInterface::getJointVelocity(JointIdMap &qdot) constXBot::XBotInterface
XBot::XBotInterface::getJointVelocity(JointNameMap &qdot) constXBot::XBotInterface
getLinkID(const std::string &link_name) const =0XBot::ModelInterfacepure virtual
getMass() const =0XBot::ModelInterfacepure virtual
getModel(const ConfigOptions &config)XBot::ModelInterfacestatic
getModel(const std::string &path_to_cfg, AnyMapConstPtr any_map=AnyMapConstPtr())XBot::ModelInterfacestatic
getModelOrderedChainName() constXBot::XBotInterfaceprotected
getModelOrderedJoints(std::vector< std::string > &joint_name) const =0XBot::ModelInterfacepure virtual
getMotorPosition(Eigen::VectorXd &q) constXBot::ModelInterface
getMotorPosition(JointIdMap &q) constXBot::ModelInterface
getMotorPosition(JointNameMap &q) constXBot::ModelInterface
XBot::XBotInterface::getMotorPosition(Eigen::VectorXd &q) constXBot::XBotInterface
XBot::XBotInterface::getMotorPosition(JointIdMap &q) constXBot::XBotInterface
XBot::XBotInterface::getMotorPosition(JointNameMap &q) constXBot::XBotInterface
getMotorVelocity(Eigen::VectorXd &qdot) constXBot::ModelInterface
getMotorVelocity(JointIdMap &qdot) constXBot::ModelInterface
getMotorVelocity(JointNameMap &qdot) constXBot::ModelInterface
XBot::XBotInterface::getMotorVelocity(Eigen::VectorXd &qdot) constXBot::XBotInterface
XBot::XBotInterface::getMotorVelocity(JointIdMap &qdot) constXBot::XBotInterface
XBot::XBotInterface::getMotorVelocity(JointNameMap &qdot) constXBot::XBotInterface
getOrientation(const std::string &source_frame, KDL::Rotation &orientation) constXBot::ModelInterface
getOrientation(const std::string &source_frame, const std::string &target_frame, KDL::Rotation &orientation) constXBot::ModelInterface
getOrientation(const std::string &source_frame, Eigen::Matrix3d &orientation) constXBot::ModelInterface
getOrientation(const std::string &source_frame, const std::string &target_frame, Eigen::Matrix3d &orientation) constXBot::ModelInterface
getPathToConfig() constXBot::XBotInterface
getPointAcceleration(const std::string &link_name, const KDL::Vector &point, KDL::Vector &acceleration) const =0XBot::ModelInterfacepure virtual
getPointAcceleration(const std::string &link_name, const Eigen::Vector3d &point, Eigen::Vector3d &acceleration) constXBot::ModelInterface
getPointPosition(const std::string &source_frame, const KDL::Vector &source_point, KDL::Vector &world_point) constXBot::ModelInterface
getPointPosition(const std::string &source_frame, const std::string &target_frame, const KDL::Vector &source_point, KDL::Vector &target_point) constXBot::ModelInterface
getPointPosition(const std::string &source_frame, const Eigen::Vector3d &source_point, Eigen::Vector3d &world_point) constXBot::ModelInterface
getPointPosition(const std::string &source_frame, const std::string &target_frame, const Eigen::Vector3d &source_point, Eigen::Vector3d &target_point) constXBot::ModelInterface
getPose(const std::string &source_frame, KDL::Frame &pose) const =0XBot::ModelInterfacepure virtual
getPose(const std::string &source_frame, const std::string &target_frame, KDL::Frame &pose) constXBot::ModelInterface
getPose(const std::string &source_frame, const std::string &target_frame, Eigen::Affine3d &pose) constXBot::ModelInterface
getPose(const std::string &source_frame, Eigen::Affine3d &pose) constXBot::ModelInterface
XBot::XBotInterface::getPositionReference(Eigen::VectorXd &q) constXBot::XBotInterface
XBot::XBotInterface::getPositionReference(JointIdMap &q) constXBot::XBotInterface
XBot::XBotInterface::getPositionReference(JointNameMap &q) constXBot::XBotInterface
getPosturalJacobian(Eigen::MatrixXd &J) constXBot::ModelInterface
getRelativeAccelerationTwist(const std::string &link_name, const std::string &base_link_name, KDL::Twist &acceleration) const =0XBot::ModelInterfacepure virtual
getRelativeAccelerationTwist(const std::string &link_name, const std::string &base_link_name, Eigen::Vector6d &acceleration) constXBot::ModelInterface
getRelativeJacobian(const std::string &target_link_name, const std::string &base_link_name, KDL::Jacobian &J) constXBot::ModelInterfacevirtual
getRelativeJacobian(const std::string &target_link_name, const std::string &base_link_name, Eigen::MatrixXd &J) constXBot::ModelInterface
getRelativeVelocityTwist(const std::string &link_name, const std::string &base_link_name, KDL::Twist &velocity) constXBot::ModelInterface
getRelativeVelocityTwist(const std::string &link_name, const std::string &base_link_name, Eigen::Vector6d &velocity) constXBot::ModelInterface
getRobotState(const std::string &state_name, Eigen::VectorXd &q) constXBot::XBotInterface
getRobotState(const std::string &state_name, JointIdMap &q) constXBot::XBotInterface
getRobotState(const std::string &state_name, JointNameMap &q) constXBot::XBotInterface
getSrdf() constXBot::XBotInterface
getSrdfPath() constXBot::XBotInterface
getSrdfString() constXBot::XBotInterface
getStiffness(Eigen::VectorXd &K) constXBot::ModelInterface
getStiffness(JointIdMap &K) constXBot::ModelInterface
getStiffness(JointNameMap &K) constXBot::ModelInterface
XBot::XBotInterface::getStiffness(Eigen::VectorXd &K) constXBot::XBotInterface
XBot::XBotInterface::getStiffness(JointIdMap &K) constXBot::XBotInterface
XBot::XBotInterface::getStiffness(JointNameMap &K) constXBot::XBotInterface
XBot::XBotInterface::getTemperature(Eigen::VectorXd &temp) constXBot::XBotInterface
XBot::XBotInterface::getTemperature(JointIdMap &temp) constXBot::XBotInterface
XBot::XBotInterface::getTemperature(JointNameMap &temp) constXBot::XBotInterface
getUrdf() constXBot::XBotInterface
getUrdfPath() constXBot::XBotInterface
getUrdfString() constXBot::XBotInterface
getVelocityLimits(Eigen::VectorXd &qdot_max) constXBot::XBotInterface
XBot::XBotInterface::getVelocityReference(Eigen::VectorXd &qdot) constXBot::XBotInterface
XBot::XBotInterface::getVelocityReference(JointIdMap &qdot) constXBot::XBotInterface
XBot::XBotInterface::getVelocityReference(JointNameMap &qdot) constXBot::XBotInterface
getVelocityTwist(const std::string &link_name, KDL::Twist &velocity) const =0XBot::ModelInterfacepure virtual
getVelocityTwist(const std::string &source_frame, const std::string &target_frame, KDL::Twist &velocity) constXBot::ModelInterfacevirtual
getVelocityTwist(const std::string &link_name, Eigen::Vector6d &velocity) constXBot::ModelInterface
getVelocityTwist(const std::string &source_frame, const std::string &target_frame, Eigen::Matrix< double, 6, 1 > &velocity) constXBot::ModelInterfacevirtual
hasChain(const std::string &chain_name) constXBot::XBotInterface
hasJoint(const std::string &joint_name) constXBot::XBotInterface
hasJoint(int joint_id) constXBot::XBotInterface
init(const std::string &path_to_cfg)XBot::XBotInterface
init(const ConfigOptions &options)XBot::XBotInterface
init_internal(const ConfigOptions &config)XBot::ModelInterfaceprotectedvirtual
init_model(const ConfigOptions &config)=0XBot::ModelInterfaceprotectedpure virtual
initLog(MatLogger2::Ptr logger, int buffer_size=-1, int interleave=1, std::string prefix="")XBot::XBotInterface
isFloatingBase() constXBot::ModelInterface
leg(int leg_id)XBot::ModelInterface
leg(int leg_id) constXBot::ModelInterface
legs() constXBot::XBotInterface
log(MatLogger2::Ptr logger, double timestamp, const std::string &prefix="") constXBot::XBotInterface
mapToEigen(const JointNameMap &map, Eigen::VectorXd &vector) constXBot::XBotInterface
mapToEigen(const JointIdMap &map, Eigen::VectorXd &vector) constXBot::XBotInterface
maskJacobian(const std::string &chain_name, KDL::Jacobian &J) constXBot::ModelInterface
maskJacobian(const std::string &chain_name, Eigen::MatrixXd &J) constXBot::ModelInterface
ModelInterface()=defaultXBot::ModelInterface
ModelInterface(const ModelInterface &other)=deleteXBot::ModelInterface
operator()(const std::string &chain_name)XBot::ModelInterface
operator()(const std::string &chain_name) constXBot::ModelInterface
operator=(const ModelInterface &other)=deleteXBot::ModelInterface
XBot::XBotInterface::operator=(const XBotInterface &rhs)XBot::XBotInterface
post_init()XBot::XBotInterfaceinlineprotectedvirtual
print() constXBot::XBotInterface
printTracking() constXBot::XBotInterface
Ptr typedefXBot::ModelInterface
rotationEigenToKDL(const Eigen::Matrix3d &eigen_rotation, KDL::Rotation &kdl_rotation) constXBot::ModelInterfaceinlineprotected
rotationKDLToEigen(const KDL::Rotation &kdl_rotation, Eigen::Matrix3d &eigen_rotation) constXBot::ModelInterfaceinlineprotected
setDamping(const Eigen::VectorXd &D)XBot::ModelInterface
setDamping(const JointIdMap &D)XBot::ModelInterface
setDamping(const JointNameMap &D)XBot::ModelInterface
XBot::XBotInterface::setDamping(const Eigen::VectorXd &D)XBot::XBotInterface
XBot::XBotInterface::setDamping(const JointIdMap &D)XBot::XBotInterface
XBot::XBotInterface::setDamping(const JointNameMap &D)XBot::XBotInterface
XBot::XBotInterface::setEffortReference(const Eigen::VectorXd &tau)XBot::XBotInterface
XBot::XBotInterface::setEffortReference(const JointIdMap &tau)XBot::XBotInterface
XBot::XBotInterface::setEffortReference(const JointNameMap &tau)XBot::XBotInterface
setFloatingBaseAngularVelocity(const KDL::Vector &floating_base_omega)XBot::ModelInterface
setFloatingBaseAngularVelocity(const Eigen::Vector3d &floating_base_omega)XBot::ModelInterface
setFloatingBaseOrientation(const KDL::Rotation &world_R_floating_base)XBot::ModelInterface
setFloatingBaseOrientation(const Eigen::Matrix3d &world_R_floating_base)XBot::ModelInterface
setFloatingBasePose(const KDL::Frame &floating_base_pose)=0XBot::ModelInterfacepure virtual
setFloatingBasePose(const Eigen::Affine3d &floating_base_pose)XBot::ModelInterface
setFloatingBaseState(const KDL::Frame &pose, const KDL::Twist &twist)XBot::ModelInterface
setFloatingBaseState(XBot::ImuSensor::ConstPtr imu, const Eigen::Matrix3d &offset=Eigen::Matrix3d::Identity())XBot::ModelInterface
setFloatingBaseState(const Eigen::Affine3d &pose, const Eigen::Vector6d &twist)XBot::ModelInterface
setFloatingBaseTwist(const KDL::Twist &floating_base_twist)=0XBot::ModelInterfacepure virtual
setFloatingBaseTwist(const Eigen::Vector6d &floating_base_twist)XBot::ModelInterfacevirtual
setGravity(const KDL::Vector &gravity)=0XBot::ModelInterfacepure virtual
setGravity(const std::string &reference_frame, const KDL::Vector &gravity)XBot::ModelInterface
setGravity(const Eigen::Vector3d &gravity)XBot::ModelInterface
setGravity(const std::string &reference_frame, const Eigen::Vector3d &gravity)XBot::ModelInterface
setJointAcceleration(const Eigen::VectorXd &qddot)XBot::ModelInterface
setJointAcceleration(const JointIdMap &qddot)XBot::ModelInterface
setJointAcceleration(const JointNameMap &qddot)XBot::ModelInterface
XBot::XBotInterface::setJointAcceleration(const Eigen::VectorXd &qddot)XBot::XBotInterface
XBot::XBotInterface::setJointAcceleration(const JointIdMap &qddot)XBot::XBotInterface
XBot::XBotInterface::setJointAcceleration(const JointNameMap &qddot)XBot::XBotInterface
setJointEffort(const Eigen::VectorXd &tau)XBot::ModelInterface
setJointEffort(const JointIdMap &tau)XBot::ModelInterface
setJointEffort(const JointNameMap &tau)XBot::ModelInterface
XBot::XBotInterface::setJointEffort(const Eigen::VectorXd &tau)XBot::XBotInterface
XBot::XBotInterface::setJointEffort(const JointIdMap &tau)XBot::XBotInterface
XBot::XBotInterface::setJointEffort(const JointNameMap &tau)XBot::XBotInterface
setJointPosition(const Eigen::VectorXd &q)XBot::ModelInterface
setJointPosition(const JointIdMap &q)XBot::ModelInterface
setJointPosition(const JointNameMap &q)XBot::ModelInterface
XBot::XBotInterface::setJointPosition(const Eigen::VectorXd &q)XBot::XBotInterface
XBot::XBotInterface::setJointPosition(const JointIdMap &q)XBot::XBotInterface
XBot::XBotInterface::setJointPosition(const JointNameMap &q)XBot::XBotInterface
setJointVelocity(const Eigen::VectorXd &qdot)XBot::ModelInterface
setJointVelocity(const JointIdMap &qdot)XBot::ModelInterface
setJointVelocity(const JointNameMap &qdot)XBot::ModelInterface
XBot::XBotInterface::setJointVelocity(const Eigen::VectorXd &qdot)XBot::XBotInterface
XBot::XBotInterface::setJointVelocity(const JointIdMap &qdot)XBot::XBotInterface
XBot::XBotInterface::setJointVelocity(const JointNameMap &qdot)XBot::XBotInterface
setMotorPosition(const Eigen::VectorXd &q)XBot::ModelInterface
setMotorPosition(const JointIdMap &q)XBot::ModelInterface
setMotorPosition(const JointNameMap &q)XBot::ModelInterface
XBot::XBotInterface::setMotorPosition(const Eigen::VectorXd &q)XBot::XBotInterface
XBot::XBotInterface::setMotorPosition(const JointIdMap &q)XBot::XBotInterface
XBot::XBotInterface::setMotorPosition(const JointNameMap &q)XBot::XBotInterface
setMotorVelocity(const Eigen::VectorXd &qdot)XBot::ModelInterface
setMotorVelocity(const JointIdMap &qdot)XBot::ModelInterface
setMotorVelocity(const JointNameMap &qdot)XBot::ModelInterface
XBot::XBotInterface::setMotorVelocity(const Eigen::VectorXd &qdot)XBot::XBotInterface
XBot::XBotInterface::setMotorVelocity(const JointIdMap &qdot)XBot::XBotInterface
XBot::XBotInterface::setMotorVelocity(const JointNameMap &qdot)XBot::XBotInterface
XBot::XBotInterface::setPositionReference(const Eigen::VectorXd &q)XBot::XBotInterface
XBot::XBotInterface::setPositionReference(const JointIdMap &q)XBot::XBotInterface
XBot::XBotInterface::setPositionReference(const JointNameMap &q)XBot::XBotInterface
setStiffness(const Eigen::VectorXd &K)XBot::ModelInterface
setStiffness(const JointIdMap &K)XBot::ModelInterface
setStiffness(const JointNameMap &K)XBot::ModelInterface
XBot::XBotInterface::setStiffness(const Eigen::VectorXd &K)XBot::XBotInterface
XBot::XBotInterface::setStiffness(const JointIdMap &K)XBot::XBotInterface
XBot::XBotInterface::setStiffness(const JointNameMap &K)XBot::XBotInterface
XBot::XBotInterface::setTemperature(const Eigen::VectorXd &temp)XBot::XBotInterface
XBot::XBotInterface::setTemperature(const JointIdMap &temp)XBot::XBotInterface
XBot::XBotInterface::setTemperature(const JointNameMap &temp)XBot::XBotInterface
XBot::XBotInterface::setVelocityReference(const Eigen::VectorXd &qdot)XBot::XBotInterface
XBot::XBotInterface::setVelocityReference(const JointIdMap &qdot)XBot::XBotInterface
XBot::XBotInterface::setVelocityReference(const JointNameMap &qdot)XBot::XBotInterface
XBot::XBotInterface::sync(const XBotInterface &other, SyncFlags... flags)XBot::XBotInterface
syncFrom(const XBotInterface &other, SyncFlags... flags)XBot::ModelInterface
syncFrom_no_update(const XBotInterface &other, SyncFlags... flags)XBot::ModelInterface
update(bool update_position=true, bool update_velocity=true, bool update_desired_acceleration=true)XBot::ModelInterface
update_internal(bool update_position, bool update_velocity, bool update_desired_acceleration)=0XBot::ModelInterfaceprotectedpure virtual
XBotInterface()XBot::XBotInterface
XBotInterface(const XBotInterface &other)XBot::XBotInterface
~XBotInterface()XBot::XBotInterfacevirtual