Class Hierarchy
This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 1234567]
 CSurgSim::Framework::AccessibleMixin class for enabling a property system on OSS classes, the instance still needs to initialize properties in the constructor by using either addSetter, addGetter, addAccessors or the macro for each member variable that should be made accessible
 CSurgSim::Devices::LabJack::AnalogInputSettingsA struct holding the data to be associated with the positive channel for an analog input
 CSurgSim::Framework::ApplicationDataEnable searching for files in a given list of paths, give access to the current directory and wrap boost::filesystem functionality
 CSurgSim::Framework::BarrierBarrier class, synchronize a set of threads to wait at a common point, all threads will wait at Barrier::wait(val) until the number of threads calling wait is equal to the number given in the constructor
 CSurgSim::Framework::BasicThreadBasic thread implementation, tries to maintain a constant rate, supplies startup an initialization, can be synchronized with other threads at startup after calling doRun() a thread be be set off and doInit() and doStartup() will be called in succession
 CSurgSim::Devices::BitSetBuffer< N >A bit set corresponding to a contiguous memory buffer
 CSurgSim::Graphics::BoneDataLocal data structure to store the bones and their references to the transforms
 CSurgSim::DataStructures::OctreeNodePlyReaderDelegateBase::BoundsDataData Structure to receive the bounds information
 CSurgSim::DataStructures::BufferedValue< T >BufferedValue is a class to enable a representation of two values for one variable, where both values need to be accessible at the same time, one in a thread safe, single threaded context, the other in a thread unsafe context
 CSurgSim::DataStructures::BufferedValue< ContactMapType >
 CSurgSim::DataStructures::BufferedValue< SurgSim::DataStructures::Vertices >
 CSurgSim::DataStructures::BufferedValue< SurgSim::Math::Vector6d >
 CSurgSim::Devices::NovintScaffold::Callback
 CSurgSim::Devices::PhantomScaffold::Callback
 CSurgSim::DataStructures::Grid< T, N >::CellContentData structure for a cell's content (the list of elements and the list of all the neighbors)
 CSurgSim::Math::clampOperator< T >Define a custom template unary functor to execute the clamp operation over an Eigen matrix structure
 CSurgSim::Collision::CollisionPairCollision Pair class, it signifies a pair of items that should be checked with the collision algorithm, this structure will be used for input as well as output, as contacts get appended to the contacts list when found
 CSurgSim::Physics::ComputationEncapsulates a calculation over a selection of objects, needs to be subclassed to be used
 CSurgSim::Physics::ConstraintBase class for all physics constraints. Contains data specific to the constraint and a pair of implementations
 CSurgSim::Physics::ConstraintDataBase class for all CosntraintData Derived classes should be specific to a given constraint
 CSurgSim::Physics::ConstraintImplementationBase class for all constraint implementations. A ConstraintImplementation defines 1 side of a constraint
 CSurgSim::Physics::ConstraintImplementationFactoryThis class manages ConstraintImplementations, and can be used to look up the correct implementation by representation and constraint type
 CSurgSim::Collision::ContactContact data structure used when two representations touch each other The convention is that if body 1 is moved along the normal vector by a distance depth (or equivalently if body 2 is moved the same distance in the opposite direction) then the penetration depth will be reduced to zero
 CSurgSim::Collision::ContactCalculationBase class responsible for calculating contact data between two objects
 CYAML::convert< std::shared_ptr< SurgSim::Framework::Asset > >
 CYAML::convert< std::shared_ptr< SurgSim::Framework::Component > >Specialization of YAML::convert for std::shared_ptr<Component>, use this for to read in a component written by the convert<SurgSim::Framework::Component> converter, or a reference to a component written by this converter
 CYAML::convert< std::shared_ptr< SurgSim::Framework::Scene > >
 CYAML::convert< std::shared_ptr< SurgSim::Framework::SceneElement > >
 CYAML::convert< std::shared_ptr< SurgSim::Math::Shape > >
 CYAML::convert< std::shared_ptr< T > >Specialization of YAML::convert for std::shared_ptr, this is used to redirect the serialization of a derived class to the specialization of the serialization for a base class, for example all subclasses of Component can use the Component serialization specialization, currently each redirection has to be implemented separately, the re is probably a way to do this automatically
 CYAML::convert< std::unordered_map< Key, T > >YAML::convert specialization for std::unordered_map
 CYAML::convert< std::unordered_set< Value > >YAML::convert specialization for std::unordered_set
 CYAML::convert< std::vector< std::shared_ptr< SurgSim::Framework::SceneElement > > >
 CYAML::convert< SurgSim::DataStructures::OptionalValue< T > >YAML::convert specialization for OptionalValue
 CYAML::convert< SurgSim::Framework::Component >Override of the convert structure for an Component, use this form to write out a full version of the component information, to decode a component use the other converter
 CYAML::convert< SurgSim::Framework::SceneElement >
 CYAML::convert< SurgSim::Graphics::Representation >Specialize of YAML::convert<> template Represensation class
 CYAML::convert< SurgSim::Graphics::SphereRepresentation >Specialize of YAML::convert<> template SphereRepresensation class
 CYAML::convert< SurgSim::Math::IntegrationScheme >
 CYAML::convert< SurgSim::Math::LinearSolver >
 CYAML::convert< SurgSim::Physics::RigidState >
 CYAML::convert< typename Eigen::AngleAxis< Type > >Specialization of convert for Eigen::AngleAxis
 CYAML::convert< typename Eigen::Matrix< Type, Rows, Cols, MOpt > >Specialization of convert for fixed size Eigen::Matrix
 CYAML::convert< typename Eigen::Quaternion< Type, QOpt > >Specialization of convert for Eigen::Quaternion
 CYAML::convert< typename Eigen::Transform< Type, Dim, TMode, TOptions > >Specialization of convert for Eigen::RigidTransform
 CSurgSim::DataStructures::PlyReader::Data
 CSurgSim::DataStructures::DataGroupA collection of NamedData objects
 CSurgSim::DataStructures::DataGroupBuilderA class that allows you to build a DataGroup structure
 CSurgSim::DataStructures::DataGroupCopierA class that assists in copying from one DataGroup to another, when assignment is not possible
 CSurgSim::Framework::ReuseFactory< T >::DeleterCustom deleter to keep unused objects for reuse, rather than actually deleting them
 CSurgSim::Devices::KeyboardScaffold::DeviceDataStruct to hold a KeyboardDevice object, a KeyboardHandler object, and a mutex for data passing
 CSurgSim::Devices::LabJackScaffold::DeviceDataThe per-device data
 CSurgSim::Devices::LeapScaffold::DeviceData
 CSurgSim::Devices::MouseScaffold::DeviceDataStruct to hold a MouseDevice object, a OsgMouseHandler, and a mutex for data passing
 CSurgSim::Devices::RawMultiAxisScaffold::DeviceData
 CSurgSim::Devices::NovintScaffold::DeviceData
 CSurgSim::Devices::OculusScaffold::DeviceData
 CSurgSim::Devices::OpenNIScaffold::DeviceData
 CSurgSim::Devices::PhantomScaffold::DeviceData
 CSurgSim::Devices::ReplayPoseScaffold::DeviceData
 CSurgSim::Devices::SixenseScaffold::DeviceData
 CSurgSim::Devices::TrackIRScaffold::DeviceData
 CSurgSim::DataStructures::OctreeNodePlyReaderDelegateBase::DimensionDataData structure to receive the dimension information from the file
 CDisplaySettings
 CSurgSim::Physics::FemPlyReaderDelegate::ElementDataInternal data to receive the fem element
 CSurgSim::DataStructures::PlyReader::ElementInfoInformation about the element in the .ply file
 CSurgSim::DataStructures::EmptyDataEmptyData class
 Cenable_shared_from_this
 Cstd::exceptionSTL class
 CSurgSim::Framework::FactoryBase< T >CRTP Base class to implement Object Factory functionality on a base class, use this rather than writing your own functions to return the factory
 CSurgSim::Framework::FactoryBase1< T, P >CRTP Base class to implement Object Factory functionality on a base class, use this rather than writing your own functions to return the factory
 CSurgSim::Framework::FactoryBase1< Component, std::string >
 CSurgSim::Framework::FactoryBase1< DeviceInterface, std::string >
 CSurgSim::Framework::FactoryBase< Asset >
 CSurgSim::Framework::FactoryBase< Shape >
 CSurgSim::Physics::FemElementBase class for all Fem Element (1D, 2D, 3D) It handles the node ids to which it is connected and requires all derived classes to compute the element mass matrix and the force vector along with the derivatives (the stiffness and damping matrices)
 CSurgSim::Physics::FemElementStructs::FemElementParameterFemElementParameter is a structure containing the parameters of an fem element following the Hooke's law of deformation (linear deformation)
 CSurgSim::Devices::FileDescriptorA wrapper for an UNIX-style integer file descriptor
 CSurgSim::Devices::FileHandleA wrapper for an Windows-style HANDLE file descriptor
 CSurgSim::Framework::Accessible::FunctorsPrivate struct to keep the map under control
 CSurgSim::Math::gaussQuadraturePoint1D Gauss-Legendre quadrature
 CSurgSim::Math::gaussQuadratureTrianglePoint2D Gauss-Legendre quadrature on a triangle
 CSurgSim::Graphics::GenerateTangentSpaceTriangleIndexFunctorTriangle index functor which calculates the tangent space basis vectors for the vertices of a geometry from texture coordinates
 CGlutCameraCamera which controls the view of the scene
 CGlutRendererSimple static class renderer built on Glut
 CGlutRenderObjectAbstract definition of an object that can render itself with Glut
 CSurgSim::DataStructures::Grid< T, N >N-dimensional grid structure with uniform non-cubic cells This data structure is useful to search for neighbors in a given range (the size of each cell)
 CSurgSim::Graphics::GroupBase graphics group class, which defines the interface that all graphics groups must implement
 CSurgSim::DataStructures::Groups< Key, T >Class to wrap grouping operations, gives access to the members of a group and the groups of members
 CSurgSim::DataStructures::Groups< std::string, std::shared_ptr< SurgSim::Framework::SceneElement > >
 CGUIEventHandler
 CSurgSim::Devices::LabJackScaffold::Handle
 CSurgSim::Devices::NovintScaffold::Handle
 CSurgSim::Devices::PhantomScaffold::Handle
 CSurgSim::DataStructures::ImageBase< T >Base class for Image-like classes
 CSurgSim::DataStructures::IndexDirectoryA simple bidirectional mapping between names (strings) and distinct consecutive non-negative indices
 CSurgSim::DataStructures::IndexedLocalCoordinateA generic (size_t index, Vector coordinate) pair
 CSurgSim::Input::InputConsumerInterfaceInterface for a consumer that monitors device and signal state updates (pose, buttons, etc)
 CSurgSim::Math::Interval< T >Interval defines the concept of a mathematical interval and provides operations on it including arithmetic operations, construction, and IO
 CSurgSim::Math::IntervalND< T, N >IntervalND defines the concept of a group of mathematical intervals and provides operations on them including arithmetic operations, construction, and IO
 CSurgSim::Math::IntervalND< T, 3 >IntervalND<T,3> defines the concept of a group of mathematical intervals specialized to 3 intervals and provides operations on them including arithmetic operations, construction, and IO
 CSurgSim::Math::KalmanFilter< M, N >Implements a linear Kalman filter, a recursive estimator
 CSurgSim::Devices::KeyboardScaffoldA class that implements the behavior of KeyboardDevice objects
 CSurgSim::Devices::LabJackScaffoldA class that implements the behavior of LabJackDevice objects
 CSurgSim::Devices::LeapScaffoldA class that manages Leap devices
 CSurgSim::Math::LinearMotion< T >LinearMotion is (intentionally) a lot like Interval, but it deals with linear motion where all operands start and end their motion simultaneously
 CSurgSim::Math::LinearMotion< double >
 CSurgSim::Math::LinearMotionND< T, N >LinearMotionND<T, N> defines the concept of a group of linear motions and provides operations on them including arithmetic operations, construction, and I/O
 CSurgSim::Math::LinearMotionND< double, 3 >
 CSurgSim::Math::LinearMotionND< T, 3 >LinearMotionND<T, 3> specializes the LinearMotionND<T, N> class for 3 dimensions
 CSurgSim::Math::LinearSolveAndInverseLinearSolveAndInverse aims at performing an efficient linear system resolution and calculating its inverse matrix at the same time
 CSurgSim::Math::LinearSparseSolveAndInverseLinearSparseSolveAndInverse aims at performing an efficient linear system resolution and calculating its inverse matrix at the same time
 CSurgSim::DataStructures::TriangleMeshPlyReaderDelegate< M >::ListDataInternal structure, the received for data from the "face" element
 CListener
 CSurgSim::Physics::LocalizationThis class localize a point on a representation (representation specific)
 CSurgSim::DataStructures::LocationA Location defines a local position w.r.t
 CSurgSim::Framework::LockedContainer< T >A simple thread-safe data container that can support multiple writers and readers
 CSurgSim::Framework::LockedContainer< MovingSquareForce::SquarePoseVectors >
 CSurgSim::Framework::LockedContainer< SurgSim::DataStructures::DataGroup >
 CSurgSim::Framework::LockedContainer< SurgSim::DataStructures::Image >
 CSurgSim::Framework::LockedContainer< SurgSim::DataStructures::Vertices >
 CSurgSim::Framework::LockedContainer< SurgSim::Graphics::Mesh >
 CSurgSim::Framework::LockedContainer< SurgSim::Physics::PhysicsManagerState >
 CSurgSim::Framework::LoggerAn object that can be used to control logging parameters, such as verbosity and log output destination
 CSurgSim::Framework::LoggerManagerClass to safely handle access to a group of loggers, manipulate the global logging threshold, and fetch logger(s) from a global pool
 CSurgSim::Framework::LogMessageBaseLogMessageBase is a base class to be used to customize messages for logging textual information can be put into a log message by using the << operator in general the message class will output all of its information when the destructor is being invoked, formats the incoming message to timestamp it and adds information about the logger
 CSurgSim::Framework::LogOutputVirtual Base class to define an interface for outputting logging information
 CSurgSim::Physics::Mass
 CSurgSim::Physics::FemPlyReaderDelegate::MaterialDataInternal data to receive the "material" data
 CSurgSim::DataStructures::MeshElement< N, Data >Element structure for meshes
 CSurgSim::Physics::MlcpMapping< T >
 CSurgSim::Physics::MlcpMapping< SurgSim::Physics::Constraint >
 CSurgSim::Physics::MlcpMapping< SurgSim::Physics::Representation >
 CSurgSim::Math::MlcpProblemA description of an MLCP (mixed linear complementarity problem, or mixed LCP) system to be solved
 CSurgSim::Math::MlcpSolutionThe description of a solution to a mixed linear complementarity problem
 CSurgSim::Math::MlcpSolverThis class provides a solver interface for mixed linear complementarity problems
 CMlcpTestData
 CSurgSim::Devices::MouseScaffoldA class that implements the behavior of MouseDevice objects
 CSurgSim::DataStructures::NamedData< T >A templated dictionary in which data can be accessed by name or index, with immutable names & indices
 CSurgSim::DataStructures::NamedData< BooleanType >
 CSurgSim::DataStructures::NamedData< boost::any >
 CSurgSim::DataStructures::NamedData< DynamicMatrixType >
 CSurgSim::DataStructures::NamedData< IntegerType >
 CSurgSim::DataStructures::NamedData< PoseType >
 CSurgSim::DataStructures::NamedData< ScalarType >
 CSurgSim::DataStructures::NamedData< StringType >
 CSurgSim::DataStructures::NamedData< SurgSim::DataStructures::Image >
 CSurgSim::DataStructures::NamedData< VectorType >
 CSurgSim::DataStructures::NamedDataBuilder< T >A class that allows you to build a NamedData structure
 CSurgSim::DataStructures::NamedDataBuilder< BooleanType >
 CSurgSim::DataStructures::NamedDataBuilder< boost::any >
 CSurgSim::DataStructures::NamedDataBuilder< DynamicMatrixType >
 CSurgSim::DataStructures::NamedDataBuilder< IntegerType >
 CSurgSim::DataStructures::NamedDataBuilder< PoseType >
 CSurgSim::DataStructures::NamedDataBuilder< ScalarType >
 CSurgSim::DataStructures::NamedDataBuilder< StringType >
 CSurgSim::DataStructures::NamedDataBuilder< SurgSim::DataStructures::Image >
 CSurgSim::DataStructures::NamedDataBuilder< VectorType >
 CSurgSim::DataStructures::Grid< T, N >::NDIdHashEnable the NDId to be used as a key in an unordered map
 CNodeVisitor
 CSurgSim::DataStructures::NormalDataStore normal for each triangle in a triangle mesh
 CNotifyHandler
 CSurgSim::Devices::NovintScaffoldA class that manages Novint Falcon devices
 CSurgSim::Framework::ObjectFactory< Base >An object factory, once a class is registered with the factory it can be used to create instances of registered classes
 CSurgSim::Framework::ObjectFactory1< Base, Parameter1 >An object factory, once a class is registered with the factory it can be used to create instances of registered classes
 CSurgSim::Framework::ObjectFactory1< UniformBase, std::string >
 CSurgSim::DataStructures::OctreePathHashEnable the OctreePath to be used as a key in an unordered map, if the int range is exceeded this will just push the least significant numbers (root addresses) out of scope, it loses a little bit of address space as octree ids only go from 0-7
 CSurgSim::Math::OdeEquationOde equation of 2nd order of the form \(M(x,v).a = F(x, v)\) with \((x0, v0)\) for initial conditions and a set of boundary conditions
 CSurgSim::Math::OdeSolverBase class for all solvers of ode equation of order 2 of the form \(M(x(t), v(t)).a(t) = f(t, x(t), v(t))\)
 CSurgSim::Math::OdeStateThe state \(y\) of an ode of 2nd order of the form \(M(x,v).a = F(x, v)\) with boundary conditions
 CSurgSim::Math::Operation< DerivedSub, SparseType, StorageOrder >Helper class to run operation a column/row of a matrix to a chunk of memory where the size is dynamically defined
 CSurgSim::Math::Operation< DerivedSub, SparseType, Eigen::ColMajor >Specialization for column major storage
 CSurgSim::Math::Operation< DerivedSub, SparseType, Eigen::RowMajor >Specialization for row major storage
 CSurgSim::DataStructures::OptionalValue< T >Container class that can indicate whether the object has been assigned a value
 CSurgSim::DataStructures::OptionalValue< bool >
 CSurgSim::DataStructures::OptionalValue< double >
 CSurgSim::DataStructures::OptionalValue< int >
 CSurgSim::DataStructures::OptionalValue< Math::Aabbd >
 CSurgSim::DataStructures::OptionalValue< Math::Vector3d >
 CSurgSim::DataStructures::OptionalValue< Matrix33d >
 CSurgSim::DataStructures::OptionalValue< RigidTransform3 >
 CSurgSim::DataStructures::OptionalValue< size_t >
 CSurgSim::DataStructures::OptionalValue< std::string >
 CSurgSim::DataStructures::OptionalValue< SurgSim::DataStructures::DataGroup >
 CSurgSim::DataStructures::OptionalValue< SurgSim::DataStructures::IndexedLocalCoordinate >
 CSurgSim::DataStructures::OptionalValue< SurgSim::DataStructures::OctreePath >
 CSurgSim::DataStructures::OptionalValue< SurgSim::Math::RigidTransform3d >
 CSurgSim::DataStructures::OptionalValue< SurgSim::Math::Vector2d >
 CSurgSim::DataStructures::OptionalValue< SurgSim::Math::Vector3d >
 CSurgSim::DataStructures::OptionalValue< SurgSim::Math::Vector4d >
 CSurgSim::DataStructures::OptionalValue< Vector3d >
 CSurgSim::Graphics::OsgPlaneOSG plane geode to be used as a primitive shape The plane is the XZ plane, with normal +Y
 CSurgSim::Graphics::OsgUnitAxes
 CSurgSim::Graphics::OsgUnitBoxOSG unit box geode to be used as a primitive shape The box is located at (0, 0, 0) and has a size of 1 on all three axes
 CSurgSim::Graphics::OsgUnitCylinderOSG unit cylinder geode to be used as a primitive shape The cylinder is located at (0, 0, 0) and has a radius of 1 and height of 1
 CSurgSim::Graphics::OsgUnitSphereOSG unit sphere geode to be used as a primitive shape The sphere is located at (0, 0, 0) and has a radius of 1
 COtherData
 COtherElem
 CSurgSim::Input::OutputProducerInterfaceInterface for a producer that generates device output updates (forces, status LED state, etc)
 Cpair
 CSurgSim::Particles::ParticleData
 CSurgSim::Devices::PhantomScaffoldA class that manages Sensable PHANTOM devices
 CSurgSim::Physics::PhysicsManagerState
 CPlyElement
 CPlyFile
 CPlyOtherElems
 CPlyOtherProp
 CPlyProperty
 CSurgSim::DataStructures::PlyReaderWrapper for the C .ply file parser This class wraps the main functionality for the original C .ply file parser at http://paulbourke.net/dataformats/ply/ it enables customization of the parsing process either through a delegate class or through executing the requestElement and requestProperty functions
 CSurgSim::DataStructures::PlyReaderDelegatePlyReaderDelegate abstract class
 CSurgSim::Particles::PointGeneratorPointGenerator is used to generate points inside or on the surface of a given shape
 CSurgSim::Math::Polynomial< T, N >Polynomial<T, N> defines the concept of an N degree polynomial with type T coefficients and provides operations on them including arithmetic operations, construction, and IO
 CSurgSim::Math::Polynomial< T, 0 >Polynomial<T, 0> specializes the Polynomial class for degree 0 (constant polynomials)
 CSurgSim::Math::Polynomial< T, 1 >Polynomial<T, 1> specializes the Polynomial class for degree 1 (linear polynomials)
 CSurgSim::Math::Polynomial< T, 2 >Polynomial<T, 2> specializes the Polynomial class for degree 2 (quadratic polynomials)
 CSurgSim::Math::Polynomial< T, 3 >Polynomial<T, 3> specializes the Polynomial class for degree 3 (cubic polynomials)
 CSurgSim::Math::PolynomialRoots< T, N >The (algebraic) roots of a Polynomial<N,T>
 CSurgSim::Math::PolynomialRootsCommon< T, N >The common base class for PolynomialRoots specializations for various N
 CSurgSim::Math::PolynomialRootsCommon< T, 1 >
 CSurgSim::Math::PolynomialRootsCommon< T, 2 >
 CSurgSim::Math::PolynomialValues< T, N >Class to manage polynomial based calculations of interval boundaries
 CSurgSim::Math::PolynomialValues< double, 2 >
 CSurgSim::Math::PolynomialValues< double, 3 >
 CSurgSim::Math::PolynomialValues< T, 0 >PolynomialValues<T, 0> specializes the PolynomialValues class for degree 0 (constant polynomials)
 CSurgSim::Math::PolynomialValues< T, 1 >PolynomialValues<T, 1> specializes the PolynomialValues class for degree 1 (linear polynomials)
 CSurgSim::Math::PolynomialValues< T, 2 >PolynomialValues<T, 2> specializes the PolynomialValues class for degree 2 (quadratic polynomials)
 CSurgSim::Math::PolynomialValues< T, 3 >PolynomialValues<T, 3> specializes the PolynomialValues class for degree 3 (cubic polynomials)
 CSurgSim::Math::PosedShape< T >PosedShape is a transformed shape with a record of the pose used to transform it
 CSurgSim::DataStructures::powerOf3< N >Templated function to compute a power of 3 at compile time (useful for template parameter)
 CSurgSim::DataStructures::powerOf3< 0 >
 CSurgSim::Graphics::ProgramBase class that defines the interface for graphics programs
 CSurgSim::Framework::PropertyPublic struct to pair an accessible with its appropriate property
 CSurgSim::DataStructures::PlyReader::PropertyInfoInformation about the property on the .ply file
 CSurgSim::Devices::RawMultiAxisScaffoldA class that implements the behavior of RawMultiAxisDevice objects
 CSurgSim::Graphics::RenderTargetRenderTarget is an abstraction of the target buffers that a Camera should use to render it's scene valid targets are a given number of color buffers, and an optional depth buffer
 CSurgSim::Framework::ReuseFactory< T >Factory for acquiring new or unused existing instances of class T to reduce repeated deallocation and reallocation of objects with short lifespans
 CSurgSim::Physics::FemElementStructs::RotationVectorDataRotationVectorData is a structure containing the rotational dof per vertex The nature of the rotation depends on the underlying Representation, but right now all OSS's representations use rotation vector for rotational dof
 CSurgSim::Math::OdeSolverRungeKutta4::RungeKuttaDerivedStateInternal structure to hold the 4 temporary evaluations
 CSurgSim::DataStructures::SegmentEmptyDataSegmentEmptyData class This class is to ensure that the static TriangleMesh::m_className in SegmentMesh does not clash with static TriangleMesh<VertexData, EdgeData, EmptyData>
 CSurgSim::Collision::SegmentSegmentCcdIntervalCheckSegmentSegmentCcdIntervalCheck uses the Interval classes including the LinearMotion and Polynomial families to quickly determine if there is a possible collision between two moving segments over a specified time interval
 CSurgSim::Collision::SegmentSegmentCcdMovingContactSegmentSegmentCcdMovingContact computes the self collisions among a SegmentMesh under motion at two time points parametrized over the time interval [0,1]
 CSurgSim::Collision::SegmentSegmentCcdStaticContactSegmentSegmentCcdStaticContact computes if there is contact between two segments at a specific point in time in support of the CCD calculations for moving intervals
 CSurgSim::Serialize::ShapesFactoryA factory implementation for shapes
 CSurgSim::Framework::SharedInstance< T >A utility class to manage a shared instance of an object
 CSurgSim::Devices::SixenseScaffoldA class that manages Sixense devices, such as the Razer Hydra
 CSurgSim::DataStructures::OctreeNodePlyReaderDelegateBase::SpacingDataData structure to receive the spacing information from the file
 CSurgSim::Physics::SpringBase class for all springs It handles the node ids to which it is connected and requires all derived classes to compute the force and its derivatives (the stiffness and damping matrices) A extra method also exist to compute all of them at once for performance purposes
 CMovingSquareForce::SquarePoseVectorsState defined by the pose of the square
 CSurgSim::Devices::InputDeviceHandle::State
 CSurgSim::Devices::WdkHidDeviceHandle::State
 CSurgSim::Devices::LeapScaffold::StateData
 CSurgSim::Devices::NimbleScaffold::StateData
 CSurgSim::Devices::NovintScaffold::StateData
 CSurgSim::Devices::OculusScaffold::StateData
 CSurgSim::Devices::OpenNIScaffold::StateData
 CSurgSim::Devices::RawMultiAxisScaffold::StateData
 CSurgSim::Devices::LabJackScaffold::StateDataThe per-scaffold data (in comparison to DeviceData the per-device data)
 CSurgSim::Devices::SixenseScaffold::StateData
 CSurgSim::Devices::TrackIRScaffold::StateData
 CSurgSim::Devices::PhantomScaffold::StateData
 CSurgSim::Devices::SystemInputDeviceHandleA wrapper for system-dependent access to an input/HID device
 CSurgSim::Framework::ThreadPool::TaskBase
 CSurgSim::Graphics::TextureBase class defining the interface for a Graphics Texture
 CSurgSim::Framework::ThreadPoolA thread pool for completing heterogenous tasks
 CSurgSim::Framework::TimerTimer class, measures execution times
 CSurgSim::Devices::LabJack::TimerSettingsA struct holding the data to be associated with a Timer
 CTrackballManipulator
 CSurgSim::Devices::TrackIRScaffoldA class that manages Natural Point TRACKIR devices
 CSurgSim::DataStructures::TreeBasic tree structure
 CSurgSim::DataStructures::TreeDataAbstract base class for data stored in a Tree
 CSurgSim::DataStructures::TreeNodeBasic tree node structure
 CSurgSim::DataStructures::TreeVisitorAbstract Class for visitors, this needs to be extended for other tree nodes when necessary return false from handle() to abort traversal
 CSurgSim::Math::TriangleCapsuleContactCalculation::TriangleCapsuleContactCalculation< T, MOpt >Class used to find the intersection between a triangle and a capsule
 CSurgSim::Math::TriangleHelper< T, MOpt >A helper class for a triangle, used for the following two purposes:
 CSurgSim::Graphics::TriangleNormalGeneratorTriangle index functor which calculates normals for the vertices of a geometry, use createNormalGenerator to instantiate this
 CSurgSim::Collision::OctreeContact::Vector3dHashEnable a Vector3d to be used as a key in an unordered map
 CSurgSim::Graphics::VectorFieldDataA (mathematical) vector is represented as (X,Y,Z) associated with an optional color (R,G,B,alpha) information
 CSurgSim::DataStructures::Vertex< Data >Vertex structure for meshes
 CSurgSim::Physics::FemPlyReaderDelegate::Vertex6DDataVertex data containing 6 dofs (3 translational and 3 rotational)
 CSurgSim::DataStructures::Vertex< void >Specialization of Vertex with no data
 CSurgSim::DataStructures::TriangleMeshPlyReaderDelegate< M >::VertexDataInternal structure, the receiver for data from the "vertex" element Provide space for standard ply vertex data, x/y/z and s/t
 CSurgSim::Graphics::VertexData
 CSurgSim::DataStructures::Vertices< VertexData >Base class for mesh structures, handling basic vertex functionality
 CSurgSim::DataStructures::Vertices< DataStructures::EmptyData >
 CSurgSim::DataStructures::Vertices< FemElementStructs::RotationVectorData >
 CSurgSim::DataStructures::Vertices< SurgSim::DataStructures::EmptyData >
 CSurgSim::DataStructures::OctreeNodePlyReaderDelegateBase::VoxelDataData structure to receive the specific voxel information from the file