►CSurgSim::Framework::Accessible | Mixin 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::Framework::Component | Component is the main interface class to pass information to the system managers each will decide whether to handle a component of a given type or not |
CSerializationMockComponent | This class is for testing the linker and checking if the definition stays in the executable even if there is not direct reference to it, DO NOT define a member of this class explicitly anywhere |
►CSurgSim::Framework::Behavior | Behaviors perform actions |
CSurgSim::Blocks::DriveElementFromInputBehavior | Behavior to copy a pose from an input component to a SceneElement By adding this behavior to a SceneElement, that SceneElement will be moved in correspondance to the input |
CSurgSim::Blocks::KeyboardTogglesComponentBehavior | This behavior is used to control the visibility of registered graphical representation(s) |
CSurgSim::Blocks::PoseInterpolator | Perform linear interpolation on two poses |
CSurgSim::Blocks::TransferPhysicsToGraphicsMeshBehavior | Behavior to copy positions of a PhysicsRepresentation to a GraphicsMesh |
CSurgSim::Blocks::TransferPhysicsToPointCloudBehavior | Behavior to copy positions of a PhysicsRepresentation to a PointCloud |
CSurgSim::Blocks::VisualizeContactsBehavior | This behavior is used to visualize the contacts on collision representation through vector field |
CSurgSim::Framework::TransferPropertiesBehavior | Behavior to copy properties between instances of Accessible |
CSurgSim::Physics::VirtualToolCoupler | The VirtualToolCoupler couples a rigid object to an input/output device through a spring and damper |
CSurgSim::Framework::PoseComponent | The PoseComponent holds a pose |
►CSurgSim::Framework::Representation | Representations are manifestations of a SceneElement |
►CSurgSim::Collision::Representation | Wrapper class to use for the collision operation, handles its enclosed shaped and a possible local to global coordinate system transform, if the physics representation is a nullptr or a has gone out of scope ASSERT's will be triggered |
CSurgSim::Collision::ShapeCollisionRepresentation | Use a Shape as a Collision Representation, any SurgSim::Physics::Representation can be used as a backing representation |
CSurgSim::Physics::DeformableCollisionRepresentation | A collision representation that can be attached to a deformable, when this contains a mesh with the same number of vertices as the deformable has nodes, the mesh vertices will move to match the positions of the nodes in the deformable |
CSurgSim::Physics::RigidCollisionRepresentation | Collision Representation class that wraps a RigidRepresentation, this can be used to strictly tie the Collision Representation to the Rigid, so even if the shape of the rigid changes, the collision representation will use the appropriate shape |
►CSurgSim::Graphics::Representation | Base graphics representation class, which defines the interface that all graphics representations must implement |
►CSurgSim::Graphics::AxesRepresentation | Displays the coordinate axes, as three lines from the origin default size is 1.0, the X/Y/Z axis are indicated by R/G/B respectively |
CSurgSim::Graphics::OsgAxesRepresentation | Osg axes representation implementation for the AxesRepresentation interface in graphics |
►CSurgSim::Graphics::BoxRepresentation | Base graphics box representation class, which defines the basic interface for a box that can be visualized |
CSurgSim::Graphics::OsgBoxRepresentation | OSG implementation of a graphics box representation |
►CSurgSim::Graphics::Camera | Base graphics camera class, which defines the basic interface for all graphics cameras |
CSurgSim::Graphics::OsgCamera | OSG implementation of a graphics camera |
►CSurgSim::Graphics::CapsuleRepresentation | Base graphics capsule representation class, which defines the basic interface for a capsule that can be visualized |
CSurgSim::Graphics::OsgCapsuleRepresentation | OSG implementation of a graphics capsule representation |
►CSurgSim::Graphics::CylinderRepresentation | Base graphics cylinder representation class, which defines the basic interface for a cylinder that can be visualized |
CSurgSim::Graphics::OsgCylinderRepresentation | OSG implementation of a graphics Cylinder representation |
►CSurgSim::Graphics::Light | Abstract interface for a light, a light needs to be assigned to a group to be active, only the members of this group will be considered to be lit by this light |
CSurgSim::Graphics::OsgLight | OpenScenegraph implementation for the Light interface |
►CSurgSim::Graphics::MeshRepresentation | Graphics representation of a mesh, can be initialized from a Mesh structure |
CSurgSim::Graphics::OsgMeshRepresentation | Implementation of a MeshRepresentation for rendering under osg |
►CSurgSim::Graphics::OctreeRepresentation | Graphic representation of an Octree |
CSurgSim::Graphics::OsgOctreeRepresentation | OSG octree representation, implements an OctreeRepresenation using OSG |
►CSurgSim::Graphics::OsgRepresentation | Base OSG implementation of a graphics representation |
CSurgSim::Graphics::OsgAxesRepresentation | Osg axes representation implementation for the AxesRepresentation interface in graphics |
CSurgSim::Graphics::OsgBoxRepresentation | OSG implementation of a graphics box representation |
CSurgSim::Graphics::OsgCamera | OSG implementation of a graphics camera |
CSurgSim::Graphics::OsgCapsuleRepresentation | OSG implementation of a graphics capsule representation |
CSurgSim::Graphics::OsgCylinderRepresentation | OSG implementation of a graphics Cylinder representation |
CSurgSim::Graphics::OsgLight | OpenScenegraph implementation for the Light interface |
CSurgSim::Graphics::OsgMeshRepresentation | Implementation of a MeshRepresentation for rendering under osg |
CSurgSim::Graphics::OsgOctreeRepresentation | OSG octree representation, implements an OctreeRepresenation using OSG |
CSurgSim::Graphics::OsgPlaneRepresentation | OSG implementation of a graphics plane representation |
CSurgSim::Graphics::OsgPointCloudRepresentation | Osg point cloud representation, implementation of a PointCloudRepresenation using OSG |
CSurgSim::Graphics::OsgSceneryRepresentation | A OsgSceneryRepresentation is used to load osg object/node from file |
CSurgSim::Graphics::OsgScreenSpaceQuadRepresentation | Implements the ScreenSpaceQuadRepresentation, provides the uniform 'texture' for the texture that it carries |
CSurgSim::Graphics::OsgSphereRepresentation | OSG implementation of a graphics sphere representation |
CSurgSim::Graphics::OsgVectorFieldRepresentation | OSG vector field representation, implements a VectorFieldRepresenation using OSG |
►CSurgSim::Graphics::PlaneRepresentation | Base graphics plane representation class, which defines the basic interface for a plane that can be visualized |
CSurgSim::Graphics::OsgPlaneRepresentation | OSG implementation of a graphics plane representation |
►CSurgSim::Graphics::PointCloudRepresentation | Graphic representation of a point cloud, hase a very basic interface and is intentionally kept generic |
CSurgSim::Graphics::OsgPointCloudRepresentation | Osg point cloud representation, implementation of a PointCloudRepresenation using OSG |
►CSurgSim::Graphics::SceneryRepresentation | Base class defining the interface for a Graphics Scenery Object |
CSurgSim::Graphics::OsgSceneryRepresentation | A OsgSceneryRepresentation is used to load osg object/node from file |
►CSurgSim::Graphics::ScreenSpaceQuadRepresentation | A quad to display on the screen in screen space coordinates, use setPose() to set the position but x,y are presumed to be in screen space with 0|0 being in the lower left corner |
CSurgSim::Graphics::OsgScreenSpaceQuadRepresentation | Implements the ScreenSpaceQuadRepresentation, provides the uniform 'texture' for the texture that it carries |
►CSurgSim::Graphics::SphereRepresentation | Base graphics sphere representation class, which defines the basic interface for a sphere that can be visualized |
CSurgSim::Graphics::OsgSphereRepresentation | OSG implementation of a graphics sphere representation |
►CSurgSim::Graphics::VectorFieldRepresentation | Graphic representation of a vector field Each point/location, i.e |
CSurgSim::Graphics::OsgVectorFieldRepresentation | OSG vector field representation, implements a VectorFieldRepresenation using OSG |
►CSurgSim::Physics::Representation | Defines the base class for all physics objects |
►CSurgSim::Physics::DeformableRepresentation | Base class for all deformable representations MassSprings, Finite Element Models,.. |
►CSurgSim::Physics::FemRepresentation | Finite Element Model (a.k.a |
CSurgSim::Physics::Fem1DRepresentation | Finite Element Model 1D is a fem built with 1D FemElement |
CSurgSim::Physics::Fem2DRepresentation | Finite Element Model 2D is a fem built with 2D FemElement |
►CSurgSim::Physics::Fem3DRepresentation | Finite Element Model 3D is a fem built with 3D FemElement |
CSurgSim::Physics::DivisbleCubeRepresentation | |
CSurgSim::Physics::TruthCubeRepresentation | Truth cube representation (extension of a Fem3DRepresentation) Defines a subdivided initial cube with cube FemElements |
►CSurgSim::Physics::MassSpringRepresentation | MassSpring model is a deformable model (a set of masses connected by springs) |
CSurgSim::Blocks::MassSpring1DRepresentation | |
CSurgSim::Blocks::MassSpring2DRepresentation | |
CSurgSim::Blocks::MassSpring3DRepresentation | |
►CSurgSim::Physics::RigidRepresentationBase | Defines the base class for all rigid motion based representations (fixed, rigid body, rigid body + vtc,...) |
CSurgSim::Physics::FixedRepresentation | Physics entity without any motion nor compliance against which others physics entities can interact |
CSurgSim::Physics::RigidRepresentation | Defines the dynamic rigid body representation Note that the rigid representation is velocity-based, therefore its degrees of freedom are the linear and angular velocities: 6 Dof |
►CSurgSim::Graphics::Material | Base class that defines the interface for graphics materials |
CSurgSim::Graphics::OsgMaterial | OSG-based implementation of a graphics material |
►CSurgSim::Graphics::View | Base graphics view class, which defines the basic interface for all graphics views |
CSurgSim::Graphics::OsgView | OSG-based implementation of graphics view class |
CSurgSim::Input::InputComponent | InputComponent combines the Component interface and the InputConsumerInterface so that input devices can provide input through the normal component interface |
CSurgSim::Input::OutputComponent | OutputComponent is a Component that has an OutputProducer, a concrete instance of OutputProducerInterface, so that output devices can receive data through the normal component interface to SceneElements |
CSurgSim::Physics::ConstraintComponent | Component class for inserting constraints between physics representations into the scene |
►CSurgSim::Graphics::UniformBase | Common base class for all graphics uniforms |
►CSurgSim::Graphics::OsgUniformBase | Base OSG implementation of graphics uniforms |
►CSurgSim::Graphics::OsgTextureUniform< OsgTexture1d > | |
CSurgSim::Graphics::OsgUniform< std::shared_ptr< OsgTexture1d > > | Specialization of OsgUniform for OsgTexture1d |
►CSurgSim::Graphics::OsgTextureUniform< OsgTexture2d > | |
CSurgSim::Graphics::OsgUniform< std::shared_ptr< OsgTexture2d > > | Specialization of OsgUniform for OsgTexture2d |
►CSurgSim::Graphics::OsgTextureUniform< OsgTexture3d > | |
CSurgSim::Graphics::OsgUniform< std::shared_ptr< OsgTexture3d > > | Specialization of OsgUniform for OsgTexture3d |
►CSurgSim::Graphics::OsgTextureUniform< OsgTextureCubeMap > | |
CSurgSim::Graphics::OsgUniform< std::shared_ptr< OsgTextureCubeMap > > | Specialization of OsgUniform for OsgTextureCubeMap |
►CSurgSim::Graphics::OsgTextureUniform< OsgTextureRectangle > | |
CSurgSim::Graphics::OsgUniform< std::shared_ptr< OsgTextureRectangle > > | Specialization of OsgUniform for OsgTextureRectangle |
CSurgSim::Graphics::OsgTextureUniform< T > | OSG implementation of graphics uniform with a texture value |
CSurgSim::Graphics::OsgUniform< T > | OSG implementation of graphics uniform with a value of type T |
CSurgSim::Graphics::OsgUniform< std::vector< T > > | Specialization of OsgUniform for vectors of values |
►CSurgSim::Graphics::Uniform< T > | Base class for a graphics uniform with a value of type T |
CSurgSim::Graphics::OsgUniform< T > | OSG implementation of graphics uniform with a value of type T |
►CSurgSim::Graphics::Uniform< std::vector< T > > | Specialization of Uniform for vectors of values |
CSurgSim::Graphics::OsgUniform< std::vector< T > > | Specialization of OsgUniform for vectors of values |
►CSurgSim::Graphics::Uniform< std::shared_ptr< OsgTexture1d > > | |
CSurgSim::Graphics::OsgTextureUniform< OsgTexture1d > | |
►CSurgSim::Graphics::Uniform< std::shared_ptr< OsgTexture2d > > | |
CSurgSim::Graphics::OsgTextureUniform< OsgTexture2d > | |
►CSurgSim::Graphics::Uniform< std::shared_ptr< OsgTexture3d > > | |
CSurgSim::Graphics::OsgTextureUniform< OsgTexture3d > | |
►CSurgSim::Graphics::Uniform< std::shared_ptr< OsgTextureCubeMap > > | |
CSurgSim::Graphics::OsgTextureUniform< OsgTextureCubeMap > | |
►CSurgSim::Graphics::Uniform< std::shared_ptr< OsgTextureRectangle > > | |
CSurgSim::Graphics::OsgTextureUniform< OsgTextureRectangle > | |
►CSurgSim::Graphics::Uniform< std::shared_ptr< T > > | |
CSurgSim::Graphics::OsgTextureUniform< T > | OSG implementation of graphics uniform with a texture value |
►CSurgSim::Math::Shape | Generic rigid shape class defining a shape |
CSurgSim::Math::BoxShape | Box shape: box centered on (0 0 0), aligned with the axis with different sizes along X, Y and Z |
CSurgSim::Math::CapsuleShape | Capsule shape: centered on (0, 0, 0), aligned along Y, with length and radius |
CSurgSim::Math::CylinderShape | Cylinder shape: centered on (0 0 0), aligned along Y, defined with length and radius |
CSurgSim::Math::DoubleSidedPlaneShape | DoubleSidedPlaneShape: The XZ plane (d = 0) with normal pointing along positive Y axis |
CSurgSim::Math::MeshShape | Mesh shape: shape made of a triangle mesh The triangle mesh needs to be watertight to produce valid volume, center and second moment of volume |
CSurgSim::Math::OctreeShape | Octree Shape A defined by an octree data structure |
CSurgSim::Math::PlaneShape | The XZ plane (d = 0) with normal pointing along positive Y axis |
CSurgSim::Math::SphereShape | Sphere shape: sphere centered on (0 0 0), defined with radius |
CSurgSim::Math::SurfaceMeshShape | SurfaceMeshShape defines a shape based on a mesh, like MeshShape |
CSurgSim::Physics::RigidRepresentationState | Describes a state (position and velocity information) |
CSurgSim::Device::LabJack::AnalogInputSettings | A struct holding the data to be associated with the positive channel for an analog input |
CSurgSim::Framework::ApplicationData | Enable searching for files in a given list of paths, give access to the current directory and wrap boost::filesystem functionality |
►CSurgSim::Framework::Asset | This class is used to facilitate file loading |
CSurgSim::DataStructures::OctreeNode< Data > | Octree data structure |
CSurgSim::DataStructures::TriangleMesh | A TriangleMesh stores normal information for the triangles |
CSurgSim::Math::MeshShape | Mesh shape: shape made of a triangle mesh The triangle mesh needs to be watertight to produce valid volume, center and second moment of volume |
CSurgSim::Math::OctreeShape | Octree Shape A defined by an octree data structure |
CSurgSim::Framework::Barrier | Barrier 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::BasicThread | Basic 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::Device::LabJackThread | A class implementing the thread context for communicating with LabJack devices |
CSurgSim::Device::RawMultiAxisThread | A class implementing the thread context for sampling RawMultiAxis devices |
CSurgSim::Device::SixenseThread | A class implementing the thread context for sampling Sixense devices |
CSurgSim::Device::TrackIRThread | A class implementing the thread context for sampling TrackIR devices |
►CSurgSim::Framework::ComponentManager | Base Component Manager class |
CSurgSim::Framework::BehaviorManager | Manager to handle Behaviors |
►CSurgSim::Graphics::Manager | Basic graphics manager class which manages graphics components to provide a visualization of the scene to the user |
CSurgSim::Graphics::OsgManager | OSG-based implementation of graphics manager class |
CSurgSim::Input::InputManager | Manager to handle InputComponent and OutputComponent, SceneElement can add these to get input from devices, or even write output to devices |
►CSurgSim::Physics::PhysicsManager | PhyicsManager handles the physics and motion calculation, it uses Computations to separate the algorithmic steps into smaller pieces |
CSurgSim::Testing::MockPhysicsManager | Testing class used to publicly expose PhysicsManager's protected member functions |
CSurgSim::Device::BitSetBuffer< N > | A bit set corresponding to a contiguous memory buffer |
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::Device::NovintScaffold::Callback | |
CSurgSim::Device::PhantomScaffold::Callback | |
CSurgSim::Collision::CollisionPair | Collision 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::Computation | Encapsulates a calculation over a selection of objects, needs to be subclassed to be used |
CSurgSim::Physics::BuildMlcp | Build an mlcp from a list of constraints stored in a PhysicsManagerState |
CSurgSim::Physics::ContactConstraintGeneration | Generate a constraint for every contact that was calculated |
CSurgSim::Physics::DcdCollision | Computation to determine the contacts between a list of CollisionPairs |
CSurgSim::Physics::FreeMotion | Apply the Freemotion calcluation to all physics representations |
CSurgSim::Physics::PostUpdate | Post Update is called prior to anything else at the beginning of each time step |
CSurgSim::Physics::PreUpdate | Pre Update is called after everything else is done in the physics time step |
CSurgSim::Physics::PushResults | Propagates the Mlcp result to the representations |
CSurgSim::Physics::SolveMlcp | Solve the system Mixed Linear Complementarity Problem (Mlcp) |
CSurgSim::Physics::UpdateCollisionRepresentations | Computation that calls the CollisionRepresentations update() function |
CSurgSim::Physics::Constraint | Base class for all physics constraints. Contains data specific to the constraint and a pair of implementations |
►CSurgSim::Physics::ConstraintData | Base class for all CosntraintData Derived classes should be specific to a given constraint |
CSurgSim::Physics::ContactConstraintData | Class for Frictionless contact (only needs a plane equation) |
►CSurgSim::Physics::ConstraintImplementation | Base class for all constraint implementations. A ConstraintImplementation defines 1 side of a constraint |
CSurgSim::Physics::Fem3DRepresentationBilateral3D | Fem3DRepresentation bilateral 3d constraint implementation |
CSurgSim::Physics::Fem3DRepresentationContact | Fem3DRepresentation frictionless contact implementation |
CSurgSim::Physics::FixedRepresentationBilateral3D | FixedRepresentation bilateral 3d constraint implementation |
CSurgSim::Physics::FixedRepresentationContact | FixedRepresentation frictionless contact implementation |
CSurgSim::Physics::MassSpringRepresentationContact | MassSpring frictionless contact implementation |
CSurgSim::Physics::RigidRepresentationBilateral3D | RigidRepresentation bilateral 3d constraint implementation |
CSurgSim::Physics::RigidRepresentationContact | RigidRepresentation frictionless contact implementation |
CSurgSim::Physics::ConstraintImplementationFactory | This class manages ConstraintImplementations, and can be used to look up the correct implementation by representation and constraint type |
CSurgSim::Collision::Contact | Contact 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::ContactCalculation | Base class responsible for calculating contact data between two given shapes, calculateContact needs to determine whether the two shapes intersect, and if yes calculate the correct data for this contact, which consists of, the normal to displace the first shape so that the two shapes just barely touch |
CSurgSim::Collision::BoxCapsuleDcdContact | Class to calculate intersections between Boxes and Capsules |
CSurgSim::Collision::BoxDoubleSidedPlaneDcdContact | Class to calculate intersections between Boxes and Planes |
CSurgSim::Collision::BoxPlaneDcdContact | Class to calculate intersections between Boxes and Planes |
CSurgSim::Collision::BoxSphereDcdContact | Class to calculate intersections between a box and a sphere |
CSurgSim::Collision::CapsuleSphereDcdContact | Class to calculate intersections between a capsule and a sphere |
CSurgSim::Collision::DefaultContactCalculation | A default calculation, it does nothing and can be used as a placeholder |
CSurgSim::Collision::OctreeDcdContact | Class to calculate intersections between an Octree and other shapes |
CSurgSim::Collision::SphereDoubleSidedPlaneDcdContact | Class to calculate intersections between Spheres and DoubleSidedPlanes |
CSurgSim::Collision::SpherePlaneDcdContact | Class to calculate intersections between Spheres and Planes |
CSurgSim::Collision::SphereSphereDcdContact | Class to calculate intersections between spheres |
CSurgSim::Collision::TriangleMeshPlaneDcdContact | Class to calculate intersections between a triangle mesh and a plane |
CSurgSim::Collision::TriangleMeshTriangleMeshDcdContact | Class to calculate intersections between a triangle mesh and a triangle mesh |
CYAML::convert< std::array< T, N > > | YAML::convert specialization for std::array |
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 > > | Specializatio 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, there 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< 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::Physics::RigidRepresentationState > | |
CYAML::convert< typename Eigen::Matrix< Type, Rows, 1, MOpt > > | Specialization for Eigen Row Vectors, which are the type that Vector2x, Vector3x use |
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::DataGroup | A collection of NamedData objects |
CSurgSim::DataStructures::DataGroupBuilder | A class that allows you to build a DataGroup structure |
CSurgSim::DataStructures::DataGroupCopier | A class that assists in copying from one DataGroup to another, when assignment is not possible |
CSurgSim::Framework::ReuseFactory< T >::Deleter | Custom deleter to keep unused objects for reuse, rather than actually deleting them |
CSurgSim::Device::NovintScaffold::DeviceData | |
CSurgSim::Device::PhantomScaffold::DeviceData | |
CSurgSim::Device::SixenseScaffold::DeviceData | |
CSurgSim::Device::TrackIRScaffold::DeviceData | |
CSurgSim::Device::KeyboardScaffold::DeviceData | Struct to hold a KeyboardDevice object, a KeyboardHandler object, and a mutex for data passing |
CSurgSim::Device::LabJackScaffold::DeviceData | The per-device data |
CSurgSim::Device::MouseScaffold::DeviceData | Struct to hold a MouseDevice object, a OsgMouseHandler, and a mutex for data passing |
CSurgSim::Device::RawMultiAxisScaffold::DeviceData | |
►CSurgSim::Input::DeviceInterface | Interface used to communicate with user-interface hardware devices |
CSurgSim::Device::MultiAxisDevice | A class implementing the communication with a multi-axis controller input device, for example a 3DConnexion SpaceNavigator |
►CSurgSim::Input::CommonDevice | A class that implements some common management code on top of the DeviceInterface |
CLabJackToPoseFilter | |
CSurgSim::Device::ForceScale | An output device filter that scales forces and/or torques |
CSurgSim::Device::IdentityPoseDevice | A class implementing the identity pose device, which is a pretend device that doesn't move |
CSurgSim::Device::KeyboardDevice | A class implementing the communication with a keyboard |
CSurgSim::Device::LabJackDevice | A class implementing the communication with a LabJack data acquisition (DAQ) device |
CSurgSim::Device::MouseDevice | A class implementing the communication with a mouse |
►CSurgSim::Device::NovintCommonDevice | A class implementing the communication with a generic Novint Falcon device |
CSurgSim::Device::Novint7DofDevice | A class implementing the communication with a Novint Falcon with the Open Surgery Grip 7-DoF device |
CSurgSim::Device::NovintDevice | A class implementing the communication with a Novint Falcon device |
CSurgSim::Device::PhantomDevice | A class implementing the communication with a SensAble/Geomagic PHANTOM device |
CSurgSim::Device::PoseIntegrator | A device filter that integrates the pose, turning a relative device into an absolute one |
CSurgSim::Device::PoseTransform | A device filter that transforms the input pose |
CSurgSim::Device::RawMultiAxisDevice | A class implementing the communication with a multi-axis controller input device, for example a 3DConnexion SpaceNavigator |
CSurgSim::Device::SixenseDevice | A class implementing the communication with one Sixense controller, for example one of the two on the Razer Hydra |
CSurgSim::Device::TrackIRDevice | A class implementing the communication with Natural Point TrackIR camera |
CSurgSim::Physics::FemPlyReaderDelegate::ElementData | Internal data to receive the fem element |
CSurgSim::DataStructures::PlyReader::ElementInfo | Information about the element in the .ply file |
CSurgSim::DataStructures::EmptyData | EmptyData class |
►Cenable_shared_from_this | |
CSurgSim::DataStructures::OctreeNode< Data > | Octree data structure |
CSurgSim::DataStructures::TriangleMesh | A TriangleMesh stores normal information for the triangles |
CSurgSim::Framework::Component | Component is the main interface class to pass information to the system managers each will decide whether to handle a component of a given type or not |
CSurgSim::Framework::Runtime | This class contains all the information about the runtime environment of the simulation, all the running threads, the state, while it is de facto a singleton it should be passed around if needed |
CSurgSim::Framework::Scene | Scene. Basic Container for SceneElements |
►CSurgSim::Framework::SceneElement | SceneElement is the basic part of a scene, it is a container of components |
CSurgSim::Blocks::SphereElement | |
►CSurgSim::Framework::BasicSceneElement | Simple concrete implementation of a scene element that does not have any higher logic |
►CSurgSim::Graphics::ViewElement | Basic SceneElement that wraps a View so that it can be added to the Scene |
CSurgSim::Graphics::OsgViewElement | OSG-based implementation of graphics view element |
►CSurgSim::Graphics::RenderPass | Encapsulation of all the components necessary needed to implement a full renderpass, this SceneElement contains a Camera and Group, it can also take a Material (for shaders and uniforms) and a RenderTarget for textures that are used as the output for the camera |
CSurgSim::Graphics::OsgScreenSpacePass | Special RenderPass to draw items using a orthogonal projection, this is specific to the Osg implementation of the SurgSim rendering |
►Cstd::exception | STL class |
►Cstd::runtime_error | STL class |
CSurgSim::Framework::AssertionFailure | An exception class thrown by SURGSIM_ASSERT() failures and SURGSIM_FAILURE() |
CSurgSim::DataStructures::TriangleMeshPlyReaderDelegate< M >::FaceData | Internal structure, the received for data from the "face" element |
►CSurgSim::Physics::FemElement | Base 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::Fem1DElementBeam | 1D FemElement based on a beam volume discretization with a fixed cross section |
CSurgSim::Physics::Fem2DElementTriangle | 2D FemElement based on a triangle with a constant thickness |
CSurgSim::Physics::Fem3DElementCube | Class for Fem Element 3D based on a cube volume discretization |
►CSurgSim::Physics::Fem3DElementTetrahedron | Class for Fem Element 3D based on a tetrahedron volume discretization |
CSurgSim::Physics::Fem3DElementCorotationalTetrahedron | Fem Element 3D co-rotational based on a tetrahedron volume discretization |
CSurgSim::Physics::FemRepresentationParameters | Defines the physical parameters for all Finite Element Model (1D, 2D, 3D) |
CSurgSim::Device::FileDescriptor | A wrapper for an UNIX-style integer file descriptor |
CSurgSim::Device::FileHandle | A wrapper for an Windows-style HANDLE file descriptor |
CSurgSim::Framework::Accessible::Functors | Private struct to keep the map under control |
CSurgSim::Math::gaussQuadraturePoint | |
CGlutCamera | Camera which controls the view of the scene |
CGlutRenderer | Simple static class renderer built on Glut |
►CGlutRenderObject | Abstract definition of an object that can render itself with Glut |
CGlutAxes | Axes with center at local origin, red axis along the local X-axis, green axis along the local Y-axis, and blue axis along the local Z-axis |
CGlutGroup | Group of objects which provides a transform hierarchy |
CGlutSphere | Sphere with center at local origin |
CGlutSquare | Square with center at local origin |
►CSurgSim::Graphics::Group | Base graphics group class, which defines the interface that all graphics groups must implement |
CSurgSim::Graphics::OsgGroup | OSG implementation of a graphics group |
►CGUIEventHandler | |
CSurgSim::Device::OsgKeyboardHandler | |
CSurgSim::Device::OsgMouseHandler | |
CSurgSim::Device::NovintScaffold::Handle | |
CSurgSim::Device::PhantomScaffold::Handle | |
CSurgSim::Device::LabJackScaffold::Handle | |
CSurgSim::DataStructures::Image< T > | A templated Image class |
CSurgSim::DataStructures::IndexDirectory | A simple bidirectional mapping between names (strings) and distinct consecutive non-negative indices |
CSurgSim::DataStructures::IndexedLocalCoordinate | A generic (size_t index, Vector coordinate) pair |
►CSurgSim::Input::InputConsumerInterface | Interface for a consumer that monitors device and signal state updates (pose, buttons, etc) |
CLabJackToPoseFilter | |
CMovingSquareForce | A simple listener to calculate collision force against a square area for the example application |
CMovingSquareGlutWindow | A simple listener to display the simple scene composed of a square and tool for the example application |
CSurgSim::Device::ForceScale | An output device filter that scales forces and/or torques |
CSurgSim::Device::PoseIntegrator | A device filter that integrates the pose, turning a relative device into an absolute one |
CSurgSim::Device::PoseTransform | A device filter that transforms the input pose |
CSurgSim::Input::InputConsumer | An input consumer monitors device and signal state update |
CSurgSim::Testing::MockInputOutput | |
CTestListener | |
CTestListener | |
CSurgSim::Device::KeyboardScaffold | A class that implements the behavior of KeyboardDevice objects |
CSurgSim::Device::LabJackScaffold | A class that implements the behavior of LabJackDevice objects |
►CSurgSim::Math::LinearSolveAndInverse | LinearSolveAndInverse aims at performing an efficient linear system resolution and calculating its inverse matrix at the same time |
CSurgSim::Math::LinearSolveAndInverseDenseMatrix | Derivation for dense matrix type |
CSurgSim::Math::LinearSolveAndInverseDiagonalMatrix | Derivation for diagonal matrix type |
►CSurgSim::Math::LinearSolveAndInverseTriDiagonalBlockMatrix< BlockSize > | Derivation for tri-diagonal block matrix type |
CSurgSim::Math::LinearSolveAndInverseSymmetricTriDiagonalBlockMatrix< BlockSize > | Derivation for symmetric tri-diagonal block matrix type |
►CSurgSim::Physics::Localization | This class localize a point on a representation (representation specific) |
CSurgSim::Physics::Fem1DRepresentationLocalization | Implementation of Localization for Fem1DRepresentation |
CSurgSim::Physics::Fem2DRepresentationLocalization | Implementation of Localization for Fem2DRepresentation |
CSurgSim::Physics::Fem3DRepresentationLocalization | Implementation of Localization for Fem3DRepresentation |
CSurgSim::Physics::FixedRepresentationLocalization | This class implement the localization on a FixedRepresentation, as a local position |
CSurgSim::Physics::MassSpringRepresentationLocalization | Implementation of Localization for MassSpringRepresentation |
CSurgSim::Physics::RigidRepresentationLocalization | This class implement the localization on a RigidRepresentation, as a local position |
CSurgSim::DataStructures::Location | |
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::Physics::SurgSim::Physics::PhysicsManagerState > | |
CSurgSim::Framework::Logger | An object that can be used to control logging parameters, such as verbosity and log output destination |
CSurgSim::Framework::LoggerManager | Class to safely handle access to a group of loggers, manipulate the global logging threshold, and fetch logger(s) from a global pool |
►CSurgSim::Framework::LogMessageBase | LogMessageBase 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::AssertMessage | An internal message class used for assertion failures |
CSurgSim::Framework::LogMessage | Specialization, handles flush on destruction |
►CSurgSim::Framework::LogOutput | Virtual Base class to define an interface for outputting logging information |
CSurgSim::Framework::FileOutput | Class to output logging information to a give file |
CSurgSim::Framework::NullOutput | |
CSurgSim::Framework::StreamOutput | Class to output logging information to a stream that can be passed into the constructor of the class |
CSurgSim::Physics::Mass | |
CSurgSim::Physics::FemPlyReaderDelegate::MaterialData | Internal 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::MlcpProblem | A description of an MLCP (mixed linear complementarity problem, or mixed LCP) system to be solved |
CSurgSim::Physics::MlcpPhysicsProblem | A description of a physical mixed LCP system to be solved |
►CSurgSim::Math::MlcpSolution | The description of a solution to a mixed linear complementarity problem |
CSurgSim::Physics::MlcpPhysicsSolution | The description of a solution to a physical MLCP problem |
►CSurgSim::Math::MlcpSolver | This class provides a solver interface for mixed linear complementarity problems |
CSurgSim::Math::MlcpGaussSeidelSolver | A solver for mixed LCP problems using the Gauss-Seidel iterative method |
CMlcpTestData | |
CSurgSim::Device::MouseScaffold | A 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::NamedVariantData | A NamedData collection of variant data type |
CSurgSim::DataStructures::NamedData< DynamicMatrixType > | |
CSurgSim::DataStructures::NamedData< int > | |
CSurgSim::DataStructures::NamedData< IntegerType > | |
CSurgSim::DataStructures::NamedData< PoseType > | |
CSurgSim::DataStructures::NamedData< ScalarType > | |
CSurgSim::DataStructures::NamedData< StringType > | |
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< VectorType > | |
CSurgSim::DataStructures::NormalData | Store normal for each triangle in a triangle mesh |
►CNotifyHandler | |
CSurgSim::Graphics::OsgLog | Enable logging of OSG through SurgSim Logging System To use this, an object of OsgLog class must be created |
CSurgSim::Device::NovintScaffold | A 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::Graphics::OsgUniformFactory | This class can create the appropriate OsgUniform from an OpenGl glsl type, use the appropriate name from glsl in the create() function to recieve the correctly typed uniform |
CSurgSim::DataStructures::OctreePathHash | Enable 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::OdeEquation | Ode 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::Physics::DeformableRepresentation | Base class for all deformable representations MassSprings, Finite Element Models,.. |
►CSurgSim::Math::OdeSolver | Base 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::OdeSolverEulerExplicit | Euler Explicit ode solver |
CSurgSim::Math::OdeSolverLinearEulerExplicit | Linear Version of the Euler Explicit ode solver This solver assumes that the system is linear, ie that Mass, Damping, and Stiffness matrices do not change |
►CSurgSim::Math::OdeSolverEulerExplicitModified | Euler Explicit Modified ode solver |
CSurgSim::Math::OdeSolverLinearEulerExplicitModified | Linear Version of the Modified Euler Explicit ode solver This solver assumes that the system is linear, ie that Mass, Damping, and Stiffness matrices do not change |
►CSurgSim::Math::OdeSolverEulerImplicit | Euler Implicit ode solver |
CSurgSim::Math::OdeSolverLinearEulerImplicit | Linear Version of the Euler Implicit ode solver This solver assumes that the system is linear, ie that Mass, Damping, and Stiffness matrices do not change |
►CSurgSim::Math::OdeSolverRungeKutta4 | Runge Kutta 4 ode solver See http://en.wikipedia.org/wiki/Runge%E2%80%93Kutta_methods |
CSurgSim::Math::OdeSolverLinearRungeKutta4 | Linear Version of the Runge Kutta 4 ode solver This solver assumes that the system is linear ie that Mass, Damping, and Stiffness matrices do not change |
►CSurgSim::Math::OdeSolverStatic | Static ode solver |
CSurgSim::Math::OdeSolverLinearStatic | Linear version of the static ode solver This solver assumes that the system is linear, ie that Stiffness matrix does not change |
CSurgSim::Math::OdeState | OdeState defines the state y of an ode of 2nd order of the form M(x,v).a = F(x, v) with boundary conditions |
CSurgSim::DataStructures::OptionalValue< T > | Container class that can indicate whether the object has been assigned a value |
CSurgSim::DataStructures::OptionalValue< double > | |
CSurgSim::DataStructures::OptionalValue< int > | |
CSurgSim::DataStructures::OptionalValue< SurgSim::DataStructures::DataGroup > | |
CSurgSim::DataStructures::OptionalValue< SurgSim::DataStructures::OctreePath > | |
CSurgSim::DataStructures::OptionalValue< SurgSim::DataStructures::SurgSim::DataStructures::IndexedLocalCoordinate > | |
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::Graphics::OsgPlane | OSG plane geode to be used as a primitive shape The plane is the XZ plane, with normal +Y |
CSurgSim::Graphics::OsgUnitAxes | |
CSurgSim::Graphics::OsgUnitBox | OSG 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::OsgUnitCylinder | OSG 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::OsgUnitSphere | OSG 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::OutputProducerInterface | Interface for a producer that generates device output updates (forces, status LED state, etc) |
CLabJackToPoseFilter | |
CMovingSquareForce | A simple listener to calculate collision force against a square area for the example application |
CSurgSim::Device::ForceScale | An output device filter that scales forces and/or torques |
CSurgSim::Device::PoseIntegrator | A device filter that integrates the pose, turning a relative device into an absolute one |
CSurgSim::Device::PoseTransform | A device filter that transforms the input pose |
CSurgSim::Input::OutputProducer | An output producer sends data to a device |
CSurgSim::Testing::MockInputOutput | |
CSurgSim::Device::PhantomScaffold | A class that manages Sensable PHANTOM devices |
CSurgSim::Physics::PhysicsManagerState | |
CPlyElement | |
CPlyFile | |
CPlyOtherElems | |
CPlyOtherProp | |
CPlyProperty | |
CSurgSim::DataStructures::PlyReader | Wrapper 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::PlyReaderDelegate | PlyReaderDelegate abstract class |
CSurgSim::DataStructures::TriangleMeshPlyReaderDelegate< M > | Implementation of PlyReaderDelegate for simple triangle meshes |
►CSurgSim::Physics::FemPlyReaderDelegate | Common part of implementation of PlyReaderDelegate for FemRepresentations |
CSurgSim::Physics::Fem1DPlyReaderDelegate | Implementation of PlyReaderDelegate for Fem1DRepresentation |
CSurgSim::Physics::Fem2DPlyReaderDelegate | Implementation of PlyReaderDelegate for Fem2DRepresentation |
CSurgSim::Physics::Fem3DPlyReaderDelegate | Implementation of PlyReaderDelegate for Fem3DRepresentation |
►CSurgSim::DataStructures::TriangleMeshPlyReaderDelegate< Mesh > | |
CSurgSim::Graphics::MeshPlyReaderDelegate | Implementation of PlyReaderDelegate for graphicsmeshes |
CSurgSim::Framework::Property | Public struct to pair an accessible with its appropriate property |
CSurgSim::DataStructures::PlyReader::PropertyInfo | Information about the property on the .ply file |
CSurgSim::Device::RawMultiAxisScaffold | A class that implements the behavior of RawMultiAxisDevice objects |
►CSurgSim::Graphics::RenderTarget | RenderTarget 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::Graphics::OsgAbstractRenderTarget | Osg abstract render target, this hides the type of the actual osg texture and lets us use OsgRenderTarget without the template type |
CSurgSim::Graphics::OsgRenderTarget< T > | Specific implementation of the render target class |
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::Math::OdeSolverRungeKutta4::RungeKuttaDerivedState | Internal structure to hold the 4 temporary evaluations |
►CSurgSim::Graphics::Shader | Base class that defines the interface for graphics shaders |
CSurgSim::Graphics::OsgShader | OSG-based implementation of a graphics shader |
CSurgSim::Serialize::ShapesFactory | A factory implementation for shapes |
CSurgSim::Framework::SharedInstance< T > | A utility class to manage a shared instance of an object |
CSurgSim::Device::SixenseScaffold | A class that manages Sixense devices, such as the Razer Hydra |
►CSurgSim::Physics::Spring | Base 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 |
CSurgSim::Physics::LinearSpring | Linear spring connecting 2 nodes with a viscous term |
CMovingSquareForce::SquarePoseVectors | State defined by the pose of the square |
CSurgSim::Input::CommonDevice::State | |
CSurgSim::Device::WdkHidDeviceHandle::State | |
CSurgSim::Device::InputDeviceHandle::State | |
CSurgSim::Device::NovintScaffold::StateData | |
CSurgSim::Device::TrackIRScaffold::StateData | |
CSurgSim::Device::PhantomScaffold::StateData | |
CSurgSim::Device::SixenseScaffold::StateData | |
CSurgSim::Device::RawMultiAxisScaffold::StateData | |
CSurgSim::Device::LabJackScaffold::StateData | The per-scaffold data (in comparison to DeviceData the per-device data) |
►CSurgSim::Device::SystemInputDeviceHandle | A wrapper for system-dependent access to an input/HID device |
CSurgSim::Device::InputDeviceHandle | Access to an input/HID device using the Input API in Linux |
CSurgSim::Device::WdkHidDeviceHandle | Access to an input/HID device using the HID API from the Windows Driver Kit |
►CTest | |
CSurgSim::DataStructures::NamedDataTest | |
CSurgSim::Graphics::OsgRepresentationRenderTests | |
►CSurgSim::Graphics::RenderTest | |
COsgOctreeRepresentationRenderTests | |
COsgVectorFieldRepresentationRenderTests | |
CSurgSim::Graphics::OsgBoxRepresentationRenderTests | |
CSurgSim::Graphics::OsgCameraRenderTests | |
CSurgSim::Graphics::OsgCapsuleRepresentationRenderTests | |
CSurgSim::Graphics::OsgCylinderRepresentationRenderTests | |
CSurgSim::Graphics::OsgMeshRepresentationRenderTests | |
CSurgSim::Graphics::OsgPointCloudRepresentationRenderTests | |
CSurgSim::Graphics::OsgSceneryRepresentationRenderTests | |
CSurgSim::Graphics::OsgScreenSpaceQuadRenderTests | |
CSurgSim::Graphics::OsgShaderRenderTests | |
►CSurgSim::Physics::Fem3DPerformanceTestBase | |
CSurgSim::Physics::IntegrationSchemeAndCountParamTest | |
CSurgSim::Physics::IntegrationSchemeParamTest | |
►CSurgSim::Physics::RenderTests | |
CSurgSim::Physics::Fem3DVSTruthCubeRenderTests | |
►CSurgSim::Graphics::Texture | Base class defining the interface for a Graphics Texture |
►CSurgSim::Graphics::OsgTexture | Base class for OSG implementations of Graphics Textures |
CSurgSim::Graphics::OsgTexture1d | OSG implementation of a 1D Texture |
CSurgSim::Graphics::OsgTexture2d | OSG implementation of a 2D Texture |
CSurgSim::Graphics::OsgTexture3d | OSG implementation of a 3D Texture |
CSurgSim::Graphics::OsgTextureCubeMap | OSG implementation of a Cube Map Texture |
CSurgSim::Graphics::OsgTextureRectangle | OSG implementation of a Rectangle Texture |
►CSurgSim::Graphics::Texture1d | Base class defining the interface for a 1D Graphics Texture |
CSurgSim::Graphics::OsgTexture1d | OSG implementation of a 1D Texture |
►CSurgSim::Graphics::Texture2d | Base class defining the interface for a 2D Graphics Texture |
CSurgSim::Graphics::OsgTexture2d | OSG implementation of a 2D Texture |
►CSurgSim::Graphics::Texture3d | Base class defining the interface for a 3D Graphics Texture |
CSurgSim::Graphics::OsgTexture3d | OSG implementation of a 3D Texture |
CSurgSim::Graphics::TextureCubeMap | Base class defining the interface for a Cube Map Graphics Texture |
►CSurgSim::Graphics::TextureRectangle | Base class defining the interface for a Rectangle Graphics Texture |
CSurgSim::Graphics::OsgTextureRectangle | OSG implementation of a Rectangle Texture |
CSurgSim::Framework::Timer | Timer class, measures execution times |
CSurgSim::Device::LabJack::TimerSettings | A struct holding the data to be associated with a Timer |
►CTrackballManipulator | |
CSurgSim::Graphics::OsgTrackballZoomManipulator | Trackball manipulator that uses the mouse wheel to control zoom amount |
CSurgSim::Device::TrackIRScaffold | A class that manages Natural Point TRACKIR devices |
►CSurgSim::DataStructures::Tree | Basic tree structure |
CSurgSim::DataStructures::AabbTree | AabbTree is a tree that is organized by the bounding boxes of the referenced objects, the bounding box used is the Axis Aligned Bounding Box (AABB), with the extents of an AABB describing the min and max of each coordinate for the given object |
►CSurgSim::DataStructures::TreeData | Abstract base class for data stored in a Tree |
CSurgSim::DataStructures::AabbTreeData | Internal class to hold a list of AABBs and their respective object ids, it can calculate the elements that intersect with a given aabb each node in the AABB tree holds one of these |
►CSurgSim::DataStructures::TreeNode | Basic tree node structure |
CSurgSim::DataStructures::AabbTreeNode | Node class for the AabbTree, this handles groups of items and subdivision if the number of items gets too big |
►CSurgSim::DataStructures::TreeVisitor | Abstract Class for visitors, this needs to be extended for other tree nodes when necessary return false from handle() to abort traversal |
CSurgSim::DataStructures::AabbTreeIntersectionVisitor | Visitor class to collect the items that intersect with a given bounding box |
CSurgSim::Math::TriangleHelper< T, MOpt > | A helper class for a triangle, used for the following two purposes: |
CSurgSim::Graphics::TriangleNormalGenerator | Triangle index functor which calculates normals for the vertices of a geometry, use createNormalGenerator to instantiate this |
CSurgSim::Physics::TruthCubeData | |
CSurgSim::Graphics::VectorFieldData | A (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::DataStructures::Vertex< void > | Specialization of Vertex with no data |
CSurgSim::DataStructures::TriangleMeshPlyReaderDelegate< M >::VertexData | Internal 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::TetrahedronMesh< VertexData, EdgeData, TriangleData, TetrahedronData > | Basic class for storing Tetrahedron Meshes, handling basic vertex, edge, triangle and tetrahedron functionality |
CSurgSim::DataStructures::TriangleMeshBase< VertexData, EdgeData, TriangleData > | Basic class for storing Triangle Meshes, handling basic vertex, edge, and triangle functionality |
►CSurgSim::DataStructures::TriangleMeshBase< VertexData, SurgSim::DataStructures::EmptyData, SurgSim::DataStructures::EmptyData > | |
CSurgSim::Graphics::Mesh | |
►CSurgSim::DataStructures::Vertices< EmptyData > | |
►CSurgSim::DataStructures::TriangleMeshBase< EmptyData, EmptyData, NormalData > | |
CSurgSim::DataStructures::TriangleMesh | A TriangleMesh stores normal information for the triangles |
►CWithParamInterface | |
CSurgSim::Physics::IntegrationSchemeAndCountParamTest | |
CSurgSim::Physics::IntegrationSchemeParamTest | |