Variables | |
| anonymous | |
| arm_commander = SrArmCommander(name="right_arm") | |
| dictionary | arm_hand_home_joints_goal |
| dictionary | arm_home_joints_goal |
| arm_to_home_plan = arm_commander.plan_to_joint_value_target(arm_home_joints_goal) | |
| arm_to_home_plan_quality = arm_commander.evaluate_given_plan(arm_to_home_plan) | |
| eef_step | |
| eval_arm_home_plan_quality = arm_commander.evaluate_plan_quality(arm_to_home_plan_quality) | |
| list | example_goal_1 = [0.9, 0.16, 0.95, -0.99, 8.27, -0.0, 1.4] |
| hand_commander = SrHandCommander(name="right_hand") | |
| initial_pose = arm_commander.get_current_pose() | |
| orientation | |
| robot_commander = SrRobotCommander(name="right_arm_and_hand") | |
| list | waypoints = [] |
| wpose = geometry_msgs.msg.Pose() | |
| x | |
| y | |
| z | |
| sr_right_hand_arm_waypoints.anonymous |
Definition at line 41 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.arm_commander = SrArmCommander(name="right_arm") |
Definition at line 47 of file sr_right_hand_arm_waypoints.py.
| dictionary sr_right_hand_arm_waypoints.arm_hand_home_joints_goal |
Definition at line 58 of file sr_right_hand_arm_waypoints.py.
| dictionary sr_right_hand_arm_waypoints.arm_home_joints_goal |
Definition at line 54 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.arm_to_home_plan = arm_commander.plan_to_joint_value_target(arm_home_joints_goal) |
Definition at line 74 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.arm_to_home_plan_quality = arm_commander.evaluate_given_plan(arm_to_home_plan) |
Definition at line 75 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.eef_step |
Definition at line 125 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.eval_arm_home_plan_quality = arm_commander.evaluate_plan_quality(arm_to_home_plan_quality) |
Definition at line 76 of file sr_right_hand_arm_waypoints.py.
| list sr_right_hand_arm_waypoints.example_goal_1 = [0.9, 0.16, 0.95, -0.99, 8.27, -0.0, 1.4] |
Definition at line 68 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.hand_commander = SrHandCommander(name="right_hand") |
Definition at line 46 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.initial_pose = arm_commander.get_current_pose() |
Definition at line 103 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.orientation |
Definition at line 113 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.robot_commander = SrRobotCommander(name="right_arm_and_hand") |
Definition at line 49 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.waypoints = [] |
Definition at line 100 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.wpose = geometry_msgs.msg.Pose() |
Definition at line 109 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.x |
Definition at line 110 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.y |
Definition at line 111 of file sr_right_hand_arm_waypoints.py.
| sr_right_hand_arm_waypoints.z |
Definition at line 112 of file sr_right_hand_arm_waypoints.py.