$search
Classes | |
| class | CommanderTCPHandler |
| class | EOF |
| class | TCPServer |
| class | UR5Connection |
| class | UR5TrajectoryFollower |
Functions | |
| def | dumpstacks |
| def | get_segment_duration |
| def | getConnectedRobot |
| def | interp_cubic |
| def | joinAll |
| def | log |
| def | main |
| def | reorder_traj_joints |
| def | sample_traj |
| def | setConnectedRobot |
Variables | |
| connected_robot = None | |
| tuple | connected_robot_cond = threading.Condition(connected_robot_lock) |
| tuple | connected_robot_lock = threading.Lock() |
| list | JOINT_NAMES |
| int | MSG_JOINT_STATES = 3 |
| int | MSG_MOVEJ = 4 |
| int | MSG_OUT = 1 |
| int | MSG_QUIT = 2 |
| int | MSG_SERVOJ = 7 |
| int | MSG_STOPJ = 6 |
| int | MSG_WAYPOINT_FINISHED = 5 |
| float | MULT_blend = 1000.0 |
| float | MULT_jointstate = 1000.0 |
| float | MULT_time = 1000000.0 |
| int | PORT = 30002 |
| prevent_programming = False | |
| tuple | pub_joint_states = rospy.Publisher('joint_states', JointState) |
| list | Q1 = [2.2,0,-1.57,0,0,0] |
| list | Q2 = [1.5,0,-1.57,0,0,0] |
| list | Q3 = [1.5,-0.2,-1.57,0,0,0] |
| int | REVERSE_PORT = 50001 |
| def driver::getConnectedRobot | ( | wait = False, |
||
timeout = -1 | ||||
| ) |
| driver::connected_robot = None |
| tuple driver::connected_robot_cond = threading.Condition(connected_robot_lock) |
| tuple driver::connected_robot_lock = threading.Lock() |
| list driver::JOINT_NAMES |
| int driver::MSG_JOINT_STATES = 3 |
| int driver::MSG_MOVEJ = 4 |
| int driver::MSG_OUT = 1 |
| int driver::MSG_QUIT = 2 |
| int driver::MSG_SERVOJ = 7 |
| int driver::MSG_STOPJ = 6 |
| int driver::MSG_WAYPOINT_FINISHED = 5 |
| float driver::MULT_blend = 1000.0 |
| float driver::MULT_jointstate = 1000.0 |
| float driver::MULT_time = 1000000.0 |
| int driver::PORT = 30002 |
| driver::prevent_programming = False |
| tuple driver::pub_joint_states = rospy.Publisher('joint_states', JointState) |
| list driver::Q1 = [2.2,0,-1.57,0,0,0] |
| list driver::Q2 = [1.5,0,-1.57,0,0,0] |
| list driver::Q3 = [1.5,-0.2,-1.57,0,0,0] |
| int driver::REVERSE_PORT = 50001 |