Classes | Typedefs | Functions | Variables
controller Namespace Reference

Classes

class  BaseKinematics
 
class  CartesianPoseController
 
class  CartesianTwistController
 
class  CartesianWrenchController
 
class  Caster
 
class  CasterController
 
class  Controller
 
class  ControllerProvider
 
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
 

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 = 1e-5
 
static const double EPS = 1e-5
 
static const double MAX_ALLOWABLE_SVD_TIME = 3e-4
 
static const double ODOMETRY_THRESHOLD = 1e-4
 

Typedef Documentation

typedef Eigen::Matrix<float, 16, 1> controller::OdomMatrix16x1

Definition at line 59 of file pr2_odometry.h.

typedef Eigen::Matrix<float, 16, 16> controller::OdomMatrix16x16

Definition at line 61 of file pr2_odometry.h.

typedef Eigen::Matrix<float, 16, 3> controller::OdomMatrix16x3

Definition at line 60 of file pr2_odometry.h.

typedef Eigen::Matrix<float, 3, 1> controller::OdomMatrix3x1

Definition at line 58 of file pr2_odometry.h.

Variable Documentation

const double controller::EPS = 1e-5
static

Definition at line 45 of file pr2_base_controller.cpp.

const double controller::EPS = 1e-5
static

Definition at line 45 of file pr2_base_controller2.cpp.

const double controller::MAX_ALLOWABLE_SVD_TIME = 3e-4
static

Definition at line 47 of file pr2_odometry.cpp.

const double controller::ODOMETRY_THRESHOLD = 1e-4
static

Definition at line 46 of file pr2_odometry.cpp.



pr2_mechanism_controllers
Author(s): Sachin Chita, John Hsu, Melonee Wise
autogenerated on Wed Jun 5 2019 19:34:08