Definition at line 56 of file test_moveit.py.
 
  
  | 
        
          | def test_moveit.TestMoveit._plan | ( |  | self | ) |  |  | private | 
 
Run `clear_pose_targets` at the beginning.
@rtype: RobotTrajectory http://docs.ros.org/api/moveit_msgs/html/msg/RobotTrajectory.html
 
Definition at line 94 of file test_moveit.py.
 
 
  
  | 
        
          | def test_moveit.TestMoveit._set_sample_pose | ( |  | self | ) |  |  | private | 
 
@return: Pose() with some values populated in.
 
Definition at line 80 of file test_moveit.py.
 
 
      
        
          | def test_moveit.TestMoveit.setUpClass | ( |  | self | ) |  | 
      
 
 
      
        
          | def test_moveit.TestMoveit.tearDownClass | ( |  | self | ) |  | 
      
 
 
      
        
          | def test_moveit.TestMoveit.test_list_activejoints | ( |  | self | ) |  | 
      
 
Check if the defined joints in a move group are loaded.
 
Definition at line 111 of file test_moveit.py.
 
 
      
        
          | def test_moveit.TestMoveit.test_list_movegroups | ( |  | self | ) |  | 
      
 
Check if the defined move groups are loaded.
 
Definition at line 107 of file test_moveit.py.
 
 
      
        
          | def test_moveit.TestMoveit.test_plan | ( |  | self | ) |  | 
      
 
 
      
        
          | def test_moveit.TestMoveit.test_planandexecute | ( |  | self | ) |  | 
      
 
Evaluate Plan and Execute works.
Currently no value checking is done (, which is better to be implemented)
 
Definition at line 123 of file test_moveit.py.
 
 
      
        
          | def test_moveit.TestMoveit.test_planning_scene | ( |  | self | ) |  | 
      
 
Check if publish_simple_scene.py is working
 
Definition at line 155 of file test_moveit.py.
 
 
      
        
          | def test_moveit.TestMoveit.test_set_pose_target | ( |  | self | ) |  | 
      
 
Check for simple planning, originally testd in moved from denso_vs060_moveit_demo_test.py
 
Definition at line 138 of file test_moveit.py.
 
 
  
  | 
        
          | test_moveit.TestMoveit._joints_movegroup_main |  | private | 
 
 
  
  | 
        
          | string test_moveit.TestMoveit._KINEMATICSOLVER_SAFE = 'RRTConnectkConfigDefault' |  | staticprivate | 
 
 
  
  | 
        
          | string test_moveit.TestMoveit._MOVEGROUP_MAIN = 'manipulator' |  | staticprivate | 
 
 
  
  | 
        
          | test_moveit.TestMoveit._movegroups |  | private | 
 
 
  
  | 
        
          | test_moveit.TestMoveit._mvgroup |  | private | 
 
 
      
        
          | test_moveit.TestMoveit.robot | 
      
 
 
The documentation for this class was generated from the following file: