.. _program_listing_file__tmp_ws_src_pick_ik_include_pick_ik_forward_kinematics.hpp: Program Listing for File forward_kinematics.hpp =============================================== |exhale_lsh| :ref:`Return to documentation for file ` (``/tmp/ws/src/pick_ik/include/pick_ik/forward_kinematics.hpp``) .. |exhale_lsh| unicode:: U+021B0 .. UPWARDS ARROW WITH TIP LEFTWARDS .. code-block:: cpp #pragma once #include #include #include #include #include namespace pick_ik { auto make_joint_axes(std::shared_ptr const& model) -> std::vector; auto make_link_frames(std::shared_ptr const& model) -> std::vector; auto get_frame(moveit::core::JointModel const& joint_model, std::vector const& variables, std::vector const& joint_axes) -> Eigen::Isometry3d; auto get_frame(moveit::core::LinkModel const& link_model, std::vector const& link_frame) -> Eigen::Isometry3d; auto has_joint_moved(moveit::core::JointModel const& joint_model, std::vector const& cached_variables, std::vector const& variables) -> bool; struct CachedJointFrames { std::vector variables; std::vector frames; }; auto get_frame(CachedJointFrames& cache, moveit::core::JointModel const& joint_model, std::vector const& variables, std::vector const& joint_axes) -> Eigen::Isometry3d; } // namespace pick_ik