►CAbstractContext3 | An abstract superclass for the Context3 objects for dynamical systems, encapsulating functionality that is independent of the numerical scalar type in use |
CContext3< T > | The context is a container for all data necessary to uniquely determine the results of computations performed by a System |
►CAbstractSystem3 | An abstract superclass for dynamical systems, encapsulating functionality that is independent of the numerical scalar type in use |
►CSystem3< T > | A superclass template for systems that use a specified scalar type T for numerical values |
CAdder3< T > | An adder for arbitrarily many vector-valued inputs of equal length |
►CDiagram3< T > | A Diagram is a concrete System that contains other System objects as subsystems and wires them together, but adds no new content |
CCascade3< T > | A Cascade is a concrete SystemDiagram containing exactly two compatible subsystems with the output of the first serving as input to the second |
CGain3< T > | Multiply the single vector input by a scalar and present the result as the single output port |
CVectorConstant3< T > | This System produces a constant VectorInterface value on its single OutputPort |
►CAbstractSystemInterface | A fully type-erased abstract superclass for dynamical systems |
►CSystemInterface< T > | A superclass template for systems that receive input, maintain state, and produce numerical output using a specified scalar type T |
CAdder< T > | An adder for arbitrarily many inputs of equal length |
►CContinuousSystemInterface< T > | A template interface for Systems that have continuous dynamics |
CContinuousSystem< T > | An abstract base class template for Systems that have continuous dynamics |
►CAbstractValue | A fully type-erased container class |
CValue< T > | A container class for an arbitrary type T |
►CAffineSystem< StateVec, InputVec, OutputVec > | AffineSystem<StateVector, InputVector, OutputVector> |
CLinearSystem< StateVec, InputVec, OutputVec > | |
►CAffineSystem< NullVector, InputVec, OutputVec > | |
►CLinearSystem< NullVector, InputVec, OutputVec > | |
CGain< InputVec, OutputVec > | |
CAttachment | |
CAutoDiffToGradientMatrix< Derived > | |
CAutoDiffToValueMatrix< Derived > | |
CBodyMotionData | |
CBodyMotionParams | |
CBotVisualizer< RobotStateVector > | BotVisualizer<RobotStateVector> |
CBounds | |
►CbtOverlapFilterCallback | |
COverlapFilterCallback | |
CBulletCollisionWorldWrapper | |
CCache< T > | |
CCache< double > | |
CCascadeSystem< System1, System2 > | CascadeSystem<System1,System2> |
CCombinedVector< ScalarType, Vector1, Vector2 > | Operator<<() |
CCombinedVectorHelper< Vector1, Vector2, Vec2IsNull > | |
CCombinedVectorHelper< Vector1, Vector2, true > | |
CCombinedVectorUtil< Vector1, Vector2, Vec1IsNull > | CombinedVectorUtil |
CCombinedVectorUtil< Vector1, Vector2, typename std::enable_if< Vector1< double >::RowsAtCompileTime==0 >::type > | |
►CConstraint | A constraint is a function + lower and upper bounds |
CLinearComplementarityConstraint | Implements a constraint of the form: |
►CLinearConstraint | Implements a constraint of the form lb <= Ax <= ub |
CBoundingBoxConstraint | Implements a constraint of the form lb <= x <= ub |
CLinearEqualityConstraint | Implements a constraint of the form Ax = b |
CPolynomialConstraint | Lb[i] <= Pi <= ub[i], where each P[i] is a multivariate polynomial in x, y.. |
CQuadraticConstraint | Lb <= .5 x'Qx + b'x <= ub |
►CDynamicConstraint | Provides a base implementation and interface for a dynamic constraint (which is intended to be used with trajectory optimization, but is not specific to that purpose) |
CSystemDynamicConstraint< System > | Implements a dynamic constraint which uses the dynamics function of a system |
CQuasiStaticConstraintWrapper | |
CSingleTimeKinematicConstraintWrapper | |
CContext< T > | The Context is a container for all of the data necessary to uniquely determine the computations performed by a System |
CContext< double > | |
CContinuityConstraint | |
CContinuousState< T > | The ContinuousState is a container for all the State variables that are unique to continuous Systems, i.e |
CContinuousState< double > | |
CCreateStateVectorDispatch< System, Scalar, Enable > | |
CCreateStateVectorDispatch< System, Scalar, typename std::enable_if< is_combined_vector< typename System::template StateVector< Scalar > >::value >::type > | |
CCreateStateVectorDispatch< System, Scalar, typename std::enable_if< is_eigen_vector< typename System::template StateVector< Scalar > >::value >::type > | |
CDecisionVariable | DecisionVariable |
CDecisionVariableView | |
CDesiredBodyAcceleration | |
CDHomogTrans< DerivedQdotToV > | |
►CDrakeJoint | |
►CDrakeJointImpl< Derived > | |
CFixedAxisOneDoFJoint< Derived > | |
►CDrakeJointImpl< FixedJoint > | |
CFixedJoint | |
►CDrakeJointImpl< HelicalJoint > | |
►CFixedAxisOneDoFJoint< HelicalJoint > | |
CHelicalJoint | |
►CDrakeJointImpl< PrismaticJoint > | |
►CFixedAxisOneDoFJoint< PrismaticJoint > | |
CPrismaticJoint | |
►CDrakeJointImpl< QuaternionFloatingJoint > | |
CQuaternionFloatingJoint | |
►CDrakeJointImpl< RevoluteJoint > | |
►CFixedAxisOneDoFJoint< RevoluteJoint > | |
CRevoluteJoint | |
►CDrakeJointImpl< RollPitchYawFloatingJoint > | |
CRollPitchYawFloatingJoint | |
CDrakeMexPointerTypeId< T > | |
CDrakeMexPointerTypeId< KinematicsCache< DrakeJoint::AutoDiffFixedMaxSize > > | |
CDrakeMexPointerTypeId< KinematicsCache< Eigen::AutoDiffScalar< Eigen::VectorXd > > > | |
CDrakeMexPointerTypeId< KinematicsCache< double > > | |
CDrakeMexPointerTypeId< RigidBodyTree > | |
CDrakeRobotState | |
CEigenVector< Rows > | EigenVector<Rows>::type<ScalarType> |
►CElement | |
►CElement | |
CRigidBody::CollisionElement | |
CVisualElement | |
►Cexception | STL class |
CUnknownShapeException | |
►Cruntime_error | STL class |
CConstraintMatrixSingularError | |
►Cfalse_type | |
Cis_combined_vector< StateVector > | Whether or not the given type is a CombinedVector |
Cis_eigen_vector< StateVector > | Whether or not the given type is an Eigen column vector |
CFeedbackSystem< System1, System2 > | FeedbackSystem<System1,System2> |
CForceTorqueMeasurement | |
CFunctionalForm | Represent an abstract form of a function of zero or more variables |
CFunctionTraits< F > | FunctionTraits |
CFunctionTraits< std::reference_wrapper< F > > | |
CFunctionTraits< std::shared_ptr< F > > | |
CFunctionTraits< std::unique_ptr< F > > | |
►CGeometry | |
CBox | |
CCapsule | |
CCylinder | |
CMesh | |
CMeshPoints | |
CSphere | |
CGetSubMatrixGradientArray< QSubvectorSize, Derived, NRows, NCols > | |
CGetSubMatrixGradientSingleElement< QSubvectorSize, Derived > | |
CGradient< Derived, Nq, DerivativeOrder > | |
CGradient< Derived, Nq, 1 > | |
CHardwareGains | |
CHardwareParams | |
CIKoptions | |
CIKResults | |
CInitializeAutoDiffTupleHelper< Index > | Helper for initializeAutoDiffTuple function (recursive) |
CInitializeAutoDiffTupleHelper< 0 > | Helper for initializeAutoDiffTuple function (base case) |
CInputEntryFinder | There is one of these corresponding to every InputPort3 in the System3 that created the containing Context3 |
CInputOutputRelation | InputOutputRelation |
►CInputPort3 | An InputPort3 represents an external data input to a System |
CVectorInputPort3< T > | A VectorInputPort3 extends InputPort3 with the restriction that only VectorOutputPort3 connections are acceptable, and the value will be of type VectorInterface |
CInputPortFinder | A system diagram may inherit an input port from one of its contained subsystems, which will know that port by a different port number than we will use here |
CInstantaneousQPController | |
CIntegratorParams | |
CJointNames | |
CJointSoftLimitParams | |
CKinematicModifications | |
CKinematicPath | |
CKinematicsCache< Scalar > | |
CKinematicsCache< double > | |
CKinematicsCacheElement< Scalar > | |
CKinematicsCacheHelper< Scalar > | Helper class to avoid recalculating a kinematics cache which is going to be used repeatedly by multiple other classes |
CKinematicsCacheHelper< double > | |
CKneeSettings | |
CLCMInputSystem< Vector, Enable > | |
CLCMInputSystem< Vector, typename std::enable_if<!std::is_void< typename Vector< double >::LCMMessageType >::value >::type > | |
CLCMLoop | |
CLCMOutputSystem< Vector, Enable > | |
CLCMOutputSystem< Vector, typename std::enable_if<!std::is_void< typename Vector< double >::LCMMessageType >::value >::type > | |
CLCMScope | |
CMatGradMult< DerivedDA, DerivedB > | |
CMatGradMultMat< DerivedA, DerivedB, DerivedDA > | |
CMathematicalProgram | A class for characterizing a mathematical program and choosing a solver |
►CMathematicalProgramSolverInterface | Interface used by implementations of individual solvers |
CEqualityConstrainedQPSolver | |
CIpoptSolver | |
CLinearSystemSolver | |
CMobyLCPSolver | |
CNloptSolver | |
CSnoptSolver | |
Cmeasure< TimeT > | |
CMexWrapper | |
►CModel | |
CBulletModel | |
CPolynomial< _CoefficientType >::Monomial | An additive atom of a Polynomial: The product of any number of Terms and a coefficient |
CNAryState< UnitVector > | NAryState is a Drake::Vector (concept implementation) which is a container of zero or more component Drake::Vector instances |
CNArySystem< UnitSystem > | A System which aggregates multiple instances of a UnitSystem system |
CNiceTypeName | Obtains canonicalized, platform-independent, human-readable names for arbitrarily-complicated C++ types |
►CNoiseModel< ScalarType, Dimension, Derived > | NoiseModel |
CAdditiveGaussianNoiseModel< ScalarType, Dimension, Derived > | GaussianNoiseModel |
CNumInputsDispatch< System, Enable > | |
CNumInputsDispatch< System, true > | |
CNumOutputsDispatch< System, Enable > | |
CNumOutputsDispatch< System, true > | |
CNumStatesDispatch< System, Enable > | |
CNumStatesDispatch< System, true > | |
COptimizationProblem | |
COutputEntryFinder | There is one of these corresponding to every OutputPort3 in the System3 that created the containing Context3 |
►COutputPort | An OutputPort represents a data output from a System |
CVectorOutputPort< T > | The OutputPort represents a data output from a System |
CVectorOutputPort< int > | |
►COutputPort3 | An OutputPort3 represents a data output from a System |
CVectorOutputPort3< T > | Extends OutputPort3 for cases where the OutputPort3 is known to be vector-valued, with scalar elements of template type T |
COutputPortFinder | See InputPortFinder for information |
►COutputPortListenerInterface | OutputPortListenerInterface is an interface that consumers of an output port must satisfy to receive notifications when the value on that output port changes |
►CInputPort< T > | The InputPort describes a single input to a System, from another System or from an external driver |
CDependentInputPort< T > | The DependentInputPort wraps a pointer to the OutputPort of a System for use as an input to another System |
CFreestandingInputPort< T > | The FreestandingInputPort encapsulates a vector of data for use as an input to a System |
CInputPort< double > | |
►CInputPort< int > | |
CDependentInputPort< int > | |
CFreestandingInputPort< int > | |
CPDControlSystem< System > | PDControlSystem<System> |
CPendulumInput< ScalarType > | A simple Drake input for unit testing |
CPendulumState< ScalarType > | A simple Drake state for unit testing |
CPIDOutput | |
►CPiecewiseFunction | |
CExponentialPlusPiecewisePolynomial< CoefficientType > | Y(t) = K * exp(A * (t - t_j)) * alpha.col(j) + piecewise_polynomial_part(t) |
CExponentialPlusPiecewisePolynomial< double > | |
►CPiecewisePolynomialBase | |
CPiecewisePolynomial< CoefficientType > | A scalar multi-variate piecewise polynomial |
CPiecewisePolynomial< double > | |
CSplineInformation | |
CPoint | |
CPointPair | Structure containing the results of a collision query |
CPolynomial< _CoefficientType > | A scalar multi-variate polynomial, modeled after the msspoly in spotless |
CPolynomial< CoefficientType > | |
CPositionIndices | |
CPolynomial< _CoefficientType >::Product< Rhs, Lhs > | |
CTrigPoly< _CoefficientType >::Product< Rhs, Lhs > | |
CQPControllerDebugData | |
CQPControllerOutput | |
CQPControllerParams | |
CQPControllerState | |
CQPLocomotionPlan | |
CQPLocomotionPlanSettings | |
CQuadraticLyapunovFunction | |
CRandomVectorDispatch< System, Enable > | |
CRandomVectorDispatch< System, typename std::enable_if< System::template StateVector< double >::RowsAtCompileTime== Eigen::Dynamic >::type > | |
CResizeDerivativesToMatchScalarImpl< Derived, Scalar > | |
CResizeDerivativesToMatchScalarImpl< Derived, Eigen::AutoDiffScalar< DerivType > > | |
CRigidBody | |
CRigidBodyActuator | |
►CRigidBodyConstraint | Base class |
►CMultipleTimeKinematicConstraint | |
CWorldFixedBodyPoseConstraint | |
CWorldFixedOrientConstraint | |
CWorldFixedPositionConstraint | |
►CMultipleTimeLinearPostureConstraint | |
CPostureChangeConstraint | |
CPostureConstraint | |
CQuasiStaticConstraint | Center of Mass (CoM) is within the support polygon |
►CSingleTimeKinematicConstraint | |
CAllBodiesClosestDistanceConstraint | |
►CEulerConstraint | |
CWorldEulerConstraint | |
►CGazeConstraint | |
►CGazeDirConstraint | |
CRelativeGazeDirConstraint | |
CWorldGazeDirConstraint | |
►CGazeOrientConstraint | |
CWorldGazeOrientConstraint | |
►CGazeTargetConstraint | |
CRelativeGazeTargetConstraint | |
CWorldGazeTargetConstraint | |
CGravityCompensationTorqueConstraint | |
CMinDistanceConstraint | |
CPoint2LineSegDistConstraint | |
CPoint2PointDistanceConstraint | |
►CPositionConstraint | |
CRelativePositionConstraint | |
CWorldCoMConstraint | |
►CWorldPositionConstraint | |
CWorldPositionInFrameConstraint | |
►CQuatConstraint | |
CRelativeQuatConstraint | |
CWorldQuatConstraint | |
CSingleTimeLinearPostureConstraint | |
►CRigidBodyForceElement | RigidBodyForceElement |
CRigidBodyPropellor | RigidBodyPropellor |
CRigidBodySpringDamper | RigidBodySpringDamper |
CRigidBodyFrame | |
CRigidBodyLoop | |
►CRigidBodySensor | An abstract parent class of all sensors |
CRigidBodyAccelerometer | RigidBodyAccelerometer |
CRigidBodyDepthSensor | RigidBodyDepthSensor |
CRigidBodyGyroscope | RigidBodyGyroscope |
CRigidBodyMagnetometer | RigidBodyMagnetometer |
CRigidBodySupportStateElement | |
CRigidBodySystem | Implements the System concept by wrapping the RigidBodyTree algorithms with additional sensors and actuators/forces |
CRigidBodyTree | |
CRobotJointIndexMap | |
CRobotPropertyCache | |
CSide | |
CSimulationOptions | |
CTrigPoly< _CoefficientType >::SinCosVars | |
CSizeDispatch< VecType, Enable > | |
CSizeDispatch< VecType, typename std::enable_if< VecType::RowsAtCompileTime== Eigen::Dynamic >::type > | |
COptimizationProblem::SolverData | |
CState< T > | The State is a container for all the data comprising the complete state of a particular System at a particular moment |
CState< double > | |
►CStateVector< T > | StateVector is an abstract base class template for vector quantities within the state of a System |
►CLeafStateVector< T > | LeafStateVector is an abstract class template that implements StateVector for leaf Systems, i.e |
CBasicStateVector< T > | BasicStateVector is a concrete class template that implements StateVector in a convenient manner for leaf Systems, by owning and wrapping a VectorInterface<T> |
CStateSubvector< T > | StateSubvector is a concrete class template that implements StateVector by providing a sliced view of a StateVector |
CStateVector< double > | |
CStepInfo< T > | Contains information about the independent variable including time and step number |
CStepInfo< double > | |
CSupportStateElement | |
CSystemIdentification< CoefficientType > | Utility functions for system identification |
CSystemOutput< T > | A container for all the output ports of a System |
CPolynomial< _CoefficientType >::Term | An individual variable raised to an integer power; e.g. x**2 |
CTotalSizeAtCompileTime< Head, Tail > | Helper for totalSizeAtCompileTime function (recursive) |
CTotalSizeAtCompileTime< Head > | Helper for totalSizeAtCompileTime function (base case) |
CTransformSpatial< Derived > | |
CTrigPoly< _CoefficientType > | A scalar multi-variate polynomial containing sines and cosines |
►Ctrue_type | |
Cis_combined_vector< CombinedVector< Scalar, Vector1, Vector2 > > | |
Cis_eigen_vector< Eigen::Matrix< Scalar, Rows, 1, Options, MaxRows, 1 > > | |
CTupleToMexHelper< Index > | |
CTupleToMexHelper< 0 > | |
CTVLQRData | |
CValueConstraint | |
►CValueListenerInterface | ValueListenerInterface is an interface that dependent computations must implement so that they can receive notifications when a prerequisite value is modified |
CCacheEntry | Each cache entry contains: |
CValueListenerList | A ValueListenerList object maintains a list of value listeners that have registered to receive notification of value changes from the holder of that list |
CFunctionalForm::Variable | Represent a variable in a FunctionalForm |
CFunctionalForm::Variables | Represent a set of Variable instances |
►CVectorInterface< T > | VectorInterface is a pure abstract interface that real-valued signals between Systems must satisfy |
CBasicVector< T > | BasicVector is a semantics-free wrapper around an Eigen vector that satisfies VectorInterface |
CVectorInterface< int > | |
CVectorObject< T > | This concrete class provides object semantics to an abstract VectorInterface by implementing a copy constructor and copy assignment using the VectorInterface's Clone() method |
CVRefIntegratorParams | |
CWholeBodyParams | |
Cdouble | |