|
| Apply (CustomArguments) |
|
| BENCHMARK_DEFINE_F (JacobianFixture, COMPUTE_FRAME_JACOBIAN_LOCAL)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, COMPUTE_FRAME_JACOBIAN_LOCAL_WORLD_ALIGNED)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, COMPUTE_FRAME_JACOBIAN_WORLD)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, COMPUTE_JOINT_JACOBIAN)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, COMPUTE_JOINT_JACOBIANS)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, COMPUTE_JOINT_JACOBIANS_Q)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, FORWARD_KINEMATICS_Q)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, GET_FRAME_JACOBIAN_LOCAL)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, GET_FRAME_JACOBIAN_LOCAL_WORLD_ALIGNED)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, GET_FRAME_JACOBIAN_WORLD)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, GET_JOINT_JACOBIAN_LOCAL)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, GET_JOINT_JACOBIAN_LOCAL_WORLD_ALIGNED)(benchmark |
|
| BENCHMARK_DEFINE_F (JacobianFixture, GET_JOINT_JACOBIAN_WORLD)(benchmark |
|
| BENCHMARK_REGISTER_F (JacobianFixture, COMPUTE_FRAME_JACOBIAN_LOCAL) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, COMPUTE_FRAME_JACOBIAN_WORLD) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, COMPUTE_JOINT_JACOBIAN) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, COMPUTE_JOINT_JACOBIANS) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, COMPUTE_JOINT_JACOBIANS_Q) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, FORWARD_KINEMATICS_Q) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, GET_FRAME_JACOBIAN_LOCAL) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, GET_FRAME_JACOBIAN_WORLD) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, GET_JOINT_JACOBIAN_LOCAL) -> Apply(CustomArguments) |
|
| BENCHMARK_REGISTER_F (JacobianFixture, GET_JOINT_JACOBIAN_WORLD) -> Apply(CustomArguments) |
|
template<pinocchio::ReferenceFrame Frame> |
static PINOCCHIO_DONT_INLINE void | computeFrameJacobianCall (const pinocchio::Model &model, pinocchio::Data &data, const Eigen::VectorXd &q, pinocchio::FrameIndex frame_id, const pinocchio::Data::Matrix6x &J) |
|
static PINOCCHIO_DONT_INLINE void | computeJointJacobianCall (const pinocchio::Model &model, pinocchio::Data &data, const Eigen::VectorXd &q, pinocchio::Index joint_id, pinocchio::Data::Matrix6x &J) |
|
static PINOCCHIO_DONT_INLINE void | computeJointJacobiansCall (const pinocchio::Model &model, pinocchio::Data &data) |
|
static PINOCCHIO_DONT_INLINE void | computeJointJacobiansQCall (const pinocchio::Model &model, pinocchio::Data &data, const Eigen::VectorXd &q) |
|
static void | CustomArguments (benchmark::internal::Benchmark *b) |
|
static PINOCCHIO_DONT_INLINE void | forwardKinematicsQCall (const pinocchio::Model &model, pinocchio::Data &data, const Eigen::VectorXd &q) |
|
template<pinocchio::ReferenceFrame Frame> |
static PINOCCHIO_DONT_INLINE void | getFrameJacobianCall (const pinocchio::Model &model, pinocchio::Data &data, pinocchio::FrameIndex frame_id, const pinocchio::Data::Matrix6x &J) |
|
template<pinocchio::ReferenceFrame Frame> |
static PINOCCHIO_DONT_INLINE void | getJointJacobianCall (const pinocchio::Model &model, const pinocchio::Data &data, pinocchio::Index joint_id, const pinocchio::Data::Matrix6x &J) |
|
| PINOCCHIO_BENCHMARK_MAIN () |
|