Simbody  3.4 (development)
Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
SimTK::AbstractMeasureThis is the base class for all Measure handle classes
SimTK::AbstractMeasure::ImplementationThe abstract parent of all Measure Implementation classes
SimTK::AbstractMeasure::SetHandleAn object of this type is used as a dummy argument to make sure the automatically-generated handle constructor's signature doesn't conflict with an explicitly-defined one
SimTK::AbstractValueAbstract base class representing an arbitrary value of self-describing type
SimTK::Array_< T, X >The SimTK::Array_<T> container class is a plug-compatible replacement for the C++ standard template library (STL) std::vector<T> class, but with some important advantages in performance, and functionality, and binary compatibility
SimTK::ArrayIndexTraits< X >This templatized type is used by the Array_<T,X> classes to obtain the information they need to use the class X as an index class for the array
SimTK::ArrayIndexTraits< bool >Specialization of ArrayIndexTraits for bool used as an index
SimTK::ArrayIndexTraits< char >Specialization of ArrayIndexTraits for char used as an index
SimTK::ArrayIndexTraits< int >Specialization of ArrayIndexTraits for (signed) int used as an index
SimTK::ArrayIndexTraits< long >Specialization of ArrayIndexTraits for (signed) long used as an index
SimTK::ArrayIndexTraits< long long >Specialization of ArrayIndexTraits for long long used as an index
SimTK::ArrayIndexTraits< short >Specialization of ArrayIndexTraits for (signed) short used as an index
SimTK::ArrayIndexTraits< signed char >Specialization of ArrayIndexTraits for signed char used as an index
SimTK::ArrayIndexTraits< unsigned >Specialization of ArrayIndexTraits for unsigned (that is, unsigned int) used as an index
SimTK::ArrayIndexTraits< unsigned char >Specialization of ArrayIndexTraits for unsigned char used as an index
SimTK::ArrayIndexTraits< unsigned long >Specialization of ArrayIndexTraits for unsigned long used as an index
SimTK::ArrayIndexTraits< unsigned long long >Specialization of ArrayIndexTraits for unsigned long long used as an index
SimTK::ArrayIndexTraits< unsigned short >Specialization of ArrayIndexTraits for unsigned short used as an index
SimTK::ArrayView_< T, X >This Array_ helper class is the base class for Array_, extending ArrayViewConst_ to add the ability to modify elements, but not the ability to change size or reallocate
SimTK::ArrayViewConst_< T, X >This Array_ helper class is the base class for ArrayView_ which is the base class for Array_; here we provide only the minimal read-only "const" functionality required by any Array_ object, and shallow copy semantics
SimTK::ArticulatedInertia_< P >An articulated body inertia (ABI) matrix P(q) contains the spatial inertia properties that a body appears to have when it is the free base body of an articulated multibody tree in a given configuration q
SimTK::AssemblerThis Study attempts to find a configuration (set of joint coordinates q) of a Simbody MultibodySystem that satisfies the System's position Constraints plus optional additional assembly conditions
SimTK::AssemblyConditionDefine an assembly condition consisting of a scalar goal and/or a related set of assembly error equations (that is, an objective and/or some constraints)
SimTK::AtomicIntegerThis class functions exactly like an int, except that the following operators are atomic: ++, --, +=, -=, *=, /=, %=, &=, |=, ^=, <<=, and >>=
SimTK::BicubicFunctionThis is a two-argument Function built using a shared BicubicSurface and managing current state to optimize for localized access
SimTK::BicubicSurfaceThis class will create a smooth surface that approximates a two-argument function F(X,Y) from a given set of samples of that function on a rectangular grid with regular or irregular spacing
SimTK::BicubicSurface::PatchHintThis object is used to hold precalculated data about the most recently accessed patch to accelerate the common case of repeated access to the same patch or to nearby patches
SimTK::BodyReference frame that can be used to describe mass properties and geometry
SimTK::Body::GroundThis is a Body representing something immobile, of effectively infinite mass and inertia, that cannot be modified to be anything else
SimTK::Body::LinearThis is a rigid body in the shape of a line, which is inherently inertialess about its axis
SimTK::Body::MasslessThis is a Body that is constitutively massless (and inertialess); meaning that no amount of fiddling with it will ever give it any mass or inertia
SimTK::Body::ParticleThis kind of body can only represent an inertialess point mass, with mass center at (0,0,0) in the local frame
SimTK::Body::RigidA general rigid body
SimTK::BrokenContactThis subclass of Contact represents a pair of contact surfaces that were in contact (meaning within cutoff range) but have now gone out of range
SimTK::CableObstacleAn obstacle is any significant object along the cable path -- one of the end points, a via point, or a surface
SimTK::CableObstacle::SurfaceThis obstacle is a solid object represented by a ContactGeometry surface
SimTK::CableObstacle::ViaPointThis is a point through which the cable must pass
SimTK::CableObstacleIndexThis is a unique integer type for identifying obstacles comprising a particular cable path
SimTK::CablePathThis class represents the path of a frictionless cable from an origin point fixed to a body, through via points and over geometric obstacles fixed to other bodies, to a final termination point
SimTK::CablePathIndexThis is a unique integer type for quickly identifying specific cables for fast lookup purposes
SimTK::CableSpringThis force element implements a passive elastic element (like a rubber band) that follows a frictionless CablePath across a set of "obstacles"
SimTK::CableTrackerSubsystemThis subsystem tracks the paths of massless, frictionless cables that take the shortest route between two distant points of a multibody system, passing smoothly over geometric obstacles that are attached to intermediate bodies
SimTK::CacheEntryIndexThis unique integer type is for selecting non-shared cache entries
SimTK::CircularPointContactThis subclass of Contact represents a contact between two non-conforming surfaces 1 and 2 that initially meet at a point where each surface has a uniform radius of curvature in all directions (R1 and R2), like a sphere (inside or outside) or a halfspace, resulting in a contact region with circular symmetry
SimTK::ClonePtr< T >Wrap a pointer to an abstract base class in a way that makes it behave like a concrete class
SimTK::CNT< K >Specialized information about Composite Numerical Types which allows us to define appropriate templatized classes using them
SimTK::CNT< K >::Result< P >
SimTK::CNT< K >::Substitute< P >
SimTK::CNT< complex< R > >Specializations of CNT for numeric types
SimTK::CNT< conjugate< R > >
SimTK::CNT< double >
SimTK::CNT< float >
SimTK::CNT< long double >
SimTK::CollisionDetectionAlgorithmA CollisionDetectionAlgorithm implements an algorithm for detecting overlaps between pairs of ContactGeometry objects, and creating Contact objects based on them
SimTK::CollisionDetectionAlgorithm::ConvexConvexThis algorithm detects contacts between two ContactGeometry::Convex objects
SimTK::CollisionDetectionAlgorithm::HalfSpaceEllipsoidThis algorithm detects contacts between a ContactGeometry::HalfSpace and a ContactGeometry::Ellipsoid
SimTK::CollisionDetectionAlgorithm::HalfSpaceSphereThis algorithm detects contacts between a ContactGeometry::HalfSpace and a ContactGeometry::Sphere
SimTK::CollisionDetectionAlgorithm::HalfSpaceTriangleMeshThis algorithm detects contacts between a ContactGeometry::HalfSpace and a ContactGeometry::TriangleMesh
SimTK::CollisionDetectionAlgorithm::SphereSphereThis algorithm detects contacts between two ContactGeometry::Sphere objects
SimTK::CollisionDetectionAlgorithm::SphereTriangleMeshThis algorithm detects contacts between a ContactGeometry::Sphere and a ContactGeometry::TriangleMesh
SimTK::CollisionDetectionAlgorithm::TriangleMeshTriangleMeshThis algorithm detects contacts between two ContactGeometry::TriangleMesh objects
SimTK::CompliantContactSubsystemThis is a force subsystem that implements a compliant contact model to respond to Contact objects as detected by a ContactTrackerSubsystem
SimTK::conjugate< R >SimTK::conjugate<R> should be instantiated only for float, double, long double
SimTK::conjugate< double >
SimTK::conjugate< float >
SimTK::conjugate< long double >
SimTK::ConstraintThis is the base class for all Constraint classes, which is just a handle for the underlying hidden implementation
SimTK::Constraint::BallEnforce that a fixed station on one body remains coincident with a fixed station on a second body, as though there were a ball joint connecting them at those points
SimTK::Constraint::BallRollingOnPlaneThis constraint enforces continuous contact and non-slip rolling between a spherical surface fixed on one body and a half space (flat surface) fixed on another
SimTK::Constraint::ConstantAccelerationConstrain a single mobility to have a particular acceleration
SimTK::Constraint::ConstantAngleThis constraint consists of a single constraint equation that enforces that a unit vector v1 fixed to one body (the "base body") must maintain a fixed angle theta with respect to a unit vector v2 fixed on the other body (the "follower body")
SimTK::Constraint::ConstantOrientationThree constraint equations
SimTK::Constraint::ConstantSpeedConstrain a single mobility to have a particular speed
SimTK::Constraint::CoordinateCouplerThis is a Constraint that uses a Function object to define a single holonomic (position) constraint equation acting to relate a set of generalized coordinates q
SimTK::Constraint::CustomThe handle class Constraint::Custom (dataless) and its companion class Constraint::Custom::Implementation can be used together to define new Constraint types with arbitrary properties
SimTK::Constraint::Custom::ImplementationThis is the abstract base class for the implementation of custom constraints. See Constraint::Custom for more information
SimTK::Constraint::NoSlip1DOne non-holonomic constraint equation
SimTK::Constraint::PointInPlaneOne constraint equation
SimTK::Constraint::PointOnLineTwo constraint equations
SimTK::Constraint::PrescribedMotionThis is a Constraint that uses a Function to prescribe the behavior of a single generalized coordinate as a function of time
SimTK::Constraint::RodThis constraint consists of one constraint equation that enforces a constant distance between a point on one body and a point on another body
SimTK::Constraint::SpeedCouplerThis is a Constraint that uses a Function object to define a nonholonomic (velocity) constraint
SimTK::Constraint::WeldSix constraint equations
SimTK::ConstraintIndexThis is for arrays indexed by constraint number within a subsystem (typically the SimbodyMatterSubsystem). It is assigned when a Constraint is added to the subsystem
SimTK::ContactA Contact contains information about the spatial relationship between two surfaces that are near, or in contact with, each other
SimTK::ContactDetailThis provides deformed geometry and force details for one element of a contact patch that may be composed of many elements
SimTK::ContactForceThis is a simple class containing the basic force information for a single contact between deformable surfaces S1 and S2 mounted on rigid bodies B1 and B2
SimTK::ContactForceGeneratorA ContactForceGenerator implements an algorithm for responding to overlaps or potential overlaps between pairs of ContactSurface objects, as detected by a ContactTrackerSubsystem
SimTK::ContactForceGenerator::DoNothingThis ContactForceGenerator silently does nothing
SimTK::ContactForceGenerator::ElasticFoundationThis ContactForceGenerator handles contact between a TriangleMesh and a variety of other geometric objects, all of which produce a TriangleMeshContact tracking object
SimTK::ContactForceGenerator::HertzCircularThis ContactForceGenerator handles contact between non-conforming objects that meet at a point and generate a circular contact patch; those generate a CircularPointContact tracking object
SimTK::ContactForceGenerator::HertzEllipticalThis ContactForceGenerator handles contact between non-conforming objects that meet at a point and generate an elliptical contact patch; those generate an EllipticalPointContact tracking object
SimTK::ContactForceGenerator::ThrowErrorThis ContactForceGenerator throws an error if it is every invoked
SimTK::ContactGeometryA ContactGeometry object describes the shape of all or part of the boundary of a solid object, for the purpose of modeling with Simbody physical effects that occur at the surface of that object, such as contact and wrapping forces
SimTK::ContactGeometry::CylinderThis ContactGeometry subclass represents a cylinder centered at the origin, with radius r in the x-y plane, and infinite length along z
SimTK::ContactGeometry::EllipsoidThis ContactGeometry subclass represents an ellipsoid centered at the origin, with its principal axes pointing along the x, y, and z axes and half dimensions a,b, and c (all > 0) along those axes, respectively
SimTK::ContactGeometry::HalfSpaceThis ContactGeometry subclass represents an object that occupies the entire half-space x>0
SimTK::ContactGeometry::SmoothHeightMapThis ContactGeometry subclass represents a smooth surface fit through a set of sampled points using bicubic patches to provide C2 continuity
SimTK::ContactGeometry::SphereThis ContactGeometry subclass represents a sphere centered at the origin
SimTK::ContactGeometry::TorusThis ContactGeometry subclass represents a torus centered at the origin with the axial direction aligned to the z-axis
SimTK::ContactGeometry::TriangleMeshThis ContactGeometry subclass represents an arbitrary shape described by a mesh of triangular faces
SimTK::ContactGeometry::TriangleMesh::OBBTreeNodeThis class represents a node in the Oriented Bounding Box Tree for a TriangleMesh
SimTK::ContactGeometryTypeIdThis is a unique integer type for quickly identifying specific types of contact geometry for fast lookup purposes
SimTK::ContactIdThis is a unique integer Id assigned to each contact pair when we first begin to track it
SimTK::ContactMaterialDefine the physical properties of the material from which a contact surface is made, including properties needed by a variety of contact response techniques that might be applied during contact
SimTK::ContactPatchA ContactPatch is the description of the forces and the deformed shape of the contact surfaces that result from compliant contact interactions
SimTK::ContactSnapshotObjects of this class represent collections of surface-pair interactions that are being tracked at a particular instant during a simulation
SimTK::ContactSurfaceThis class combines a piece of ContactGeometry with a ContactMaterial to make an object suitable for attaching to a body which can then engage in contact behavior with other contact surfaces
SimTK::ContactSurfaceIndexThis defines a unique index for all the contact surfaces being handled either by a ContactTrackerSubsystem or within a single ContactSet of a GeneralContactSubsystem
SimTK::ContactTrackerA ContactTracker implements an algorithm for detecting overlaps or potential overlaps between pairs of ContactGeometry objects, and managing Contact objects that track individual contacts as they evolve through time
SimTK::ContactTracker::ConvexImplicitPairThis ContactTracker handles contacts between two smooth, convex objects by using their implicit functions
SimTK::ContactTracker::GeneralImplicitPair(TODO: not implemented yet) This ContactTracker handles contacts between two arbitrary smooth surfaces by using their implicit functions, with no shape restrictions
SimTK::ContactTracker::HalfSpaceEllipsoidThis ContactTracker handles contacts between a ContactGeometry::HalfSpace and a ContactGeometry::Ellipsoid, in that order
SimTK::ContactTracker::HalfSpaceSphereThis ContactTracker handles contacts between a ContactGeometry::HalfSpace and a ContactGeometry::Sphere, in that order
SimTK::ContactTracker::HalfSpaceTriangleMeshThis ContactTracker handles contacts between a ContactGeometry::HalfSpace and a ContactGeometry::TriangleMesh, in that order
SimTK::ContactTracker::SphereSphereThis ContactTracker handles contacts between two ContactGeometry::Sphere objects
SimTK::ContactTracker::SphereTriangleMeshThis ContactTracker handles contacts between a ContactGeometry::Sphere and a ContactGeometry::TriangleMesh, in that order
SimTK::ContactTracker::TriangleMeshTriangleMeshThis ContactTracker handles contacts between two ContactGeometry::TriangleMesh surfaces
SimTK::ContactTrackerSubsystemThis subsystem identifies and tracks potential contacts between bodies of a multibody system, but does not generate any physical responses to those contacts
SimTK::ContactTypeIdThis is a small integer that serves as the unique typeid for each type of concrete Contact class
SimTK::CoordinateAxisThis class, along with its sister class CoordinateDirection, provides convenient manipulation of the three coordinate axes via the definition of three constants XAxis, YAxis, and ZAxis each with a unique subtype and implicit conversion to the integers 0, 1, and 2 whenever necessary. Methods are provided to allow code to be written once that can be used to work with the axes in any order
SimTK::CoordinateAxis::XCoordinateAxis
SimTK::CoordinateAxis::YCoordinateAxis
SimTK::CoordinateAxis::ZCoordinateAxis
SimTK::CoordinateDirectionA CoordinateDirection is a CoordinateAxis plus a direction indicating the positive or negative direction along that axis
SimTK::CoordinateDirection::NegativeUse for compile-time construction of a negative CoordinateDirection along one of the coordinate axes
SimTK::CoordinateDirection::NegXDirection
SimTK::CoordinateDirection::NegYDirection
SimTK::CoordinateDirection::NegZDirection
SimTK::CPodesThis is a straightforward translation of the Sundials CPODES C interface into C++
SimTK::CPodesIntegratorThis is an Integrator based on the CPODES library
SimTK::CPodesSystemThis abstract class defines the system to be integrated with SimTK CPodes
SimTK::DeadMatrixView_< ELT >This is a MatrixView_ with the additional property that we are about to delete it
SimTK::DecorationGeneratorA DecorationGenerator is used to define geometry that may change over the course of a simulation
SimTK::DecorationsThis defines a single DecorativeGeometry object that is composed of a collection of other DecorativeGeometry objects
SimTK::DecorationSubsystemThis is the client-side handle class encapsulating the hidden implementation of the DecorationSubsystem
SimTK::DecorativeBrickThis defines a rectangular solid centered at the origin and aligned with the local frame axes
SimTK::DecorativeCircleThis defines a circle in the x-y plane, centered at the origin
SimTK::DecorativeCylinderThis defines a cylinder centered on the origin and aligned in the y direction
SimTK::DecorativeEllipsoidThis defines an ellipsoidal solid centered at the origin and aligned with the local frame axes
SimTK::DecorativeFrameThis defines geometry to represent a coordinate frame
SimTK::DecorativeGeometryThis is the client-side interface to an implementation-independent representation of "Decorations" suitable for visualization, annotation, logging, or debugging but which cannot have any effect on the behavior of a System or the evolution of a Study
SimTK::DecorativeGeometryImplementationUse this abstract class to connect your implementation of decorative geometry to the implementation-independent classes above
SimTK::DecorativeLineA line between two points
SimTK::DecorativeMeshThis defines a displayable mesh by referencing an already-existing PolygonalMesh object
SimTK::DecorativePointA point of interest
SimTK::DecorativeSphereThis defines a sphere centered at the origin
SimTK::DecorativeTextThis defines a text label with its base at the origin
SimTK::DefaultOptimizer
SimTK::DefaultSystemSubsystemThis is a concrete Subsystem that is part of every System. It provides a variety of services for the System, such as maintaining lists of event handlers and reporters, and acting as a source of globally unique event IDs
SimTK::DifferentiatorGiven a function f(y), where f, y or both can be vectors, calculate the derivative (gradient, Jacobian) df/dy
SimTK::Differentiator::FunctionThis abstract class defines a function to be differentiated (repeatedly) by a Differentiator object
SimTK::Differentiator::GradientFunctionDerive a concrete class from this one if you have a scalar function of multiple variables that you want to differentiate
SimTK::Differentiator::JacobianFunctionDerive a concrete class from this one if you have a set of functions (i.e., a vector-valued function) of multiple variables that you want to differentiate
SimTK::Differentiator::ScalarFunctionDerive a concrete class from this one if you have a scalar function of a single scalar variable that you want to differentiate
SimTK::DiscreteVariableIndexThis unique integer type is for selecting discrete variables
SimTK::EigenClass to compute Eigen values and Eigen vectors of a matrix
SimTK::ElasticFoundationForceThis class implements an elastic foundation or "bed of springs" contact model
SimTK::EllipticalPointContactThis subclass of Contact represents a contact between two non-conforming surfaces 1 and 2 that initially meet at a point and where each surface has two principal curvatures (maximum and minimum) in perpendicular directions
SimTK::EventAn Event is "something that happens" during a Study that is advancing through time
SimTK::Event::CauseThese are all the possible causes for events
SimTK::EventHandlerAn EventHandler is an object that defines an event that can occur within a system
SimTK::EventIdThis is a class to represent unique IDs for events in a type-safe way
SimTK::EventReporterAn EventReporter is an object that defines an event that can occur within a system
SimTK::EventTriggerByStageIndexUnique integer type for Subsystem-local, per-stage event indexing
SimTK::EventTriggerInfoThis class is used to communicate between the System and an Integrator regarding the properties of a particular event trigger function
SimTK::Exception::APIArgcheckFailedThis is for reporting problems detected by checking the caller's supplied arguments to a SimTK API method
SimTK::Exception::APIMethodFailed
SimTK::Exception::AssertThis is for reporting internally-detected bugs only, not problems induced by confused users (that is, it is for confused developers instead)
SimTK::Exception::Base
SimTK::Exception::CacheEntryOutOfDate
SimTK::Exception::Cant
SimTK::Exception::ConvergedFailed
SimTK::Exception::ErrorCheckThis is for reporting errors occurring during execution of SimTK core methods, beyond those caused by mere improper API arguments, which should be reported with APIArgcheck instead
SimTK::Exception::IllegalLapackArg
SimTK::Exception::IncompatibleValues
SimTK::Exception::IncorrectArrayLength
SimTK::Exception::IndexOutOfRange
SimTK::Exception::LoopConstraintConstructionFailure
SimTK::Exception::MobilizerCantExactlyRepresentRequestedQuantity
SimTK::Exception::NewtonRaphsonFailure
SimTK::Exception::NotPositiveDefinite
SimTK::Exception::OperationNotAllowedOnNonconstReadOnlyView
SimTK::Exception::OperationNotAllowedOnOwner
SimTK::Exception::OperationNotAllowedOnView
SimTK::Exception::OptimizerFailed
SimTK::Exception::RealizeCheckFailed
SimTK::Exception::RealizeTopologyMustBeCalledFirst
SimTK::Exception::RepLevelException
SimTK::Exception::SingularMatrix
SimTK::Exception::SizeOutOfRange
SimTK::Exception::SizeWasNegative
SimTK::Exception::StageIsWrong
SimTK::Exception::StageOutOfRange
SimTK::Exception::StageTooHigh
SimTK::Exception::StageTooLow
SimTK::Exception::StateAndSystemTopologyVersionsMustMatch
SimTK::Exception::UnimplementedMethod
SimTK::Exception::UnimplementedVirtualMethod
SimTK::Exception::UnrecognizedParameter
SimTK::Exception::ValueOutOfRange
SimTK::Exception::ValueWasNegative
SimTK::ExplicitEulerIntegratorThis is an Integrator based on the explicit Euler algorithm
SimTK::FactorBase class for the various matrix factorizations
SimTK::FactorLUClass for performing LU matrix factorizations
SimTK::FactorQTZClass to perform a QTZ (linear least squares) factorization
SimTK::FactorSVDClass to compute a singular value decomposition of a matrix
SimTK::ForceThis is the base class from which all Force element handle classes derive
SimTK::Force::ConstantForceA constant force applied to a body station
SimTK::Force::ConstantTorqueA constant torque to a body
SimTK::Force::CustomThis class is used to define new force elements
SimTK::Force::Custom::ImplementationEvery custom force requires implementation of a class that is derived from this abstract class. See Force::Custom for details
SimTK::Force::DiscreteForcesArbitrary discrete body forces and mobility (generalized) forces. Useful for applying external forces or forces that are updated at discrete times due to the occurrence of events
SimTK::Force::GlobalDamperA general energy "drain" on the system
SimTK::Force::GravityThis force element represents a uniform gravitational field applied to a set of bodies
SimTK::Force::LinearBushingThis force element represents a bushing acting to connect a frame F fixed on one body (B1) to a frame M fixed on a second body (B2), by a massless, compliant element with linear stiffness and damping properties
SimTK::Force::MobilityConstantForceA constant generalized force f (a scalar) applied to a mobility
SimTK::Force::MobilityDiscreteForceA discrete mobility (generalized) force f applied to a particular mobility that is specified at construction. Useful for applying external forces or forces that are updated at discrete times due to the occurrence of events
SimTK::Force::MobilityLinearDamperA linear damper that acts along or around a mobility coordinate to apply a generalized force there
SimTK::Force::MobilityLinearSpringA linear spring that acts along or around a mobility coordinate to apply a generalized force there
SimTK::Force::MobilityLinearStopModel a compliant stop element that acts to keep a mobilizer coordinate q within specified bounds
SimTK::Force::ThermostatThis is a feedback-controlled force that uses Nose'-Hoover chains to maintain a particular temperature Tb, as though the system were immersed in an infinite heat bath at that temperature
SimTK::Force::TwoPointConstantForceA constant force f (a signed scalar) which acts along the line between two points, specified as a station on each of two bodies
SimTK::Force::TwoPointLinearDamperA force which resists changes in the distance between two points, acting along the line between those points
SimTK::Force::TwoPointLinearSpringA linear spring between two points, specified as a station on each of two bodies
SimTK::Force::UniformGravityA uniform gravitational force applied to every body in the system. See Force::Gravity for a more flexible option
SimTK::ForceIndexThis type represents the index of a Force element within its subsystem
SimTK::ForceSubsystemThis is logically an abstract class, more specialized than "Subsystem" but not yet concrete
SimTK::ForceSubsystem::GutsPublic declaration of internals for ForceSubsystem extension
SimTK::Function_< T >This abstract class represents a mathematical function that calculates a value of arbitrary type based on M real arguments
SimTK::Function_< T >::ConstantThis is a Function_ subclass which simply returns a fixed value, independent of its arguments
SimTK::Function_< T >::LinearThis is a Function_ subclass whose output value is a linear function of its arguments: f(x, y, ...) = ax+by+...+c
SimTK::Function_< T >::PolynomialThis is a Function_ subclass whose output value is a polynomial of its argument: f(x) = ax^n+bx^(n-1)+...+c
SimTK::Function_< T >::SinusoidThis is a Function_ subclass whose output value is a sinusoid of its argument: f(x) = a*sin(w*x + p) where a is amplitude, w is frequency in radians per unit of x, p is phase in radians
SimTK::Function_< T >::StepThis is a Function_ subclass whose output value y=f(x) is smoothly stepped from y=y0 to y1 as its input argument goes from x=x0 to x1
SimTK::GCVSPLUtilThis class provides entry points for using the GCVSPL algorithm in terms of SimTK data types
SimTK::GeneralContactSubsystemThis class performs collision detection for use in contact modeling
SimTK::GeneralForceSubsystemThis is a concrete subsystem which can apply arbitrary forces to a MultibodySystem
SimTK::GeoCollects geometric primitives intended to deal with raw, fixed-size geometric shapes occupying minimal memory and providing maximum performance through small inline methods and larger high performance algorithms
SimTK::Geo::AlignedBox_< P >A 3d box aligned with an unspecified frame F and centered at a given point measured from that frame's origin
SimTK::Geo::BicubicBezierPatch_< P >A primitive useful for computations involving a single bicubic Bezier patch
SimTK::Geo::BicubicHermitePatch_< P >A primitive useful for computations involving a single bicubic Hermite patch
SimTK::Geo::Box_< P >A 3d rectangular box aligned with an unspecified frame F and centered at that frame's origin
SimTK::Geo::CubicBezierCurve_< P >This is a primitive useful for computations involving a single cubic Bezier curve segment
SimTK::Geo::CubicHermiteCurve_< P >A primitive useful for computations involving a single cubic Hermite curve segment in algebraic or geometric (Hermite) form
SimTK::Geo::LineSeg_< P >A 3d line segment primitive represented by its end points in an unspecified frame, and a collection of line segment-related utility methods
SimTK::Geo::OrientedBox_< P >TODO: A 3d box oriented and positioned with respect to an unspecified frame F
SimTK::Geo::Point_< P >A 3d point primitive represented by a Vec3 from the origin of an unspecified frame, and a collection of point-related utility methods
SimTK::Geo::Sphere_< P >A geometric primitive representing a sphere by its radius and center point, and a collection of sphere-related utility methods
SimTK::Geo::Triangle_< P >A geometric primitive representing a triangle by its vertices as points in some unspecified frame, and a collection of triangle-related utility methods
SimTK::GeodesicThis class stores a geodesic curve after it has been determined
SimTK::GeodesicDecoratorThis class generates decoration (line segments) for a geodesic curve
SimTK::GeodesicIntegrator< Eqn >This is a stripped-down numerical integrator for small ODE or DAE problems whose size is known at compile time, with no provision for discrete variables, event detection, or interpolation
SimTK::GeodesicOptionsThis class stores options for calculating geodesics
SimTK::GeodHitPlaneEventA event handler to terminate integration when geodesic hits the plane
SimTK::HandleEventsOptionsOptions for the handleEvent() method
SimTK::HandleEventsResultsResults returned by the handleEvent() method
SimTK::HuntCrossleyContactThis is a concrete subsystem that handles simple, frictionless contact situations with a model due to Hunt & Crossley: K
SimTK::HuntCrossleyForceThis class models the forces generated by simple point contacts, such as between two spheres, or a sphere and a half space
SimTK::Inertia_< P >The physical meaning of an inertia is the distribution of a rigid body's mass about a particular point
SimTK::IntegratorAn Integrator is an object that can advance the State of a System through time
SimTK::InverseRotation_< P >
SimTK::InverseTransform_< P >Transform from frame B to frame F, but with the internal representation inverted
SimTK::Lapack
SimTK::LocalEnergyMinimizerThis class performs local potential energy minimization of a MultibodySystem
SimTK::MarkersThis AssemblyCondition specifies a correspondence between stations on mobilized bodies ("markers") and fixed ground-frame locations ("observations")
SimTK::MassProperties_< P >This class contains the mass, center of mass, and unit inertia matrix of a rigid body B
SimTK::Mat< M, N, ELT, CS, RS >This class represents a small matrix whose size is known at compile time, containing elements of any Composite Numerical Type (CNT) and engineered to have no runtime overhead whatsoever
SimTK::Mat< M, N, ELT, CS, RS >::EltResult< P >
SimTK::Mat< M, N, ELT, CS, RS >::Result< P >
SimTK::Mat< M, N, ELT, CS, RS >::SubMat< MM, NN >
SimTK::Mat< M, N, ELT, CS, RS >::Substitute< P >
SimTK::Matrix_< ELT >This is the Matrix class intended to appear in user code
SimTK::MatrixBase< ELT >Variable-size 2d matrix of Composite Numerical Type (ELT) elements
SimTK::MatrixBase< ELT >::EltResult< P >
SimTK::MatrixCharacterA MatrixCharacter is a set containing a value for each of the matrix characteristics except element type, which is part of the templatized declaration of a Matrix, Vector, or RowVector handle
SimTK::MatrixCharacter::LapackFullPredefined MatrixCharacter for an ordinary Lapack-style full matrix of a particular dimension m x n (nrows X ncols)
SimTK::MatrixCharacter::MaskThis class collects masks of each characteristic type for representing sets of accceptable characteristics
SimTK::MatrixCharacter::RowVectorPredefined MatrixCharacter for an ordinary row vector of a particular size
SimTK::MatrixCharacter::VectorPredefined MatrixCharacter for an ordinary column vector of a particular size
SimTK::MatrixCommitmentA MatrixCommitment provides a set of acceptable matrix characteristics
SimTK::MatrixCommitment::HermitianThis is the default commitment for a Hermitian (*not* symmetric) matrix
SimTK::MatrixCommitment::RowVectorThis is the default commitment for a row vector
SimTK::MatrixCommitment::SkewHermitianThis is the default commitment for a skew Hermitian (*not* skew symmetric) matrix
SimTK::MatrixCommitment::SkewSymmetricThis is the default commitment for skew symmetric (*not* skew Hermitian) matrix
SimTK::MatrixCommitment::SymmetricThis is the default commitment for a symmetric (*not* Hermitian) matrix
SimTK::MatrixCommitment::TriangularThis is the default commitment for a triangular matrix
SimTK::MatrixCommitment::VectorThis is the default commitment for a column vector
SimTK::MatrixConditionMatrix "condition" is a statement about the numerical characteristics of a Matrix
SimTK::MatrixCondition::MaskUse this class to represent a set of acceptable Condition values
SimTK::MatrixHelper< S >Here we define class MatrixHelper<S>, the scalar-type templatized helper class for the more general, composite numerical type-templatized class MatrixBase<ELT>
SimTK::MatrixHelper< S >::DeepCopy
SimTK::MatrixHelper< S >::DiagonalView
SimTK::MatrixHelper< S >::ShallowCopy
SimTK::MatrixHelper< S >::TransposeView
SimTK::MatrixOutlineMatrix "outline" refers to the characteristic relationship between the number of rows and columns of a matrix, without necessarily specifying the absolute dimensions
SimTK::MatrixOutline::Mask
SimTK::MatrixStorageMatrix "storage" refers to the physical layout of data in the computer’s memory
SimTK::MatrixStorage::MaskUse this class to represent sets of acceptable values for each of the storage attributes (packing, position, order, diagonal)
SimTK::MatrixStructureMatrix "structure" refers to an inherent mathematical (or at least algorithmic) characteristic of the matrix rather than a storage strategy
SimTK::MatrixStructure::Mask
SimTK::MatrixView_< ELT >This class is identical to a Matrix_; it is used only to manage the C++ rules for when copy constructors are called by introducing a separate type to prevent certain allowed optimizations from occuring when we don't want them
SimTK::Measure_< T >This is the base handle class for all Measures whose value type is known, including all the Simbody built-in Measure types
SimTK::Measure_< T >::ConstantThis creates a Measure whose value is a Topology-stage constant of any type T
SimTK::Measure_< T >::Constant::Implementation
SimTK::Measure_< T >::Delay(CAUTION: still under development) This is a Measure whose value at time t is the value that its source operand had at time t-delay for a specified delay
SimTK::Measure_< T >::Delay::Implementation
SimTK::Measure_< T >::DifferentiateThis Measure operator returns the time derivative of its operand measure, or a numerical approximation of the time derivative if an analytic one is not available
SimTK::Measure_< T >::Differentiate::Implementation
SimTK::Measure_< T >::ExtremeThis Measure tracks extreme values attained by the elements of its source operand since the last initialize() call or explicit call to setValue()
SimTK::Measure_< T >::Extreme::Implementation
SimTK::Measure_< T >::ImplementationThis is the base Implementation class for all Measures whose value type is known
SimTK::Measure_< T >::IntegrateThis measure yields the time integral of a given derivative measure, initializing with an initial condition measure of the same type T
SimTK::Measure_< T >::Integrate::ImplementationThe implementation for Integrate measures allocates a continuous state variable or variables from the State's z pool and generates zdot values to be integrated into those z variables
SimTK::Measure_< T >::MaxAbsTrack the value of the operand that is of maximum absolute value
SimTK::Measure_< T >::MaximumTrack the maximum value of the operand (signed)
SimTK::Measure_< T >::MinAbsTrack the value of the operand that is of minimum absolute value (not very useful)
SimTK::Measure_< T >::MinimumTrack the minimum value of the operand (signed)
SimTK::Measure_< T >::MinusThis Measure is the difference of two Measures of the same type T
SimTK::Measure_< T >::Minus::Implementation
SimTK::Measure_< T >::OneThis creates a Measure::Constant whose value is always T(1) and can't be changed
SimTK::Measure_< T >::PlusThis Measure is the sum of two Measures of the same type T
SimTK::Measure_< T >::Plus::Implementation
SimTK::Measure_< T >::ResultThis Measure holds the result of some externally-determined computation, and helps to coordinate the validity of that computation with respect to the state variables
SimTK::Measure_< T >::Result::Implementation
SimTK::Measure_< T >::SampleAndHoldNOT IMPLEMENTED YET -- This is a Measure operator which, upon occurrence of a designated event, samples its source Measure and then holds its value in a discrete state variable until the next occurrence of the event
SimTK::Measure_< T >::ScaleThis Measure multiplies some other Measure by a Real scale factor
SimTK::Measure_< T >::Scale::Implementation
SimTK::Measure_< T >::SinusoidThis measure produces a sinusoidal function of time:
SimTK::Measure_< T >::Sinusoid::Implementation
SimTK::Measure_< T >::TimeThis creates a Measure::Time whose value is always T(time)
SimTK::Measure_< T >::Time::Implementation
SimTK::Measure_< T >::VariableThis creates a Measure whose value is a discrete State variable of any type T
SimTK::Measure_< T >::Variable::Implementation
SimTK::Measure_< T >::ZeroThis creates a Measure::Constant whose value is always T(0) and can't be changed
SimTK::MobilizedBodyA MobilizedBody is Simbody's fundamental body-and-joint object used to parameterize a system's motion by constructing a multibody tree containing each body and its unique "mobilizer" (internal coordinate joint)
SimTK::MobilizedBody::BallThree mobilities -- unrestricted orientation modeled with a quaternion which is never singular
SimTK::MobilizedBody::BendStretchTwo mobilities: The z axis of the parent's F frame is used for rotation (and that is always aligned with the M frame z axis)
SimTK::MobilizedBody::BushingSix mobilities -- arbitrary relative motion modeled as x-y-z translation followed by an x-y-z body-fixed Euler angle sequence, though with a singularity when the middle angle is +/- 90 degrees
SimTK::MobilizedBody::CustomThe handle class MobilizedBody::Custom (dataless) and its companion class MobilizedBody::Custom::Implementation can be used together to define new MobilizedBody types with arbitrary properties
SimTK::MobilizedBody::Custom::ImplementationThis is the implementation class for Custom mobilizers
SimTK::MobilizedBody::CylinderTwo mobilities -- rotation and translation along the common z axis of the inboard and outboard mobilizer frames
SimTK::MobilizedBody::EllipsoidThree mobilities -- coordinated rotation and translation along the surface of an ellipsoid fixed to the parent (inboard) body
SimTK::MobilizedBody::FreeUnrestricted motion for a rigid body (six mobilities)
SimTK::MobilizedBody::FreeLineFive mobilities, representing unrestricted motion for a body which is inertialess along its own z axis
SimTK::MobilizedBody::FunctionBasedThis is a subclass of MobilizedBody::Custom which uses a set of Function objects to define the behavior of the MobilizedBody
SimTK::MobilizedBody::GimbalThree mobilities -- unrestricted orientation modeled as a 1-2-3 body-fixed Euler angle sequence, though with a singularity when the middle angle is +/- 90 degrees
SimTK::MobilizedBody::GroundThis is a special type of "mobilized" body generated automatically by Simbody as a placeholder for Ground in the 0th slot for a SimbodyMatterSubsystem's mobilized bodies; don't create this yourself
SimTK::MobilizedBody::LineOrientationTwo mobilities, representing unrestricted orientation for a body which is inertialess along its own z axis
SimTK::MobilizedBody::PinProvides one rotational mobility about the common z axis of the F and M frames of the mobilizer
SimTK::MobilizedBody::PlanarThree mobilities -- z rotation and x,y translation
SimTK::MobilizedBody::ScrewOne mobility -- coordinated rotation and translation along the common z axis of the inboard and outboard mobilizer frames
SimTK::MobilizedBody::SliderOne mobility -- translation along the common x axis of the F (inboard) and M (outboard) mobilizer frames
SimTK::MobilizedBody::SphericalCoordsThree mobilities -- body fixed 3-2 (z-y) rotation followed by translation along body z or body x
SimTK::MobilizedBody::TranslationThree translational mobilities describing the Cartesian motion of a point
SimTK::MobilizedBody::UniversalTwo mobilities -- rotation about the x axis, followed by a rotation about the new y axis
SimTK::MobilizedBody::WeldZero mobilities
SimTK::MobilizedBodyIndexThis is for arrays indexed by mobilized body number within a subsystem (typically the SimbodyMatterSubsystem). It is assigned when a MobilizedBody is added to a subsystem. You can abbreviate this as MobodIndex if you prefer
SimTK::MobilizerQIndexThe Mobilizer associated with each MobilizedBody, once modeled, has a specific number of generalized coordinates q (0-7) and generalized speeds (mobilities) u (0-6). This is the index type for the small array of Mobilizer-local q's
SimTK::MobilizerUIndexThe Mobilizer associated with each MobilizedBody, once modeled, has a specific number of generalized coordinates q (0-7) and generalized speeds (mobilities) u (0-6). This is the index type for the small array of Mobilizer-local u's
SimTK::MotionA Motion object belongs to a particular MobilizedBody and prescribes how the associated motion is to be calculated
SimTK::Motion::CustomThis class can be used to define new motions
SimTK::Motion::Custom::ImplementationThis is the abstract base class for Custom Motion implementations
SimTK::Motion::SinusoidPrescribe position, velocity, or acceleration motion as a sinusoidal function of time, m(t) = a * sin( w*t + p )
SimTK::Motion::SteadyThis non-holonomic Motion object imposes a constant rate on all mobilities
SimTK::MultibodyGraphMakerConstruct a reasonably good spanning-tree-plus-constraints structure for modeling a given set of bodies and joints with a generalized coordinate multibody system like Simbody
SimTK::MultibodyGraphMaker::BodyLocal class that collects information about bodies
SimTK::MultibodyGraphMaker::JointLocal class that collects information about joints
SimTK::MultibodyGraphMaker::JointTypeLocal class that defines the properties of a known joint type
SimTK::MultibodyGraphMaker::LoopConstraintLocal class that represents one of the constraints that were added to close topological loops that were cut to form the spanning tree
SimTK::MultibodyGraphMaker::MobilizerLocal class that represents one of the mobilizers (tree joints) in the generated spanning tree
SimTK::MultibodySystemThe job of the MultibodySystem class is to coordinate the activities of various subsystems which can be part of a multibody system
SimTK::MultiplierIndexUnique integer type for Subsystem-local multiplier indexing
SimTK::Narrowest< R1, R2 >This class is specialized for all 36 combinations of standard types (that is, real and complex types in each of three precisions) and has typedefs "Type" which is the appropriate "narrowed" type for use when R1 & R2 appear in an operation together where the result must be of the narrower precision, and "Precision" which is the expected precision of the result (float, double, long double)
SimTK::Narrowest< complex< R1 >, complex< R2 > >
SimTK::Narrowest< complex< R1 >, R2 >
SimTK::Narrowest< double, double >
SimTK::Narrowest< double, float >
SimTK::Narrowest< double, long double >
SimTK::Narrowest< float, double >
SimTK::Narrowest< float, float >
SimTK::Narrowest< float, long double >
SimTK::Narrowest< long double, double >
SimTK::Narrowest< long double, float >
SimTK::Narrowest< long double, long double >
SimTK::Narrowest< R1, complex< R2 > >
SimTK::negator< NUMBER >Negator<N>, where N is a number type (real, complex, conjugate), is represented in memory identically to N, but behaves as though multiplied by -1, though at zero cost
SimTK::negator< NUMBER >::Result< P >
SimTK::negator< NUMBER >::Substitute< P >
SimTK::NTraits< N >
SimTK::NTraits< complex< R > >Partial specialization for complex numbers -- underlying real R is still a template parameter
SimTK::NTraits< complex< R > >::Result< P >
SimTK::NTraits< complex< R > >::Substitute< P >
SimTK::NTraits< conjugate< R > >
SimTK::NTraits< conjugate< R > >::Result< P >
SimTK::NTraits< conjugate< R > >::Substitute< P >
SimTK::OBBLeafTODO
SimTK::OBBNodeTODO
SimTK::OBBTreeTODO
SimTK::ObservedPointFitterThis class attempts to find the configuration of an internal coordinate model which best fits a set of observed data
SimTK::OptimizerAPI for SimTK Simmath's optimizers
SimTK::Optimizer::OptimizerRep
SimTK::OptimizerSystemAbstract class which defines an objective/cost function which is optimized by and Optimizer object
SimTK::OrientedBoundingBoxThis class represents a rectangular box with arbitrary position and orientation
SimTK::Parallel2DExecutorThis class is used for performing multithreaded computations over two dimensional ranges
SimTK::Parallel2DExecutor::TaskConcrete subclasses of this abstract class represent tasks that can be executed by a Parallel2DExecutor
SimTK::ParallelExecutorThis class is used for performing multithreaded computations
SimTK::ParallelExecutor::TaskConcrete subclasses of this abstract class represent tasks that can be executed by a ParallelExecutor
SimTK::ParallelWorkQueueThis class is used for performing multithreaded computations. It maintains a queue of tasks to be executed, and a pool of threads for executing them
SimTK::ParallelWorkQueue::TaskConcrete subclasses of this abstract class represent tasks that can be executed by a ParallelWorkQueue
SimTK::ParticleConSurfaceSystem
SimTK::ParticleConSurfaceSystemGuts
SimTK::PathDecoratorThis class generates decoration for contact points and straight line path segments
SimTK::PathnameThis class encapsulates the handling of file and directory pathnames in a platform-independent manner
SimTK::PeriodicEventHandlerPeriodicEventHandler is a subclass of ScheduledEventHandler which generates a series of uniformly spaced events at regular intervals
SimTK::PeriodicEventReporterPeriodicEventReporter is a subclass of ScheduledEventReporter which generates a series of uniformly spaced events at regular intervals
SimTK::PhiMatrix
SimTK::PhiMatrixTranspose
SimTK::PIMPLHandle< HANDLE, IMPL, PTR >This class provides some infrastructure useful in making SimTK Private Implementation (PIMPL) classes
SimTK::PIMPLImplementation< HANDLE, IMPL >This class provides some infrastructure useful in creating PIMPL Implementation classes (the ones referred to by Handles)
SimTK::PlaneA simple plane class
SimTK::PlaneDecoratorThis class generates decoration for a plane
SimTK::PluginThis is the base class for representing a runtime-linked dynamic library, also known as a "plugin", in a platform-independent manner
SimTK::PointContactOBSOLETE -- use CircularPointContact or EllipticalPointContact
SimTK::PolygonalMeshThis class provides a description of a mesh made of polygonal faces (not limited to triangles)
SimTK::PolynomialRootFinderThis class provides static methods for finding the roots of polynomials
SimTK::PolynomialRootFinder::ZeroLeadingCoefficientThis is an exception which is thrown by all of the PolynomialRootFinder::findRoots() methods
SimTK::ProjectOptionsOptions for the advanced project() methods
SimTK::ProjectResultsResults for advanced users of project() methods
SimTK::QErrIndexUnique integer type for Subsystem-local qErr indexing
SimTK::QIndexUnique integer type for Subsystem-local q indexing
SimTK::Quaternion_< P >A Quaternion is a Vec4 with the following behavior:
SimTK::QValueThis AssemblyCondition requests that a particular generalized coordinate end up with a specified value
SimTK::RandomThis class defines the interface for pseudo-random number generators
SimTK::Random::GaussianThis is a subclass of Random that generates numbers according to a Gaussian distribution with a specified mean and standard deviation
SimTK::Random::UniformThis is a subclass of Random that generates numbers uniformly distributed within a specified range
SimTK::RealizeOptions(NOT USED YET) Options for the advanced realize() methods
SimTK::RealizeResults(NOT USED YET) Results for advanced users of realize() methods
SimTK::ReferencePtr< T >This is a smart pointer that implements "cross reference" semantics where a pointer data member of some object is intended to refer to some target object in a larger data structure
SimTK::Rotation_< P >The Rotation class is a Mat33 that guarantees that the matrix is a legitimate 3x3 array associated with the relative orientation of two right-handed, orthogonal, unit vector bases
SimTK::Row< N, ELT, STRIDE >Generic Row
SimTK::Row< N, ELT, STRIDE >::EltResult< P >
SimTK::Row< N, ELT, STRIDE >::Result< P >
SimTK::Row< N, ELT, STRIDE >::Substitute< P >
SimTK::RowVector_< ELT >RowVectors are much less common than Vectors
SimTK::RowVectorBase< ELT >This is a dataless rehash of the MatrixBase class to specialize it for RowVectors
SimTK::RowVectorBase< ELT >::EltResult< P >
SimTK::RowVectorView_< ELT >This class is identical to a RowVector_; it is used only to manage the C++ rules for when copy constructors are called by introducing a separate type to prevent certain allowed optimizations from occuring when we don't want them
SimTK::RTraits< R >RTraits is a helper class for NTraits
SimTK::RTraits< double >
SimTK::RTraits< float >
SimTK::RTraits< long double >
SimTK::RungeKutta2IntegratorThis is a 2nd order Runge-Kutta Integrator using coefficients that are also known as the explicit trapezoid rule
SimTK::RungeKutta3IntegratorThis is a 3rd order Runge-Kutta Integrator using coefficents from J.C
SimTK::RungeKuttaFeldbergIntegrator
SimTK::RungeKuttaMersonIntegrator
SimTK::ScheduledEventHandlerScheduledEventHandler is a subclass of EventHandler for events that occur at a particular time that is known in advance
SimTK::ScheduledEventReporterScheduledEventReporter is a subclass of EventReporter for events that occur at a particular time that is known in advance
SimTK::SemiExplicitEuler2IntegratorThis is an implementation of a variable-step, first-order semi-explicit Euler method, also known as semi-implicit Euler or symplectic Euler
SimTK::SemiExplicitEulerIntegratorThis is an implementation of the fixed-step Semi-Explicit Euler method, also known as Semi-Implicit Euler or Symplectic Euler
SimTK::SimbodyMatterSubsystemThis subsystem contains the bodies ("matter") in the multibody system, the mobilizers (joints) that define the generalized coordinates used to represent the motion of those bodies, and constraints that must be satisfied by the values of those coordinates
SimTK::SimbodyMatterSubtreeA SimbodyMatterSubtree is a view of a connected subgraph of the tree of mobilized bodies in a SimbodyMatterSubsystem
SimTK::SimbodyMatterSubtreeResults
SimTK::SpatialInertia_< P >A spatial inertia contains the mass, center of mass point, and inertia matrix for a rigid body
SimTK::Spline_< T >This class implements a non-uniform Bezier curve
SimTK::Spline_< T >::SplineImplThis is the implementation class that supports the Spline_ interface
SimTK::SplineFitter< T >Given a set of data points, this class creates a Spline_ which interpolates or approximates them
SimTK::SplineFitter< T >::SplineFitterImpl
SimTK::StableArray< T >StableArray<T> is like std::vector<T> (or SimTK::Array_<T>) but more stable in two ways:
SimTK::StageThis class is basically a glorified enumerated type, type-safe and range checked but permitting convenient (if limited) arithmetic
SimTK::StateThis is the handle class for the hidden State implementation
SimTK::StringSimTK::String is a plug-compatible std::string replacement (plus some additional functionality) intended to be suitable for passing through the SimTK API without introducing binary compatibility problems the way std::string does, especially on Windows
SimTK::Study
SimTK::Study::GutsThis is the declaration for the Study::Guts class, the abstract object to which a Study handle points
SimTK::SubsystemThe abstract parent of all Subsystems
SimTK::Subsystem::GutsThe abstract parent of all Subsystem "Guts" implementation classes
SimTK::SubsystemIndexProvide a unique integer type for identifying Subsystems
SimTK::SymMat< M, ELT, RS >RS is total spacing between rows in memory (default 1)
SimTK::SymMat< M, ELT, RS >::EltResult< P >
SimTK::SymMat< M, ELT, RS >::Result< P >
SimTK::SymMat< M, ELT, RS >::Substitute< P >
SimTK::SysConstraintFunc
SimTK::SysObjectiveFunc
SimTK::SystemThis is the base class that serves as the parent of all SimTK System objects; most commonly Simbody's MultibodySystem class
SimTK::System::GutsThis is the declaration for the System::Guts class, the abstract object to which a System handle points
SimTK::SystemEventTriggerByStageIndexThis unique integer type is for identifying a triggered event within a particular Stage of the full System-level view of the State
SimTK::SystemEventTriggerIndexThis unique integer type is for identifying a triggered event in the full System-level view of the State
SimTK::SystemMultiplierIndexThis unique integer type is for indexing global "multiplier-like" arrays, that is, arrays that inherently have the same dimension as the total number of Lagrange multipliers in the full System-level view of the State
SimTK::SystemQErrIndexThis unique integer type is for indexing global "qErr-like" arrays, that is, arrays that inherently have the same dimension as the total number of position-level constraint equations in the full System-level view of the State
SimTK::SystemQIndexThis unique integer type is for indexing global "q-like" arrays, that is, arrays that inherently have the same dimension as the total number of second order state variables (generalized coordinates) in the full System-level view of the State
SimTK::SystemUDotErrIndexThis unique integer type is for indexing global "uDotErr-like" arrays, that is, arrays that inherently have the same dimension as the total number of acceleration-level constraint equations in the full System-level view of the State
SimTK::SystemUErrIndexThis unique integer type is for indexing global "uErr-like" arrays, that is, arrays that inherently have the same dimension as the total number of velocity-level constraint equations in the full System-level view of the State
SimTK::SystemUIndexThis unique integer type is for indexing global "u-like" arrays, that is, arrays that inherently have the same dimension as the total number of mobilities (generalized speeds) in the full System-level view of the State
SimTK::SystemYErrIndexThis unique integer type is for indexing the global, System-level "yErr-like" arrays, that is, the arrays in which all of the various Subsystems' qErr and uErr constraint equation slots have been collected together
SimTK::SystemYIndexThis unique integer type is for indexing the global, System-level "y-like" arrays, that is, the arrays in which all of the various Subsystems' continuous state variables q, u, and z have been collected into contiguous memory
SimTK::SystemZIndexThis unique integer type is for indexing global "z-like" arrays, that is, arrays that inherently have the same dimension as the total number of auxiliary state variables in the full System-level view of the State
SimTK::TestThis is the main class to support testing
SimTK::Test::SubtestInternal utility class for generating test messages for subtests
SimTK::TextDataEventReporterThis is an EventReporter which prints out numeric data at regular intervals in tabular form
SimTK::TextDataEventReporter::UserFunction< T >This template class defines a standard interface for objects that calculate a function based on a System and State for use in a TextDataEventReporter
SimTK::ThreadLocal< T >This class represents a "thread local" variable: one which has a different value on each thread
SimTK::TimeStepperThis class uses an Integrator to advance a System through time
SimTK::Transform_< P >This class represents the rotate-and-shift transform which gives the location and orientation of a new frame F in a base (reference) frame B
SimTK::TriangleMeshContactThis subclass of Contact is used when one or both of the ContactGeometry objects is a TriangleMesh
SimTK::TriggeredEventHandlerTriggeredEventHandler is a subclass of EventHandler for events that occur when some condition is satisfied within the system
SimTK::TriggeredEventReporterTriggeredEventReporter is a subclass of EventReporter for events that occur when some condition is satisfied within the system
SimTK::UDotErrIndexUnique integer type for Subsystem-local uDotErr indexing
SimTK::UErrIndexUnique integer type for Subsystem-local uErr indexing
SimTK::UIndexUnique integer type for Subsystem-local u indexing
SimTK::UnitInertia_< P >A UnitInertia matrix is a unit-mass inertia matrix; you can convert it to an Inertia by multiplying it by the actual body mass
SimTK::UnitRow< P, S >This type is used for the transpose of UnitVec, and as the returned row type of a Rotation
SimTK::UnitVec< P, S >This class is a Vec3 plus an ironclad guarantee either that:
SimTK::UntrackedContactThis subclass of Contact represents a pair of contact surfaces that are not yet being tracked; there is no ContactId for them
SimTK::Value< T >Templatized version of the abstract class, providing generic type-specific functionality that does not require specialization, with automatic conversion to the underlying type
SimTK::Vec< M, ELT, STRIDE >This is a fixed length column vector designed for no-overhead inline computation
SimTK::Vec< M, ELT, STRIDE >::EltResult< P >
SimTK::Vec< M, ELT, STRIDE >::Result< P >
SimTK::Vec< M, ELT, STRIDE >::Substitute< P >Shape-preserving element substitution (always packed)
SimTK::Vector_< ELT >This is the Vector class intended to appear in user code
SimTK::VectorBase< ELT >This is a dataless rehash of the MatrixBase class to specialize it for Vectors
SimTK::VectorBase< ELT >::EltResult< P >
SimTK::VectorIterator< ELT, VECTOR_CLASS >This is an iterator for iterating over the elements of a Vector
SimTK::VectorView_< ELT >This class is identical to a Vector_; it is used only to manage the C++ rules for when copy constructors are called by introducing a separate type to prevent certain allowed optimizations from occuring when we don't want them
SimTK::VerletIntegratorThis is an Integrator based on the velocity Verlet algorithm
SimTK::VisualizerProvide simple visualization of and interaction with a Simbody simulation, with real time control of the frame rate. There are several operating modes available, including real time operation permitting responsive user interaction with the simulation
SimTK::Visualizer::FrameControllerThis abstract class represents an object that will be invoked by the Visualizer just prior to rendering each frame
SimTK::Visualizer::InputListenerThis abstract class defines methods to be called when the Visualizer reports user activity back to the simulation process. Derive a concrete event listener whose methods take appropriate actions when event of interest occur
SimTK::Visualizer::InputSiloThis pre-built InputListener is extremely useful for processing user input that is intended to affect a running simulation
SimTK::Visualizer::ReporterThis is an EventReporter that makes it easy to generate on-screen movies of any simulation
SimTK::Wider< R1, R2 >
SimTK::Wider< double, double >
SimTK::Wider< double, float >
SimTK::Wider< double, long double >
SimTK::Wider< float, double >
SimTK::Wider< float, float >
SimTK::Wider< float, long double >
SimTK::Wider< long double, double >
SimTK::Wider< long double, float >
SimTK::Wider< long double, long double >
SimTK::Widest< R1, R2 >This class is specialized for all 36 combinations of standard types (that is, real and complex types in each of three precisions) and has typedefs "Type" which is the appropriate "widened" type for use when R1 & R2 appear in an operation together, and "Precision" which is the wider precision (float,double,long double)
SimTK::Widest< complex< R1 >, complex< R2 > >
SimTK::Widest< complex< R1 >, R2 >
SimTK::Widest< double, double >
SimTK::Widest< double, float >
SimTK::Widest< double, long double >
SimTK::Widest< float, double >
SimTK::Widest< float, float >
SimTK::Widest< float, long double >
SimTK::Widest< long double, double >
SimTK::Widest< long double, float >
SimTK::Widest< long double, long double >
SimTK::Widest< R1, complex< R2 > >
SimTK::XmlThis class provides a minimalist capability for reading and writing XML documents, as files or strings
SimTK::Xml::AttributeElements can have attributes, which are name="value" pairs that appear within the element start tag in an XML document; this class represents the in-memory representation of one of those attributes and can be used to examine or modify the name or value
SimTK::Xml::attribute_iteratorThis is a bidirectional iterator suitable for moving forward or backward within a list of Attributes within an Element, for writable access
SimTK::Xml::CommentA comment contains only uninterpreted text
SimTK::Xml::ElementAn element has (1) a tagword, (2) a map of (name,value) pairs called attributes, and (3) a list of child nodes
SimTK::Xml::element_iteratorThis is a bidirectional iterator suitable for moving forward or backward within a list of Element nodes, for writable access
SimTK::Xml::NodeAbstract handle for holding any kind of node in an XML tree
SimTK::Xml::node_iteratorThis is a bidirectional iterator suitable for moving forward or backward within a list of Nodes, for writable access
SimTK::Xml::TextThis is the "leaf" content of an element
SimTK::Xml::UnknownThis is something we don't understand but can carry around
SimTK::ZIndexUnique integer type for Subsystem-local z indexing
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends Defines