diff --git a/RobotModelRBDL_8cpp.html b/RobotModelRBDL_8cpp.html index 703f7acc..36f02a73 100644 --- a/RobotModelRBDL_8cpp.html +++ b/RobotModelRBDL_8cpp.html @@ -74,6 +74,7 @@ #include <rbdl/rbdl_utils.h>
#include <rbdl/addons/urdfreader/urdfreader.h>
#include <base-logging/Logging.hpp>
+#include <tinyxml2.h>
diff --git a/RobotModelRBDL_8hpp_source.html b/RobotModelRBDL_8hpp_source.html index ba4b856a..c83b78b6 100644 --- a/RobotModelRBDL_8hpp_source.html +++ b/RobotModelRBDL_8hpp_source.html @@ -125,28 +125,28 @@
102#endif
RobotModel.hpp
wbc::RobotModelRBDL
Definition RobotModelRBDL.hpp:9
-
wbc::RobotModelRBDL::biasForces
virtual const base::VectorXd & biasForces()
Definition RobotModelRBDL.cpp:380
-
wbc::RobotModelRBDL::systemState
virtual void systemState(base::VectorXd &q, base::VectorXd &qd, base::VectorXd &qdd)
Definition RobotModelRBDL.cpp:204
-
wbc::RobotModelRBDL::computeInverseDynamics
virtual void computeInverseDynamics(base::commands::Joints &solver_output)
Compute and return the inverse dynamics solution.
Definition RobotModelRBDL.cpp:412
-
wbc::RobotModelRBDL::configure
virtual bool configure(const RobotModelConfig &cfg)
Load and configure the robot model.
Definition RobotModelRBDL.cpp:26
-
wbc::RobotModelRBDL::rigidBodyState
virtual const base::samples::RigidBodyStateSE3 & rigidBodyState(const std::string &root_frame, const std::string &tip_frame)
Computes and returns the relative transform between the two given frames. By convention this is the p...
Definition RobotModelRBDL.cpp:210
+
wbc::RobotModelRBDL::biasForces
virtual const base::VectorXd & biasForces()
Definition RobotModelRBDL.cpp:381
+
wbc::RobotModelRBDL::systemState
virtual void systemState(base::VectorXd &q, base::VectorXd &qd, base::VectorXd &qdd)
Definition RobotModelRBDL.cpp:205
+
wbc::RobotModelRBDL::computeInverseDynamics
virtual void computeInverseDynamics(base::commands::Joints &solver_output)
Compute and return the inverse dynamics solution.
Definition RobotModelRBDL.cpp:413
+
wbc::RobotModelRBDL::configure
virtual bool configure(const RobotModelConfig &cfg)
Load and configure the robot model.
Definition RobotModelRBDL.cpp:27
+
wbc::RobotModelRBDL::rigidBodyState
virtual const base::samples::RigidBodyStateSE3 & rigidBodyState(const std::string &root_frame, const std::string &tip_frame)
Computes and returns the relative transform between the two given frames. By convention this is the p...
Definition RobotModelRBDL.cpp:211
wbc::RobotModelRBDL::q
Eigen::VectorXd q
Definition RobotModelRBDL.hpp:14
-
wbc::RobotModelRBDL::~RobotModelRBDL
virtual ~RobotModelRBDL()
Definition RobotModelRBDL.cpp:17
+
wbc::RobotModelRBDL::~RobotModelRBDL
virtual ~RobotModelRBDL()
Definition RobotModelRBDL.cpp:18
wbc::RobotModelRBDL::qd
Eigen::VectorXd qd
Definition RobotModelRBDL.hpp:14
-
wbc::RobotModelRBDL::spaceJacobian
virtual const base::MatrixXd & spaceJacobian(const std::string &root_frame, const std::string &tip_frame)
Returns the Space Jacobian for the kinematic chain between root and the tip frame as full body Jacobi...
Definition RobotModelRBDL.cpp:245
-
wbc::RobotModelRBDL::RobotModelRBDL
RobotModelRBDL()
Definition RobotModelRBDL.cpp:13
-
wbc::RobotModelRBDL::clear
void clear()
Definition RobotModelRBDL.cpp:21
-
wbc::RobotModelRBDL::comJacobian
virtual const base::MatrixXd & comJacobian()
Returns the CoM Jacobian for the entire robot, which maps the robot joint velocities to linear spatia...
Definition RobotModelRBDL.cpp:315
-
wbc::RobotModelRBDL::jacobianDot
virtual const base::MatrixXd & jacobianDot(const std::string &root_frame, const std::string &tip_frame)
Returns the derivative of the Jacobian for the kinematic chain between root and the tip frame as full...
Definition RobotModelRBDL.cpp:338
+
wbc::RobotModelRBDL::spaceJacobian
virtual const base::MatrixXd & spaceJacobian(const std::string &root_frame, const std::string &tip_frame)
Returns the Space Jacobian for the kinematic chain between root and the tip frame as full body Jacobi...
Definition RobotModelRBDL.cpp:246
+
wbc::RobotModelRBDL::RobotModelRBDL
RobotModelRBDL()
Definition RobotModelRBDL.cpp:14
+
wbc::RobotModelRBDL::clear
void clear()
Definition RobotModelRBDL.cpp:22
+
wbc::RobotModelRBDL::comJacobian
virtual const base::MatrixXd & comJacobian()
Returns the CoM Jacobian for the entire robot, which maps the robot joint velocities to linear spatia...
Definition RobotModelRBDL.cpp:316
+
wbc::RobotModelRBDL::jacobianDot
virtual const base::MatrixXd & jacobianDot(const std::string &root_frame, const std::string &tip_frame)
Returns the derivative of the Jacobian for the kinematic chain between root and the tip frame as full...
Definition RobotModelRBDL.cpp:339
wbc::RobotModelRBDL::jointNamesInRBDLOrder
std::vector< std::string > jointNamesInRBDLOrder(const std::string &urdf_file)
-
wbc::RobotModelRBDL::centerOfMass
virtual const base::samples::RigidBodyStateSE3 & centerOfMass()
Return Current center of gravity in expressed base frame.
Definition RobotModelRBDL.cpp:391
+
wbc::RobotModelRBDL::centerOfMass
virtual const base::samples::RigidBodyStateSE3 & centerOfMass()
Return Current center of gravity in expressed base frame.
Definition RobotModelRBDL.cpp:392
wbc::RobotModelRBDL::tau
Eigen::VectorXd tau
Definition RobotModelRBDL.hpp:14
wbc::RobotModelRBDL::reg
static RobotModelRegistry< RobotModelRBDL > reg
Definition RobotModelRBDL.hpp:11
wbc::RobotModelRBDL::rbdl_model
std::shared_ptr< RigidBodyDynamics::Model > rbdl_model
Definition RobotModelRBDL.hpp:13
-
wbc::RobotModelRBDL::spatialAccelerationBias
virtual const base::Acceleration & spatialAccelerationBias(const std::string &root_frame, const std::string &tip_frame)
Returns the spatial acceleration bias, i.e. the term Jdot*qdot.
Definition RobotModelRBDL.cpp:342
-
wbc::RobotModelRBDL::bodyJacobian
virtual const base::MatrixXd & bodyJacobian(const std::string &root_frame, const std::string &tip_frame)
Returns the Body Jacobian for the kinematic chain between root and the tip frame as full body Jacobia...
Definition RobotModelRBDL.cpp:281
-
wbc::RobotModelRBDL::update
virtual void update(const base::samples::Joints &joint_state, const base::samples::RigidBodyStateSE3 &floating_base_state=base::samples::RigidBodyStateSE3())
Update the robot configuration.
Definition RobotModelRBDL.cpp:120
-
wbc::RobotModelRBDL::jointSpaceInertiaMatrix
virtual const base::MatrixXd & jointSpaceInertiaMatrix()
Definition RobotModelRBDL.cpp:369
+
wbc::RobotModelRBDL::spatialAccelerationBias
virtual const base::Acceleration & spatialAccelerationBias(const std::string &root_frame, const std::string &tip_frame)
Returns the spatial acceleration bias, i.e. the term Jdot*qdot.
Definition RobotModelRBDL.cpp:343
+
wbc::RobotModelRBDL::bodyJacobian
virtual const base::MatrixXd & bodyJacobian(const std::string &root_frame, const std::string &tip_frame)
Returns the Body Jacobian for the kinematic chain between root and the tip frame as full body Jacobia...
Definition RobotModelRBDL.cpp:282
+
wbc::RobotModelRBDL::update
virtual void update(const base::samples::Joints &joint_state, const base::samples::RigidBodyStateSE3 &floating_base_state=base::samples::RigidBodyStateSE3())
Update the robot configuration.
Definition RobotModelRBDL.cpp:121
+
wbc::RobotModelRBDL::jointSpaceInertiaMatrix
virtual const base::MatrixXd & jointSpaceInertiaMatrix()
Definition RobotModelRBDL.cpp:370
wbc::RobotModelRBDL::H_q
RigidBodyDynamics::Math::MatrixNd H_q
Definition RobotModelRBDL.hpp:15
wbc::RobotModelRBDL::J
RigidBodyDynamics::Math::MatrixNd J
Definition RobotModelRBDL.hpp:15
wbc::RobotModelRBDL::qdd
Eigen::VectorXd qdd
Definition RobotModelRBDL.hpp:14

Namespaces