rt_manipulators_cpp
  • Links
    • Rosindex
  • C++ API
    • Class Hierarchy
    • File Hierarchy
    • Full C++ API
      • Namespaces
        • Namespace config_file_parser
        • Namespace dynamixel_base
        • Namespace dynamixel_p
        • Namespace dynamixel_ph42
        • Namespace dynamixel_x
        • Namespace dynamixel_xh430
        • Namespace dynamixel_xh540
        • Namespace dynamixel_xm430
        • Namespace dynamixel_xm540
        • Namespace hardware_communicator
        • Namespace hardware_joints
        • Namespace joint
        • Namespace kinematics
        • Namespace kinematics_utils
        • Namespace manipulators_link
        • Namespace rt_manipulators_cpp
      • Classes and Structs
        • Class DynamixelBase
        • Class DynamixelP
        • Class DynamixelPH42
        • Class DynamixelX
        • Class DynamixelXH430
        • Class DynamixelXH540
        • Class DynamixelXM430
        • Class DynamixelXM540
        • Class Communicator
        • Class Joints
        • Class Joint
        • Class JointGroup
        • Class Link
        • Class Hardware
      • Functions
        • Function config_file_parser::parse
        • Function kinematics::forward_kinematics
        • Function kinematics::inverse_kinematics_LM
        • Function kinematics_utils::calc_basic_jacobian
        • Function kinematics_utils::calc_error
        • Function kinematics_utils::calc_error_p
        • Function kinematics_utils::calc_error_R
        • Function kinematics_utils::find_route
        • Function kinematics_utils::get_q_list
        • Function kinematics_utils::parse_link_config_file
        • Function kinematics_utils::print_links
        • Function kinematics_utils::rodrigues
        • Function kinematics_utils::rotation_from_euler_ZYX
        • Function kinematics_utils::rotation_to_axis_angle_representation
        • Function kinematics_utils::rotation_to_euler_ZYX
        • Function kinematics_utils::set_q_list
        • Function kinematics_utils::skew_symmetric_matrix_for_cross_product
      • Typedefs
        • Typedef config_file_parser::JointName
        • Typedef dynamixel_base::comm_t
        • Typedef hardware_communicator::dxl_address_t
        • Typedef hardware_communicator::dxl_byte_t
        • Typedef hardware_communicator::dxl_data_length_t
        • Typedef hardware_communicator::dxl_double_word_t
        • Typedef hardware_communicator::dxl_error_t
        • Typedef hardware_communicator::dxl_id_t
        • Typedef hardware_communicator::dxl_result_t
        • Typedef hardware_communicator::dxl_word_t
        • Typedef hardware_communicator::group_name_t
        • Typedef hardware_communicator::GroupSyncRead
        • Typedef hardware_communicator::GroupSyncWrite
        • Typedef hardware_joints::current_t
        • Typedef hardware_joints::dxl_id_t
        • Typedef hardware_joints::group_map_t
        • Typedef hardware_joints::group_name_t
        • Typedef hardware_joints::joint_name_t
        • Typedef hardware_joints::position_t
        • Typedef hardware_joints::temperature_t
        • Typedef hardware_joints::velocity_t
        • Typedef hardware_joints::voltage_t
        • Typedef kinematics_utils::link_id_t
        • Typedef kinematics_utils::links_t
        • Typedef kinematics_utils::q_list_t
        • Typedef rt_manipulators_cpp::JointGroupName
        • Typedef rt_manipulators_cpp::JointName
      • Directories
        • Directory include
      • Files
        • File config_file_parser.hpp
        • File dynamixel_base.hpp
        • File dynamixel_p.hpp
        • File dynamixel_ph42.hpp
        • File dynamixel_x.hpp
        • File dynamixel_xh430.hpp
        • File dynamixel_xh540.hpp
        • File dynamixel_xm430.hpp
        • File dynamixel_xm540.hpp
        • File hardware.hpp
        • File hardware_communicator.hpp
        • File hardware_joints.hpp
        • File joint.hpp
        • File kinematics.hpp
        • File kinematics_utils.hpp
        • File link.hpp
  • Standard Documents
    • PACKAGE
    • CHANGELOG
      • Changelog for package rt_manipulators_cpp
        • 1.1.0 (2024-08-09)
        • 1.0.0 (2022-06-13)
    • README
      • RTマニピュレータC++ライブラリ
        • ライブラリのインストール
        • ライブラリのアンインストール
        • ライブラリの使い方
        • ライブラリのファイル構成
        • ライブラリのテスト
  • Index
rt_manipulators_cpp
  • C++ API
  • File hardware_joints.hpp
  • View page source

File hardware_joints.hpp

↰ Parent directory (include)

Contents

  • Definition (include/hardware_joints.hpp)

  • Includes

  • Included By

  • Namespaces

  • Classes

  • Typedefs

Definition (include/hardware_joints.hpp)

  • Program Listing for File hardware_joints.hpp

Includes

  • joint.hpp (File joint.hpp)

  • map

  • memory

  • string

  • thread

  • vector

Included By

  • File config_file_parser.hpp

  • File hardware.hpp

Namespaces

  • Namespace hardware_joints

Classes

  • Class Joints

Typedefs

  • Typedef hardware_joints::current_t

  • Typedef hardware_joints::dxl_id_t

  • Typedef hardware_joints::group_map_t

  • Typedef hardware_joints::group_name_t

  • Typedef hardware_joints::joint_name_t

  • Typedef hardware_joints::position_t

  • Typedef hardware_joints::temperature_t

  • Typedef hardware_joints::velocity_t

  • Typedef hardware_joints::voltage_t

Previous Next

© Copyright The <rt_manipulators_cpp> Contributors. License: Apache License 2.0.

Built with Sphinx using a theme provided by Read the Docs.