$search
| Public Member Functions | |
| def | __init__ | 
| def | getArmSeedAngles | 
| def | getIK | 
| def | getJointAngles | 
| def | getJointNames | 
| def | getState | 
| def | goToAngle | 
| def | goToPoint | 
| def | goToPose | 
| def | sendTraj | 
| Public Attributes | |
| cAngles | |
| controller | |
| ikPath | |
| joint_names | |
| trajClient | |
| Private Attributes | |
| _runIK | |
Definition at line 102 of file controllers.py.
| def controllers::Arm::__init__ | ( | self, | ||
| controller, | ||||
| ikPath | ||||
| ) | 
Definition at line 103 of file controllers.py.
| def controllers::Arm::getArmSeedAngles | ( | self | ) | 
Definition at line 138 of file controllers.py.
| def controllers::Arm::getIK | ( | self, | ||
| goalPose, | ||||
| link_name, | ||||
| seedAngles | ||||
| ) | 
Calls inverse kinematics service for the arm. 
    goalPose -  Pose Stamped message showing desired position of link in coord system
    linkName - goal Pose target link name -  (r_wrist_roll_link or l_wrist_roll_link)
    startAngles -  seed angles for IK
Definition at line 145 of file controllers.py.
| def controllers::Arm::getJointAngles | ( | self | ) | 
Definition at line 131 of file controllers.py.
| def controllers::Arm::getJointNames | ( | self | ) | 
Contacts param server to get controller joints
Definition at line 127 of file controllers.py.
| def controllers::Arm::getState | ( | self | ) | 
Returns the current state of action client
Definition at line 122 of file controllers.py.
| def controllers::Arm::goToAngle | ( | self, | ||
| angles, | ||||
| time, | ||||
| wait = True | ||||
| ) | 
Definition at line 161 of file controllers.py.
| def controllers::Arm::goToPoint | ( | self, | ||
| point, | ||||
| frame_id = "torso_lift_link", | ||||
| wait = True | ||||
| ) | 
Definition at line 176 of file controllers.py.
| def controllers::Arm::goToPose | ( | self, | ||
| pos, | ||||
| orientation, | ||||
| frame_id, | ||||
| time, | ||||
| wait = True | ||||
| ) | 
This method uses getIK to move the x_wrist_roll_link to the 
    specific point and orientation specified in frame_id's coordinates. 
    Time specifies the duration of the planned trajectory, 
    wait whether to block or not. 
Definition at line 182 of file controllers.py.
| def controllers::Arm::sendTraj | ( | self, | ||
| traj, | ||||
| wait = True | ||||
| ) | 
Send the joint trajectory goal to the action server
Definition at line 115 of file controllers.py.
| controllers::Arm::_runIK  [private] | 
Definition at line 111 of file controllers.py.
Definition at line 108 of file controllers.py.
Definition at line 104 of file controllers.py.
Definition at line 110 of file controllers.py.
Definition at line 107 of file controllers.py.
Definition at line 105 of file controllers.py.