Public Member Functions | |
def | setUpClass |
def | tearDownClass |
def | test_list_activejoints |
def | test_list_movegroups |
def | test_plan |
def | test_planandexecute |
def | test_planning_scene |
def | test_set_pose_target |
Public Attributes | |
robot | |
Private Member Functions | |
def | _plan |
def | _set_sample_pose |
Private Attributes | |
_joints_movegroup_main | |
_movegroups | |
_mvgroup | |
Static Private Attributes | |
string | _KINEMATICSOLVER_SAFE = 'RRTConnectkConfigDefault' |
string | _MOVEGROUP_MAIN = 'manipulator' |
Definition at line 49 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 82 of file test_moveit.py.
def test_moveit.TestMoveit._set_sample_pose | ( | self | ) | [private] |
@return: Pose() with some values populated in.
Definition at line 68 of file test_moveit.py.
def test_moveit.TestMoveit.setUpClass | ( | self | ) |
Definition at line 54 of file test_moveit.py.
def test_moveit.TestMoveit.tearDownClass | ( | self | ) |
Definition at line 65 of file test_moveit.py.
def test_moveit.TestMoveit.test_list_activejoints | ( | self | ) |
Check if the defined joints in a move group are loaded.
Definition at line 99 of file test_moveit.py.
def test_moveit.TestMoveit.test_list_movegroups | ( | self | ) |
Check if the defined move groups are loaded.
Definition at line 95 of file test_moveit.py.
def test_moveit.TestMoveit.test_plan | ( | self | ) |
Evaluate plan (RobotTrajectory)
Definition at line 103 of file test_moveit.py.
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 111 of file test_moveit.py.
def test_moveit.TestMoveit.test_planning_scene | ( | self | ) |
Check if publish_simple_scene.py is working
Definition at line 133 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 121 of file test_moveit.py.
Definition at line 54 of file test_moveit.py.
string test_moveit.TestMoveit::_KINEMATICSOLVER_SAFE = 'RRTConnectkConfigDefault' [static, private] |
Definition at line 51 of file test_moveit.py.
string test_moveit.TestMoveit::_MOVEGROUP_MAIN = 'manipulator' [static, private] |
Definition at line 50 of file test_moveit.py.
test_moveit.TestMoveit::_movegroups [private] |
Definition at line 54 of file test_moveit.py.
test_moveit.TestMoveit::_mvgroup [private] |
Definition at line 54 of file test_moveit.py.
Definition at line 54 of file test_moveit.py.