Go to the documentation of this file.
17 int main(
int argc,
const char ** argv)
19 using namespace Eigen;
24 const int NBT = 1000 * 100;
27 std::cout <<
"(the time score in debug mode is not relevant) " << std::endl;
39 const std::string ff_option = argv[2];
40 if (ff_option ==
"-no-ff")
50 std::cout <<
"nq = " <<
model.nq << std::endl;
53 VectorXd qmax = Eigen::VectorXd::Ones(
model.nq);
60 for (
size_t i = 0;
i < NBT; ++
i)
70 std::cout <<
"Zero Order Kinematics = \t";
71 timer.
toc(std::cout, NBT);
78 std::cout <<
"computeJointJacobian = \t\t";
79 timer.
toc(std::cout, NBT);
86 std::cout <<
"computeJointJacobians(q) = \t";
87 timer.
toc(std::cout, NBT);
94 std::cout <<
"computeJointJacobians() = \t";
95 timer.
toc(std::cout, NBT);
102 std::cout <<
"getJointJacobian(LOCAL) = \t";
103 timer.
toc(std::cout, NBT);
110 std::cout <<
"getJointJacobian(WORLD) = \t";
111 timer.
toc(std::cout, NBT);
113 std::cout <<
"--" << std::endl;
void forwardKinematics(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q)
Update the joint placements according to the current joint configuration.
void humanoidRandom(ModelTpl< Scalar, Options, JointCollectionTpl > &model, bool usingFF=true)
Create a humanoid kinematic tree with 6-DOF limbs and random joint placements.
JointModelFreeFlyerTpl< Scalar > JointModelFreeFlyer
const DataTpl< Scalar, Options, JointCollectionTpl >::Matrix6x & computeJointJacobians(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q)
Computes the full model Jacobian, i.e. the stack of all motion subspace expressed in the world frame....
void randomConfiguration(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const Eigen::MatrixBase< ConfigVectorIn1 > &lowerLimits, const Eigen::MatrixBase< ConfigVectorIn2 > &upperLimits, const Eigen::MatrixBase< ReturnType > &qout)
Generate a configuration vector uniformly sampled among provided limits.
pinocchio::JointIndex JointIndex
void getJointJacobian(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, const DataTpl< Scalar, Options, JointCollectionTpl > &data, const JointIndex joint_id, const ReferenceFrame reference_frame, const Eigen::MatrixBase< Matrix6Like > &J)
Computes the Jacobian of a specific joint frame expressed in one of the pinocchio::ReferenceFrame opt...
ModelTpl< Scalar, Options, JointCollectionTpl > & buildModel(const std::string &filename, const typename ModelTpl< Scalar, Options, JointCollectionTpl >::JointModel &rootJoint, const std::string &rootJointName, ModelTpl< Scalar, Options, JointCollectionTpl > &model, const bool verbose=false)
Build the model from a URDF file with a particular joint as root of the model tree inside the model g...
void computeJointJacobian(const ModelTpl< Scalar, Options, JointCollectionTpl > &model, DataTpl< Scalar, Options, JointCollectionTpl > &data, const Eigen::MatrixBase< ConfigVectorType > &q, const JointIndex joint_id, const Eigen::MatrixBase< Matrix6Like > &J)
Computes the Jacobian of a specific joint frame expressed in the local frame of the joint and store t...
Eigen::Matrix< Scalar, 6, Eigen::Dynamic, Options > Matrix6x
The 6d jacobian type (temporary)
#define PINOCCHIO_ALIGNED_STD_VECTOR(Type)
int main(int argc, const char **argv)
Main pinocchio namespace.
#define PINOCCHIO_MODEL_DIR
pinocchio
Author(s):
autogenerated on Thu Dec 19 2024 03:41:33