Classes | |
class | BaseKinematics |
class | CartesianPoseController |
class | CartesianTwistController |
class | CartesianWrenchController |
class | Caster |
class | CasterCalibrationController |
class | CasterController |
class | Controller |
class | ControllerProvider |
class | FakeCalibrationController |
class | GripperCalibrationController |
class | JointCalibrationController |
class | JointEffortController |
class | JointPositionController |
class | JointSplineTrajectoryController |
class | JointTolerance |
class | JointTrajectoryActionController |
class | JointVelocityController |
class | JTCartesianController |
struct | Kin |
class | LaserScannerTrajController |
class | LaserScannerTrajControllerNode |
class | Pr2BaseController |
class | Pr2BaseController2 |
class | Pr2GripperController |
class | Pr2Odometry |
class | RTServerGoalHandle |
class | Wheel |
class | WristCalibrationController |
Typedefs | |
typedef Eigen::Matrix< float, 16, 1 > | OdomMatrix16x1 |
typedef Eigen::Matrix< float, 16, 16 > | OdomMatrix16x16 |
typedef Eigen::Matrix< float, 16, 3 > | OdomMatrix16x3 |
typedef Eigen::Matrix< float, 3, 1 > | OdomMatrix3x1 |
Functions | |
static void | computePoseError (const Eigen::Affine3d &xact, const Eigen::Affine3d &xdes, Eigen::Matrix< double, 6, 1 > &err) |
static void | generatePowers (int n, double x, double *powers) |
static void | getCubicSplineCoefficients (double start_pos, double start_vel, double end_pos, double end_vel, double time, std::vector< double > &coefficients) |
static void | getQuinticSplineCoefficients (double start_pos, double start_vel, double start_acc, double end_pos, double end_vel, double end_acc, double time, std::vector< double > &coefficients) |
static void | sampleQuinticSpline (const std::vector< double > &coefficients, double time, double &position, double &velocity, double &acceleration) |
static bool | setsEqual (const std::vector< std::string > &a, const std::vector< std::string > &b) |
static boost::shared_ptr< Member > | share_member (boost::shared_ptr< Enclosure > enclosure, Member &member) |
Variables | |
static const double | EPS |
static const double | EPS |
static const double | MAX_ALLOWABLE_SVD_TIME |
static const double | ODOMETRY_THRESHOLD |