| 
| testing::AssertionResult  | isNear (const char *expr1, const char *expr2, const char *, const geometry_msgs::msg::Point &val1, const geometry_msgs::msg::Point &val2, double abs_error) | 
|   | 
| testing::AssertionResult  | isNear (const char *expr1, const char *expr2, const char *, const geometry_msgs::msg::Quaternion &val1, const geometry_msgs::msg::Quaternion &val2, double abs_error) | 
|   | 
| testing::AssertionResult  | expectNearHelper (const char *expr1, const char *expr2, const char *abs_error_expr, const std::vector< geometry_msgs::msg::Pose > &val1, const std::vector< geometry_msgs::msg::Pose > &val2, double abs_error) | 
|   | 
| void  | searchIKCallback (const std::vector< double > &joint_state, moveit_msgs::msg::MoveItErrorCodes &error_code) | 
|   | 
Definition at line 161 of file test_kinematics_plugin.cpp.
 
◆ expectNearHelper()
  
  
      
        
          | testing::AssertionResult KinematicsTest::expectNearHelper  | 
          ( | 
          const char *  | 
          expr1,  | 
         
        
           | 
           | 
          const char *  | 
          expr2,  | 
         
        
           | 
           | 
          const char *  | 
          abs_error_expr,  | 
         
        
           | 
           | 
          const std::vector< geometry_msgs::msg::Pose > &  | 
          val1,  | 
         
        
           | 
           | 
          const std::vector< geometry_msgs::msg::Pose > &  | 
          val2,  | 
         
        
           | 
           | 
          double  | 
          abs_error  | 
         
        
           | 
          ) | 
           |  | 
         
       
   | 
  
inline   | 
  
 
 
◆ isNear() [1/2]
  
  
      
        
          | testing::AssertionResult KinematicsTest::isNear  | 
          ( | 
          const char *  | 
          expr1,  | 
         
        
           | 
           | 
          const char *  | 
          expr2,  | 
         
        
           | 
           | 
          const char *  | 
          ,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::Point &  | 
          val1,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::Point &  | 
          val2,  | 
         
        
           | 
           | 
          double  | 
          abs_error  | 
         
        
           | 
          ) | 
           |  | 
         
       
   | 
  
inline   | 
  
 
 
◆ isNear() [2/2]
  
  
      
        
          | testing::AssertionResult KinematicsTest::isNear  | 
          ( | 
          const char *  | 
          expr1,  | 
         
        
           | 
           | 
          const char *  | 
          expr2,  | 
         
        
           | 
           | 
          const char *  | 
          ,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::Quaternion &  | 
          val1,  | 
         
        
           | 
           | 
          const geometry_msgs::msg::Quaternion &  | 
          val2,  | 
         
        
           | 
           | 
          double  | 
          abs_error  | 
         
        
           | 
          ) | 
           |  | 
         
       
   | 
  
inline   | 
  
 
 
◆ operator=()
  
  
      
        
          | void KinematicsTest::operator=  | 
          ( | 
          const SharedData &  | 
          data | ) | 
           | 
         
       
   | 
  
inlineprotected   | 
  
 
 
◆ searchIKCallback()
  
  
      
        
          | void KinematicsTest::searchIKCallback  | 
          ( | 
          const std::vector< double > &  | 
          joint_state,  | 
         
        
           | 
           | 
          moveit_msgs::msg::MoveItErrorCodes &  | 
          error_code  | 
         
        
           | 
          ) | 
           |  | 
         
       
   | 
  
inline   | 
  
 
 
◆ SetUp()
  
  
      
        
          | void KinematicsTest::SetUp  | 
          ( | 
           | ) | 
           | 
         
       
   | 
  
inlineoverrideprotected   | 
  
 
 
◆ consistency_limits_
      
        
          | std::vector<double> KinematicsTest::consistency_limits_ | 
        
      
 
 
◆ group_name_
      
        
          | std::string KinematicsTest::group_name_ | 
        
      
 
 
◆ ik_plugin_name_
      
        
          | std::string KinematicsTest::ik_plugin_name_ | 
        
      
 
 
◆ jmg_
◆ joints_
      
        
          | std::vector<std::string> KinematicsTest::joints_ | 
        
      
 
 
◆ kinematics_solver_
      
        
          | kinematics::KinematicsBasePtr KinematicsTest::kinematics_solver_ | 
        
      
 
 
◆ node_
      
        
          | rclcpp::Node::SharedPtr KinematicsTest::node_ | 
        
      
 
 
◆ num_fk_tests_
      
        
          | unsigned int KinematicsTest::num_fk_tests_ | 
        
      
 
 
◆ num_ik_cb_tests_
      
        
          | unsigned int KinematicsTest::num_ik_cb_tests_ | 
        
      
 
 
◆ num_ik_multiple_tests_
      
        
          | unsigned int KinematicsTest::num_ik_multiple_tests_ | 
        
      
 
 
◆ num_ik_tests_
      
        
          | unsigned int KinematicsTest::num_ik_tests_ | 
        
      
 
 
◆ num_nearest_ik_tests_
      
        
          | unsigned int KinematicsTest::num_nearest_ik_tests_ | 
        
      
 
 
◆ publish_trajectory_
      
        
          | bool KinematicsTest::publish_trajectory_ | 
        
      
 
 
◆ rng_
      
        
          | random_numbers::RandomNumberGenerator KinematicsTest::rng_ { 42 } | 
        
      
 
 
◆ robot_model_
      
        
          | moveit::core::RobotModelPtr KinematicsTest::robot_model_ | 
        
      
 
 
◆ root_link_
      
        
          | std::string KinematicsTest::root_link_ | 
        
      
 
 
◆ seed_
      
        
          | std::vector<double> KinematicsTest::seed_ | 
        
      
 
 
◆ timeout_
      
        
          | double KinematicsTest::timeout_ | 
        
      
 
 
◆ tip_link_
      
        
          | std::string KinematicsTest::tip_link_ | 
        
      
 
 
◆ tolerance_
      
        
          | double KinematicsTest::tolerance_ | 
        
      
 
 
The documentation for this class was generated from the following file: