▼NSurgSim | |
►NBlocks | |
CDriveElementFromInputBehavior | 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 |
CKeyboardTogglesComponentBehavior | This behavior is used to control the visibility of registered graphical representation(s) |
CMassSpring1DRepresentation | |
CMassSpring2DRepresentation | |
CMassSpring3DRepresentation | |
CPoseInterpolator | Perform linear interpolation on two poses |
CSphereElement | |
CTransferPhysicsToGraphicsMeshBehavior | Behavior to copy positions of a PhysicsRepresentation to a GraphicsMesh |
CTransferPhysicsToPointCloudBehavior | Behavior to copy positions of a PhysicsRepresentation to a PointCloud |
CVisualizeContactsBehavior | This behavior is used to visualize the contacts on collision representation through vector field |
►NCollision | |
CBoxCapsuleDcdContact | Class to calculate intersections between Boxes and Capsules |
CBoxDoubleSidedPlaneDcdContact | Class to calculate intersections between Boxes and Planes |
CBoxPlaneDcdContact | Class to calculate intersections between Boxes and Planes |
CBoxSphereDcdContact | Class to calculate intersections between a box and a sphere |
CCapsuleSphereDcdContact | Class to calculate intersections between a capsule and a sphere |
CCollisionPair | 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 |
CContact | 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 |
CContactCalculation | 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 |
CDefaultContactCalculation | A default calculation, it does nothing and can be used as a placeholder |
COctreeDcdContact | Class to calculate intersections between an Octree and other shapes |
CRepresentation | 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 |
CShapeCollisionRepresentation | Use a Shape as a Collision Representation, any SurgSim::Physics::Representation can be used as a backing representation |
CSphereDoubleSidedPlaneDcdContact | Class to calculate intersections between Spheres and DoubleSidedPlanes |
CSpherePlaneDcdContact | Class to calculate intersections between Spheres and Planes |
CSphereSphereDcdContact | Class to calculate intersections between spheres |
CTriangleMeshPlaneDcdContact | Class to calculate intersections between a triangle mesh and a plane |
CTriangleMeshTriangleMeshDcdContact | Class to calculate intersections between a triangle mesh and a triangle mesh |
►NDataStructures | |
CAabbTree | 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 |
CAabbTreeData | 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 |
CAabbTreeIntersectionVisitor | Visitor class to collect the items that intersect with a given bounding box |
CAabbTreeNode | Node class for the AabbTree, this handles groups of items and subdivision if the number of items gets too big |
CBufferedValue | 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 |
CDataGroup | A collection of NamedData objects |
CDataGroupBuilder | A class that allows you to build a DataGroup structure |
CDataGroupCopier | A class that assists in copying from one DataGroup to another, when assignment is not possible |
CEmptyData | EmptyData class |
CImage | A templated Image class |
CIndexDirectory | A simple bidirectional mapping between names (strings) and distinct consecutive non-negative indices |
CIndexedLocalCoordinate | A generic (size_t index, Vector coordinate) pair |
CLocation | |
CMeshElement | Element structure for meshes |
CNamedData | A templated dictionary in which data can be accessed by name or index, with immutable names & indices |
CNamedDataBuilder | A class that allows you to build a NamedData structure |
CNamedDataTest | |
CNamedVariantData | A NamedData collection of variant data type |
CNormalData | Store normal for each triangle in a triangle mesh |
COctreeNode | Octree data structure |
COctreePathHash | 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 |
COptionalValue | Container class that can indicate whether the object has been assigned a value |
►CPlyReader | 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 |
CData | |
CElementInfo | Information about the element in the .ply file |
CPropertyInfo | Information about the property on the .ply file |
CPlyReaderDelegate | PlyReaderDelegate abstract class |
CTetrahedronMesh | Basic class for storing Tetrahedron Meshes, handling basic vertex, edge, triangle and tetrahedron functionality |
CTree | Basic tree structure |
CTreeData | Abstract base class for data stored in a Tree |
CTreeNode | Basic tree node structure |
CTreeVisitor | Abstract Class for visitors, this needs to be extended for other tree nodes when necessary return false from handle() to abort traversal |
CTriangleMesh | A TriangleMesh stores normal information for the triangles |
CTriangleMeshBase | Basic class for storing Triangle Meshes, handling basic vertex, edge, and triangle functionality |
►CTriangleMeshPlyReaderDelegate | Implementation of PlyReaderDelegate for simple triangle meshes |
CFaceData | Internal structure, the received for data from the "face" element |
CVertexData | Internal structure, the receiver for data from the "vertex" element Provide space for standard ply vertex data, x/y/z and s/t |
CVertex | Vertex structure for meshes |
CVertex< void > | Specialization of Vertex with no data |
CVertices | Base class for mesh structures, handling basic vertex functionality |
►NDevice | |
►NLabJack | A collection of checksum functions specifically tailored for the labjackusb driver |
CAnalogInputSettings | A struct holding the data to be associated with the positive channel for an analog input |
CTimerSettings | A struct holding the data to be associated with a Timer |
CBitSetBuffer | A bit set corresponding to a contiguous memory buffer |
CFileDescriptor | A wrapper for an UNIX-style integer file descriptor |
CFileHandle | A wrapper for an Windows-style HANDLE file descriptor |
CForceScale | An output device filter that scales forces and/or torques |
CIdentityPoseDevice | A class implementing the identity pose device, which is a pretend device that doesn't move |
►CInputDeviceHandle | Access to an input/HID device using the Input API in Linux |
CState | |
CKeyboardDevice | A class implementing the communication with a keyboard |
►CKeyboardScaffold | A class that implements the behavior of KeyboardDevice objects |
CDeviceData | Struct to hold a KeyboardDevice object, a KeyboardHandler object, and a mutex for data passing |
CLabJackDevice | A class implementing the communication with a LabJack data acquisition (DAQ) device |
►CLabJackScaffold | A class that implements the behavior of LabJackDevice objects |
CDeviceData | The per-device data |
CHandle | |
CStateData | The per-scaffold data (in comparison to DeviceData the per-device data) |
CLabJackThread | A class implementing the thread context for communicating with LabJack devices |
CMouseDevice | A class implementing the communication with a mouse |
►CMouseScaffold | A class that implements the behavior of MouseDevice objects |
CDeviceData | Struct to hold a MouseDevice object, a OsgMouseHandler, and a mutex for data passing |
CMultiAxisDevice | A class implementing the communication with a multi-axis controller input device, for example a 3DConnexion SpaceNavigator |
CNovint7DofDevice | A class implementing the communication with a Novint Falcon with the Open Surgery Grip 7-DoF device |
CNovintCommonDevice | A class implementing the communication with a generic Novint Falcon device |
CNovintDevice | A class implementing the communication with a Novint Falcon device |
►CNovintScaffold | A class that manages Novint Falcon devices |
CCallback | |
CDeviceData | |
CHandle | |
CStateData | |
COsgKeyboardHandler | |
COsgMouseHandler | |
CPhantomDevice | A class implementing the communication with a SensAble/Geomagic PHANTOM device |
►CPhantomScaffold | A class that manages Sensable PHANTOM devices |
CCallback | |
CDeviceData | |
CHandle | |
CStateData | |
CPoseIntegrator | A device filter that integrates the pose, turning a relative device into an absolute one |
CPoseTransform | A device filter that transforms the input pose |
CRawMultiAxisDevice | A class implementing the communication with a multi-axis controller input device, for example a 3DConnexion SpaceNavigator |
►CRawMultiAxisScaffold | A class that implements the behavior of RawMultiAxisDevice objects |
CDeviceData | |
CStateData | |
CRawMultiAxisThread | A class implementing the thread context for sampling RawMultiAxis devices |
CSixenseDevice | A class implementing the communication with one Sixense controller, for example one of the two on the Razer Hydra |
►CSixenseScaffold | A class that manages Sixense devices, such as the Razer Hydra |
CDeviceData | |
CStateData | |
CSixenseThread | A class implementing the thread context for sampling Sixense devices |
CSystemInputDeviceHandle | A wrapper for system-dependent access to an input/HID device |
CTrackIRDevice | A class implementing the communication with Natural Point TrackIR camera |
►CTrackIRScaffold | A class that manages Natural Point TRACKIR devices |
CDeviceData | |
CStateData | |
CTrackIRThread | A class implementing the thread context for sampling TrackIR devices |
►CWdkHidDeviceHandle | Access to an input/HID device using the HID API from the Windows Driver Kit |
CState | |
►NFramework | |
►CAccessible | 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 |
CFunctors | Private struct to keep the map under control |
CApplicationData | Enable searching for files in a given list of paths, give access to the current directory and wrap boost::filesystem functionality |
CAssertionFailure | An exception class thrown by SURGSIM_ASSERT() failures and SURGSIM_FAILURE() |
CAssertMessage | An internal message class used for assertion failures |
CAsset | This class is used to facilitate file loading |
CBarrier | 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 |
CBasicSceneElement | Simple concrete implementation of a scene element that does not have any higher logic |
CBasicThread | 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 |
CBehavior | Behaviors perform actions |
CBehaviorManager | Manager to handle Behaviors |
CComponent | 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 |
CComponentManager | Base Component Manager class |
CFileOutput | Class to output logging information to a give file |
CLockedContainer | A simple thread-safe data container that can support multiple writers and readers |
CLogger | An object that can be used to control logging parameters, such as verbosity and log output destination |
CLoggerManager | Class to safely handle access to a group of loggers, manipulate the global logging threshold, and fetch logger(s) from a global pool |
CLogMessage | Specialization, handles flush on destruction |
CLogMessageBase | 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 |
CLogOutput | Virtual Base class to define an interface for outputting logging information |
CNullOutput | |
CObjectFactory | An object factory, once a class is registered with the factory it can be used to create instances of registered classes |
CObjectFactory1 | An object factory, once a class is registered with the factory it can be used to create instances of registered classes |
CPoseComponent | The PoseComponent holds a pose |
CProperty | Public struct to pair an accessible with its appropriate property |
CRepresentation | Representations are manifestations of a SceneElement |
►CReuseFactory | Factory for acquiring new or unused existing instances of class T to reduce repeated deallocation and reallocation of objects with short lifespans |
CDeleter | Custom deleter to keep unused objects for reuse, rather than actually deleting them |
CRuntime | 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 |
CScene | Scene. Basic Container for SceneElements |
CSceneElement | SceneElement is the basic part of a scene, it is a container of components |
CSharedInstance | A utility class to manage a shared instance of an object |
CStreamOutput | Class to output logging information to a stream that can be passed into the constructor of the class |
CTimer | Timer class, measures execution times |
CTransferPropertiesBehavior | Behavior to copy properties between instances of Accessible |
►NGraphics | |
CAxesRepresentation | 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 |
CBoxRepresentation | Base graphics box representation class, which defines the basic interface for a box that can be visualized |
CCamera | Base graphics camera class, which defines the basic interface for all graphics cameras |
CCapsuleRepresentation | Base graphics capsule representation class, which defines the basic interface for a capsule that can be visualized |
CCylinderRepresentation | Base graphics cylinder representation class, which defines the basic interface for a cylinder that can be visualized |
CGroup | Base graphics group class, which defines the interface that all graphics groups must implement |
CLight | 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 |
CManager | Basic graphics manager class which manages graphics components to provide a visualization of the scene to the user |
CMaterial | Base class that defines the interface for graphics materials |
CMesh | |
CMeshPlyReaderDelegate | Implementation of PlyReaderDelegate for graphicsmeshes |
CMeshRepresentation | Graphics representation of a mesh, can be initialized from a Mesh structure |
COctreeRepresentation | Graphic representation of an Octree |
COsgAbstractRenderTarget | Osg abstract render target, this hides the type of the actual osg texture and lets us use OsgRenderTarget without the template type |
COsgAxesRepresentation | Osg axes representation implementation for the AxesRepresentation interface in graphics |
COsgBoxRepresentation | OSG implementation of a graphics box representation |
COsgBoxRepresentationRenderTests | |
COsgCamera | OSG implementation of a graphics camera |
COsgCameraRenderTests | |
COsgCapsuleRepresentation | OSG implementation of a graphics capsule representation |
COsgCapsuleRepresentationRenderTests | |
COsgCylinderRepresentation | OSG implementation of a graphics Cylinder representation |
COsgCylinderRepresentationRenderTests | |
COsgGroup | OSG implementation of a graphics group |
COsgLight | OpenScenegraph implementation for the Light interface |
COsgLog | Enable logging of OSG through SurgSim Logging System To use this, an object of OsgLog class must be created |
COsgManager | OSG-based implementation of graphics manager class |
COsgMaterial | OSG-based implementation of a graphics material |
COsgMeshRepresentation | Implementation of a MeshRepresentation for rendering under osg |
COsgMeshRepresentationRenderTests | |
COsgOctreeRepresentation | OSG octree representation, implements an OctreeRepresenation using OSG |
COsgPlane | OSG plane geode to be used as a primitive shape The plane is the XZ plane, with normal +Y |
COsgPlaneRepresentation | OSG implementation of a graphics plane representation |
COsgPointCloudRepresentation | Osg point cloud representation, implementation of a PointCloudRepresenation using OSG |
COsgPointCloudRepresentationRenderTests | |
COsgRenderTarget | Specific implementation of the render target class |
COsgRepresentation | Base OSG implementation of a graphics representation |
COsgRepresentationRenderTests | |
COsgSceneryRepresentation | A OsgSceneryRepresentation is used to load osg object/node from file |
COsgSceneryRepresentationRenderTests | |
COsgScreenSpacePass | Special RenderPass to draw items using a orthogonal projection, this is specific to the Osg implementation of the SurgSim rendering |
COsgScreenSpaceQuadRenderTests | |
COsgScreenSpaceQuadRepresentation | Implements the ScreenSpaceQuadRepresentation, provides the uniform 'texture' for the texture that it carries |
COsgShader | OSG-based implementation of a graphics shader |
COsgShaderRenderTests | |
COsgSphereRepresentation | OSG implementation of a graphics sphere representation |
COsgTexture | Base class for OSG implementations of Graphics Textures |
COsgTexture1d | OSG implementation of a 1D Texture |
COsgTexture2d | OSG implementation of a 2D Texture |
COsgTexture3d | OSG implementation of a 3D Texture |
COsgTextureCubeMap | OSG implementation of a Cube Map Texture |
COsgTextureRectangle | OSG implementation of a Rectangle Texture |
COsgTextureUniform | OSG implementation of graphics uniform with a texture value |
COsgTrackballZoomManipulator | Trackball manipulator that uses the mouse wheel to control zoom amount |
COsgUniform | OSG implementation of graphics uniform with a value of type T |
COsgUniform< std::shared_ptr< OsgTexture1d > > | Specialization of OsgUniform for OsgTexture1d |
COsgUniform< std::shared_ptr< OsgTexture2d > > | Specialization of OsgUniform for OsgTexture2d |
COsgUniform< std::shared_ptr< OsgTexture3d > > | Specialization of OsgUniform for OsgTexture3d |
COsgUniform< std::shared_ptr< OsgTextureCubeMap > > | Specialization of OsgUniform for OsgTextureCubeMap |
COsgUniform< std::shared_ptr< OsgTextureRectangle > > | Specialization of OsgUniform for OsgTextureRectangle |
COsgUniform< std::vector< T > > | Specialization of OsgUniform for vectors of values |
COsgUniformBase | Base OSG implementation of graphics uniforms |
COsgUniformFactory | 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 |
COsgUnitAxes | |
COsgUnitBox | 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 |
COsgUnitCylinder | 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 |
COsgUnitSphere | 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 |
COsgVectorFieldRepresentation | OSG vector field representation, implements a VectorFieldRepresenation using OSG |
COsgView | OSG-based implementation of graphics view class |
COsgViewElement | OSG-based implementation of graphics view element |
CPlaneRepresentation | Base graphics plane representation class, which defines the basic interface for a plane that can be visualized |
CPointCloudRepresentation | Graphic representation of a point cloud, hase a very basic interface and is intentionally kept generic |
CRenderPass | 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 |
CRenderTarget | 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 |
CRenderTest | |
CRepresentation | Base graphics representation class, which defines the interface that all graphics representations must implement |
CSceneryRepresentation | Base class defining the interface for a Graphics Scenery Object |
CScreenSpaceQuadRepresentation | 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 |
CShader | Base class that defines the interface for graphics shaders |
CSphereRepresentation | Base graphics sphere representation class, which defines the basic interface for a sphere that can be visualized |
CTexture | Base class defining the interface for a Graphics Texture |
CTexture1d | Base class defining the interface for a 1D Graphics Texture |
CTexture2d | Base class defining the interface for a 2D Graphics Texture |
CTexture3d | Base class defining the interface for a 3D Graphics Texture |
CTextureCubeMap | Base class defining the interface for a Cube Map Graphics Texture |
CTextureRectangle | Base class defining the interface for a Rectangle Graphics Texture |
CTriangleNormalGenerator | Triangle index functor which calculates normals for the vertices of a geometry, use createNormalGenerator to instantiate this |
CUniform | Base class for a graphics uniform with a value of type T |
CUniform< std::vector< T > > | Specialization of Uniform for vectors of values |
CUniformBase | Common base class for all graphics uniforms |
CVectorFieldData | A (mathematical) vector is represented as (X,Y,Z) associated with an optional color (R,G,B,alpha) information |
CVectorFieldRepresentation | Graphic representation of a vector field Each point/location, i.e |
CVertexData | |
CView | Base graphics view class, which defines the basic interface for all graphics views |
CViewElement | Basic SceneElement that wraps a View so that it can be added to the Scene |
►NInput | |
►CCommonDevice | A class that implements some common management code on top of the DeviceInterface |
CState | |
CDeviceInterface | Interface used to communicate with user-interface hardware devices |
CInputComponent | InputComponent combines the Component interface and the InputConsumerInterface so that input devices can provide input through the normal component interface |
CInputConsumer | An input consumer monitors device and signal state update |
CInputConsumerInterface | Interface for a consumer that monitors device and signal state updates (pose, buttons, etc) |
CInputManager | Manager to handle InputComponent and OutputComponent, SceneElement can add these to get input from devices, or even write output to devices |
COutputComponent | 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 |
COutputProducer | An output producer sends data to a device |
COutputProducerInterface | Interface for a producer that generates device output updates (forces, status LED state, etc) |
►NMath | |
CBoxShape | Box shape: box centered on (0 0 0), aligned with the axis with different sizes along X, Y and Z |
CCapsuleShape | Capsule shape: centered on (0, 0, 0), aligned along Y, with length and radius |
CCylinderShape | Cylinder shape: centered on (0 0 0), aligned along Y, defined with length and radius |
CDoubleSidedPlaneShape | DoubleSidedPlaneShape: The XZ plane (d = 0) with normal pointing along positive Y axis |
CgaussQuadraturePoint | |
CLinearSolveAndInverse | LinearSolveAndInverse aims at performing an efficient linear system resolution and calculating its inverse matrix at the same time |
CLinearSolveAndInverseDenseMatrix | Derivation for dense matrix type |
CLinearSolveAndInverseDiagonalMatrix | Derivation for diagonal matrix type |
CLinearSolveAndInverseSymmetricTriDiagonalBlockMatrix | Derivation for symmetric tri-diagonal block matrix type |
CLinearSolveAndInverseTriDiagonalBlockMatrix | Derivation for tri-diagonal block matrix type |
CMeshShape | 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 |
CMlcpGaussSeidelSolver | A solver for mixed LCP problems using the Gauss-Seidel iterative method |
CMlcpProblem | A description of an MLCP (mixed linear complementarity problem, or mixed LCP) system to be solved |
CMlcpSolution | The description of a solution to a mixed linear complementarity problem |
CMlcpSolver | This class provides a solver interface for mixed linear complementarity problems |
COctreeShape | Octree Shape A defined by an octree data structure |
COdeEquation | 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 |
COdeSolver | 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)) |
COdeSolverEulerExplicit | Euler Explicit ode solver |
COdeSolverEulerExplicitModified | Euler Explicit Modified ode solver |
COdeSolverEulerImplicit | Euler Implicit ode solver |
COdeSolverLinearEulerExplicit | 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 |
COdeSolverLinearEulerExplicitModified | 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 |
COdeSolverLinearEulerImplicit | 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 |
COdeSolverLinearRungeKutta4 | 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 |
COdeSolverLinearStatic | Linear version of the static ode solver This solver assumes that the system is linear, ie that Stiffness matrix does not change |
►COdeSolverRungeKutta4 | Runge Kutta 4 ode solver See http://en.wikipedia.org/wiki/Runge%E2%80%93Kutta_methods |
CRungeKuttaDerivedState | Internal structure to hold the 4 temporary evaluations |
COdeSolverStatic | Static ode solver |
COdeState | OdeState defines the state y of an ode of 2nd order of the form M(x,v).a = F(x, v) with boundary conditions |
CPlaneShape | The XZ plane (d = 0) with normal pointing along positive Y axis |
CShape | Generic rigid shape class defining a shape |
CSphereShape | Sphere shape: sphere centered on (0 0 0), defined with radius |
CSurfaceMeshShape | SurfaceMeshShape defines a shape based on a mesh, like MeshShape |
CTriangleHelper | A helper class for a triangle, used for the following two purposes: |
►NPhysics | |
CBuildMlcp | Build an mlcp from a list of constraints stored in a PhysicsManagerState |
CComputation | Encapsulates a calculation over a selection of objects, needs to be subclassed to be used |
CConstraint | Base class for all physics constraints. Contains data specific to the constraint and a pair of implementations |
CConstraintComponent | Component class for inserting constraints between physics representations into the scene |
CConstraintData | Base class for all CosntraintData Derived classes should be specific to a given constraint |
CConstraintImplementation | Base class for all constraint implementations. A ConstraintImplementation defines 1 side of a constraint |
CConstraintImplementationFactory | This class manages ConstraintImplementations, and can be used to look up the correct implementation by representation and constraint type |
CContactConstraintData | Class for Frictionless contact (only needs a plane equation) |
CContactConstraintGeneration | Generate a constraint for every contact that was calculated |
CDcdCollision | Computation to determine the contacts between a list of CollisionPairs |
CDeformableCollisionRepresentation | 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 |
CDeformableRepresentation | Base class for all deformable representations MassSprings, Finite Element Models,.. |
CDivisbleCubeRepresentation | |
CFem1DElementBeam | 1D FemElement based on a beam volume discretization with a fixed cross section |
CFem1DPlyReaderDelegate | Implementation of PlyReaderDelegate for Fem1DRepresentation |
CFem1DRepresentation | Finite Element Model 1D is a fem built with 1D FemElement |
CFem1DRepresentationLocalization | Implementation of Localization for Fem1DRepresentation |
CFem2DElementTriangle | 2D FemElement based on a triangle with a constant thickness |
CFem2DPlyReaderDelegate | Implementation of PlyReaderDelegate for Fem2DRepresentation |
CFem2DRepresentation | Finite Element Model 2D is a fem built with 2D FemElement |
CFem2DRepresentationLocalization | Implementation of Localization for Fem2DRepresentation |
CFem3DElementCorotationalTetrahedron | Fem Element 3D co-rotational based on a tetrahedron volume discretization |
CFem3DElementCube | Class for Fem Element 3D based on a cube volume discretization |
CFem3DElementTetrahedron | Class for Fem Element 3D based on a tetrahedron volume discretization |
CFem3DPerformanceTestBase | |
CFem3DPlyReaderDelegate | Implementation of PlyReaderDelegate for Fem3DRepresentation |
CFem3DRepresentation | Finite Element Model 3D is a fem built with 3D FemElement |
CFem3DRepresentationBilateral3D | Fem3DRepresentation bilateral 3d constraint implementation |
CFem3DRepresentationContact | Fem3DRepresentation frictionless contact implementation |
CFem3DRepresentationLocalization | Implementation of Localization for Fem3DRepresentation |
CFem3DVSTruthCubeRenderTests | |
CFemElement | 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) |
►CFemPlyReaderDelegate | Common part of implementation of PlyReaderDelegate for FemRepresentations |
CElementData | Internal data to receive the fem element |
CMaterialData | Internal data to receive the "material" data |
CFemRepresentation | Finite Element Model (a.k.a |
CFemRepresentationParameters | Defines the physical parameters for all Finite Element Model (1D, 2D, 3D) |
CFixedRepresentation | Physics entity without any motion nor compliance against which others physics entities can interact |
CFixedRepresentationBilateral3D | FixedRepresentation bilateral 3d constraint implementation |
CFixedRepresentationContact | FixedRepresentation frictionless contact implementation |
CFixedRepresentationLocalization | This class implement the localization on a FixedRepresentation, as a local position |
CFreeMotion | Apply the Freemotion calcluation to all physics representations |
CIntegrationSchemeAndCountParamTest | |
CIntegrationSchemeParamTest | |
CLinearSpring | Linear spring connecting 2 nodes with a viscous term |
CLocalization | This class localize a point on a representation (representation specific) |
CMass | |
CMassSpringRepresentation | MassSpring model is a deformable model (a set of masses connected by springs) |
CMassSpringRepresentationContact | MassSpring frictionless contact implementation |
CMassSpringRepresentationLocalization | Implementation of Localization for MassSpringRepresentation |
CMlcpMapping | |
CMlcpPhysicsProblem | A description of a physical mixed LCP system to be solved |
CMlcpPhysicsSolution | The description of a solution to a physical MLCP problem |
CPhysicsManager | PhyicsManager handles the physics and motion calculation, it uses Computations to separate the algorithmic steps into smaller pieces |
CPhysicsManagerState | |
CPostUpdate | Post Update is called prior to anything else at the beginning of each time step |
CPreUpdate | Pre Update is called after everything else is done in the physics time step |
CPushResults | Propagates the Mlcp result to the representations |
CRenderTests | |
CRepresentation | Defines the base class for all physics objects |
CRigidCollisionRepresentation | 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 |
CRigidRepresentation | 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 |
CRigidRepresentationBase | Defines the base class for all rigid motion based representations (fixed, rigid body, rigid body + vtc,...) |
CRigidRepresentationBilateral3D | RigidRepresentation bilateral 3d constraint implementation |
CRigidRepresentationContact | RigidRepresentation frictionless contact implementation |
CRigidRepresentationLocalization | This class implement the localization on a RigidRepresentation, as a local position |
CRigidRepresentationState | Describes a state (position and velocity information) |
CSolveMlcp | Solve the system Mixed Linear Complementarity Problem (Mlcp) |
CSpring | 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 |
CTruthCubeData | |
CTruthCubeRepresentation | Truth cube representation (extension of a Fem3DRepresentation) Defines a subdivided initial cube with cube FemElements |
CUpdateCollisionRepresentations | Computation that calls the CollisionRepresentations update() function |
CVirtualToolCoupler | The VirtualToolCoupler couples a rigid object to an input/output device through a spring and damper |
►NSerialize | |
CShapesFactory | A factory implementation for shapes |
►NTesting | |
CMockInputOutput | |
CMockPhysicsManager | Testing class used to publicly expose PhysicsManager's protected member functions |
▼NYAML | |
Cconvert< std::array< T, N > > | YAML::convert specialization for std::array |
Cconvert< 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 |
Cconvert< std::shared_ptr< SurgSim::Framework::Scene > > | |
Cconvert< std::shared_ptr< SurgSim::Framework::SceneElement > > | |
Cconvert< std::shared_ptr< SurgSim::Math::Shape > > | |
Cconvert< 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 |
Cconvert< std::unordered_map< Key, T > > | YAML::convert specialization for std::unordered_map |
Cconvert< std::unordered_set< Value > > | YAML::convert specialization for std::unordered_set |
Cconvert< SurgSim::DataStructures::OptionalValue< T > > | YAML::convert specialization for OptionalValue |
Cconvert< 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 |
Cconvert< SurgSim::Framework::SceneElement > | |
Cconvert< SurgSim::Graphics::Representation > | Specialize of YAML::convert<> template Represensation class |
Cconvert< SurgSim::Graphics::SphereRepresentation > | Specialize of YAML::convert<> template SphereRepresensation class |
Cconvert< SurgSim::Math::IntegrationScheme > | |
Cconvert< SurgSim::Physics::RigidRepresentationState > | |
Cconvert< typename Eigen::Matrix< Type, Rows, 1, MOpt > > | Specialization for Eigen Row Vectors, which are the type that Vector2x, Vector3x use |
Cconvert< typename Eigen::Matrix< Type, Rows, Cols, MOpt > > | Specialization of convert for fixed size Eigen::Matrix |
Cconvert< typename Eigen::Quaternion< Type, QOpt > > | Specialization of convert for Eigen::Quaternion |
Cconvert< typename Eigen::Transform< Type, Dim, TMode, TOptions > > | Specialization of convert for Eigen::RigidTransform |
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 |
CGlutCamera | Camera which controls the view of the scene |
CGlutGroup | Group of objects which provides a transform hierarchy |
CGlutRenderer | Simple static class renderer built on Glut |
CGlutRenderObject | Abstract definition of an object that can render itself with Glut |
CGlutSphere | Sphere with center at local origin |
CGlutSquare | Square with center at local origin |
CLabJackToPoseFilter | |
CMlcpTestData | |
▼CMovingSquareForce | A simple listener to calculate collision force against a square area for the example application |
CSquarePoseVectors | State defined by the pose of the square |
CMovingSquareGlutWindow | A simple listener to display the simple scene composed of a square and tool for the example application |
COsgOctreeRepresentationRenderTests | |
COsgVectorFieldRepresentationRenderTests | |
COtherData | |
COtherElem | |
CPlyElement | |
CPlyFile | |
CPlyOtherElems | |
CPlyOtherProp | |
CPlyProperty | |
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 |
CTestListener | |