test fixtures base class  
 More...
test fixtures base class 
Definition at line 81 of file unittest_trajectory_functions.cpp.
 
◆ attachToLink()
attach a collision object and subframes to a link 
- Parameters
 - 
  
    | state | the state we are updating  | 
    | link | the link we are attaching the collision object to  | 
    | object_name | a unique name for the collision object  | 
    | object_pose | the pose of the object relative to the parent link  | 
    | subframes | subframe names and poses relative to the object they attach to  | 
  
   
Definition at line 226 of file unittest_trajectory_functions.cpp.
 
 
◆ getJoints()
get the current joint values of the robot state 
- Parameters
 - 
  
    | jmg | the joint model group whose joints we are interested in  | 
    | state | the robot state to fetch the current joint positions for  | 
  
   
- Returns
 - the joint positions for joints from jmg, set to the positions determined from state 
 
Definition at line 215 of file unittest_trajectory_functions.cpp.
 
 
◆ jointsNear()
  
  
      
        
          | bool TrajectoryFunctionsTestBase::jointsNear  | 
          ( | 
          const std::vector< double > &  | 
          joints1,  | 
         
        
           | 
           | 
          const std::vector< double > &  | 
          joints2,  | 
         
        
           | 
           | 
          double  | 
          epsilon  | 
         
        
           | 
          ) | 
           |  | 
         
       
   | 
  
protected   | 
  
 
check if two sets of joint positions are close 
- Parameters
 - 
  
    | joints1 | the first set of joint positions to compare  | 
    | joints2 | the second set of joint positions to compare  | 
    | epsilon | the tolerance a all joint position diffs must satisfy  | 
  
   
- Returns
 - false if any joint diff exceeds tolerance. true otherwise 
 
Definition at line 198 of file unittest_trajectory_functions.cpp.
 
 
◆ SetUp()
  
  
      
        
          | void TrajectoryFunctionsTestBase::SetUp  | 
          ( | 
           | ) | 
           | 
         
       
   | 
  
inlineoverrideprotected   | 
  
 
 
◆ TearDown()
  
  
      
        
          | void TrajectoryFunctionsTestBase::TearDown  | 
          ( | 
           | ) | 
           | 
         
       
   | 
  
inlineoverrideprotected   | 
  
 
 
◆ tfNear()
  
  
      
        
          | bool TrajectoryFunctionsTestBase::tfNear  | 
          ( | 
          const Eigen::Isometry3d &  | 
          pose1,  | 
         
        
           | 
           | 
          const Eigen::Isometry3d &  | 
          pose2,  | 
         
        
           | 
           | 
          const double &  | 
          epsilon  | 
         
        
           | 
          ) | 
           |  | 
         
       
   | 
  
protected   | 
  
 
 
◆ group_tip_link_
  
  
      
        
          | std::string TrajectoryFunctionsTestBase::group_tip_link_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ ik_fast_link_
  
  
      
        
          | std::string TrajectoryFunctionsTestBase::ik_fast_link_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ joint_names_
  
  
      
        
          | std::vector<std::string> TrajectoryFunctionsTestBase::joint_names_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ node_
  
  
      
        
          | rclcpp::Node::SharedPtr TrajectoryFunctionsTestBase::node_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ planning_group_
  
  
      
        
          | std::string TrajectoryFunctionsTestBase::planning_group_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ planning_scene_
  
  
      
        
          | planning_scene::PlanningSceneConstPtr TrajectoryFunctionsTestBase::planning_scene_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ random_seed_
  
  
      
        
          | uint32_t TrajectoryFunctionsTestBase::random_seed_ { 100 } | 
         
       
   | 
  
protected   | 
  
 
 
◆ random_test_number_
  
  
      
        
          | int TrajectoryFunctionsTestBase::random_test_number_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ rm_loader_
◆ rng_
  
  
      
        
          | random_numbers::RandomNumberGenerator TrajectoryFunctionsTestBase::rng_ { random_seed_ } | 
         
       
   | 
  
protected   | 
  
 
 
◆ robot_model_
  
  
      
        
          | moveit::core::RobotModelConstPtr TrajectoryFunctionsTestBase::robot_model_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ robot_state_
  
  
      
        
          | moveit::core::RobotStatePtr TrajectoryFunctionsTestBase::robot_state_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ tcp_link_
  
  
      
        
          | std::string TrajectoryFunctionsTestBase::tcp_link_ | 
         
       
   | 
  
protected   | 
  
 
 
◆ zero_state_
  
  
      
        
          | std::map<std::string, double> TrajectoryFunctionsTestBase::zero_state_ | 
         
       
   | 
  
protected   | 
  
 
 
The documentation for this class was generated from the following file: