Go to the source code of this file.
Namespaces | |
namespace | test_moveit |
Variables | |
test_moveit.anonymous = True) | |
tuple | test_moveit.display_trajectory = moveit_msgs.msg.DisplayTrajectory() |
tuple | test_moveit.display_trajectory_publisher |
tuple | test_moveit.group_left = moveit_commander.MoveGroupCommander("left_arm") |
tuple | test_moveit.group_right = moveit_commander.MoveGroupCommander("right_arm") |
tuple | test_moveit.group_variable_values = group_left.get_current_joint_values() |
tuple | test_moveit.plan_left = group_left.plan() |
tuple | test_moveit.plan_right = group_right.plan() |
tuple | test_moveit.robot = moveit_commander.RobotCommander() |
tuple | test_moveit.scene = moveit_commander.PlanningSceneInterface() |