AGX Dynamics 2.38.0.0
Loading...
Searching...
No Matches
agx Namespace Reference

The agx namespace contains the dynamics/math part of the AGX Dynamics API. More...

Namespaces

namespace  detail
 
namespace  FloatingPointExceptions
 
namespace  GraphNode
 
namespace  Math
 
namespace  Physics
 

Classes

class  AbstractMemoryPool
 
class  AddedMassInteraction
 Interface to write added mass matrices for one or two rigid bodies. More...
 
class  AddedMassInteractionHandler
 Class containing and handling a global view of several objects interacting trough strong added mass interactions. More...
 
class  AffineMatrix4x4T
 Matrix class for rigid transformations (translation, rotation). More...
 
class  AgXString
 
class  AlignedAllocator
 Aligned allocator. More...
 
class  Allocator
 Templated allocator. More...
 
class  AnalysisBox
 Class that can be used to extract data from elements in a simulation within a specified bound. More...
 
class  Angle
 Constraint angle class. More...
 
class  AngularJointBase
 An angular joint is defined by having 2 rotational degrees of freedom. More...
 
class  AngularLockJoint
 Constraint that removes 3 DOF (rotational degrees of freedom) between two bodies, or one body and the world. More...
 
class  ArrayParameter
 Array parameter. More...
 
class  AtomicValueT
 AtomicValueT template for integral types, all operations are atomic. More...
 
class  Attachment
 Constraint attachment base class for any type of frame. More...
 
class  AttachmentPair
 Constraint attachment pair class. More...
 
class  AutoInit
 Convenience class to automatically call agx::init / agx::shutdown. More...
 
class  BallJoint
 Constraint that removes the three translation DOF between two bodies (or one and the world). More...
 
class  BallJointFrame
 Class for storing the geometric information of a BallJoint. More...
 
class  Barrier
 Barrier synchronization primitive. More...
 
class  BasicControllerConstraint
 Base class for constraint angle based elementary constraints (secondary constraints). More...
 
class  BasicThread
 Basic wrapper class aroud std::thread. More...
 
class  BatchAllocator
 Batch allocator. More...
 
class  BitArray
 Class for stack-storage of a (at compile time) specified number of bits with a minimal size of storage. More...
 
class  BitSet_small
 Special class for small bitset, because minimum bitset size in clang/gcc is 8 bytes, and we only need 4. More...
 
class  Block
 Block synchronization primitive. More...
 
class  BlockStructure
 
class  BodyBodyContactJacobianT
 
class  BodyContactJacobianT
 
class  BoundT
 A BoundT represents a range defined by a minimum and a maximum value. More...
 
class  BoxedHybridPivotAlgorithm
 
class  BoxedKellerAlgorithm
 
class  BoxedMurtyAlgorithm
 
class  BoxFrictionModel
 Box friction. More...
 
class  BufferPrinter
 
class  BulkMaterial
 Physical properties for the bulk of geometries made up by a Material. More...
 
class  ByteAllocator
 Byte allocator. More...
 
class  Callback
 Generalized callback, using std::function. More...
 
class  Callback1
 Templated callback with one argument. More...
 
class  Callback2
 Templated callback with two arguments. More...
 
class  Callback3
 Templated callback with three arguments. More...
 
class  Callback4
 
class  CallbackComponentVisitor
 ComponentVisitor which applies a callback function on each visited node. More...
 
class  CellReordering
 
struct  CellSortEntry
 
class  CellTable
 
class  Clock
 Clock class keeps representation of virtual/simulated time. More...
 
class  ColumnStorage
 Class that stores rows and columns of the matrix. More...
 
struct  ComplementaryElementT
 
struct  ComplementaryElementT< agxSIMD::Jacobian6DOFElement32 >
 
struct  ComplementaryElementT< agxSIMD::Jacobian6DOFElement64 >
 
struct  ComplementaryElementT< Jacobian6DOFElement32 >
 
struct  ComplementaryElementT< Jacobian6DOFElement64 >
 
class  Component
 A component is an object containing other objects, enabling hierarchical structuring. More...
 
class  ComponentVisitor
 Base class for ComponentVisitors. More...
 
class  ConeLimit
 Elementary secondary constraint to set a conic limit to a BallJoint. More...
 
class  ConeLimitAngle
 Implementation of angle for the cone limit. More...
 
class  ConeLimitData
 Basic data holder class for cone limit constraint data. More...
 
class  ConfigSingleton
 Class for holding a reference to the Config db for the core settings defined in the file "settings.cfg". More...
 
class  ConstantNormalForceOrientedBoxFrictionModel
 Oriented box friction model that uses the same normal force magnitude for all contact points associated to this friction model. More...
 
class  Constraint
 The base class for a constraint. More...
 
class  Constraint1DOF
 Specialization for constraints that have only one degree of freedom such as Hinge and Prismatic. More...
 
class  Constraint2DOF
 Specialization for constraints that have two degree of freedom such as Cylindrical. More...
 
class  ConstraintAngleBasedData
 Basic data holder class for "angle based" (secondary) constraints. More...
 
class  ConstraintImplementation
 
class  ConstraintNlmcpCallback
 Constraint solver callback interface with context and start rows for context. More...
 
class  ContactForceFilter
 A ContactForceFilter provide resting contact forces as seen through either an exponential moving average filter or a median filter. More...
 
class  ContactForceReader
 Class for reading contact forces between rigid bodies and geometries. More...
 
class  ContactMaterial
 This class store the combine material properties between two agx::Material's. More...
 
class  ContactNormal
 
class  ContactTangent
 
class  Container
 The Container is the base class for several of the container classes proided by AGX, such as agx::Vector and agx::HashSet. More...
 
class  CpuDevice
 Representation of the CPU. More...
 
class  CpuKernel
 A kernel which executes on the CPU using native C/C++ code. More...
 
class  CubicFunction2D
 
class  CubicSplineLookupTable
 Base class for spline interpolation between the inserted variable/value pairs. More...
 
class  CustomGravityField
 The custom gravity field allow a user to derive from this class and implement their own gravity function based on the center of mass of a particle/rigid body. More...
 
class  CylindricalJoint
 A cylindrical joint is similar to a prismatic joint but with an extra degree of freedom free (rotation around the axis). More...
 
class  CylindricalJointFrame
 Helper function to define the reference frame used by the prismatic constraint. More...
 
class  Date
 
class  Device
 An agx::Device is an abstract representation of a device on which data can be stored and processed. More...
 
class  DeviceGroup
 A device group contain other devices, enables hierarchical device structuring. More...
 
class  DirectMultiTangentsFrictionModel
 Friction model with an arbitrary number of tangents in the friction plane. More...
 
class  DirectSolverData
 
class  DistanceJoint
 This joint will preserve the initial distance between a body and a point in world coordinate or between two bodies. More...
 
class  Dot1
 Dot1 elementary constraint: Two orthogonal vectors. More...
 
class  Dot1Data
 Data holder class for elementary constraint Dot1. More...
 
class  Dot1Joint
 Given two vectors or directions, this constraint will keep the two vectors orthogonal. More...
 
class  Dot1Slack
 Dot1Slack is similar to the Dot1 elementary constraint but also supports slack and uses twice as many equations in the solver. More...
 
class  Dot1SlackData
 Extended Dot1Data with additional slack parameter. More...
 
class  Dot2
 Dot2 elementary constraint: Separation vector orthogonal to direction vector. More...
 
class  Dot2Data
 Data holder class for elementary constraint Dot2. More...
 
class  Dot2Slack
 Dot2Slack is similar to Dot2 elementary constraint. More...
 
class  Dot2SlackData
 Data holder class for elementary constraint Dot2Slack. More...
 
class  DynamicLibrary
 
class  DynamicsSystem
 The complete physical system with bodies, interactions, data layout, time stepper, and solver. More...
 
class  ElectricMotorController
 Implementation of a electric motor controller. More...
 
class  ElementaryConstraint
 Elementary constraint base class with interface and global constraint functionality. More...
 
class  ElementaryConstraintData
 Class to hold data for elementary constraints. More...
 
class  ElementaryConstraintN
 Helper class to hold data that is general for elementary constraints. More...
 
class  ElementaryConstraintNData
 
class  ElementaryContactPoint
 Base class of custom implementations of contact point constraints. More...
 
class  ElementaryContactPointFactory
 Interface factory for custom contact point constraint implementations. More...
 
class  ElementaryMultiTangentsContactPoint
 Elementary contact point supporting N >= 0 tangents. More...
 
class  ElementaryMultiTangentsContactPointFactory
 Factory for the ElementaryMultiTangentsContactPoint contact model. More...
 
class  Emitter
 Spawns new bodys inside a given volume. More...
 
class  EmptySolver
 Algorithm for an island without solve models. More...
 
class  EntityDataParameter
 Entity parameter. More...
 
class  EntityInstanceParameter
 EntityInstance parameter. More...
 
class  EntityPtrParameter
 EntityPtr parameter. More...
 
class  EulerAngles
 This class provides conversion services between Euler angles in any of the 24 conventions and corresponding quaternions and orthogonal 3x3 matrices. More...
 
class  EulerConvention
 
class  Event
 An event with no arguments. More...
 
class  Event1
 An event with one argument. More...
 
class  Event2
 An event with two arguments. More...
 
class  Event3
 An event with three arguments. More...
 
class  EventModel
 TODO: Documentation. More...
 
class  EventT
 An event has a list of listeners (agx::Callback), which are called when the event is triggered. More...
 
class  ForceField
 Fields produce force on physical bodies which have the appropriate charge. More...
 
class  Frame
 The object defining a frame of reference and providing transformations operations. More...
 
class  FrictionController
 Translational or rotational friction controller for Hinge, Prismatic and CylindricalJoint. More...
 
class  FrictionControllerNlCallback
 Solver callback class for elementary FrictionController. More...
 
class  FrictionModel
 Base class for all friction models with interface and some utility/necessary methods implemented. More...
 
class  GenericConstraint
 Generic constraint which by default is empty of elementary constraints. More...
 
class  GenericConstraintBodyData
 Constraint body data used with GenericElementaryConstraint containing the per body Jacobian data. More...
 
class  GenericConstraintComplianceMatrix
 Compliance matrix data containing the lower triangle (including the diagonal) of the compliance matrix of the constraint. More...
 
class  GenericConstraintData
 Constraint data used with GenericElementaryConstraint containing data such as; constraint violation, constraint velocity and bounds. More...
 
class  GenericElementaryConstraint
 Generic elementary constraint with minimal amount of user callbacks to reduce development/prototype time and trivially exported using SWIG to e.g., Python or C#. More...
 
class  GenericJsonParameter
 A template class that can be used to read/write a json property and set/get the value in another object. More...
 
class  GeometryContactConstraint
 Class matching geometry contacts given an execute filter and is solving each matching contact point with the given elementary constraint implementation. More...
 
class  GlobalResult
 GlobalResult is used by kernels to generate result data from different threads. More...
 
class  GlobalResultBuffer
 
class  GlobalResultStorage
 
class  GranularContactForceReader
 Class for reading contact forces between granular bodies and rigid bodies and geometries. More...
 
class  GranularDataExporter
 Class used to extract data from a granular journal, in the form of writing contact and particle data to file. More...
 
class  GranularImpactDataWriter
 
class  GranularReaderWriter
 Utility class for reading and writing granular body data to .csv, .agx and .aagx files. More...
 
class  GravityField
 The class GravityField is responsible for calculating and applying a gravity force on a set of bodies and particles. More...
 
struct  GridTier
 
struct  HashFn
 
struct  HashFn< agx::String >
 
struct  HashFn< const char * >
 
struct  HashFn< Int32 >
 
struct  HashFn< Int64 >
 
struct  HashFn< ref_ptr< T > >
 
struct  HashFn< std::pair< T1, T2 > >
 
struct  HashFn< std::string >
 
struct  HashFn< T * >
 
struct  HashFn< UInt32 >
 
struct  HashFn< UInt64 >
 
struct  HashFn< Vec2T< T > >
 
struct  HashFn< Vec3T< T > >
 
class  HashSet
 Inheritance with partial specialization due to bug with ref_ptr containers. More...
 
class  HashSet< agx::ref_ptr< KeyT >, HashT, AllocatorT >
 
class  HashSetImplementation
 Same as hash table, but only containing keys, not key-value pairs. More...
 
class  HashVector
 This class is a combined container which has the find complexity of a HashTable, deterministic iteration of a Vector (using begin(), end()). More...
 
class  HighAccuracyTimer
 The HighAccurayTimer class can replace the regular Timer class in high level applications where the need for accuracy is greater than performance. More...
 
class  HighLevelConstraintImplementation
 
class  Hinge
 The hinge constraint between two rigid bodies or one rigid body and the world. More...
 
class  HingeFrame
 Specialization for the constraint frame class that add convenient accessors/mutator methods for manipulation of the geometry of the frame for a Hinge. More...
 
class  HybridSolver
 Algorithm for hybrid solve. More...
 
class  ICloneable
 Interface class for a cloneable reference counted object. More...
 
class  Indentation
 
struct  IndexedRangeReal
 Data type to bind an index and ranges associated with it. More...
 
class  IndexLambdaKernel
 Utility entrance to the task system, simplifying parallelization of algorithms. More...
 
class  IndexListRange
 
class  IndexRangeT
 A range of indices. More...
 
class  IndexSet
 
class  InitCallback
 Do not use class directly. Use AGX_INIT_CALLBACK instead. More...
 
class  INlSolveDataH5
 
class  Interaction
 The base class for interactions. More...
 
class  InternalData
 Internal data for any object, ObjT, with methods: agx::Referenced* ObjT::getInternalData() const; void ObjT::setInternalData( agx::Referenced* data );. More...
 
class  InterruptException
 A specific exception thrown when a signal is caught, as the current simulation step is interrupted. More...
 
struct  InvalidIndexStruct
 Tag for invalid UInt values. More...
 
class  IslandEntry
 
class  IterativeProjectedConeFriction
 Iterative Projected Cone Friction (IPC friction) model. More...
 
class  Jacobian6DOFElementT
 
class  JacobianAccessorT
 
struct  JacobianMetaT
 
class  Job
 An abstract job/workblock representation, which allows work threads to execute arbitrary tasks. More...
 
class  JobGenerator
 Utility class used to generate jobs for ALL islands. More...
 
class  JobGroup
 A group of jobs to be executed. More...
 
class  Journal
 
class  JournalCustomDataRecorder
 
class  JsonDataDumpDebug
 
class  Kernel
 A kernel is an abstract representation of data parallel tasks. More...
 
class  LambdaKernel
 
class  LinearLookupTable
 Linear interpolation between the inserted variable/value pairs. More...
 
class  LinearProbingHashSet
 Inheritance with partial specialization due to bug with ref_ptr containers. More...
 
class  LinearProbingHashSet< agx::ref_ptr< KeyT >, HashT >
 
class  LinearProbingHashSetImplementation
 A cache-friendly hash set with open addressing, linear probing and power-of-two capacity. More...
 
class  LinearProbingHashTable
 Inheritance with partial specialization due to bug with ref_ptr containers. More...
 
class  LinearProbingHashTable< agx::ref_ptr< KeyT >, DataT, HashT, AllocatorT >
 
class  LinearProbingHashTableImplementation
 A cache-friendly hash table with open addressing, linear probing and power-of-two capacity. More...
 
class  LineT
 
class  List
 
class  LocalBodyContactJacobianT
 
struct  LocalOverlap
 
class  LocalRollingResistanceJacobianT
 
class  LocalTangentJacobianT
 
class  LockController
 Elementary secondary constraint to keep constraint angle at a given target position. More...
 
class  LockJoint
 Constraint that removes all 6 DOF between two bodies, or one body and the world. More...
 
class  Logger
 Logger is a class for writing information, debug info, warnings but also throwing exceptions in a stream-alike way. More...
 
class  LoggerSubscriber
 Class for polling messages from the LOGGER system in a Subscriber pattern. More...
 
class  LogicalStructure
 
class  LogStream
 Class for printing out messages to console, file, virtual method and or a callback function. More...
 
class  LookupTable
 Return a value of y given any value of x. More...
 
class  LSquareComplianceMatrix
 Interface to the lower triangle of the compliance matrix block in the system matrix. More...
 
class  LSquareComplianceMatrixRow
 Interface to a row in the compliance matrix. More...
 
class  MarchingCubes
 
class  MassProperties
 Class for rigid body inertia tensor and mass. More...
 
class  Material
 Main material class which acts as a holder of a Surface Material and a Bulk material. More...
 
class  MaterialLibrary
 Class with functionality to view items in the Material Library and load Materials. More...
 
class  MaterialReaderWriter
 Utility class for reading and writing Materials. More...
 
class  Matrix3x3T
 
class  Matrix4x4T
 Matrix class for affine transformations. More...
 
class  MatrixType
 A class to distinguish between various types of matrices, both in terms of storage properties, i.e., dense or sparse, or lower or upper triangular in the case of symmetric matrices. More...
 
class  McpAlgorithmStats
 Storage location for solver statistics. More...
 
class  MemoryPool
 Memory pool. More...
 
class  MemoryPoolOld
 
class  MergedBody
 Structure holding several "normal" rigid bodies. More...
 
class  MixedLCPOld
 Definition of a mixed LCP problem. More...
 
class  MLCP
 
class  Model
 A model is an abstract representation of the class of an agx::Object. More...
 
class  Name
 Representation of a name string. More...
 
class  Namespace
 A namespace is used as a group node in the agx::Model hierarchy. More...
 
class  NlmcpCallback
 Interface class for solver callbacks. More...
 
struct  NlmcpCallbackSolverData
 Data from the solver the ConstraintNlmcpCallback is part of. More...
 
class  NlMixedCp
 Class that implements a method to solve linear- or nonlinear complementary problems. More...
 
class  Notify
 Class for handling logging of messages. More...
 
class  NotifyCallback
 Callback class, derive from this and Register to the notify singleton to get callbacks. More...
 
class  Object
 agx::Object is a refcounted object with a name. More...
 
class  ObjectWrapper
 
class  observer_ptr
 Smart pointer for observed objects, that automatically set pointers to them to null when they deleted. More...
 
class  ObserverFrame
 With this class you can attach an ObserverFrame object relative to a RigidBody. More...
 
class  OctaveDumper
 
class  OrientedBoxFrictionModel
 Box friction model with oriented friction box. More...
 
class  OrientedFrictionModelImpl
 Oriented friction box base implementation containing a frame of reference and the primary direction given in that frame. More...
 
class  OrientedIterativeProjectedConeFrictionModel
 Iterative projected cone friction model with oriented friction box. More...
 
class  OrientedScaleBoxFrictionModel
 Scale box friction model with oriented friction box. More...
 
class  OrthoMatrix3x3
 Specialized types of matrices for holding orthogonal transformation matrices. More...
 
class  ParallelRaContainerKernel
 
class  ParallelTask
 ParallelTask. More...
 
class  Parameter
 A representation of a task/kernel parameter, which can be bound using a string path or explicitly to a data node. More...
 
class  ParameterBinding
 A binding between a formal function parameter and an actual value. More...
 
class  ParticleBodyContactJacobianT
 
class  ParticleContactSensor
 This class is for detecting and handling particle collisions with geometries in the simulation. More...
 
class  ParticleContactWire
 
class  ParticleEmitter
 Spawns new particles inside a given volume given to the Emitter. More...
 
class  ParticleParticleContactJacobianT
 
class  ParticleSink
 A sink which destroys particles. More...
 
class  ParticleSystem
 A basic particle system that contains all the storages and buffers required for basic operation and also a rendering task. More...
 
class  Path
 Representation of a path, a list of name components. More...
 
class  PlaneJoint
 
class  PlaneT
 Class representing the mathematical concept of a plane, also called a half- space. More...
 
class  Point2D
 
class  Pointer
 A pointer to an agx::Object. More...
 
class  PointerParameter
 Pointer parameter. More...
 
class  PointerT
 
class  PointGravityField
 The class PointGravityField calculates a gravity which is uniform in magnitude over the entire space and directed from the given position outwards from origin. More...
 
class  Prismatic
 A prismatic joint keeps a fixed relative orientation between the attached bodies but allows them to slide along a given axis. More...
 
class  PrismaticFrame
 Helper function to define the reference frame used by the prismatic constraint. More...
 
class  PrismaticUniversalJoint
 A Prismatic Universal Joint has two translational dof's constrained. More...
 
class  PropertyContainer
 Class that is a container of named properties. More...
 
class  PureDirectSolver
 Algorithm for pure direct solve. More...
 
class  PureIterativeSolver
 Algorithm for pure iterative solve. More...
 
class  QuadraticProbingHashTable
 Inheritance with partial specialization due to bug with ref_ptr containers. More...
 
class  QuadraticProbingHashTable< agx::ref_ptr< KeyT >, DataT, HashT, AllocatorT >
 
class  QuadraticProbingHashTableImplementation
 A simple hash table using quadratic probing. More...
 
class  QuatLock
 Locks the three rotational degrees of freedom (relative coordinates). More...
 
class  QuatLockData
 Data holder class for elementary constraint QuatLock. More...
 
class  QuatT
 The object holding quaternions and providing operations on these. More...
 
class  RandomGenerator
 
class  Range
 A range object has a min and max value of a given type and provides services to tell whether a value is in that range or not. More...
 
class  Range6T
 
class  RangeController
 Elementary secondary constraint to keep constraint angle within two given values. More...
 
class  RangeJob
 A range job executes a kernel implementation on a subset of the data. More...
 
class  RangeJobT
 
class  RangeViolation
 This class will store a computed violation of a range. More...
 
class  ReaderWriterLock
 ReaderWriterLock provides shared access for readers and exclusive access for writers. More...
 
class  RealEntry
 SparseInverse holds a subset of the columns of the inverse of a given sparse matrix. More...
 
class  RealTimeClock
 
class  RealTimeTrigger
 
class  ref_ptr
 Smart pointer for handling referenced counted objects. More...
 
class  Referenced
 Base class providing referencing counted objects. More...
 
class  ReferencedModel
 Abstract description of the data attributes for the Referenced entity. More...
 
class  ReferencedPtr
 Pointer to a entity instance of type Referenced. More...
 
struct  RefPtrAccessor
 
class  RefWrapper
 Utility class to be able to use reference counting on objects which does not support it natively. More...
 
class  RegularizationParameters
 All ghost variables have compliance and damping attributes. More...
 
class  RigidBody
 The rigid body class, combining a geometric model and a frame of reference. More...
 
class  RigidBodyAttachment
 Constraint attachment class for agx::RigidBody. More...
 
class  RigidBodyEmitter
 Spawns new Rigid Bodies inside a volume given to the Emitter. More...
 
class  RigidParticleSystem
 A specialization of the particle system that simulates the particles as a set of hard core spheres. More...
 
class  RollingResistanceJacobianT
 
class  RotationalAngle
 Implementation of constraint angle ABOUT an axis. More...
 
class  RowAllocator
 Class to allocate an array of elements where some other structure works on pointer. More...
 
class  Runtime
 The Runtime class will read a license file upon creation and check what configuration is allowed to run. More...
 
class  ScalarParameter
 Scalar parameter. More...
 
class  ScaleBoxFrictionModel
 Scale box friction. More...
 
class  ScrewController
 
class  SeparationAngle
 Implementation of constraint angle ALONG an axis. More...
 
class  SerialTask
 SerialTask. More...
 
class  SetVector
 This class is a combined container which has the find complexity of a HashTable, deterministic iteration of a Vector (using begin(), end()). More...
 
class  ShutdownCallback
 
struct  SimpleContactMaterial
 
class  Singleton
 Base class for Singletons that should have its shutdown called explicitly before exit of the application. More...
 
class  Slack3ConstraintData
 Generic class for holding constraint data including 3 slack parameters. More...
 
class  SlackCylindricalJoint
 A constraint that is equal to the. More...
 
class  SlackHingeJoint
 A constraint that is equal to the. More...
 
class  SlackLockJoint
 A constraint that is equal to the. More...
 
class  SlackPrismaticJoint
 A constraint that is equal to the. More...
 
class  SolveAlgorithm
 Parent class for solve algorithms compatible with the constraint framework. More...
 
class  SolveIslandSplitAlgorithm
 The rigid body class, combining a geometric model and a frame of reference. More...
 
class  SparseInverse
 
class  SparseMatrix
 agx::SparseMatrix holds a matrix representation which contains the data. More...
 
class  SparseMatrixRep
 SparseMatrixRep. More...
 
class  SparseMatrixRepSabre
 
class  SparseRangeReal
 Essentially a sparse array of bounds. More...
 
class  SparseVector
 A sparse vector here is an Vector of entries with a few additional operations for creation and sorting. More...
 
class  SPDMatrix3x3
 Specialized type of matrices for holding symmetric positive definite matrices. More...
 
class  Spherical
 Spherical elementary constraint: Two points in world coincide. More...
 
class  SphericalRel
 Spherical elementary constraint: Two points in world coincide. More...
 
class  SphericalRelSlack
 SphericalRelSalck is similar to the SphericalRel elementary constraint, but also supports slack and uses twice as many equations in the solver. More...
 
class  SpinMutex
 Spin-lock mutex. More...
 
class  SplineJoint
 A SplineJoint is a constraint with a motor/range/lock for translation/rotation that will restrict a body to move along a spline path. More...
 
class  SplitNode
 
class  SplitNodeSeparator
 
class  StabilityReport
 
class  StackAllocator
 The StackAllocator class is designed to be used with the STL vector class. More...
 
class  StackArray
 Templated stack array class. More...
 
class  StaticDataInitializer
 
class  StaticInitializer
 
class  StaticShutdown
 
class  Statistics
 Base statistics gathering class. More...
 
class  StatisticsFrameReader
 
class  Stream
 TODO: Documentation. More...
 
class  StrongInteraction
 Base class for a strong interaction concept where there interaction is defined in the mass matrix part of the system matrix. More...
 
class  StrongInteractionConstraint
 EXPERIMENTAL. More...
 
class  SurfaceMaterial
 Physical properties for the surface of a Material. More...
 
class  Swing
 Swing elementary constraint: Two orthogonal vectors with hookean behaviour. More...
 
class  SwingData
 Data holder class for elementary swing constraint. More...
 
class  SwingTwistLock
 Constraint that removes all 6 DOF between two bodies, or one body and the world. More...
 
class  SymmetricPair
 A std::pair, with both elements of the same type, and symmetric so (a, b) == (b, a) More...
 
class  SystemInformation
 
class  TangentJacobianT
 
class  TargetSpeedController
 Elementary secondary constraint to drive something given target speed (translational or rotational). More...
 
class  Task
 A representation of a generic task. More...
 
class  TaskGroup
 TaskGroup. More...
 
class  TaskJob
 A task job is a job which executes an agx::Task. More...
 
class  TaskLoadError
 
class  TaskManager
 
class  TaskPlugin
 
class  TaskPluginImplementation
 
class  TaskPluginImplementationT
 
class  Thread
 agx::Thread is a representation of an OS specific implementation of a computational thread. More...
 
class  ThreadLocalAllocator
 
class  ThreadTask
 
class  ThreadTimelineEntryModel
 Abstract description of the data attributes for the ThreadTimelineEntry entity. More...
 
class  ThreadTimelineEntryPtr
 Pointer to a entity instance of type ThreadTimelineEntry. More...
 
class  TimeGovernor
 
class  Timer
 The Timer class permits timing execution speed with the same refinement as the built in hardware clock of the CPU. More...
 
struct  TimingInfo
 
class  Twist
 Twist elementary constraint. More...
 
class  TwistData
 Data holder class for elementary constraint Twist. More...
 
class  TwistRangeController
 Twist range elementary constraint. More...
 
union  uint32_t_union
 
class  UniformGravityField
 The class UniformGravityField calculates a gravity which is uniform in magnitude over the entire space and directed along a specified vector. More...
 
struct  UniqueIdStruct_
 Struct holding information about a Unique Id. More...
 
class  UniversalJoint
 A Universal Joint has one fixed relative point, the 3 translational dof's, and one constrained axis (the rotation around the N axis of each frame the bodies) More...
 
class  UnresolvedParameter
 Unresolved parameter. More...
 
class  UnresolvedTask
 
class  Uuid
 A UUID, or Universally unique identifier, is intended to uniquely identify information in a distributed environment without significant central coordination. More...
 
class  UuidGenerator
 Generator of UUID values based on V4 http://en.wikipedia.org/wiki/Universally_unique_identifier. More...
 
class  Vec2T
 
class  Vec3T
 A class holding 3 dimensional vectors and providing basic arithmetic. More...
 
class  Vec4T
 A class holding 4 dimensional vectors and providing basic arithmetic. More...
 
class  Vec6
 
class  Vector
 Templated vector class. More...
 
class  VectorPOD
 Vector containing 'raw' data. More...
 
class  VirtualConstraintInertia
 This class will add a virtual inertia along or around the constraint axis (N-axis), which will affect the resulting rotational or translational acceleration on the affected rigid bodies. More...
 
class  WaitJob
 A job used as a synchronization utility when waiting for another job to complete. More...
 
class  WireContactBendConstraint
 
class  WireContactConstraint
 A one row constraint. More...
 
class  WireContactDistanceConstraint
 
class  WireContactFrictionConstraint
 
class  WireContactSolver
 Given a wire, and positions along the wire, we solve for new contact positions. More...
 
class  WireContactSpringConstraint
 Ad-hoc constraint to find normalforces (it is a distanceconstraint in normaldirection of the contact nodes) More...
 
class  WireMaterial
 Physical properties for the contact between a Geometry and an agx::Wire. More...
 
class  WireParticle
 
class  WorldFrameBallJoint
 Special version of a ball joint where the spatial reference frame is world for the body/bodies. More...
 
struct  XmlLoaderRegistrator
 

Typedefs

typedef agx::observer_ptr< const AddedMassInteractionAddedMassInteractionConstObserver
 
typedef agx::ref_ptr< const AddedMassInteractionAddedMassInteractionConstRef
 
typedef ref_ptr< AddedMassInteractionHandlerAddedMassInteractionHandlerRef
 
typedef agx::observer_ptr< AddedMassInteractionAddedMassInteractionObserver
 
typedef agx::ref_ptr< AddedMassInteractionAddedMassInteractionRef
 
typedef AffineMatrix4x4T< RealAffineMatrix4x4
 
typedef AffineMatrix4x4T< Real64AffineMatrix4x4d
 
typedef VectorPOD< AffineMatrix4x4dAffineMatrix4x4dVector
 
typedef AffineMatrix4x4T< Real32AffineMatrix4x4f
 
typedef VectorPOD< AffineMatrix4x4fAffineMatrix4x4fVector
 
using AffineMatrix4x4Vector = VectorPOD< AffineMatrix4x4 >
 
typedef agx::observer_ptr< const AnalysisBoxAnalysisBoxConstObserver
 
typedef agx::ref_ptr< const AnalysisBoxAnalysisBoxConstRef
 
typedef agx::observer_ptr< AnalysisBoxAnalysisBoxObserver
 
typedef agx::ref_ptr< AnalysisBoxAnalysisBoxRef
 
typedef agx::Vector< AngleRefAngleContainer
 
typedef agx::ref_ptr< AngleAngleRef
 
typedef ref_ptr< AngularJointBaseAngularJointBaseRef
 
typedef ref_ptr< AngularLockJointAngularLockJointRef
 
typedef agx::observer_ptr< const ArrayParameterArrayParameterConstObserver
 
typedef agx::ref_ptr< const ArrayParameterArrayParameterConstRef
 
typedef agx::observer_ptr< ArrayParameterArrayParameterObserver
 
typedef agx::Vector< ArrayParameterObserverArrayParameterObserverVector
 
typedef agx::VectorPOD< ArrayParameter * > ArrayParameterPtrVector
 
typedef agx::ref_ptr< ArrayParameterArrayParameterRef
 
typedef agx::Vector< ArrayParameterRefArrayParameterRefVector
 
using AtomicValue = AtomicValueT< agx::Int32 >
 agx::AtomicValue is an alias for agx::AtomicValueT<agx::Int32>
 
typedef VectorPOD< Attachment * > AttachmentPtrVector
 
typedef agx::ref_ptr< AttachmentAttachmentRef
 
typedef ref_ptr< BallJointBallJointRef
 
typedef BodyBodyContactJacobianT< Vec3BodyBodyContactJacobian
 
typedef BodyBodyContactJacobianT< Vec3fBodyBodyContactJacobian32
 
typedef BodyBodyContactJacobianT< Vec3dBodyBodyContactJacobian64
 
typedef BodyContactJacobianT< Jacobian6DOFElementBodyContactJacobian
 
typedef BodyContactJacobianT< Jacobian6DOFElement32BodyContactJacobian32
 
typedef BodyContactJacobianT< Jacobian6DOFElement64BodyContactJacobian64
 
typedef bool Bool
 
typedef std::valarray< agx::BoolBoolValarray
 Data type used for selecting sub-matrices.
 
typedef VectorPOD< BoolBoolVector
 
typedef BoundT< RealBound1
 
typedef BoundT< Real64Bound1d
 
typedef BoundT< Real32Bound1f
 
typedef BoundT< IntBound1i
 
typedef BoundT< Int32Bound1i32
 
typedef BoundT< Int64Bound1i64
 
typedef BoundT< UIntBound1u
 
typedef BoundT< UInt32Bound1u32
 
typedef BoundT< UInt64Bound1u64
 
typedef BoundT< Vec2Bound2
 
typedef BoundT< Vec2dBound2d
 
typedef BoundT< Vec2fBound2f
 
typedef BoundT< Vec2iBound2i
 
typedef BoundT< Vec2i32Bound2i32
 
typedef BoundT< Vec2i64Bound2i64
 
typedef BoundT< Vec2uBound2u
 
typedef BoundT< Vec2u32Bound2u32
 
typedef BoundT< Vec2u64Bound2u64
 
typedef BoundT< Vec3Bound3
 
typedef BoundT< Vec3dBound3d
 
typedef BoundT< Vec3fBound3f
 
typedef BoundT< Vec3iBound3i
 
typedef BoundT< Vec3i32Bound3i32
 
typedef BoundT< Vec3i64Bound3i64
 
typedef BoundT< Vec3uBound3u
 
typedef BoundT< Vec3u32Bound3u32
 
typedef BoundT< Vec3u64Bound3u64
 
typedef agx::ref_ptr< BoxedHybridPivotAlgorithmBoxedHybridPivotAlgorithmRef
 
typedef agx::ref_ptr< BoxedKellerAlgorithmBoxedKellerAlgorithmRef
 
typedef agx::ref_ptr< BoxedMurtyAlgorithmBoxedMurtyAlgorithmRef
 
typedef agx::observer_ptr< const BoxFrictionModelBoxFrictionModelConstObserver
 
typedef agx::ref_ptr< const BoxFrictionModelBoxFrictionModelConstRef
 
typedef agx::observer_ptr< BoxFrictionModelBoxFrictionModelObserver
 
typedef agx::ref_ptr< BoxFrictionModelBoxFrictionModelRef
 
typedef agx::observer_ptr< const BulkMaterialBulkMaterialConstObserver
 
typedef agx::ref_ptr< const BulkMaterialBulkMaterialConstRef
 
typedef agx::observer_ptr< BulkMaterialBulkMaterialObserver
 
typedef agx::ref_ptr< BulkMaterialBulkMaterialRef
 
typedef agx::observer_ptr< const CellReorderingCellReorderingConstObserver
 
typedef agx::ref_ptr< const CellReorderingCellReorderingConstRef
 
typedef agx::observer_ptr< CellReorderingCellReorderingObserver
 
typedef agx::ref_ptr< CellReorderingCellReorderingRef
 
typedef VectorPOD< char > CharVector
 
typedef agx::observer_ptr< const ClockClockConstObserver
 
typedef agx::ref_ptr< const ClockClockConstRef
 
typedef agx::observer_ptr< ClockClockObserver
 
typedef agx::Vector< ClockObserverClockObserverVector
 
typedef agx::VectorPOD< Clock * > ClockPtrVector
 
typedef agx::ref_ptr< ClockClockRef
 
typedef agx::Vector< ClockRefClockRefVector
 
typedef agx::observer_ptr< const ComponentComponentConstObserver
 
typedef agx::ref_ptr< const ComponentComponentConstRef
 
typedef agx::observer_ptr< ComponentComponentObserver
 
typedef agx::Vector< ComponentObserverComponentObserverVector
 
typedef agx::VectorPOD< Component * > ComponentPtrVector
 
typedef agx::ref_ptr< ComponentComponentRef
 
typedef agx::Vector< ComponentRefComponentRefVector
 
using Condition = std::condition_variable
 
typedef ref_ptr< ConeLimitAngleConeLimitAngleRef
 
typedef agx::ref_ptr< ConeLimitConeLimitRef
 
typedef agx::observer_ptr< const Constraint1DOFConstraint1DOFConstObserver
 
typedef agx::ref_ptr< const Constraint1DOFConstraint1DOFConstRef
 
typedef agx::observer_ptr< Constraint1DOFConstraint1DOFObserver
 
typedef agx::Vector< Constraint1DOFObserverConstraint1DOFObserverVector
 
typedef agx::VectorPOD< Constraint1DOF * > Constraint1DOFPtrVector
 
typedef agx::ref_ptr< Constraint1DOFConstraint1DOFRef
 
typedef agx::Vector< Constraint1DOFRefConstraint1DOFRefVector
 
typedef agx::observer_ptr< const Constraint2DOFConstraint2DOFConstObserver
 
typedef agx::ref_ptr< const Constraint2DOFConstraint2DOFConstRef
 
typedef agx::observer_ptr< Constraint2DOFConstraint2DOFObserver
 
typedef agx::ref_ptr< Constraint2DOFConstraint2DOFRef
 
typedef agx::observer_ptr< const ConstraintConstraintConstObserver
 
using ConstraintConstPtrSet = agx::HashSet< const agx::Constraint * >
 
using ConstraintConstRef = agx::ref_ptr< const Constraint >
 
typedef agx::HashTable< int, ConstraintImplementation * > ConstraintImplementationHashTable
 
typedef HashTable< ConstraintImplementation *, int > ConstraintImplementationPtrIntHashTable
 
typedef VectorPOD< ConstraintImplementation * > ConstraintImplPtrVector
 
using ConstraintNlmcpCallbackRef = ref_ptr< ConstraintNlmcpCallback >
 
typedef agx::observer_ptr< ConstraintConstraintObserver
 
typedef agx::Vector< ConstraintObserverConstraintObserverVector
 
typedef agx::VectorPOD< Constraint * > ConstraintPtrVector
 
using ConstraintRef = agx::ref_ptr< Constraint >
 
using ConstraintRefSetVector = agx::SetVector< ref_ptr< Constraint > >
 
using ConstraintRefVector = agx::Vector< ConstraintRef >
 
typedef Vector< RigidBody * > ConstraintRigidBodyContainer
 
typedef ref_ptr< ContactForceReaderContactForceReaderRef
 
typedef agx::observer_ptr< const ContactMaterialContactMaterialConstObserver
 
typedef agx::ref_ptr< const ContactMaterialContactMaterialConstRef
 
typedef agx::observer_ptr< ContactMaterialContactMaterialObserver
 
typedef agx::Vector< const agx::ContactMaterial * > ContactMaterialPtrVector
 
typedef agx::ref_ptr< ContactMaterialContactMaterialRef
 
typedef agx::SetVector< agx::ref_ptr< agx::ContactMaterial > > ContactMaterialRefSetVector
 
typedef agx::Vector< agx::ref_ptr< agx::ContactMaterial > > ContactMaterialRefVector
 
typedef agx::ref_ptr< ContactNormalContactNormalRef
 
typedef agx::ref_ptr< ContactTangentContactTangentRef
 
typedef agx::HashTable< Vec3i, agx::Physics::HierarchicalGrid::ContactZonePtr > ContactZoneTable
 
typedef agx::observer_ptr< const CpuDeviceCpuDeviceConstObserver
 
typedef agx::ref_ptr< const CpuDeviceCpuDeviceConstRef
 
typedef agx::observer_ptr< CpuDeviceCpuDeviceObserver
 
typedef agx::ref_ptr< CpuDeviceCpuDeviceRef
 
typedef agx::observer_ptr< const CpuKernelCpuKernelConstObserver
 
typedef agx::ref_ptr< const CpuKernelCpuKernelConstRef
 
typedef agx::observer_ptr< CpuKernelCpuKernelObserver
 
typedef agx::Vector< CpuKernelObserverCpuKernelObserverVector
 
typedef agx::VectorPOD< CpuKernel * > CpuKernelPtrVector
 
typedef agx::ref_ptr< CpuKernelCpuKernelRef
 
typedef agx::Vector< CpuKernelRefCpuKernelRefVector
 
typedef agx::Bool(* CreateElementaryConstraintsFunction) (class HighLevelConstraintImplementation *)
 
typedef agx::ref_ptr< CubicFunction2DCubicFunction2DRef
 
typedef agx::ref_ptr< CubicSplineLookupTableCubicSplineLookupTableRef
 
typedef agx::observer_ptr< const CustomGravityFieldCustomGravityFieldConstObserver
 
typedef agx::ref_ptr< const CustomGravityFieldCustomGravityFieldConstRef
 
typedef agx::observer_ptr< CustomGravityFieldCustomGravityFieldObserver
 
typedef agx::ref_ptr< CustomGravityFieldCustomGravityFieldRef
 
typedef ref_ptr< CylindricalJointCylindricalJointRef
 
typedef agx::observer_ptr< const DateDateConstObserver
 
typedef agx::ref_ptr< const DateDateConstRef
 
typedef agx::observer_ptr< DateDateObserver
 
typedef agx::ref_ptr< DateDateRef
 
typedef agx::observer_ptr< const DeviceDeviceConstObserver
 
typedef agx::ref_ptr< const DeviceDeviceConstRef
 
typedef agx::observer_ptr< const DeviceGroupDeviceGroupConstObserver
 
typedef agx::ref_ptr< const DeviceGroupDeviceGroupConstRef
 
typedef agx::observer_ptr< DeviceGroupDeviceGroupObserver
 
typedef agx::ref_ptr< DeviceGroupDeviceGroupRef
 
typedef agx::observer_ptr< DeviceDeviceObserver
 
typedef agx::ref_ptr< DeviceDeviceRef
 
typedef agx::observer_ptr< const DirectMultiTangentsFrictionModelDirectMultiTangentsFrictionModelConstObserver
 
typedef agx::ref_ptr< const DirectMultiTangentsFrictionModelDirectMultiTangentsFrictionModelConstRef
 
typedef agx::observer_ptr< DirectMultiTangentsFrictionModelDirectMultiTangentsFrictionModelObserver
 
typedef agx::ref_ptr< DirectMultiTangentsFrictionModelDirectMultiTangentsFrictionModelRef
 
typedef agx::observer_ptr< const DirectSolverDataDirectSolverDataConstObserver
 
typedef agx::ref_ptr< const DirectSolverDataDirectSolverDataConstRef
 
typedef agx::observer_ptr< DirectSolverDataDirectSolverDataObserver
 
typedef agx::ref_ptr< DirectSolverDataDirectSolverDataRef
 
typedef ref_ptr< DistanceJointDistanceJointRef
 
typedef ref_ptr< Dot1JointDot1JointRef
 
typedef agx::ref_ptr< Dot1Dot1Ref
 
typedef agx::ref_ptr< Dot1SlackDot1SlackRef
 
typedef agx::ref_ptr< Dot2Dot2Ref
 
typedef std::vector< bool > DynamicBitSet
 
typedef agx::observer_ptr< const DynamicLibraryDynamicLibraryConstObserver
 
typedef agx::ref_ptr< const DynamicLibraryDynamicLibraryConstRef
 
typedef agx::observer_ptr< DynamicLibraryDynamicLibraryObserver
 
typedef agx::ref_ptr< DynamicLibraryDynamicLibraryRef
 
typedef ref_ptr< DynamicsSystemDynamicsSystemRef
 
typedef agx::ref_ptr< ElectricMotorControllerElectricMotorControllerRef
 
typedef agx::ref_ptr< ElementaryConstraintElementaryConstraintRef
 
typedef agx::observer_ptr< const ElementaryContactPointElementaryContactPointConstObserver
 
typedef agx::ref_ptr< const ElementaryContactPointElementaryContactPointConstRef
 
typedef agx::observer_ptr< const ElementaryContactPointFactoryElementaryContactPointFactoryConstObserver
 
typedef agx::ref_ptr< const ElementaryContactPointFactoryElementaryContactPointFactoryConstRef
 
typedef agx::observer_ptr< ElementaryContactPointFactoryElementaryContactPointFactoryObserver
 
typedef agx::ref_ptr< ElementaryContactPointFactoryElementaryContactPointFactoryRef
 
typedef agx::observer_ptr< ElementaryContactPointElementaryContactPointObserver
 
typedef agx::ref_ptr< ElementaryContactPointElementaryContactPointRef
 
using ElementaryContactPointRefVector = Vector< ElementaryContactPointRef >
 
typedef agx::observer_ptr< const ElementaryMultiTangentsContactPointElementaryMultiTangentsContactPointConstObserver
 
typedef agx::ref_ptr< const ElementaryMultiTangentsContactPointElementaryMultiTangentsContactPointConstRef
 
typedef agx::observer_ptr< const ElementaryMultiTangentsContactPointFactoryElementaryMultiTangentsContactPointFactoryConstObserver
 
typedef agx::ref_ptr< const ElementaryMultiTangentsContactPointFactoryElementaryMultiTangentsContactPointFactoryConstRef
 
typedef agx::observer_ptr< ElementaryMultiTangentsContactPointFactoryElementaryMultiTangentsContactPointFactoryObserver
 
typedef agx::ref_ptr< ElementaryMultiTangentsContactPointFactoryElementaryMultiTangentsContactPointFactoryRef
 
typedef agx::observer_ptr< ElementaryMultiTangentsContactPointElementaryMultiTangentsContactPointObserver
 
typedef agx::ref_ptr< ElementaryMultiTangentsContactPointElementaryMultiTangentsContactPointRef
 
typedef agx::observer_ptr< const EmitterEmitterConstObserver
 
typedef agx::ref_ptr< const EmitterEmitterConstRef
 
typedef agx::observer_ptr< EmitterEmitterObserver
 
typedef agx::Vector< EmitterObserverEmitterObserverVector
 
typedef agx::VectorPOD< Emitter * > EmitterPtrVector
 
typedef agx::ref_ptr< EmitterEmitterRef
 
typedef agx::SetVector< ref_ptr< Emitter > > EmitterRefSetVector
 
typedef agx::Vector< EmitterRefEmitterRefVector
 
typedef agx::observer_ptr< const EntityDataParameterEntityDataParameterConstObserver
 
typedef agx::ref_ptr< const EntityDataParameterEntityDataParameterConstRef
 
typedef agx::observer_ptr< EntityDataParameterEntityDataParameterObserver
 
typedef agx::Vector< EntityDataParameterObserverEntityDataParameterObserverVector
 
typedef agx::VectorPOD< EntityDataParameter * > EntityDataParameterPtrVector
 
typedef agx::ref_ptr< EntityDataParameterEntityDataParameterRef
 
typedef agx::Vector< EntityDataParameterRefEntityDataParameterRefVector
 
typedef agx::observer_ptr< const EntityInstanceParameterEntityInstanceParameterConstObserver
 
typedef agx::ref_ptr< const EntityInstanceParameterEntityInstanceParameterConstRef
 
typedef agx::observer_ptr< EntityInstanceParameterEntityInstanceParameterObserver
 
typedef agx::Vector< EntityInstanceParameterObserverEntityInstanceParameterObserverVector
 
typedef agx::VectorPOD< EntityInstanceParameter * > EntityInstanceParameterPtrVector
 
typedef agx::ref_ptr< EntityInstanceParameterEntityInstanceParameterRef
 
typedef agx::Vector< EntityInstanceParameterRefEntityInstanceParameterRefVector
 
typedef agx::observer_ptr< const EntityPtrParameterEntityPtrParameterConstObserver
 
typedef agx::ref_ptr< const EntityPtrParameterEntityPtrParameterConstRef
 
typedef agx::observer_ptr< EntityPtrParameterEntityPtrParameterObserver
 
typedef agx::Vector< EntityPtrParameterObserverEntityPtrParameterObserverVector
 
typedef agx::VectorPOD< EntityPtrParameter * > EntityPtrParameterPtrVector
 
typedef agx::ref_ptr< EntityPtrParameterEntityPtrParameterRef
 
typedef agx::Vector< EntityPtrParameterRefEntityPtrParameterRefVector
 
typedef std::runtime_error Error
 
typedef agx::observer_ptr< const EventModelEventModelConstObserver
 
typedef agx::ref_ptr< const EventModelEventModelConstRef
 
typedef agx::observer_ptr< EventModelEventModelObserver
 
typedef agx::ref_ptr< EventModelEventModelRef
 
typedef agx::VectorPOD< FluidContactPoint > FluidContactVector
 
typedef HashTable< RigidBody *, FluidContactVector *, FluidHasher > FluidParticleHash
 
typedef agx::observer_ptr< const FrameFrameConstObserver
 
typedef agx::ref_ptr< const FrameFrameConstRef
 
typedef agx::observer_ptr< FrameFrameObserver
 
typedef agx::ref_ptr< FrameFrameRef
 
typedef agx::ref_ptr< FrictionControllerFrictionControllerRef
 
typedef agx::SetVector< ref_ptr< FrictionController > > FrictionControllerRefSetVector
 
typedef agx::observer_ptr< const FrictionModelFrictionModelConstObserver
 
typedef agx::ref_ptr< const FrictionModelFrictionModelConstRef
 
typedef agx::observer_ptr< FrictionModelFrictionModelObserver
 
typedef agx::ref_ptr< FrictionModelFrictionModelRef
 
typedef void(* FunctionHandle) ()
 
using GenericConstraintComplianceMatrixRef = agx::ref_ptr< GenericConstraintComplianceMatrix >
 
typedef agx::observer_ptr< const GeometryContactConstraintGeometryContactConstraintConstObserver
 
typedef agx::ref_ptr< const GeometryContactConstraintGeometryContactConstraintConstRef
 
typedef agx::observer_ptr< GeometryContactConstraintGeometryContactConstraintObserver
 
typedef agx::ref_ptr< GeometryContactConstraintGeometryContactConstraintRef
 
typedef agx::observer_ptr< const GlobalResultBufferGlobalResultBufferConstObserver
 
typedef agx::ref_ptr< const GlobalResultBufferGlobalResultBufferConstRef
 
typedef agx::observer_ptr< GlobalResultBufferGlobalResultBufferObserver
 
typedef agx::ref_ptr< GlobalResultBufferGlobalResultBufferRef
 
typedef agx::observer_ptr< const GlobalResultStorageGlobalResultStorageConstObserver
 
typedef agx::ref_ptr< const GlobalResultStorageGlobalResultStorageConstRef
 
typedef agx::observer_ptr< GlobalResultStorageGlobalResultStorageObserver
 
typedef agx::ref_ptr< GlobalResultStorageGlobalResultStorageRef
 
typedef ref_ptr< GranularContactForceReaderGranularContactForceReaderRef
 
typedef agx::observer_ptr< const GranularImpactDataWriterGranularImpactDataWriterConstObserver
 
typedef agx::ref_ptr< const GranularImpactDataWriterGranularImpactDataWriterConstRef
 
typedef agx::observer_ptr< GranularImpactDataWriterGranularImpactDataWriterObserver
 
typedef agx::ref_ptr< GranularImpactDataWriterGranularImpactDataWriterRef
 
typedef agx::observer_ptr< const GravityFieldGravityFieldConstObserver
 
typedef agx::ref_ptr< const GravityFieldGravityFieldConstRef
 
typedef agx::observer_ptr< GravityFieldGravityFieldObserver
 
typedef agx::ref_ptr< GravityFieldGravityFieldRef
 
typedef CellTable< Vec2iGridCell2DTable
 
typedef CellTable< Vec3iGridCellTable
 
template<typename KeyT , typename DataT , typename HashT = HashFn<KeyT>, typename AllocatorT = ByteAllocator>
using HashTable = LinearProbingHashTable< KeyT, DataT, HashT, AllocatorT >
 
typedef ref_ptr< HingeHingeRef
 
typedef agx::observer_ptr< const ICloneableICloneableConstObserver
 
typedef agx::ref_ptr< const ICloneableICloneableConstRef
 
typedef agx::observer_ptr< ICloneableICloneableObserver
 
typedef agx::ref_ptr< ICloneableICloneableRef
 
typedef UInt32 Index
 
typedef agx::HashSet< agx::IndexIndexHashSet
 
using IndexLambdaKernelRef = agx::ref_ptr< IndexLambdaKernel >
 
typedef IndexRangeT< agx::UIntIndexRange
 
typedef IndexRangeT< agx::UInt32IndexRange32
 
typedef VectorPOD< IndexRange32IndexRange32Vector
 
typedef IndexRangeT< agx::UInt64IndexRange64
 
typedef VectorPOD< IndexRange64IndexRange64Vector
 
typedef VectorPOD< IndexRangeIndexRangeVector
 
typedef VectorPOD< IndexIndexVector
 
typedef int32_t Int
 
typedef int16_t Int16
 
typedef VectorPOD< Int16Int16Vector
 
typedef int32_t Int32
 
typedef VectorPOD< Int32Int32Vector
 
typedef int64_t Int64
 
typedef VectorPOD< Int64Int64Vector
 
typedef int8_t Int8
 
typedef VectorPOD< Int8Int8Vector
 
typedef agx::observer_ptr< const InteractionInteractionConstObserver
 
typedef agx::ref_ptr< const InteractionInteractionConstRef
 
typedef agx::observer_ptr< InteractionInteractionObserver
 
typedef agx::ref_ptr< InteractionInteractionRef
 
typedef agx::SetVector< InteractionRefInteractionRefSetVector
 
typedef std::valarray< agx::IntIntValarray
 
typedef VectorPOD< IntIntVector
 
typedef agx::observer_ptr< const IterativeProjectedConeFrictionIterativeProjectedConeFrictionConstObserver
 
typedef agx::ref_ptr< const IterativeProjectedConeFrictionIterativeProjectedConeFrictionConstRef
 
typedef agx::observer_ptr< IterativeProjectedConeFrictionIterativeProjectedConeFrictionObserver
 
typedef agx::ref_ptr< IterativeProjectedConeFrictionIterativeProjectedConeFrictionRef
 
typedef Jacobian6DOFElementT< Vec3Jacobian6DOFElement
 
typedef Jacobian6DOFElementT< Vec3fJacobian6DOFElement32
 
typedef Jacobian6DOFElementT< Vec3dJacobian6DOFElement64
 
typedef JacobianMetaT< Vec3JacobianMeta
 
typedef JacobianMetaT< Vec3fJacobianMeta32
 
typedef JacobianMetaT< Vec3dJacobianMeta64
 
typedef agx::VectorPOD< agx::JobGroup * > JobGroupPtrVector
 
typedef class JobJobPtr
 
typedef std::deque< class Job * > JobPtrQueue
 
typedef VectorPOD< class Job * > JobPtrVector
 
typedef Vector< JobJobVector
 
typedef agx::observer_ptr< const JournalJournalConstObserver
 
typedef agx::ref_ptr< const JournalJournalConstRef
 
typedef agx::observer_ptr< const JournalCustomDataRecorderJournalCustomDataRecorderConstObserver
 
typedef agx::ref_ptr< const JournalCustomDataRecorderJournalCustomDataRecorderConstRef
 
typedef agx::observer_ptr< JournalCustomDataRecorderJournalCustomDataRecorderObserver
 
typedef agx::Vector< JournalCustomDataRecorderObserverJournalCustomDataRecorderObserverVector
 
typedef agx::VectorPOD< JournalCustomDataRecorder * > JournalCustomDataRecorderPtrVector
 
typedef agx::ref_ptr< JournalCustomDataRecorderJournalCustomDataRecorderRef
 
typedef agx::Vector< JournalCustomDataRecorderRefJournalCustomDataRecorderRefVector
 
typedef agx::observer_ptr< JournalJournalObserver
 
typedef agx::ref_ptr< JournalJournalRef
 
typedef agx::observer_ptr< const KernelKernelConstObserver
 
typedef agx::ref_ptr< const KernelKernelConstRef
 
typedef agx::observer_ptr< KernelKernelObserver
 
typedef agx::Vector< KernelObserverKernelObserverVector
 
typedef agx::VectorPOD< Kernel * > KernelPtrVector
 
typedef agx::ref_ptr< KernelKernelRef
 
typedef agx::Vector< KernelRefKernelRefVector
 
typedef agx::observer_ptr< const LambdaKernelLambdaKernelConstObserver
 
typedef agx::ref_ptr< const LambdaKernelLambdaKernelConstRef
 
typedef agx::observer_ptr< LambdaKernelLambdaKernelObserver
 
typedef agx::ref_ptr< LambdaKernelLambdaKernelRef
 
typedef LineT< Vec3Line
 
typedef LineT< Vec3fLine32
 
typedef LineT< Vec3dLine64
 
typedef agx::ref_ptr< LinearLookupTableLinearLookupTableRef
 
typedef LocalBodyContactJacobianT< Jacobian6DOFElementLocalBodyContactJacobian
 
typedef LocalBodyContactJacobianT< Jacobian6DOFElement32LocalBodyContactJacobian32
 
typedef LocalBodyContactJacobianT< Jacobian6DOFElement64LocalBodyContactJacobian64
 
typedef agxData::LocalVector< LocalOverlapLocalOverlapVector
 
typedef LocalRollingResistanceJacobianT< Jacobian6DOFElementLocalRollingResistanceJacobian
 
typedef LocalRollingResistanceJacobianT< Jacobian6DOFElement32LocalRollingResistanceJacobian32
 
typedef LocalRollingResistanceJacobianT< Jacobian6DOFElement64LocalRollingResistanceJacobian64
 
typedef LocalTangentJacobianT< Jacobian6DOFElementLocalTangentJacobian
 
typedef LocalTangentJacobianT< Jacobian6DOFElement32LocalTangentJacobian32
 
typedef LocalTangentJacobianT< Jacobian6DOFElement64LocalTangentJacobian64
 
typedef agx::LockController Lock1D
 
typedef agx::ref_ptr< LockControllerLockControllerRef
 
using LockJointRef = ref_ptr< LockJoint >
 
typedef ref_ptr< LoggerLoggerRef
 
typedef ref_ptr< MarchingCubesMarchingCubesRef
 
typedef agx::observer_ptr< const MaterialMaterialConstObserver
 
typedef agx::ref_ptr< const MaterialMaterialConstRef
 
typedef agx::observer_ptr< MaterialMaterialObserver
 
typedef agx::Vector< const agx::Material * > MaterialPtrVector
 
typedef agx::ref_ptr< MaterialMaterialRef
 
typedef Matrix3x3T< RealMatrix3x3
 
typedef Matrix3x3T< Real64Matrix3x3d
 
typedef Matrix3x3T< Real32Matrix3x3f
 
typedef Matrix4x4T< RealMatrix4x4
 
typedef Matrix4x4T< Real64Matrix4x4d
 
typedef Matrix4x4T< Real32Matrix4x4f
 
typedef agx::observer_ptr< const MergedBodyMergedBodyConstObserver
 
typedef agx::ref_ptr< const MergedBodyMergedBodyConstRef
 
typedef agx::observer_ptr< MergedBodyMergedBodyObserver
 
typedef agx::Vector< MergedBodyObserverMergedBodyObserverVector
 
typedef agx::VectorPOD< MergedBody * > MergedBodyPtrVector
 
typedef agx::ref_ptr< MergedBodyMergedBodyRef
 
typedef agx::SetVector< agx::MergedBodyRefMergedBodyRefSetVector
 
typedef agx::Vector< MergedBodyRefMergedBodyRefVector
 
typedef agx::observer_ptr< const ModelModelConstObserver
 
typedef agx::ref_ptr< const ModelModelConstRef
 
typedef agx::observer_ptr< ModelModelObserver
 
typedef agx::ref_ptr< ModelModelRef
 
typedef agx::TargetSpeedController Motor1D
 
using Mutex = std::mutex
 
typedef agx::observer_ptr< const NamespaceNamespaceConstObserver
 
typedef agx::ref_ptr< const NamespaceNamespaceConstRef
 
typedef agx::observer_ptr< NamespaceNamespaceObserver
 
typedef agx::ref_ptr< NamespaceNamespaceRef
 
typedef Vector< NameNameVector
 
using NlmcpCallbackRef = ref_ptr< NlmcpCallback >
 
using NlmcpCallbacks = agx::Vector< NlmcpCallbackRef >
 
typedef agx::ref_ptr< class NlMixedCpNlMixedCpRef
 
typedef agx::observer_ptr< const ObjectObjectConstObserver
 
typedef agx::ref_ptr< const ObjectObjectConstRef
 
typedef agx::observer_ptr< ObjectObjectObserver
 
typedef agx::Vector< ObjectObserverObjectObserverVector
 
typedef HashTable< Name, Object * > ObjectPtrTable
 
typedef agx::VectorPOD< Object * > ObjectPtrVector
 
typedef agx::ref_ptr< ObjectObjectRef
 
typedef agx::Vector< ObjectRefObjectRefVector
 
typedef agx::observer_ptr< const ObserverFrameObserverFrameConstObserver
 
typedef agx::ref_ptr< const ObserverFrameObserverFrameConstRef
 
typedef agx::observer_ptr< ObserverFrameObserverFrameObserver
 
typedef agx::Vector< ObserverFrameObserverObserverFrameObserverVector
 
typedef agx::VectorPOD< ObserverFrame * > ObserverFramePtrVector
 
typedef agx::ref_ptr< ObserverFrameObserverFrameRef
 
typedef agx::SetVector< ObserverFrameRefObserverFrameRefSetVector
 
typedef agx::Vector< ObserverFrameRefObserverFrameRefVector
 
typedef agx::observer_ptr< const ParallelTaskParallelTaskConstObserver
 
typedef agx::ref_ptr< const ParallelTaskParallelTaskConstRef
 
typedef agx::observer_ptr< ParallelTaskParallelTaskObserver
 
typedef agx::ref_ptr< ParallelTaskParallelTaskRef
 
typedef agx::VectorPOD< ParameterBindingParameterBindingVector
 
typedef agx::observer_ptr< const ParameterParameterConstObserver
 
typedef agx::ref_ptr< const ParameterParameterConstRef
 
typedef agx::observer_ptr< ParameterParameterObserver
 
typedef agx::Vector< ParameterObserverParameterObserverVector
 
typedef agx::VectorPOD< Parameter * > ParameterPtrVector
 
typedef agx::ref_ptr< ParameterParameterRef
 
typedef agx::Vector< ParameterRefParameterRefVector
 
typedef HashTable< String, UnresolvedParameterRefParameterTable
 
typedef ParticleBodyContactJacobianT< Vec3ParticleBodyContactJacobian
 
typedef ParticleBodyContactJacobianT< Vec3fParticleBodyContactJacobian32
 
typedef ParticleBodyContactJacobianT< Vec3dParticleBodyContactJacobian64
 
typedef agx::observer_ptr< const ParticleContactSensorParticleContactSensorConstObserver
 
typedef agx::ref_ptr< const ParticleContactSensorParticleContactSensorConstRef
 
typedef agx::observer_ptr< ParticleContactSensorParticleContactSensorObserver
 
typedef agx::Vector< ParticleContactSensorObserverParticleContactSensorObserverVector
 
typedef agx::VectorPOD< ParticleContactSensor * > ParticleContactSensorPtrVector
 
typedef agx::ref_ptr< ParticleContactSensorParticleContactSensorRef
 
typedef agx::Vector< ParticleContactSensorRefParticleContactSensorRefVector
 
typedef ref_ptr< ParticleContactWireParticleContactWireRef
 
typedef agx::observer_ptr< const ParticleEmitterParticleEmitterConstObserver
 
typedef agx::ref_ptr< const ParticleEmitterParticleEmitterConstRef
 
typedef agx::observer_ptr< ParticleEmitterParticleEmitterObserver
 
typedef agx::Vector< ParticleEmitterObserverParticleEmitterObserverVector
 
typedef agx::VectorPOD< ParticleEmitter * > ParticleEmitterPtrVector
 
typedef agx::ref_ptr< ParticleEmitterParticleEmitterRef
 
typedef agx::Vector< ParticleEmitterRefParticleEmitterRefVector
 
typedef HashTable< ParticleEmitter *, ref_ptr< ParticleEmitter > > ParticleEmitterTable
 
typedef ParticleParticleContactJacobianT< Vec3ParticleParticleContactJacobian
 
typedef ParticleParticleContactJacobianT< Vec3fParticleParticleContactJacobian32
 
typedef ParticleParticleContactJacobianT< Vec3dParticleParticleContactJacobian64
 
typedef agx::observer_ptr< const ParticleSinkParticleSinkConstObserver
 
typedef agx::ref_ptr< const ParticleSinkParticleSinkConstRef
 
typedef agx::observer_ptr< ParticleSinkParticleSinkObserver
 
typedef agx::Vector< ParticleSinkObserverParticleSinkObserverVector
 
typedef agx::VectorPOD< ParticleSink * > ParticleSinkPtrVector
 
typedef agx::ref_ptr< ParticleSinkParticleSinkRef
 
typedef agx::Vector< ParticleSinkRefParticleSinkRefVector
 
typedef HashTable< ParticleSink *, ref_ptr< ParticleSink > > ParticleSinkTable
 
typedef agx::observer_ptr< const ParticleSystemParticleSystemConstObserver
 
typedef agx::ref_ptr< const ParticleSystemParticleSystemConstRef
 
typedef agx::observer_ptr< ParticleSystemParticleSystemObserver
 
typedef agx::Vector< ParticleSystemObserverParticleSystemObserverVector
 
typedef agx::VectorPOD< ParticleSystem * > ParticleSystemPtrVector
 
typedef agx::ref_ptr< ParticleSystemParticleSystemRef
 
typedef agx::SetVector< agx::ref_ptr< agx::ParticleSystem > > ParticleSystemRefSetVector
 
typedef agx::Vector< ParticleSystemRefParticleSystemRefVector
 
typedef HashTable< ParticleSystem *, ref_ptr< ParticleSystem > > ParticleSystemTable
 
typedef PlaneT< agx::RealPlane
 
typedef PlaneT< agx::Real32Plane32
 
typedef PlaneT< agx::Real64Plane64
 
typedef agx::ref_ptr< agx::PlaneJointPlaneJointRef
 
typedef void * PluginHandle
 
typedef agx::Vector< Point2DPoint2DVector
 
typedef agx::observer_ptr< const PointerPointerConstObserver
 
typedef agx::ref_ptr< const PointerPointerConstRef
 
typedef agx::observer_ptr< PointerPointerObserver
 
typedef agx::Vector< PointerObserverPointerObserverVector
 
typedef agx::observer_ptr< const PointerParameterPointerParameterConstObserver
 
typedef agx::ref_ptr< const PointerParameterPointerParameterConstRef
 
typedef agx::observer_ptr< PointerParameterPointerParameterObserver
 
typedef agx::Vector< PointerParameterObserverPointerParameterObserverVector
 
typedef agx::VectorPOD< PointerParameter * > PointerParameterPtrVector
 
typedef agx::ref_ptr< PointerParameterPointerParameterRef
 
typedef agx::Vector< PointerParameterRefPointerParameterRefVector
 
typedef agx::VectorPOD< Pointer * > PointerPtrVector
 
typedef agx::ref_ptr< PointerPointerRef
 
typedef agx::Vector< PointerRefPointerRefVector
 
typedef agx::observer_ptr< const PointGravityFieldPointGravityFieldConstObserver
 
typedef agx::ref_ptr< const PointGravityFieldPointGravityFieldConstRef
 
typedef agx::observer_ptr< PointGravityFieldPointGravityFieldObserver
 
typedef agx::ref_ptr< PointGravityFieldPointGravityFieldRef
 
typedef ref_ptr< PrismaticPrismaticRef
 
typedef ref_ptr< PrismaticUniversalJointPrismaticUniversalJointRef
 
typedef agx::ref_ptr< PropertyContainerPropertyContainerRef
 
typedef QuatT< RealQuat
 
typedef QuatT< Real32Quat32
 
typedef QuatT< Real64Quat64
 
typedef agx::ref_ptr< QuatLockQuatLockRef
 
typedef VectorPOD< QuatQuatVector
 
typedef agx::RangeController Range1D
 
typedef Range6T< RealRange6
 
typedef Range6T< Real64Range6d
 
typedef Range6T< Real32Range6f
 
using RangeCallback = agx::Callback1< const RangeJob & >
 
typedef agx::ref_ptr< RangeControllerRangeControllerRef
 
typedef Vector< RangeJobRangeJobVector
 
typedef Range< RealRangeReal
 A short hand for ranges of floating point numbers.
 
typedef Range< UIntRangeUInt
 A short hand for ranges of unsigned integer numbers.
 
typedef RangeViolation< RealRangeViolationReal
 
typedef RangeViolation< UIntRangeViolationUInt
 
typedef double Real
 
typedef float Real32
 
typedef VectorPOD< Real32Real32Vector
 
typedef double Real64
 
typedef VectorPOD< Real64Real64Vector
 
typedef agx::Vector< agx::RealVectorRealMatrix
 
typedef std::pair< Real, RealRealPair
 
typedef agx::List< std::pair< agx::Real, agx::Real > > RealPairList
 
typedef agx::Vector< std::pair< agx::Real, agx::Real > > RealPairVector
 
typedef agx::observer_ptr< const RealTimeClockRealTimeClockConstObserver
 
typedef agx::ref_ptr< const RealTimeClockRealTimeClockConstRef
 
typedef agx::observer_ptr< RealTimeClockRealTimeClockObserver
 
typedef agx::ref_ptr< RealTimeClockRealTimeClockRef
 
typedef std::valarray< agx::RealRealValarray
 For this module, vectors are defined using valarray.
 
using RealVector = VectorPOD< Real >
 
using ReentrantMutex = std::recursive_mutex
 
typedef agx::observer_ptr< const ReferencedModelReferencedModelConstObserver
 
typedef agx::ref_ptr< const ReferencedModelReferencedModelConstRef
 
typedef agx::observer_ptr< ReferencedModelReferencedModelObserver
 
typedef agx::ref_ptr< ReferencedModelReferencedModelRef
 
typedef agxData::Array< ReferencedPtrReferencedPtrArray
 
typedef agx::VectorPOD< ReferencedPtrReferencedPtrVector
 
typedef agxData::EntityRef< ReferencedPtrReferencedRef
 
typedef agx::Vector< agx::ref_ptr< Referenced > > RefVector
 
typedef agx::ref_ptr< RigidBodyAttachmentRigidBodyAttachmentRef
 
typedef agx::observer_ptr< const RigidBodyRigidBodyConstObserver
 
using RigidBodyConstRef = agx::ref_ptr< const RigidBody >
 
typedef agx::observer_ptr< const RigidBodyEmitterRigidBodyEmitterConstObserver
 
typedef agx::ref_ptr< const RigidBodyEmitterRigidBodyEmitterConstRef
 
typedef agx::observer_ptr< RigidBodyEmitterRigidBodyEmitterObserver
 
typedef agx::Vector< RigidBodyEmitterObserverRigidBodyEmitterObserverVector
 
typedef agx::VectorPOD< RigidBodyEmitter * > RigidBodyEmitterPtrVector
 
typedef agx::ref_ptr< RigidBodyEmitterRigidBodyEmitterRef
 
typedef agx::Vector< RigidBodyEmitterRefRigidBodyEmitterRefVector
 
typedef agx::observer_ptr< RigidBodyRigidBodyObserver
 
typedef agx::Vector< RigidBodyObserverRigidBodyObserverVector
 
typedef agx::HashTable< RigidBody *, Attachment * > RigidBodyPtrAttachmentPtrHashTable
 
using RigidBodyPtrHashSet = agx::HashSet< agx::RigidBody * >
 
typedef HashTable< RigidBody *, int > RigidBodyPtrIntHash
 
typedef HashTable< RigidBody *, RealRigidBodyPtrRealHash
 
typedef agx::SetVector< RigidBody * > RigidBodyPtrSetVector
 
typedef HashTable< RigidBody *, Vec3RigidBodyPtrVec3Hash
 
typedef agx::VectorPOD< RigidBody * > RigidBodyPtrVector
 
typedef agx::ref_ptr< RigidBodyRigidBodyRef
 
typedef agx::SetVector< ref_ptr< RigidBody > > RigidBodyRefSetVector
 
typedef agx::Vector< RigidBodyRefRigidBodyRefVector
 
typedef HashTable< RigidBody *, ref_ptr< RigidBody > > RigidBodyTable
 
typedef agx::observer_ptr< const RigidParticleSystemRigidParticleSystemConstObserver
 
typedef agx::ref_ptr< const RigidParticleSystemRigidParticleSystemConstRef
 
typedef agx::observer_ptr< RigidParticleSystemRigidParticleSystemObserver
 
typedef agx::ref_ptr< RigidParticleSystemRigidParticleSystemRef
 
typedef RollingResistanceJacobianT< Jacobian6DOFElementRollingResistanceJacobian
 
typedef RollingResistanceJacobianT< Jacobian6DOFElement32RollingResistanceJacobian32
 
typedef RollingResistanceJacobianT< Jacobian6DOFElement64RollingResistanceJacobian64
 
typedef agx::ref_ptr< RotationalAngleRotationalAngleRef
 
typedef agx::observer_ptr< const ScalarParameterScalarParameterConstObserver
 
typedef agx::ref_ptr< const ScalarParameterScalarParameterConstRef
 
typedef agx::observer_ptr< ScalarParameterScalarParameterObserver
 
typedef agx::Vector< ScalarParameterObserverScalarParameterObserverVector
 
typedef agx::VectorPOD< ScalarParameter * > ScalarParameterPtrVector
 
typedef agx::ref_ptr< ScalarParameterScalarParameterRef
 
typedef agx::Vector< ScalarParameterRefScalarParameterRefVector
 
typedef agx::observer_ptr< const ScaleBoxFrictionModelScaleBoxFrictionModelConstObserver
 
typedef agx::ref_ptr< const ScaleBoxFrictionModelScaleBoxFrictionModelConstRef
 
typedef agx::observer_ptr< ScaleBoxFrictionModelScaleBoxFrictionModelObserver
 
typedef agx::ref_ptr< ScaleBoxFrictionModelScaleBoxFrictionModelRef
 
template<class T >
using ScopeLock = std::lock_guard< T >
 agx::ScopeLock is an alias for std::lock_guard
 
typedef agx::ScrewController Screw1D
 
typedef agx::ref_ptr< SeparationAngleSeparationAngleRef
 
typedef agx::observer_ptr< const SerialTaskSerialTaskConstObserver
 
typedef agx::ref_ptr< const SerialTaskSerialTaskConstRef
 
typedef agx::observer_ptr< SerialTaskSerialTaskObserver
 
typedef agx::ref_ptr< SerialTaskSerialTaskRef
 
typedef ref_ptr< SingletonSingletonRef
 
typedef size_t Size
 
typedef ref_ptr< SlackCylindricalJointSlackCylindricalJointRef
 
typedef SlackHingeJoint SlackHinge
 
typedef ref_ptr< SlackHingeJointSlackHingeJointRef
 
typedef ref_ptr< SlackLockJointSlackLockJointRef
 
typedef SlackPrismaticJoint SlackPrismatic
 
typedef ref_ptr< SlackPrismaticJointSlackPrismaticJointRef
 
typedef agx::ref_ptr< SolveAlgorithmSolveAlgorithmRef
 
typedef agx::ref_ptr< SolveIslandSplitAlgorithmSolveIslandSplitAlgorithmRef
 
typedef agx::observer_ptr< const SparseMatrixRepSparseMatrixRepConstObserver
 
typedef agx::ref_ptr< const SparseMatrixRepSparseMatrixRepConstRef
 
typedef agx::observer_ptr< SparseMatrixRepSparseMatrixRepObserver
 
typedef agx::ref_ptr< SparseMatrixRepSparseMatrixRepRef
 
typedef VectorPOD< SPDMatrix3x3SPDMatrix3x3Vector
 
typedef agx::ref_ptr< SphericalSphericalRef
 
typedef agx::ref_ptr< SphericalRelSphericalRelRef
 
typedef agx::ref_ptr< SphericalRelSlackSphericalRelSlackRef
 
typedef agx::observer_ptr< const SplineJointSplineJointConstObserver
 
typedef agx::ref_ptr< const SplineJointSplineJointConstRef
 
typedef agx::observer_ptr< SplineJointSplineJointObserver
 
typedef agx::ref_ptr< SplineJointSplineJointRef
 
typedef SplitNodeRefVector::iterator SplitNodeIterator
 
typedef agx::ref_ptr< SplitNodeSplitNodeRef
 
typedef agx::Vector< SplitNodeRefSplitNodeRefVector
 
typedef agx::ref_ptr< SplitNodeSeparatorSplitNodeSeparatorRef
 
typedef agx::observer_ptr< const StabilityReportStabilityReportConstObserver
 
typedef agx::ref_ptr< const StabilityReportStabilityReportConstRef
 
typedef agx::observer_ptr< StabilityReportStabilityReportObserver
 
typedef agx::ref_ptr< StabilityReportStabilityReportRef
 
typedef agx::observer_ptr< const StreamStreamConstObserver
 
typedef agx::ref_ptr< const StreamStreamConstRef
 
typedef agx::observer_ptr< StreamStreamObserver
 
typedef agx::ref_ptr< StreamStreamRef
 
typedef AgXString< std::string > String
 
typedef Vector< AgXString< std::string > > StringVector
 
typedef agx::observer_ptr< const StrongInteractionStrongInteractionConstObserver
 
typedef agx::observer_ptr< const StrongInteractionConstraintStrongInteractionConstraintConstObserver
 
typedef agx::ref_ptr< const StrongInteractionConstraintStrongInteractionConstraintConstRef
 
typedef agx::observer_ptr< StrongInteractionConstraintStrongInteractionConstraintObserver
 
typedef agx::ref_ptr< StrongInteractionConstraintStrongInteractionConstraintRef
 
typedef agx::ref_ptr< const StrongInteractionStrongInteractionConstRef
 
typedef agx::observer_ptr< StrongInteractionStrongInteractionObserver
 
typedef agx::ref_ptr< StrongInteractionStrongInteractionRef
 
typedef agx::SetVector< InteractionRefStrongInteractionRefSetVector
 
typedef agx::observer_ptr< const SurfaceMaterialSurfaceMaterialConstObserver
 
typedef agx::ref_ptr< const SurfaceMaterialSurfaceMaterialConstRef
 
typedef agx::observer_ptr< SurfaceMaterialSurfaceMaterialObserver
 
typedef agx::ref_ptr< SurfaceMaterialSurfaceMaterialRef
 
typedef RealVector SVec
 
typedef agx::ref_ptr< SwingSwingRef
 
typedef ref_ptr< SwingTwistLockSwingTwistLockRef
 
typedef TangentJacobianT< Jacobian6DOFElementTangentJacobian
 
typedef TangentJacobianT< Jacobian6DOFElement32TangentJacobian32
 
typedef TangentJacobianT< Jacobian6DOFElement64TangentJacobian64
 
typedef agx::ref_ptr< TargetSpeedControllerTargetSpeedControllerRef
 
typedef agx::observer_ptr< const TaskTaskConstObserver
 
typedef agx::ref_ptr< const TaskTaskConstRef
 
typedef agx::observer_ptr< const TaskGroupTaskGroupConstObserver
 
typedef agx::ref_ptr< const TaskGroupTaskGroupConstRef
 
typedef agx::observer_ptr< TaskGroupTaskGroupObserver
 
typedef agx::ref_ptr< TaskGroupTaskGroupRef
 
typedef agx::observer_ptr< TaskTaskObserver
 
typedef agx::Vector< TaskObserverTaskObserverVector
 
typedef HashTable< const char *, TaskPlugin * > TaskPluginTable
 
typedef agx::VectorPOD< Task * > TaskPtrVector
 
typedef agx::ref_ptr< TaskTaskRef
 
typedef agx::Vector< TaskRefTaskRefVector
 
typedef agx::observer_ptr< const TaskTimingReportHandle > TaskTimingReportHandleConstObserver
 
typedef agx::ref_ptr< const TaskTimingReportHandle > TaskTimingReportHandleConstRef
 
typedef agx::observer_ptr< TaskTimingReportHandle > TaskTimingReportHandleObserver
 
typedef agx::ref_ptr< TaskTimingReportHandle > TaskTimingReportHandleRef
 
typedef agx::VectorPOD< Thread * > ThreadPtrVector
 
typedef agx::observer_ptr< const ThreadTaskThreadTaskConstObserver
 
typedef agx::ref_ptr< const ThreadTaskThreadTaskConstRef
 
typedef agx::observer_ptr< ThreadTaskThreadTaskObserver
 
typedef agx::ref_ptr< ThreadTaskThreadTaskRef
 
typedef agx::observer_ptr< const ThreadTimelineEntryModelThreadTimelineEntryModelConstObserver
 
typedef agx::ref_ptr< const ThreadTimelineEntryModelThreadTimelineEntryModelConstRef
 
typedef agx::observer_ptr< ThreadTimelineEntryModelThreadTimelineEntryModelObserver
 
typedef agx::ref_ptr< ThreadTimelineEntryModelThreadTimelineEntryModelRef
 
typedef agxData::Array< ThreadTimelineEntryPtrThreadTimelineEntryPtrArray
 
typedef agx::VectorPOD< ThreadTimelineEntryPtrThreadTimelineEntryPtrVector
 
typedef agx::ref_ptr< TimeGovernorTimeGovernorRef
 
typedef agx::Real TimeStamp
 
typedef agx::ref_ptr< TwistRangeControllerTwistRangeControllerRef
 
typedef agx::ref_ptr< TwistTwistRef
 
typedef uint32_t UInt
 
typedef uint16_t UInt16
 
typedef VectorPOD< UInt16UInt16Vector
 
typedef uint32_t UInt32
 
typedef VectorPOD< UInt32UInt32Vector
 
typedef uint64_t UInt64
 
typedef VectorPOD< UInt64UInt64Vector
 
typedef uint8_t UInt8
 
typedef VectorPOD< UInt8UInt8Vector
 
typedef HashTable< UInt, Real * > UIntRealPtrTable
 
typedef std::valarray< agx::UIntUIntValarray
 
typedef VectorPOD< UIntUIntVector
 
typedef agx::observer_ptr< const UniformGravityFieldUniformGravityFieldConstObserver
 
typedef agx::ref_ptr< const UniformGravityFieldUniformGravityFieldConstRef
 
typedef agx::observer_ptr< UniformGravityFieldUniformGravityFieldObserver
 
typedef agx::ref_ptr< UniformGravityFieldUniformGravityFieldRef
 
typedef RandomGenerator< agx::Int32, std::uniform_int_distribution > UniformInt32Generator
 
typedef RandomGenerator< agx::Int64, std::uniform_int_distribution > UniformInt64Generator
 
typedef RandomGenerator< agx::Int, std::uniform_int_distribution > UniformIntGenerator
 
typedef RandomGenerator< agx::Real32, std::uniform_real_distribution > UniformReal32Generator
 
typedef RandomGenerator< agx::Real64, std::uniform_real_distribution > UniformReal64Generator
 
typedef RandomGenerator< agx::Real, std::uniform_real_distribution > UniformRealGenerator
 
typedef struct agx::UniqueIdStruct_ UniqueIdStruct
 Struct holding information about a Unique Id.
 
typedef ref_ptr< UniversalJointUniversalJointRef
 
typedef agx::observer_ptr< const UnresolvedParameterUnresolvedParameterConstObserver
 
typedef agx::ref_ptr< const UnresolvedParameterUnresolvedParameterConstRef
 
typedef agx::observer_ptr< UnresolvedParameterUnresolvedParameterObserver
 
typedef agx::ref_ptr< UnresolvedParameterUnresolvedParameterRef
 
typedef agx::observer_ptr< const UnresolvedTaskUnresolvedTaskConstObserver
 
typedef agx::ref_ptr< const UnresolvedTaskUnresolvedTaskConstRef
 
typedef agx::observer_ptr< UnresolvedTaskUnresolvedTaskObserver
 
typedef agx::Vector< UnresolvedTaskObserverUnresolvedTaskObserverVector
 
typedef agx::VectorPOD< UnresolvedTask * > UnresolvedTaskPtrVector
 
typedef agx::ref_ptr< UnresolvedTaskUnresolvedTaskRef
 
typedef agx::Vector< UnresolvedTaskRefUnresolvedTaskRefVector
 
typedef Vec2T< RealVec2
 The object holding 2 dimensional vectors and providing basic arithmetic.
 
typedef Vec2T< Real64Vec2d
 
typedef VectorPOD< Vec2dVec2dVector
 
typedef Vec2T< Real32Vec2f
 
typedef VectorPOD< Vec2fVec2fVector
 
typedef Vec2T< IntVec2i
 
typedef Vec2T< Int16Vec2i16
 
typedef VectorPOD< Vec2i16Vec2i16Vector
 
typedef Vec2T< Int32Vec2i32
 
typedef VectorPOD< Vec2i32Vec2i32Vector
 
typedef Vec2T< Int64Vec2i64
 
typedef VectorPOD< Vec2i64Vec2i64Vector
 
typedef Vec2T< Int8Vec2i8
 
typedef VectorPOD< Vec2i8Vec2i8Vector
 
typedef VectorPOD< Vec2iVec2iVector
 
typedef Vec2T< UIntVec2u
 
typedef Vec2T< UInt16Vec2u16
 
typedef VectorPOD< Vec2u16Vec2u16Vector
 
typedef Vec2T< UInt32Vec2u32
 
typedef VectorPOD< Vec2u32Vec2u32Vector
 
typedef Vec2T< UInt64Vec2u64
 
typedef VectorPOD< Vec2u64Vec2u64Vector
 
typedef Vec2T< UInt8Vec2u8
 
typedef VectorPOD< Vec2u8Vec2u8Vector
 
typedef VectorPOD< Vec2uVec2uVector
 
typedef VectorPOD< Vec2Vec2Vector
 
typedef Vec3T< RealVec3
 The object holding 3 dimensional vectors and providing basic arithmetic.
 
typedef Vec3T< Real64Vec3d
 
typedef VectorPOD< Vec3dVec3dVector
 
typedef Vec3T< Real32Vec3f
 
typedef VectorPOD< Vec3fVec3fVector
 
typedef Vec3T< IntVec3i
 
typedef Vec3T< Int16Vec3i16
 
typedef VectorPOD< Vec3i16Vec3i16Vector
 
typedef Vec3T< Int32Vec3i32
 
typedef VectorPOD< Vec3i32Vec3i32Vector
 
typedef Vec3T< Int64Vec3i64
 
typedef VectorPOD< Vec3i64Vec3i64Vector
 
typedef Vec3T< Int8Vec3i8
 
typedef VectorPOD< Vec3i8Vec3i8Vector
 
typedef VectorPOD< Vec3iVec3iVector
 
typedef Vec3T< UIntVec3u
 
typedef Vec3T< UInt16Vec3u16
 
typedef VectorPOD< Vec3u16Vec3u16Vector
 
typedef Vec3T< UInt32Vec3u32
 
typedef VectorPOD< Vec3u32Vec3u32Vector
 
typedef Vec3T< UInt64Vec3u64
 
typedef VectorPOD< Vec3u64Vec3u64Vector
 
typedef Vec3T< UInt8Vec3u8
 
typedef VectorPOD< Vec3u8Vec3u8Vector
 
typedef VectorPOD< Vec3uVec3uVector
 
typedef VectorPOD< Vec3Vec3Vector
 
typedef Vec4T< RealVec4
 
typedef Vec4T< Real64Vec4d
 
typedef VectorPOD< Vec4dVec4dVector
 
typedef Vec4T< Real32Vec4f
 
typedef VectorPOD< Vec4fVec4fVector
 
typedef Vec4T< IntVec4i
 
typedef Vec4T< Int16Vec4i16
 
typedef VectorPOD< Vec4i16Vec4i16Vector
 
typedef Vec4T< Int32Vec4i32
 
typedef VectorPOD< Vec4i32Vec4i32Vector
 
typedef Vec4T< Int64Vec4i64
 
typedef VectorPOD< Vec4i64Vec4i64Vector
 
typedef Vec4T< Int8Vec4i8
 
typedef VectorPOD< Vec4i8Vec4i8Vector
 
typedef VectorPOD< Vec4iVec4iVector
 
typedef Vec4T< UIntVec4u
 
typedef Vec4T< UInt16Vec4u16
 
typedef VectorPOD< Vec4u16Vec4u16Vector
 
typedef Vec4T< UInt32Vec4u32
 
typedef VectorPOD< Vec4u32Vec4u32Vector
 
typedef Vec4T< UInt64Vec4u64
 
typedef VectorPOD< Vec4u64Vec4u64Vector
 
typedef Vec4T< UInt8Vec4u8
 
typedef VectorPOD< Vec4u8Vec4u8Vector
 
typedef VectorPOD< Vec4uVec4uVector
 
typedef VectorPOD< Vec4Vec4Vector
 
typedef agx::observer_ptr< const VirtualConstraintInertiaVirtualConstraintInertiaConstObserver
 
typedef agx::ref_ptr< const VirtualConstraintInertiaVirtualConstraintInertiaConstRef
 
typedef agx::observer_ptr< VirtualConstraintInertiaVirtualConstraintInertiaObserver
 
typedef agx::ref_ptr< VirtualConstraintInertiaVirtualConstraintInertiaRef
 
typedef ref_ptr< WireContactBendConstraintWireContactBendConstraintRef
 
typedef ref_ptr< WireContactConstraintWireContactConstraintRef
 
typedef agx::Vector< WireContactConstraintRefWireContactConstraintRefVector
 
typedef ref_ptr< WireContactDistanceConstraintWireContactDistanceConstraintRef
 
typedef ref_ptr< WireContactFrictionConstraintWireContactFrictionConstraintRef
 
typedef ref_ptr< WireContactSolverWireContactSolverRef
 
typedef ref_ptr< WireContactSpringConstraintWireContactSpringConstraintRef
 
typedef agx::observer_ptr< const WireMaterialWireMaterialConstObserver
 
typedef agx::ref_ptr< const WireMaterialWireMaterialConstRef
 
typedef agx::observer_ptr< WireMaterialWireMaterialObserver
 
typedef agx::ref_ptr< WireMaterialWireMaterialRef
 
typedef ref_ptr< WireParticleWireParticleRef
 
typedef agx::Vector< WireParticleRefWireParticleRefVector
 
typedef ref_ptr< WorldFrameBallJointWorldFrameBallJointRef
 
typedef std::function< Object *(TiXmlElement *, Device *)> XmlLoadFunction
 
typedef agx::HashTable< UInt64, agx::Physics::HierarchicalGrid::ContactZoneDependencyPtr > ZoneDependencyTable
 

Enumerations

enum  BuildConfiguration {
  USE_64BIT_ARCHITECTURE , SABRE_USE_METIS , USE_OPENGL_INSTANCING , USE_PREFETCHING ,
  USE_SSE , SABRE_USE_SSE3 , SABRE_USE_PADDING , USE_TINYXML ,
  USE_OPENGL , USE_OSG , UNITTEST_ENABLED , USE_AGXSENSOR ,
  USE_AGXCALLABLE , USE_PARTICLE_SYSTEM , USE_OPENCL , USE_DEBUG ,
  USE_COMPOSITE , WINDOWS_PLATFORM , USE_ASSIMP , NUM_BUILD_CONFIGURATIONS
}
 Specifies flags set at build time. Used when querying what is enabled in this current build. More...
 
enum  CellState { CELL_DEAD , CELL_UNINITIALIZED , CELL_ACTIVE }
 
enum  PrefetchType { L1 = 3 , L2 = 2 , L3 = 1 , NTA = 0 }
 
enum  RealModeEnum { REAL_32BIT , REAL_64BIT }
 The data type for basic floating point representation. More...
 

Functions

AGXCORE_EXPORT Thread__agx_Event_getActiveThread ()
 
template<typename T >
bool _equivalent (T lhs, T rhs, T epsilon=T(AGX_EQUIVALENT_EPSILON))
 Compare two values for equality.
 
template<typename T >
bool _relativelyEquivalent (T lhs, T rhs, T relativeEpsilon=T(AGX_EQUIVALENT_EPSILON))
 Compare two values for relative equality.
 
AGXCORE_EXPORT void abort () AGX_NO_RETURN
 
template<typename T >
Vec2T< T > absolute (const agx::Vec2T< T > &a)
 
template<typename T >
Vec3T< T > absolute (const agx::Vec3T< T > &a)
 
template<typename T >
Vec4T< T > absolute (const agx::Vec4T< T > &a)
 
template<typename T >
absolute (T v)
 return the absolute value.
 
AGXPHYSICS_EXPORT void addGranularImpactCustomBuffers (agx::ParticleSystem *system)
 
AGXPHYSICS_EXPORT void addSecondaryConstraints1DOF (agx::HighLevelConstraintImplementation *constraint, agx::Angle *angle)
 Add secondary controllers with default name to the constraint.
 
AGXPHYSICS_EXPORT void addSecondaryConstraints2DOF (agx::HighLevelConstraintImplementation *constraint, agx::SeparationAngle *sepAngle, agx::RotationalAngle *rotAngle)
 Add secondary controllers with default name to the constraint.
 
 AGX_DECLARE_HASHSET_TYPES (Object)
 
static Real align (Real value, Real alignment)
 
template<typename T1 , typename T2 >
T1 * align_ceil (const T1 *ptr, T2 alignment)
 
template<typename T >
align_ceil (T value, T alignment)
 
template<typename T1 , typename T2 >
T1 * align_ceil2 (const T1 *ptr, T2 alignment)
 
template<typename T >
align_ceil2 (T value, T alignment)
 
template<typename T1 , typename T2 >
T1 * align_floor (const T1 *ptr, T2 alignment)
 
template<typename T >
align_floor (T value, T alignment)
 
template<typename T1 , typename T2 >
T1 * align_floor2 (const T1 *ptr, T2 alignment)
 
template<typename T >
align_floor2 (T value, T alignment)
 
Int32 alignPowerOfTwo (Int32 value)
 
Int64 alignPowerOfTwo (Int64 value)
 
UInt32 alignPowerOfTwo (UInt32 value)
 
UInt64 alignPowerOfTwo (UInt64 value)
 
template<typename T >
Vec3T< T > asin (const agx::Vec3T< T > &a)
 
template<typename T , size_t N>
const T * begin (const StackArray< T, N > &array)
 
template<typename T , typename A >
Vector< T, A >::const_iterator begin (const Vector< T, A > &v)
 
template<typename T , typename A >
VectorPOD< T, A >::const_iterator begin (const VectorPOD< T, A > &v)
 
template<typename KeyT , typename HashT >
LinearProbingHashSetImplementation< KeyT, HashT >::iterator begin (LinearProbingHashSetImplementation< KeyT, HashT > &set)
 
template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::iterator begin (LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &table)
 
template<typename T , size_t N>
T * begin (StackArray< T, N > &array)
 
template<typename T , typename A >
Vector< T, A >::iterator begin (Vector< T, A > &v)
 
template<typename T , typename A >
VectorPOD< T, A >::iterator begin (VectorPOD< T, A > &v)
 
AGXCORE_EXPORT std::string buildErrorString (const char *baseFormat, std::string msgFormat,...)
 
AGXCORE_EXPORT agx::UInt64 buildHashKey (agx::UInt32 id1, agx::UInt32 id2)
 
static uint16_t ByteSwap16 (uint16_t x)
 
static uint32_t ByteSwap32 (uint32_t x)
 
static uint64_t ByteSwap64 (uint64_t x)
 
template<typename GridCellTableT >
Real calculateBoundingRadius (Real)
 
template<>
Real calculateBoundingRadius< agx::GridCell2DTable > (Real tierSize)
 
template<>
Real calculateBoundingRadius< agx::GridCellTable > (Real tierSize)
 
UInt calculateCellChildIndex (const Vec2i &cellId)
 
UInt calculateCellChildIndex (const Vec3i &cellId)
 
Vec2i calculateCellId (const Vec2 &position, Real invCellSize)
 
void calculateCellId (const Vec3 &pos, Real invCellSize, Vec2i &id)
 
void calculateCellId (const Vec3 &pos, Real invCellSize, Vec3i &id)
 
Vec2i calculateCellId (Real x, Real y, Real invCellSize)
 
Vec3i calculateCellId (Real x, Real y, Real z, Real invCellSize)
 
Vec3i calculateCellId (Vec3 position, Real invCellSize)
 
Vec2i calculateChildCellId (const Vec2i &cellId, UInt8 childIndex)
 
Vec3i calculateChildCellId (const Vec3i &cellId, UInt8 childIndex)
 
Vec2i calculateNonNegativeId (const Vec2i &cellId, UInt8)
 
Vec3i calculateNonNegativeId (const Vec3i &cellId, UInt8)
 
Vec2i calculateParentCellId (const Vec2i &cellId)
 
Vec3i calculateParentCellId (const Vec3i &cellId)
 
UInt calculateRootCellIndex (const Vec2i &cellId)
 
UInt calculateRootCellIndex (const Vec3i &cellId)
 
UInt8 calculateTier (Real minCellSize, const agxData::Array< Real > &gridTier_size)
 Calculates the tier where the given object size will fit.
 
template<typename KeyT , typename HashT >
LinearProbingHashSetImplementation< KeyT, HashT >::const_iterator cbegin (const LinearProbingHashSetImplementation< KeyT, HashT > &set)
 
template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::const_iterator cbegin (const LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &table)
 
template<typename KeyT , typename HashT >
LinearProbingHashSetImplementation< KeyT, HashT >::const_iterator cend (const LinearProbingHashSetImplementation< KeyT, HashT > &set)
 
template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::const_iterator cend (const LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &table)
 
template<typename T >
Vec2T< T > clamp (const Vec2T< T > &vec, const Vec2T< T > &minimum, const Vec2T< T > &maximum)
 
template<typename T >
Vec3T< T > clamp (const Vec3T< T > &vec, const Vec3T< T > &minimum, const Vec3T< T > &maximum)
 
template<typename T >
Vec4T< T > clamp (const Vec4T< T > &vec, const Vec4T< T > &minimum, const Vec4T< T > &maximum)
 
template<typename T1 , typename T2 , typename T3 >
T1 clamp (T1 v, T2 minimum, T3 maximum)
 
AGXCORE_EXPORT bool ClosePlugin (PluginHandle handle)
 Closes a plugin.
 
bool compareCellSortEntries (const CellSortEntry &p1, const CellSortEntry &p2)
 
AGXCORE_EXPORT void computeEigenvalues (agx::Matrix3x3 a, agx::Vec3 &realPart, agx::Vec3 &imgPart)
 
template<typename T >
Real computeVolume (const T &a, const T &b, const T &c, const T &d)
 a, b, c, d sides of the tetrahedron
 
template<typename T >
Real computeVolume (const T &f1, const T &f2, const T &f3, const T &b1, const T &b2, const T &b3)
 compute the volume of a prism.
 
template<typename GridTierDataT , typename CellDataT , typename CellT , typename CellIdT , typename CellPosT , typename GridCellTableT , size_t NumNeighbors>
UInt32 connectToParentCell (agxData::Array< agx::UInt32 > &deadCells, agxData::Array< Physics::HierarchicalGrid::ContactZonePtr > &emptyZones, Index cellIndex, UInt8 tier, const CellIdT cellId, GridTierDataT &gridTier, CellDataT &cell, agxData::Array< CellT > &rootCells, const CellIdT *NeighborTable, agx::Bool &hasNewTiers, Physics::HierarchicalGrid::SolveBodyManager *solveBodyManager, const agx::UInt &contactZoneAccumulationLevel)
 
template<typename CellDataT , typename CellIdT >
void connectToParentCell (Index cellIndex, const CellIdT cellId, Index parentCellIndex, CellDataT &cell, Physics::HierarchicalGrid::SolveBodyManager *solveBodyManager, const agx::UInt &contactZoneAccumulationLevel)
 
template<class T , class Y >
ref_ptr< T > const_pointer_cast (const ref_ptr< Y > &rp)
 
Vec3 cornerOffsets2D (Real32 radius, size_t corner)
 
AGXCORE_EXPORT void createBuiltinModel (const char *path, Model *parent, Model *&result)
 
template<typename GridTierDataT , typename CellDataT , typename CellT , typename CellIdT , typename CellPosT , typename GridCellTableT , size_t NumNeighbors>
UInt32 createCell (agxData::Array< agx::UInt32 > &deadCells, agxData::Array< Physics::HierarchicalGrid::ContactZonePtr > &emptyZones, UInt8 tier, const CellIdT cellId, GridTierDataT &gridTier, CellDataT &cell, agxData::Array< CellT > &rootCells, const CellIdT *NeighborTable, agx::Bool &hasNewTiers, Physics::HierarchicalGrid::SolveBodyManager *solveBodyManager, const agx::UInt &contactZoneAccumulationLevel)
 Create and connect a cell.
 
AGXCORE_EXPORT void createImplementedModel (const char *path, Model *&result)
 
template<typename GridTierDataT , typename CellDataT , typename CellT , typename CellIdT , typename CellPosT , typename GridCellTableT , size_t NumNeighbors>
size_t createMissingTiers (Real minCellSize, agxData::Array< agx::UInt32 > &deadCells, agxData::Array< Physics::HierarchicalGrid::ContactZonePtr > &emptyZones, GridTierDataT &gridTier, CellDataT &cell, agxData::Array< CellT > &rootCells, const CellIdT *NeighborTable, agx::Bool &hasNewTiers, Physics::HierarchicalGrid::SolveBodyManager *solveBodyManager, const agx::UInt &contactZoneAccumulationLevel)
 
template<typename GridTierDataT , typename GridCellTableT >
void createTier (size_t tier, Real tierSize, agxData::Buffer *cellIdBuffer, GridTierDataT &gridTier)
 
AGXCORE_EXPORT const char * cStr (const char *str)
 
AGXCORE_EXPORT const char * cStr (const std::string &str)
 
Real degreesToRadians (Real angle)
 
template<class T , class Y >
ref_ptr< T > dynamic_pointer_cast (const ref_ptr< Y > &rp)
 
template<typename T , size_t N>
const T * end (const StackArray< T, N > &array)
 
template<typename T , typename A >
Vector< T, A >::const_iterator end (const Vector< T, A > &v)
 
template<typename T , typename A >
VectorPOD< T, A >::const_iterator end (const VectorPOD< T, A > &v)
 
template<typename KeyT , typename HashT >
LinearProbingHashSetImplementation< KeyT, HashT >::iterator end (LinearProbingHashSetImplementation< KeyT, HashT > &set)
 
template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::iterator end (LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &table)
 
template<typename T , size_t N>
T * end (StackArray< T, N > &array)
 
template<typename T , typename A >
Vector< T, A >::iterator end (Vector< T, A > &v)
 
template<typename T , typename A >
VectorPOD< T, A >::iterator end (VectorPOD< T, A > &v)
 
AGXPHYSICS_EXPORT agx::Bool equalsZero (const agx::AddedMassInteraction::Matrix6x6 &matrix, agx::Real eps=agx::RealEpsilon)
 
bool equalsZero (double d, double eps=DBL_EPSILON)
 
bool equalsZero (float f, float eps=FLT_EPSILON)
 
AGXPHYSICS_EXPORT agx::Bool equivalent (const agx::AddedMassInteraction::Matrix6x6 &lhs, const agx::AddedMassInteraction::Matrix6x6 &rhs, agx::Real eps=agx::RealEpsilon)
 
template<typename T >
bool equivalent (const agx::AffineMatrix4x4T< T > &a, const agx::AffineMatrix4x4T< T > &b, T epsilon=T(AGX_EQUIVALENT_EPSILON))
 
template<typename T >
bool equivalent (const agx::Matrix4x4T< T > &a, const agx::Matrix4x4T< T > &b, T epsilon=1e-6)
 
template<typename T >
bool equivalent (const agx::QuatT< T > &a, const agx::QuatT< T > &b, T epsilon=T(AGX_EQUIVALENT_EPSILON))
 
template<typename T >
bool equivalent (const agx::Vec2T< T > &a, const agx::Vec2T< T > &b, T epsilon=T(AGX_EQUIVALENT_EPSILON))
 
template<typename T >
bool equivalent (const agx::Vec3T< T > &a, const agx::Vec3T< T > &b, T epsilon=T(AGX_EQUIVALENT_EPSILON))
 
template<typename T >
bool equivalent (const agx::Vec4T< T > &a, const agx::Vec4T< T > &b, T epsilon=T(AGX_EQUIVALENT_EPSILON))
 
bool equivalent (const SPDMatrix3x3 &m1, const SPDMatrix3x3 &m2, Real epsilon=Real(AGX_EQUIVALENT_EPSILON))
 
bool equivalent (double lhs, double rhs, double epsilon=(double) AGX_EQUIVALENT_EPSILON)
 Compare two values for equality.
 
bool equivalent (float lhs, float rhs, double epsilon)
 Compare two values for equality.
 
bool equivalent (float lhs, float rhs, float epsilon=(float) AGX_EQUIVALENT_EPSILON)
 Compare two values for equality.
 
fmiStatus fmiInit (nsFMI::Export::Module *module)
 
fmiStatus fmiInitApplication (nsFMI::Export::Module *module)
 
fmiStatus fmiShutdown (nsFMI::Export::Module *module)
 
AGXCORE_EXPORT bool forcedShutdown ()
 
void AGXCORE_EXPORT generateChromeTracing (const String &rootPath, agxData::JournalArchive::Session *journalSession)
 A Chrome trace is a thread time line written in the chrome tracing format.
 
void AGXCORE_EXPORT generateTaskProfiles (const String &rootPath, agxData::JournalArchive::Session *journalSession)
 
void AGXCORE_EXPORT generateThreadTimeline (const String &rootPath, agxData::JournalArchive::Session *journalSession)
 
bool geq (double a, double b, double eps=(double) AGX_EQUIVALENT_EPSILON)
 
bool geq (float a, float b, float eps=(float) AGX_EQUIVALENT_EPSILON)
 
template<class T >
T * get_pointer (const ref_ptr< T > &rp)
 
Real getAngle (const Vec3 &a, const Vec3 &b, const Vec3 &c)
 a and b should be orthogonal
 
std::string AGXCORE_EXPORT getBuildConfigurationString (BuildConfiguration config)
 
template<>
Vec2i getCornerId (size_t corner, Real32 radius, Vec3f centerPosition, Real32 invCellSize)
 
template<typename CellIdT >
CellIdT getCornerId (size_t, Real32, Vec3f, Real32)
 
AGXCORE_EXPORT ThreadgetCurrentThread ()
 
AGXCORE_EXPORT const agx::StringgetEmptyString ()
 Return a reference to an empty string that is owned by an AGX Dynamics shared library.
 
AGXCORE_EXPORT bool getEntityCreationThreadSafe ()
 
AGXCORE_EXPORT int getExceptionNotifyLevel ()
 
AGXCORE_EXPORT ModelgetModel (const char *path, const Path &_namespace=Path())
 
AGXCORE_EXPORT ModelgetModel (const Path &path, const Name &implementation, const Path &_namespace=Path())
 
template<typename T >
T * getModel (const Path &path, const Name &implementation, const Path &_namespace=Path())
 
AGXCORE_EXPORT ModelgetModel (const Path &path, const Path &_namespace=Path())
 
template<typename T >
T * getModel (const Path &path, const Path &_namespace=Path())
 
AGXCORE_EXPORT ModelgetModel (const String &path, const Path &_namespace=Path())
 
AGXCORE_EXPORT ModelgetModel (TiXmlElement *element)
 
agx::Index AGXCORE_EXPORT getNumThreads ()
 
agx::Index AGXCORE_EXPORT getNumThreadsIncludingRegistered ()
 
AGXPHYSICS_EXPORT agx::Physics::ParticleGeometryContactData * getParticleGeometryImpacts (agx::Physics::GranularBodySystem *system)
 
AGXPHYSICS_EXPORT agxData::EntityStoragegetParticleGeometryImpactsStorage (agx::Physics::GranularBodySystem *system)
 
AGXPHYSICS_EXPORT agx::Physics::ParticlePairContactData * getParticlePairImpacts (agx::Physics::GranularBodySystem *system)
 
AGXPHYSICS_EXPORT agxData::EntityStoragegetParticlePairImpactsStorage (agx::Physics::GranularBodySystem *system)
 
AGXCORE_EXPORT agx::String GetPluginError ()
 Get plugin error.
 
AGXCORE_EXPORT agx::UniformInt32GeneratorgetRandGenerator ()
 
UInt64 AGXCORE_EXPORT getStartTick ()
 
AGXCORE_EXPORT agx::ReentrantMutexgetTypeSystemMutex ()
 
agx::UInt32 hash (agx::UInt32 x, agx::UInt32 y, agx::UInt32 z)
 
template<typename T >
AGXCORE_EXPORT UInt32 hash (const T &key)
 
template<typename T >
UInt32 hash (const T &key)
 
UInt32 AGXCORE_EXPORT hash (UInt32 h1, UInt32 h2)
 
AGXCORE_EXPORT bool hashKeyContains (agx::UInt64 key, agx::UInt32 id)
 
bool hashKeyEqual (char *key1, char *key2)
 
bool hashKeyEqual (const char *key1, const char *key2)
 
template<typename T1 , typename T2 >
bool hashKeyEqual (const T1 &key1, const T2 &key2)
 
AGXPHYSICS_EXPORT uint32_t hashword (const uint32_t *k, size_t length, uint32_t initval)
 
AGXPHYSICS_EXPORT void hashword2 (const uint32_t *k, size_t length, uint32_t *pc, uint32_t *pb)
 
template<typename T >
agx::UInt8 highestBitToIndex (T n)
 
void AGXPHYSICS_EXPORT init ()
 Initialize AGX Dynamics API including thread resources and must be executed before using the AGX API.
 
double innerProd_6 (const Vec3d &v_01, const Vec3d &v_02, const Vec3d &v_11, const Vec3d &v_12)
 
float innerProd_6 (const Vec3f &v_01, const Vec3f &v_02, const Vec3f &v_11, const Vec3f &v_12)
 
template<typename T >
inverse (const T &value)
 
template<>
AffineMatrix4x4d inverse< AffineMatrix4x4d > (const AffineMatrix4x4d &value)
 
template<>
AffineMatrix4x4f inverse< AffineMatrix4x4f > (const AffineMatrix4x4f &value)
 
template<>
Matrix4x4d inverse< Matrix4x4d > (const Matrix4x4d &value)
 
template<>
Matrix4x4f inverse< Matrix4x4f > (const Matrix4x4f &value)
 
int irandom (int min, int max)
 
template<typename T1 , typename T2 >
bool isAligned (const T1 *ptr, T2 alignment)
 
template<typename T >
bool isAligned (T value, T alignment)
 
bool AGXCORE_EXPORT isASCII (const char *str)
 
bool AGXCORE_EXPORT isASCII (const std::string &s)
 
bool AGXCORE_EXPORT isBuiltWith (BuildConfiguration config)
 
template<typename T >
bool isEven (T val)
 
template<typename T >
bool isFinite (T v)
 
template<typename T >
bool isInf (T v)
 
bool AGXPHYSICS_EXPORT isInitialized ()
 
template<typename T >
bool isNaN (T v)
 
template<typename T >
bool isPowerOfTwo (T value)
 
bool AGXPHYSICS_EXPORT isShutdown ()
 This method indicates if agx::shutdown() has been started or already done.
 
bool leq (double a, double b, double eps=(double) AGX_EQUIVALENT_EPSILON)
 
bool leq (float a, float b, float eps=(float) AGX_EQUIVALENT_EPSILON)
 
template<typename T1 , typename T2 >
T1 const lerp (T1 const &a, T1 const &b, T2 s)
 Linearly interpolate from a to b using s = {0,..1}.
 
Int32 log2 (size_t val)
 
AGXCORE_EXPORT void log_throw (const std::string &where, const char *what)
 
template<typename T >
T const logInterpolate (T const &a, T const &b, float s)
 logarithmic interpolation from a to b using s = {0,..1}
 
template<typename T >
IndexRangeT< T > makeIndexRange (const T begin, const T end)
 
AGXCORE_EXPORT FunctionHandle MapPluginSymbol (PluginHandle handle, const char *symbolName)
 
template<typename T >
Vec3T< T > max (const Vec3T< T > &lhs, const Vec3T< T > &rhs)
 
void microSleep (Real microSeconds)
 Sleep the current thread.
 
template<typename T >
Vec3T< T > min (const Vec3T< T > &lhs, const Vec3T< T > &rhs)
 
UInt32 morton (const Vec2i32 &vec)
 
UInt64 morton (const Vec2i64 &vec)
 
UInt32 morton (const Vec2u32 &vec)
 
UInt64 morton (const Vec2u64 &vec)
 
UInt32 morton (const Vec3i32 &vec)
 
UInt64 morton (const Vec3i64 &vec)
 
UInt32 morton (const Vec3u32 &vec)
 
UInt64 morton (const Vec3u64 &vec)
 
UInt32 morton (UInt32 x, UInt32 y)
 
UInt32 morton (UInt32 x, UInt32 y, UInt32 z)
 
UInt64 morton (UInt64 x, UInt64 y)
 
UInt64 morton (UInt64 x, UInt64 y, UInt64 z)
 
UInt32 morton_part1By1 (UInt32 n)
 
UInt64 morton_part1By1 (UInt64 n)
 
UInt32 morton_part1By2 (UInt32 n)
 
UInt64 morton_part1By2 (UInt64 n)
 
UInt32 morton_reference (UInt32 x, UInt32 y)
 
UInt32 morton_reference (UInt32 x, UInt32 y, UInt32 z)
 
UInt64 morton_reference (UInt64 x, UInt64 y)
 
UInt64 morton_reference (UInt64 x, UInt64 y, UInt64 z)
 
template<typename T >
Real mult (const Jacobian6DOFElementT< T > &G1, const Jacobian6DOFElementT< T > &G2)
 
Vec3f mult (const Matrix3x3f &m, const Vec3f &v)
 
void nanoSleep (long)
 
AGXCORE_EXPORT int nextPrime (int n)
 
void noopLoop (UInt64 numIterations)
 
AGXCORE_EXPORT Real normalizedAngle (Real angle, bool positiveRange=false)
 Normalize an angle.
 
AGXCORE_EXPORT PluginHandle OpenPlugin (const char *path)
 Opens a plugin. Corresponds to LoadLibrary or dlopen.
 
bool operator!= (const agx::String &str, const agx::Name &name)
 
bool operator!= (const char *str, const agx::Name &name)
 
bool operator!= (const std::string &str, const agx::Name &name)
 
template<typename T >
bool operator!= (const SymmetricPair< T > &a, const SymmetricPair< T > &b)
 
template<typename T , typename U >
bool operator!= (T *p, ref_ptr< U > const &rp)
 
template<typename T , typename U >
bool operator!= (T const *p, ref_ptr< U > const &rp)
 
template<typename T >
bool operator!= (T val, InvalidIndexStruct)
 
agx::Vec6 operator* (const agx::Real &r, const agx::Vec6 &v)
 
SPDMatrix3x3 operator* (const Real &r, const SPDMatrix3x3 &m)
 
template<typename T >
Matrix3x3T< T > operator* (const T &r, const Matrix3x3T< T > &m)
 
Vec3 operator* (const Vec3 &v, const OrthoMatrix3x3 &m)
 
Vec3 operator* (const Vec3 &v, const SPDMatrix3x3 &m)
 
template<typename T >
Real operator* (const Vec3T< T > &lhs, const Vec4T< T > &rhs)
 Compute the dot product of a (Vec3,1.0) and a Vec4.
 
template<typename T >
Vec3T< T > operator* (const Vec3T< T > &v, const AffineMatrix4x4T< T > &m)
 
template<typename T >
Vec3T< T > operator* (const Vec3T< T > &v, const Matrix3x3T< T > &m)
 
template<typename T >
Vec3T< T > operator* (const Vec3T< T > &v, const Matrix4x4T< T > &m)
 
template<typename T >
Real operator* (const Vec4T< T > &lhs, const Vec3T< T > &rhs)
 Compute the dot product of a Vec4 and a (Vec3,1.0).
 
template<typename T >
Vec4T< T > operator* (const Vec4T< T > &v, const AffineMatrix4x4T< T > &m)
 
template<typename T >
Vec4T< T > operator* (const Vec4T< T > &v, const Matrix4x4T< T > &m)
 
template<typename T >
Vec3T< T > operator* (T val, const Vec3T< T > &vec)
 
template<typename T >
AgXString< T > operator+ (const char *str1, const AgXString< T > &str2)
 
template<typename T >
AgXString< T > operator+ (const char elem, const AgXString< T > &str)
 
template<typename T >
AgXString< T > operator+ (const Indentation &indentation, const AgXString< T > &str)
 
std::ostream & operator<< (std::ostream &os, const agx::AddedMassInteraction::Matrix6x6 &m)
 
std::ostream & operator<< (std::ostream &os, const EulerAngles &e)
 
std::ostream & operator<< (std::ostream &os, const Matrix &m)
 
template<typename T >
std::ostream & operator<< (std::ostream &os, const Matrix3x3T< T > &m)
 
template<typename T >
std::ostream & operator<< (std::ostream &os, const Matrix4x4T< T > &m)
 
std::ostream & operator<< (std::ostream &os, const OrthoMatrix3x3 &m)
 
std::ostream & operator<< (std::ostream &os, const SPDMatrix3x3 &m)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const BoundT< T > &bound)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const IndexRangeT< T > &range)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const LineT< T > &line)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const PlaneT< T > &plane)
 
std::ostream & operator<< (std::ostream &output, const Quat &vec)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const QuatT< T > &quat)
 
template<typename T , size_t N>
std::ostream & operator<< (std::ostream &output, const StackArray< T, N > &array)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const SymmetricPair< T > &pair)
 
std::ostream & operator<< (std::ostream &output, const Vec2 &vec)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const Vec2T< T > &v)
 
std::ostream & operator<< (std::ostream &output, const Vec3d &vec)
 
std::ostream & operator<< (std::ostream &output, const Vec3f &vec)
 
std::ostream & operator<< (std::ostream &output, const Vec3i &vec)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const Vec3T< T > &v)
 
std::ostream & operator<< (std::ostream &output, const Vec4 &vec)
 
template<typename T >
std::ostream & operator<< (std::ostream &output, const Vec4T< T > &v)
 
template<typename T , typename A >
std::ostream & operator<< (std::ostream &output, const Vector< T, A > &vec)
 
template<typename T , typename A >
std::ostream & operator<< (std::ostream &output, const VectorPOD< T, A > &vec)
 
template<typename T >
std::ostream & operator<< (std::ostream &stream, const agx::EventT< T > &e)
 
template<class T >
std::ostream & operator<< (std::ostream &stream, const AtomicValueT< T > &value)
 
std::ostream & operator<< (std::ostream &stream, const Indentation &indentation)
 
AGXCORE_EXPORT std::ostream & operator<< (std::ostream &stream, const Name &name)
 
AGXCORE_EXPORT std::ostream & operator<< (std::ostream &stream, const Path &path)
 
template<typename T >
std::ostream & operator<< (std::ostream &stream, const Range< T > &range)
 
std::ostream & operator<< (std::ostream &stream, const SimpleContactMaterial &)
 
AGXCORE_EXPORT std::ostream & operator<< (std::ostream &stream, const Uuid &uuid)
 
bool operator== (const agx::String &str, const agx::Name &name)
 
bool operator== (const char *str, const agx::Name &name)
 
bool operator== (const std::string &str, const agx::Name &name)
 
template<typename T >
bool operator== (const SymmetricPair< T > &a, const SymmetricPair< T > &b)
 
template<typename T , typename U >
bool operator== (T *p, ref_ptr< U > const &rp)
 
template<typename T , typename U >
bool operator== (T const *p, ref_ptr< U > const &rp)
 
template<typename T >
bool operator== (T val, InvalidIndexStruct)
 
template<typename ch , typename char_traits >
std::basic_istream< ch, char_traits > & operator>> (std::basic_istream< ch, char_traits > &is, Uuid &u)
 
std::istream & operator>> (std::istream &input, Quat &vec)
 
std::istream & operator>> (std::istream &input, Vec2 &vec)
 
std::istream & operator>> (std::istream &input, Vec3d &vec)
 
std::istream & operator>> (std::istream &input, Vec3f &vec)
 
std::istream & operator>> (std::istream &input, Vec3i &vec)
 
std::istream & operator>> (std::istream &input, Vec4 &vec)
 
uint32_t PACK_UINT32 (uint8_t b0, uint8_t b1, uint8_t b2, uint8_t b3)
 Pack 4 8 bit unsigned integers into one 32bit unsigned integer.
 
template<typename T >
parseAttribute (const TiXmlElement *element, const char *attributeName)
 
template<>
Name parseAttribute< Name > (const TiXmlElement *element, const char *attributeName)
 
template<>
String parseAttribute< String > (const TiXmlElement *element, const char *attributeName)
 
template<typename T >
agx::UInt32 pow2Exponent (T value)
 Finds and returns n given value = 2^n.
 
template<int hint, typename T >
void prefetch (const T *)
 
template<int hint, typename T >
void prefetch_128 (const T *)
 
template<int hint, typename T >
void prefetch_256 (const T *)
 
template<int hint, typename T >
void prefetch_64 (const T *)
 
template<int PrefetchT>
void prefetchBytes (const void *, size_t)
 
template<typename T >
void prefetchL3 (const T *, size_t)
 
template<typename T >
void prefetchNTA (const T *, size_t)
 
template<typename T >
agx::String printBin (const T &val)
 
agx::String AGXCORE_EXPORT printBin (const void *data, UInt numBytes)
 
agx::String AGXCORE_EXPORT printBin (Real32 val)
 
agx::String AGXCORE_EXPORT printBin (Real64 val)
 
agx::String AGXCORE_EXPORT printBin (UInt32 val)
 
agx::String AGXCORE_EXPORT printBin (UInt64 val)
 
template<typename T >
agx::String printHex (const T &val)
 
agx::String AGXCORE_EXPORT printHex (const void *data, UInt numBytes)
 
agx::String AGXCORE_EXPORT printHex (Real32 val)
 
agx::String AGXCORE_EXPORT printHex (Real64 val)
 
agx::String AGXCORE_EXPORT printHex (UInt32 val)
 
agx::String AGXCORE_EXPORT printHex (UInt64 val)
 
AGXCORE_EXPORT void printNode (const char *path)
 Debugging.
 
template<typename VectorT >
std::ostream & printVector (std::ostream &output, const VectorT &vec)
 
Real radiansToDegrees (Real angle)
 
template<typename T >
random (T min, T max)
 
bool relativelyEquivalent (double lhs, double rhs, double epsilon=(double) AGX_EQUIVALENT_EPSILON)
 Compare two values for relative equality.
 
bool relativelyEquivalent (float lhs, float rhs, double epsilon)
 Compare two values for relative equality.
 
bool relativelyEquivalent (float lhs, float rhs, float epsilon=(float) AGX_EQUIVALENT_EPSILON)
 Compare two values for relative equality.
 
void AGXCORE_EXPORT resetStartTick ()
 Reset the startTick value to the current tick.
 
AGXCORE_EXPORT Componentroot ()
 
AGXCORE_EXPORT void setEntityCreationThreadSafe (bool)
 Iff true you can move the entity to another thread (but you may only use it from one thread at the time).
 
AGXCORE_EXPORT int setExceptionNotifyLevel (int level)
 
void AGXCORE_EXPORT setNumThreads (size_t numThreads)
 Set the number of threads to use (including the main thread).
 
void AGXPHYSICS_EXPORT shutdown ()
 Shutdown of the AGX Dynamics API will be done when the number of shutdown matches the number of calls to init().
 
template<typename T >
sign (T v)
 
template<typename T >
signedSquare (T v)
 
template<typename T >
Vec3T< T > sinc (const agx::Vec3T< T > &a)
 
Real sinc (Real x, Real nearZero=Real(1E-4))
 Sinc function.
 
bool sphereBoxOverlapTest (Real sphereRadius, const Vec3 &spherePosition, const Vec3 &boxHalfExtents, const AffineMatrix4x4 &boxInvTransform)
 
AGXCORE_EXPORT void splitHashKey (agx::UInt64 key, agx::UInt32 &id1, agx::UInt32 &id2)
 
template<typename T >
square (T v)
 
template<class T , class Y >
ref_ptr< T > static_pointer_cast (const ref_ptr< Y > &rp)
 
template<typename T >
UInt32 stringHash (const T &key, UInt32 startValue=0)
 
AGXCORE_EXPORT double strtod (const char *nptr, char **endptr)
 strtod ignoring global locale
 
AGXCORE_EXPORT float strtof (const char *nptr, char **endptr)
 strtod ignoring global locale
 
template<class T >
void swap (Vector< T > &x, Vector< T > &y)
 
template<class T >
void swap (VectorPOD< T > &x, VectorPOD< T > &y)
 
AGXCORE_EXPORT const char * UnicodeName (const char *s)
 
AGXCORE_EXPORT const std::string & UnicodeName (const std::string &s)
 
void UNPACK_UINT32 (uint32_t val, uint8_t &c0, uint8_t &c1, uint8_t &c2, uint8_t &c3)
 Unpack 4 8 bit unsigned integers from one unsigned 32bit integer.
 
std::wstring AGXCORE_EXPORT utf8ToWide (const char *str)
 
std::wstring AGXCORE_EXPORT utf8ToWide (const std::string &s)
 
std::string AGXCORE_EXPORT wideToUtf8 (const std::wstring &wide)
 
const Vec3 X_AXIS (1.0, 0.0, 0.0)
 
const Vec2 X_AXIS_2D (1.0, 0.0)
 
const Vec3 Y_AXIS (0.0, 1.0, 0.0)
 
const Vec2 Y_AXIS_2D (0.0, 1.0)
 
const Vec3 Z_AXIS (0.0, 0.0, 1.0)
 

Variables

const Real AGX_EQUIVALENT_EPSILON = (double)1E-9
 
AGXCORE_EXPORT const char *const BUILD_TYPE
 
AGXCORE_EXPORT const char *const C_BUILD_FLAGS
 
AGXCORE_EXPORT const char *const CPP_BUILD_FLAGS
 
const Real DEG_TO_RAD = agx::Real(0.017453292519943295769236907684886)
 
const Real GRAVITY_ACCELERATION = Real(9.80665)
 
AGXCORE_EXPORT const Real Infinity
 
const Int16 Int16Max = std::numeric_limits<Int16>::max()
 
const Int32 Int32Max = std::numeric_limits<Int32>::max()
 
const Int64 Int64Max = std::numeric_limits<Int64>::max()
 
const Int8 Int8Max = std::numeric_limits<Int8>::max()
 
const Int IntMax = std::numeric_limits<Int>::max()
 
AGXCORE_EXPORT const InvalidIndexStruct InvalidIndex
 
const Real PI = agx::Real(M_PI)
 
const Real PI_2 = agx::Real(M_PI_2)
 
const Real PI_4 = agx::Real(M_PI_4)
 
const Real RAD_TO_DEG = agx::Real(57.295779513082320876798154814105)
 
AGXCORE_EXPORT const Real32 Real32Epsilon
 
AGXCORE_EXPORT const Real32 Real32Max
 
AGXCORE_EXPORT const Real32 Real32Min
 
AGXCORE_EXPORT const Real64 Real64Epsilon
 
AGXCORE_EXPORT const Real64 Real64Max
 
AGXCORE_EXPORT const Real64 Real64Min
 
AGXCORE_EXPORT const Real REAL_SQRT_EPSILON
 
AGXCORE_EXPORT const Real RealEpsilon
 
AGXCORE_EXPORT const Real RealMax
 
AGXCORE_EXPORT const Real RealMin
 
static const RealModeEnum RealMode = REAL_64BIT
 
const Size SizeMax = std::numeric_limits<Size>::max()
 
const UInt16 UInt16Max = std::numeric_limits<UInt16>::max()
 
const UInt32 UInt32Max = std::numeric_limits<UInt32>::max()
 
const UInt64 UInt64Max = std::numeric_limits<UInt64>::max()
 
const UInt8 UInt8Max = std::numeric_limits<UInt8>::max()
 
const UInt UIntMax = std::numeric_limits<UInt>::max()
 

Detailed Description

The agx namespace contains the dynamics/math part of the AGX Dynamics API.

Typedef Documentation

◆ AddedMassInteractionConstObserver

◆ AddedMassInteractionConstRef

◆ AddedMassInteractionHandlerRef

◆ AddedMassInteractionObserver

◆ AddedMassInteractionRef

◆ AffineMatrix4x4

Definition at line 390 of file AffineMatrix4x4.h.

◆ AffineMatrix4x4d

Definition at line 393 of file AffineMatrix4x4.h.

◆ AffineMatrix4x4dVector

◆ AffineMatrix4x4f

Definition at line 392 of file AffineMatrix4x4.h.

◆ AffineMatrix4x4fVector

◆ AffineMatrix4x4Vector

◆ AnalysisBoxConstObserver

Definition at line 27 of file AnalysisBox.h.

◆ AnalysisBoxConstRef

Definition at line 27 of file AnalysisBox.h.

◆ AnalysisBoxObserver

Definition at line 27 of file AnalysisBox.h.

◆ AnalysisBoxRef

Definition at line 27 of file AnalysisBox.h.

◆ AngleContainer

Definition at line 121 of file ConstraintAngle.h.

◆ AngleRef

Definition at line 120 of file ConstraintAngle.h.

◆ AngularJointBaseRef

◆ AngularLockJointRef

Definition at line 83 of file AngularLockJoint.h.

◆ ArrayParameterConstObserver

Definition at line 40 of file Parameter.h.

◆ ArrayParameterConstRef

Definition at line 40 of file Parameter.h.

◆ ArrayParameterObserver

◆ ArrayParameterObserverVector

◆ ArrayParameterPtrVector

Definition at line 49 of file Parameter.h.

◆ ArrayParameterRef

Definition at line 40 of file Parameter.h.

◆ ArrayParameterRefVector

◆ AtomicValue

agx::AtomicValue is an alias for agx::AtomicValueT<agx::Int32>

Definition at line 103 of file AtomicValue.h.

◆ AttachmentPtrVector

Definition at line 96 of file agx_vector_types.h.

◆ AttachmentRef

Definition at line 202 of file agx/Attachment.h.

◆ BallJointRef

Definition at line 219 of file BallJoint.h.

◆ BodyBodyContactJacobian

◆ BodyBodyContactJacobian32

◆ BodyBodyContactJacobian64

◆ BodyContactJacobian

◆ BodyContactJacobian32

◆ BodyContactJacobian64

◆ Bool

typedef bool agx::Bool

Definition at line 48 of file Integer.h.

◆ BoolValarray

typedef std::valarray< agx::Bool > agx::BoolValarray

Data type used for selecting sub-matrices.

Definition at line 32 of file agx_valarray_types.h.

◆ BoolVector

Definition at line 91 of file agx_vector_types.h.

◆ Bound1

Definition at line 125 of file Bound.h.

◆ Bound1d

Definition at line 127 of file Bound.h.

◆ Bound1f

Definition at line 126 of file Bound.h.

◆ Bound1i

Definition at line 128 of file Bound.h.

◆ Bound1i32

Definition at line 129 of file Bound.h.

◆ Bound1i64

Definition at line 130 of file Bound.h.

◆ Bound1u

Definition at line 131 of file Bound.h.

◆ Bound1u32

Definition at line 132 of file Bound.h.

◆ Bound1u64

Definition at line 133 of file Bound.h.

◆ Bound2

Definition at line 136 of file Bound.h.

◆ Bound2d

Definition at line 138 of file Bound.h.

◆ Bound2f

Definition at line 137 of file Bound.h.

◆ Bound2i

Definition at line 139 of file Bound.h.

◆ Bound2i32

Definition at line 140 of file Bound.h.

◆ Bound2i64

Definition at line 141 of file Bound.h.

◆ Bound2u

Definition at line 142 of file Bound.h.

◆ Bound2u32

Definition at line 143 of file Bound.h.

◆ Bound2u64

Definition at line 144 of file Bound.h.

◆ Bound3

Definition at line 147 of file Bound.h.

◆ Bound3d

Definition at line 149 of file Bound.h.

◆ Bound3f

Definition at line 148 of file Bound.h.

◆ Bound3i

Definition at line 151 of file Bound.h.

◆ Bound3i32

Definition at line 152 of file Bound.h.

◆ Bound3i64

Definition at line 153 of file Bound.h.

◆ Bound3u

Definition at line 155 of file Bound.h.

◆ Bound3u32

Definition at line 156 of file Bound.h.

◆ Bound3u64

Definition at line 157 of file Bound.h.

◆ BoxedHybridPivotAlgorithmRef

◆ BoxedKellerAlgorithmRef

◆ BoxedMurtyAlgorithmRef

◆ BoxFrictionModelConstObserver

◆ BoxFrictionModelConstRef

Definition at line 202 of file FrictionModel.h.

◆ BoxFrictionModelObserver

◆ BoxFrictionModelRef

◆ BulkMaterialConstObserver

Definition at line 56 of file Material.h.

◆ BulkMaterialConstRef

Definition at line 56 of file Material.h.

◆ BulkMaterialObserver

Definition at line 56 of file Material.h.

◆ BulkMaterialRef

Definition at line 56 of file Material.h.

◆ CellReorderingConstObserver

◆ CellReorderingConstRef

Definition at line 25 of file CellReordering.h.

◆ CellReorderingObserver

◆ CellReorderingRef

Definition at line 25 of file CellReordering.h.

◆ CharVector

typedef VectorPOD<char> agx::CharVector

Definition at line 92 of file agx_vector_types.h.

◆ ClockConstObserver

Definition at line 28 of file Clock.h.

◆ ClockConstRef

Definition at line 28 of file Clock.h.

◆ ClockObserver

Definition at line 28 of file Clock.h.

◆ ClockObserverVector

Definition at line 29 of file Clock.h.

◆ ClockPtrVector

Definition at line 29 of file Clock.h.

◆ ClockRef

Definition at line 28 of file Clock.h.

◆ ClockRefVector

Definition at line 29 of file Clock.h.

◆ ComponentConstObserver

Definition at line 31 of file Component.h.

◆ ComponentConstRef

Definition at line 31 of file Component.h.

◆ ComponentObserver

Definition at line 31 of file Component.h.

◆ ComponentObserverVector

◆ ComponentPtrVector

Definition at line 32 of file Component.h.

◆ ComponentRef

Definition at line 31 of file Component.h.

◆ ComponentRefVector

Definition at line 32 of file Component.h.

◆ Condition

using agx::Condition = typedef std::condition_variable

Definition at line 59 of file ThreadSynchronization.h.

◆ ConeLimitAngleRef

Definition at line 302 of file ConstraintAngle.h.

◆ ConeLimitRef

Definition at line 1423 of file ElementaryConstraint.h.

◆ Constraint1DOFConstObserver

◆ Constraint1DOFConstRef

Definition at line 666 of file Constraint.h.

◆ Constraint1DOFObserver

◆ Constraint1DOFObserverVector

◆ Constraint1DOFPtrVector

◆ Constraint1DOFRef

Definition at line 666 of file Constraint.h.

◆ Constraint1DOFRefVector

◆ Constraint2DOFConstObserver

◆ Constraint2DOFConstRef

Definition at line 755 of file Constraint.h.

◆ Constraint2DOFObserver

◆ Constraint2DOFRef

Definition at line 755 of file Constraint.h.

◆ ConstraintConstObserver

Definition at line 53 of file Constraint.h.

◆ ConstraintConstPtrSet

Definition at line 39 of file InverseDynamics.h.

◆ ConstraintConstRef

Definition at line 53 of file Constraint.h.

◆ ConstraintImplementationHashTable

◆ ConstraintImplementationPtrIntHashTable

◆ ConstraintImplPtrVector

◆ ConstraintNlmcpCallbackRef

◆ ConstraintObserver

Definition at line 53 of file Constraint.h.

◆ ConstraintObserverVector

◆ ConstraintPtrVector

Definition at line 54 of file Constraint.h.

◆ ConstraintRef

Definition at line 53 of file Constraint.h.

◆ ConstraintRefSetVector

◆ ConstraintRefVector

Definition at line 54 of file Constraint.h.

◆ ConstraintRigidBodyContainer

◆ ContactForceReaderRef

◆ ContactMaterialConstObserver

◆ ContactMaterialConstRef

Definition at line 60 of file Material.h.

◆ ContactMaterialObserver

◆ ContactMaterialPtrVector

◆ ContactMaterialRef

Definition at line 60 of file Material.h.

◆ ContactMaterialRefSetVector

◆ ContactMaterialRefVector

◆ ContactNormalRef

◆ ContactTangentRef

◆ ContactZoneTable

typedef agx::HashTable< Vec3i, agx::Physics::HierarchicalGrid::ContactZonePtr > agx::ContactZoneTable

Definition at line 112 of file Common.h.

◆ CpuDeviceConstObserver

Definition at line 42 of file Device.h.

◆ CpuDeviceConstRef

Definition at line 42 of file Device.h.

◆ CpuDeviceObserver

Definition at line 42 of file Device.h.

◆ CpuDeviceRef

Definition at line 42 of file Device.h.

◆ CpuKernelConstObserver

Definition at line 39 of file Kernel.h.

◆ CpuKernelConstRef

Definition at line 39 of file Kernel.h.

◆ CpuKernelObserver

Definition at line 39 of file Kernel.h.

◆ CpuKernelObserverVector

Definition at line 40 of file Kernel.h.

◆ CpuKernelPtrVector

Definition at line 40 of file Kernel.h.

◆ CpuKernelRef

Definition at line 39 of file Kernel.h.

◆ CpuKernelRefVector

Definition at line 40 of file Kernel.h.

◆ CreateElementaryConstraintsFunction

typedef agx::Bool(* agx::CreateElementaryConstraintsFunction) (class HighLevelConstraintImplementation *)

Definition at line 24 of file AngularJointBase.h.

◆ CubicFunction2DRef

◆ CubicSplineLookupTableRef

◆ CustomGravityFieldConstObserver

◆ CustomGravityFieldConstRef

◆ CustomGravityFieldObserver

◆ CustomGravityFieldRef

◆ CylindricalJointRef

◆ DateConstObserver

Definition at line 26 of file Date.h.

◆ DateConstRef

Definition at line 26 of file Date.h.

◆ DateObserver

Definition at line 26 of file Date.h.

◆ DateRef

Definition at line 26 of file Date.h.

◆ DeviceConstObserver

Definition at line 41 of file Device.h.

◆ DeviceConstRef

Definition at line 41 of file Device.h.

◆ DeviceGroupConstObserver

Definition at line 43 of file Device.h.

◆ DeviceGroupConstRef

Definition at line 43 of file Device.h.

◆ DeviceGroupObserver

Definition at line 43 of file Device.h.

◆ DeviceGroupRef

Definition at line 43 of file Device.h.

◆ DeviceObserver

Definition at line 41 of file Device.h.

◆ DeviceRef

Definition at line 41 of file Device.h.

◆ DirectMultiTangentsFrictionModelConstObserver

◆ DirectMultiTangentsFrictionModelConstRef

◆ DirectMultiTangentsFrictionModelObserver

◆ DirectMultiTangentsFrictionModelRef

◆ DirectSolverDataConstObserver

◆ DirectSolverDataConstRef

◆ DirectSolverDataObserver

◆ DirectSolverDataRef

◆ DistanceJointRef

Definition at line 112 of file DistanceJoint.h.

◆ Dot1JointRef

Definition at line 81 of file Dot1Joint.h.

◆ Dot1Ref

Definition at line 466 of file ElementaryConstraint.h.

◆ Dot1SlackRef

Definition at line 64 of file ElementarySlackConstraint.h.

◆ Dot2Ref

Definition at line 539 of file ElementaryConstraint.h.

◆ DynamicBitSet

typedef std::vector<bool> agx::DynamicBitSet

Definition at line 24 of file DynamicBitSet.h.

◆ DynamicLibraryConstObserver

◆ DynamicLibraryConstRef

Definition at line 31 of file DynamicLibrary.h.

◆ DynamicLibraryObserver

◆ DynamicLibraryRef

Definition at line 31 of file DynamicLibrary.h.

◆ DynamicsSystemRef

Definition at line 458 of file DynamicsSystem.h.

◆ ElectricMotorControllerRef

◆ ElementaryConstraintRef

◆ ElementaryContactPointConstObserver

◆ ElementaryContactPointConstRef

◆ ElementaryContactPointFactoryConstObserver

◆ ElementaryContactPointFactoryConstRef

◆ ElementaryContactPointFactoryObserver

◆ ElementaryContactPointFactoryRef

◆ ElementaryContactPointObserver

◆ ElementaryContactPointRef

◆ ElementaryContactPointRefVector

◆ ElementaryMultiTangentsContactPointConstObserver

◆ ElementaryMultiTangentsContactPointConstRef

◆ ElementaryMultiTangentsContactPointFactoryConstObserver

◆ ElementaryMultiTangentsContactPointFactoryConstRef

◆ ElementaryMultiTangentsContactPointFactoryObserver

◆ ElementaryMultiTangentsContactPointFactoryRef

◆ ElementaryMultiTangentsContactPointObserver

◆ ElementaryMultiTangentsContactPointRef

◆ EmitterConstObserver

Definition at line 36 of file Emitter.h.

◆ EmitterConstRef

Definition at line 36 of file Emitter.h.

◆ EmitterObserver

Definition at line 36 of file Emitter.h.

◆ EmitterObserverVector

Definition at line 37 of file Emitter.h.

◆ EmitterPtrVector

Definition at line 37 of file Emitter.h.

◆ EmitterRef

Definition at line 36 of file Emitter.h.

◆ EmitterRefSetVector

Definition at line 38 of file Emitter.h.

◆ EmitterRefVector

Definition at line 37 of file Emitter.h.

◆ EntityDataParameterConstObserver

◆ EntityDataParameterConstRef

Definition at line 42 of file Parameter.h.

◆ EntityDataParameterObserver

◆ EntityDataParameterObserverVector

◆ EntityDataParameterPtrVector

◆ EntityDataParameterRef

◆ EntityDataParameterRefVector

◆ EntityInstanceParameterConstObserver

◆ EntityInstanceParameterConstRef

◆ EntityInstanceParameterObserver

◆ EntityInstanceParameterObserverVector

◆ EntityInstanceParameterPtrVector

◆ EntityInstanceParameterRef

◆ EntityInstanceParameterRefVector

◆ EntityPtrParameterConstObserver

◆ EntityPtrParameterConstRef

Definition at line 43 of file Parameter.h.

◆ EntityPtrParameterObserver

◆ EntityPtrParameterObserverVector

◆ EntityPtrParameterPtrVector

◆ EntityPtrParameterRef

◆ EntityPtrParameterRefVector

◆ Error

typedef std::runtime_error agx::Error

Definition at line 50 of file debug.h.

◆ EventModelConstObserver

Definition at line 27 of file Stream.h.

◆ EventModelConstRef

Definition at line 27 of file Stream.h.

◆ EventModelObserver

Definition at line 27 of file Stream.h.

◆ EventModelRef

Definition at line 27 of file Stream.h.

◆ FluidContactVector

typedef agx::VectorPOD<FluidContactPoint> agx::FluidContactVector

Definition at line 115 of file agx_vector_types.h.

◆ FluidParticleHash

Definition at line 57 of file agx_hash_types.h.

◆ FrameConstObserver

Definition at line 52 of file agx/Frame.h.

◆ FrameConstRef

Definition at line 52 of file agx/Frame.h.

◆ FrameObserver

Definition at line 52 of file agx/Frame.h.

◆ FrameRef

Definition at line 52 of file agx/Frame.h.

◆ FrictionControllerRef

◆ FrictionControllerRefSetVector

◆ FrictionModelConstObserver

◆ FrictionModelConstRef

Definition at line 46 of file FrictionModel.h.

◆ FrictionModelObserver

◆ FrictionModelRef

Definition at line 46 of file FrictionModel.h.

◆ FunctionHandle

typedef void(* agx::FunctionHandle) ()

Definition at line 26 of file PluginMacros.h.

◆ GenericConstraintComplianceMatrixRef

◆ GeometryContactConstraintConstObserver

◆ GeometryContactConstraintConstRef

◆ GeometryContactConstraintObserver

◆ GeometryContactConstraintRef

◆ GlobalResultBufferConstObserver

◆ GlobalResultBufferConstRef

◆ GlobalResultBufferObserver

◆ GlobalResultBufferRef

◆ GlobalResultStorageConstObserver

◆ GlobalResultStorageConstRef

◆ GlobalResultStorageObserver

◆ GlobalResultStorageRef

◆ GranularContactForceReaderRef

◆ GranularImpactDataWriterConstObserver

◆ GranularImpactDataWriterConstRef

◆ GranularImpactDataWriterObserver

◆ GranularImpactDataWriterRef

◆ GravityFieldConstObserver

Definition at line 29 of file GravityField.h.

◆ GravityFieldConstRef

Definition at line 29 of file GravityField.h.

◆ GravityFieldObserver

◆ GravityFieldRef

Definition at line 29 of file GravityField.h.

◆ GridCell2DTable

Definition at line 110 of file Common.h.

◆ GridCellTable

Definition at line 109 of file Common.h.

◆ HashTable

template<typename KeyT , typename DataT , typename HashT = HashFn<KeyT>, typename AllocatorT = ByteAllocator>
using agx::HashTable = typedef LinearProbingHashTable<KeyT, DataT, HashT, AllocatorT>

Definition at line 24 of file HashTable.h.

◆ HingeRef

Definition at line 181 of file Hinge.h.

◆ ICloneableConstObserver

Definition at line 24 of file ICloneable.h.

◆ ICloneableConstRef

Definition at line 24 of file ICloneable.h.

◆ ICloneableObserver

Definition at line 24 of file ICloneable.h.

◆ ICloneableRef

Definition at line 24 of file ICloneable.h.

◆ Index

typedef UInt32 agx::Index

Definition at line 52 of file Integer.h.

◆ IndexHashSet

Definition at line 59 of file agx_hash_types.h.

◆ IndexLambdaKernelRef

Definition at line 166 of file IndexLambdaKernel.h.

◆ IndexRange

Definition at line 140 of file IndexRange.h.

◆ IndexRange32

Definition at line 141 of file IndexRange.h.

◆ IndexRange32Vector

Definition at line 145 of file IndexRange.h.

◆ IndexRange64

Definition at line 142 of file IndexRange.h.

◆ IndexRange64Vector

Definition at line 146 of file IndexRange.h.

◆ IndexRangeVector

Definition at line 144 of file IndexRange.h.

◆ IndexVector

Definition at line 109 of file agx_vector_types.h.

◆ Int

typedef int32_t agx::Int

Definition at line 35 of file Integer.h.

◆ Int16

typedef int16_t agx::Int16

Definition at line 44 of file Integer.h.

◆ Int16Vector

Definition at line 101 of file agx_vector_types.h.

◆ Int32

typedef int32_t agx::Int32

Definition at line 45 of file Integer.h.

◆ Int32Vector

Definition at line 100 of file agx_vector_types.h.

◆ Int64

typedef int64_t agx::Int64

Definition at line 46 of file Integer.h.

◆ Int64Vector

Definition at line 99 of file agx_vector_types.h.

◆ Int8

typedef int8_t agx::Int8

Definition at line 43 of file Integer.h.

◆ Int8Vector

Definition at line 102 of file agx_vector_types.h.

◆ InteractionConstObserver

Definition at line 24 of file Interaction.h.

◆ InteractionConstRef

Definition at line 24 of file Interaction.h.

◆ InteractionObserver

Definition at line 24 of file Interaction.h.

◆ InteractionRef

Definition at line 24 of file Interaction.h.

◆ InteractionRefSetVector

◆ IntValarray

typedef std::valarray< agx::Int > agx::IntValarray

Definition at line 28 of file agx_valarray_types.h.

◆ IntVector

Definition at line 98 of file agx_vector_types.h.

◆ IterativeProjectedConeFrictionConstObserver

◆ IterativeProjectedConeFrictionConstRef

◆ IterativeProjectedConeFrictionObserver

◆ IterativeProjectedConeFrictionRef

◆ Jacobian6DOFElement

◆ Jacobian6DOFElement32

◆ Jacobian6DOFElement64

◆ JacobianMeta

Definition at line 383 of file agx/Jacobian.h.

◆ JacobianMeta32

Definition at line 382 of file agx/Jacobian.h.

◆ JacobianMeta64

Definition at line 381 of file agx/Jacobian.h.

◆ JobGroupPtrVector

Definition at line 49 of file SolveAlgorithms.h.

◆ JobPtr

typedef class Job* agx::JobPtr

Definition at line 48 of file Job.h.

◆ JobPtrQueue

typedef std::deque<class Job *> agx::JobPtrQueue

Definition at line 52 of file Job.h.

◆ JobPtrVector

typedef VectorPOD<class Job *> agx::JobPtrVector

Definition at line 51 of file Job.h.

◆ JobVector

Definition at line 275 of file Job.h.

◆ JournalConstObserver

Definition at line 45 of file Journal.h.

◆ JournalConstRef

Definition at line 45 of file Journal.h.

◆ JournalCustomDataRecorderConstObserver

◆ JournalCustomDataRecorderConstRef

◆ JournalCustomDataRecorderObserver

◆ JournalCustomDataRecorderObserverVector

◆ JournalCustomDataRecorderPtrVector

◆ JournalCustomDataRecorderRef

◆ JournalCustomDataRecorderRefVector

◆ JournalObserver

Definition at line 45 of file Journal.h.

◆ JournalRef

Definition at line 45 of file Journal.h.

◆ KernelConstObserver

Definition at line 37 of file Kernel.h.

◆ KernelConstRef

Definition at line 37 of file Kernel.h.

◆ KernelObserver

Definition at line 37 of file Kernel.h.

◆ KernelObserverVector

Definition at line 38 of file Kernel.h.

◆ KernelPtrVector

Definition at line 38 of file Kernel.h.

◆ KernelRef

Definition at line 37 of file Kernel.h.

◆ KernelRefVector

Definition at line 38 of file Kernel.h.

◆ LambdaKernelConstObserver

Definition at line 172 of file Kernel.h.

◆ LambdaKernelConstRef

Definition at line 172 of file Kernel.h.

◆ LambdaKernelObserver

Definition at line 172 of file Kernel.h.

◆ LambdaKernelRef

Definition at line 172 of file Kernel.h.

◆ Line

typedef LineT<Vec3> agx::Line

Definition at line 39 of file agx/Line.h.

◆ Line32

Definition at line 40 of file agx/Line.h.

◆ Line64

Definition at line 41 of file agx/Line.h.

◆ LinearLookupTableRef

◆ LocalBodyContactJacobian

◆ LocalBodyContactJacobian32

◆ LocalBodyContactJacobian64

◆ LocalOverlapVector

◆ LocalRollingResistanceJacobian

◆ LocalRollingResistanceJacobian32

◆ LocalRollingResistanceJacobian64

◆ LocalTangentJacobian

◆ LocalTangentJacobian32

◆ LocalTangentJacobian64

◆ Lock1D

Definition at line 662 of file Constraint.h.

◆ LockControllerRef

◆ LockJointRef

Definition at line 102 of file LockJoint.h.

◆ LoggerRef

Definition at line 91 of file Logger.h.

◆ MarchingCubesRef

Definition at line 122 of file MarchingCubes.h.

◆ MaterialConstObserver

Definition at line 59 of file Material.h.

◆ MaterialConstRef

Definition at line 59 of file Material.h.

◆ MaterialObserver

Definition at line 59 of file Material.h.

◆ MaterialPtrVector

Definition at line 31 of file MaterialManager.h.

◆ MaterialRef

Definition at line 59 of file Material.h.

◆ Matrix3x3

Definition at line 287 of file Matrix3x3.h.

◆ Matrix3x3d

Definition at line 290 of file Matrix3x3.h.

◆ Matrix3x3f

Definition at line 289 of file Matrix3x3.h.

◆ Matrix4x4

Definition at line 308 of file Matrix4x4.h.

◆ Matrix4x4d

Definition at line 311 of file Matrix4x4.h.

◆ Matrix4x4f

Definition at line 310 of file Matrix4x4.h.

◆ MergedBodyConstObserver

Definition at line 46 of file MergedBody.h.

◆ MergedBodyConstRef

Definition at line 46 of file MergedBody.h.

◆ MergedBodyObserver

Definition at line 46 of file MergedBody.h.

◆ MergedBodyObserverVector

◆ MergedBodyPtrVector

Definition at line 47 of file MergedBody.h.

◆ MergedBodyRef

Definition at line 46 of file MergedBody.h.

◆ MergedBodyRefSetVector

◆ MergedBodyRefVector

Definition at line 47 of file MergedBody.h.

◆ ModelConstObserver

Definition at line 32 of file Model.h.

◆ ModelConstRef

Definition at line 32 of file Model.h.

◆ ModelObserver

Definition at line 32 of file Model.h.

◆ ModelRef

Definition at line 32 of file Model.h.

◆ Motor1D

Definition at line 661 of file Constraint.h.

◆ Mutex

typedef std::mutex agx::Mutex

Definition at line 99 of file Referenced.h.

◆ NamespaceConstObserver

Definition at line 24 of file Namespace.h.

◆ NamespaceConstRef

Definition at line 24 of file Namespace.h.

◆ NamespaceObserver

Definition at line 24 of file Namespace.h.

◆ NamespaceRef

Definition at line 24 of file Namespace.h.

◆ NameVector

Definition at line 42 of file agx_vector_types.h.

◆ NlmcpCallbackRef

Definition at line 165 of file NlmcpCallback.h.

◆ NlmcpCallbacks

Definition at line 24 of file SparseTypes.h.

◆ NlMixedCpRef

Definition at line 40 of file MixedLCP.h.

◆ ObjectConstObserver

Definition at line 50 of file Object.h.

◆ ObjectConstRef

Definition at line 50 of file Object.h.

◆ ObjectObserver

Definition at line 50 of file Object.h.

◆ ObjectObserverVector

Definition at line 51 of file Object.h.

◆ ObjectPtrTable

Definition at line 286 of file Object.h.

◆ ObjectPtrVector

Definition at line 51 of file Object.h.

◆ ObjectRef

Definition at line 50 of file Object.h.

◆ ObjectRefVector

Definition at line 51 of file Object.h.

◆ ObserverFrameConstObserver

◆ ObserverFrameConstRef

Definition at line 32 of file ObserverFrame.h.

◆ ObserverFrameObserver

◆ ObserverFrameObserverVector

◆ ObserverFramePtrVector

◆ ObserverFrameRef

Definition at line 32 of file ObserverFrame.h.

◆ ObserverFrameRefSetVector

◆ ObserverFrameRefVector

◆ ParallelTaskConstObserver

Definition at line 45 of file Task.h.

◆ ParallelTaskConstRef

Definition at line 45 of file Task.h.

◆ ParallelTaskObserver

Definition at line 45 of file Task.h.

◆ ParallelTaskRef

Definition at line 45 of file Task.h.

◆ ParameterBindingVector

◆ ParameterConstObserver

Definition at line 37 of file Parameter.h.

◆ ParameterConstRef

Definition at line 37 of file Parameter.h.

◆ ParameterObserver

Definition at line 37 of file Parameter.h.

◆ ParameterObserverVector

◆ ParameterPtrVector

Definition at line 46 of file Parameter.h.

◆ ParameterRef

Definition at line 37 of file Parameter.h.

◆ ParameterRefVector

Definition at line 46 of file Parameter.h.

◆ ParameterTable

◆ ParticleBodyContactJacobian

◆ ParticleBodyContactJacobian32

◆ ParticleBodyContactJacobian64

◆ ParticleContactSensorConstObserver

◆ ParticleContactSensorConstRef

◆ ParticleContactSensorObserver

◆ ParticleContactSensorObserverVector

◆ ParticleContactSensorPtrVector

◆ ParticleContactSensorRef

◆ ParticleContactSensorRefVector

◆ ParticleContactWireRef

◆ ParticleEmitterConstObserver

◆ ParticleEmitterConstRef

Definition at line 26 of file ParticleEmitter.h.

◆ ParticleEmitterObserver

◆ ParticleEmitterObserverVector

◆ ParticleEmitterPtrVector

◆ ParticleEmitterRef

◆ ParticleEmitterRefVector

◆ ParticleEmitterTable

◆ ParticleParticleContactJacobian

◆ ParticleParticleContactJacobian32

◆ ParticleParticleContactJacobian64

◆ ParticleSinkConstObserver

Definition at line 32 of file ParticleSink.h.

◆ ParticleSinkConstRef

Definition at line 32 of file ParticleSink.h.

◆ ParticleSinkObserver

◆ ParticleSinkObserverVector

◆ ParticleSinkPtrVector

Definition at line 33 of file ParticleSink.h.

◆ ParticleSinkRef

Definition at line 32 of file ParticleSink.h.

◆ ParticleSinkRefVector

◆ ParticleSinkTable

◆ ParticleSystemConstObserver

◆ ParticleSystemConstRef

Definition at line 54 of file ParticleSystem.h.

◆ ParticleSystemObserver

◆ ParticleSystemObserverVector

◆ ParticleSystemPtrVector

◆ ParticleSystemRef

Definition at line 54 of file ParticleSystem.h.

◆ ParticleSystemRefSetVector

◆ ParticleSystemRefVector

◆ ParticleSystemTable

◆ Plane

Definition at line 121 of file agx/Plane.h.

◆ Plane32

Definition at line 122 of file agx/Plane.h.

◆ Plane64

Definition at line 123 of file agx/Plane.h.

◆ PlaneJointRef

Definition at line 63 of file PlaneJoint.h.

◆ PluginHandle

typedef void* agx::PluginHandle

Definition at line 25 of file PluginMacros.h.

◆ Point2DVector

Definition at line 144 of file LookupTables.h.

◆ PointerConstObserver

Definition at line 27 of file Pointer.h.

◆ PointerConstRef

Definition at line 27 of file Pointer.h.

◆ PointerObserver

Definition at line 27 of file Pointer.h.

◆ PointerObserverVector

Definition at line 28 of file Pointer.h.

◆ PointerParameterConstObserver

◆ PointerParameterConstRef

Definition at line 41 of file Parameter.h.

◆ PointerParameterObserver

◆ PointerParameterObserverVector

◆ PointerParameterPtrVector

◆ PointerParameterRef

Definition at line 41 of file Parameter.h.

◆ PointerParameterRefVector

◆ PointerPtrVector

Definition at line 28 of file Pointer.h.

◆ PointerRef

Definition at line 27 of file Pointer.h.

◆ PointerRefVector

Definition at line 28 of file Pointer.h.

◆ PointGravityFieldConstObserver

◆ PointGravityFieldConstRef

◆ PointGravityFieldObserver

◆ PointGravityFieldRef

◆ PrismaticRef

Definition at line 131 of file Prismatic.h.

◆ PrismaticUniversalJointRef

◆ PropertyContainerRef

◆ Quat

typedef QuatT<Real> agx::Quat

Definition at line 24 of file Quat.h.

◆ Quat32

Definition at line 26 of file Quat.h.

◆ Quat64

Definition at line 27 of file Quat.h.

◆ QuatLockRef

Definition at line 646 of file ElementaryConstraint.h.

◆ QuatVector

Definition at line 87 of file agx_vector_types.h.

◆ Range1D

Definition at line 663 of file Constraint.h.

◆ Range6

Definition at line 101 of file Range6.h.

◆ Range6d

Definition at line 103 of file Range6.h.

◆ Range6f

Definition at line 102 of file Range6.h.

◆ RangeCallback

using agx::RangeCallback = typedef agx::Callback1<const RangeJob&>

Definition at line 55 of file Job.h.

◆ RangeControllerRef

◆ RangeJobVector

Definition at line 316 of file Job.h.

◆ RangeReal

A short hand for ranges of floating point numbers.

Definition at line 196 of file Range.h.

◆ RangeUInt

A short hand for ranges of unsigned integer numbers.

Definition at line 202 of file Range.h.

◆ RangeViolationReal

Definition at line 197 of file Range.h.

◆ RangeViolationUInt

Definition at line 203 of file Range.h.

◆ Real

typedef double agx::Real

Definition at line 42 of file Real.h.

◆ Real32

typedef float agx::Real32

Definition at line 44 of file Real.h.

◆ Real32Vector

Definition at line 113 of file agx_vector_types.h.

◆ Real64

typedef double agx::Real64

Definition at line 45 of file Real.h.

◆ Real64Vector

Definition at line 112 of file agx_vector_types.h.

◆ RealMatrix

Definition at line 31 of file HeightMapGenerator.h.

◆ RealPair

typedef std::pair< agx::Real, agx::Real > agx::RealPair

Definition at line 68 of file ConstraintImplementation.h.

◆ RealPairList

typedef agx::List< std::pair< agx::Real, agx::Real > > agx::RealPairList

Definition at line 28 of file LookupTables.h.

◆ RealPairVector

Definition at line 29 of file LookupTables.h.

◆ RealTimeClockConstObserver

◆ RealTimeClockConstRef

Definition at line 26 of file RealTimeClock.h.

◆ RealTimeClockObserver

◆ RealTimeClockRef

Definition at line 26 of file RealTimeClock.h.

◆ RealValarray

typedef std::valarray< agx::Real > agx::RealValarray

For this module, vectors are defined using valarray.

Definition at line 27 of file agx_valarray_types.h.

◆ RealVector

Definition at line 111 of file agx_vector_types.h.

◆ ReentrantMutex

typedef std::recursive_mutex agx::ReentrantMutex

Definition at line 48 of file Object.h.

◆ ReferencedModelConstObserver

◆ ReferencedModelConstRef

Definition at line 61 of file ReferencedEntity.h.

◆ ReferencedModelObserver

◆ ReferencedModelRef

◆ ReferencedPtrArray

◆ ReferencedPtrVector

◆ ReferencedRef

◆ RefVector

Definition at line 116 of file agx_vector_types.h.

◆ RigidBodyAttachmentRef

◆ RigidBodyConstObserver

Definition at line 44 of file RigidBody.h.

◆ RigidBodyConstRef

Definition at line 44 of file RigidBody.h.

◆ RigidBodyEmitterConstObserver

◆ RigidBodyEmitterConstRef

◆ RigidBodyEmitterObserver

◆ RigidBodyEmitterObserverVector

◆ RigidBodyEmitterPtrVector

◆ RigidBodyEmitterRef

◆ RigidBodyEmitterRefVector

◆ RigidBodyObserver

Definition at line 44 of file RigidBody.h.

◆ RigidBodyObserverVector

◆ RigidBodyPtrAttachmentPtrHashTable

◆ RigidBodyPtrHashSet

Definition at line 30 of file InverseDynamics.h.

◆ RigidBodyPtrIntHash

Definition at line 49 of file agx_hash_types.h.

◆ RigidBodyPtrRealHash

Definition at line 50 of file agx_hash_types.h.

◆ RigidBodyPtrSetVector

◆ RigidBodyPtrVec3Hash

Definition at line 51 of file agx_hash_types.h.

◆ RigidBodyPtrVector

Definition at line 45 of file RigidBody.h.

◆ RigidBodyRef

Definition at line 44 of file RigidBody.h.

◆ RigidBodyRefSetVector

Definition at line 46 of file RigidBody.h.

◆ RigidBodyRefVector

Definition at line 45 of file RigidBody.h.

◆ RigidBodyTable

Definition at line 43 of file agx_hash_types.h.

◆ RigidParticleSystemConstObserver

◆ RigidParticleSystemConstRef

◆ RigidParticleSystemObserver

◆ RigidParticleSystemRef

◆ RollingResistanceJacobian

◆ RollingResistanceJacobian32

◆ RollingResistanceJacobian64

◆ RotationalAngleRef

◆ ScalarParameterConstObserver

◆ ScalarParameterConstRef

Definition at line 39 of file Parameter.h.

◆ ScalarParameterObserver

◆ ScalarParameterObserverVector

◆ ScalarParameterPtrVector

◆ ScalarParameterRef

Definition at line 39 of file Parameter.h.

◆ ScalarParameterRefVector

◆ ScaleBoxFrictionModelConstObserver

◆ ScaleBoxFrictionModelConstRef

◆ ScaleBoxFrictionModelObserver

◆ ScaleBoxFrictionModelRef

◆ ScopeLock

template<class T >
using agx::ScopeLock = typedef std::lock_guard<T>

agx::ScopeLock is an alias for std::lock_guard

Definition at line 31 of file ScopeLock.h.

◆ Screw1D

Definition at line 664 of file Constraint.h.

◆ SeparationAngleRef

◆ SerialTaskConstObserver

Definition at line 44 of file Task.h.

◆ SerialTaskConstRef

Definition at line 44 of file Task.h.

◆ SerialTaskObserver

Definition at line 44 of file Task.h.

◆ SerialTaskRef

Definition at line 44 of file Task.h.

◆ SingletonRef

Definition at line 77 of file Singleton.h.

◆ Size

typedef size_t agx::Size

Definition at line 50 of file Integer.h.

◆ SlackCylindricalJointRef

◆ SlackHinge

Definition at line 131 of file SlackHingeJoint.h.

◆ SlackHingeJointRef

◆ SlackLockJointRef

Definition at line 126 of file SlackLockJoint.h.

◆ SlackPrismatic

◆ SlackPrismaticJointRef

◆ SolveAlgorithmRef

◆ SolveIslandSplitAlgorithmRef

◆ SparseMatrixRepConstObserver

◆ SparseMatrixRepConstRef

Definition at line 29 of file SparseMatrix.h.

◆ SparseMatrixRepObserver

◆ SparseMatrixRepRef

Definition at line 29 of file SparseMatrix.h.

◆ SPDMatrix3x3Vector

Definition at line 86 of file agx_vector_types.h.

◆ SphericalRef

Definition at line 575 of file ElementaryConstraint.h.

◆ SphericalRelRef

◆ SphericalRelSlackRef

◆ SplineJointConstObserver

Definition at line 81 of file SplineJoint.h.

◆ SplineJointConstRef

Definition at line 81 of file SplineJoint.h.

◆ SplineJointObserver

Definition at line 81 of file SplineJoint.h.

◆ SplineJointRef

Definition at line 81 of file SplineJoint.h.

◆ SplitNodeIterator

◆ SplitNodeRef

◆ SplitNodeRefVector

◆ SplitNodeSeparatorRef

◆ StabilityReportConstObserver

◆ StabilityReportConstRef

Definition at line 34 of file StabilityReport.h.

◆ StabilityReportObserver

◆ StabilityReportRef

◆ StreamConstObserver

Definition at line 44 of file Stream.h.

◆ StreamConstRef

Definition at line 44 of file Stream.h.

◆ StreamObserver

Definition at line 44 of file Stream.h.

◆ StreamRef

Definition at line 44 of file Stream.h.

◆ String

typedef AgXString<std::string> agx::String

Definition at line 427 of file String.h.

◆ StringVector

typedef Vector<AgXString<std::string> > agx::StringVector

Definition at line 34 of file String.h.

◆ StrongInteractionConstObserver

◆ StrongInteractionConstraintConstObserver

◆ StrongInteractionConstraintConstRef

◆ StrongInteractionConstraintObserver

◆ StrongInteractionConstraintRef

◆ StrongInteractionConstRef

◆ StrongInteractionObserver

◆ StrongInteractionRef

◆ StrongInteractionRefSetVector

◆ SurfaceMaterialConstObserver

◆ SurfaceMaterialConstRef

Definition at line 57 of file Material.h.

◆ SurfaceMaterialObserver

◆ SurfaceMaterialRef

Definition at line 57 of file Material.h.

◆ SVec

Definition at line 26 of file SVec.h.

◆ SwingRef

Definition at line 504 of file ElementaryConstraint.h.

◆ SwingTwistLockRef

Definition at line 102 of file SwingTwistLock.h.

◆ TangentJacobian

◆ TangentJacobian32

◆ TangentJacobian64

◆ TargetSpeedControllerRef

◆ TaskConstObserver

Definition at line 42 of file Task.h.

◆ TaskConstRef

Definition at line 42 of file Task.h.

◆ TaskGroupConstObserver

Definition at line 46 of file Task.h.

◆ TaskGroupConstRef

Definition at line 46 of file Task.h.

◆ TaskGroupObserver

Definition at line 46 of file Task.h.

◆ TaskGroupRef

Definition at line 46 of file Task.h.

◆ TaskObserver

Definition at line 42 of file Task.h.

◆ TaskObserverVector

Definition at line 43 of file Task.h.

◆ TaskPluginTable

typedef HashTable<const char *, TaskPlugin *> agx::TaskPluginTable

Definition at line 86 of file TaskManager.h.

◆ TaskPtrVector

Definition at line 43 of file Task.h.

◆ TaskRef

Definition at line 42 of file Task.h.

◆ TaskRefVector

Definition at line 43 of file Task.h.

◆ TaskTimingReportHandleConstObserver

typedef agx::observer_ptr< const TaskTimingReportHandle > agx::TaskTimingReportHandleConstObserver

Definition at line 79 of file Statistics.h.

◆ TaskTimingReportHandleConstRef

typedef agx::ref_ptr< const TaskTimingReportHandle > agx::TaskTimingReportHandleConstRef

Definition at line 79 of file Statistics.h.

◆ TaskTimingReportHandleObserver

typedef agx::observer_ptr< TaskTimingReportHandle > agx::TaskTimingReportHandleObserver

Definition at line 79 of file Statistics.h.

◆ TaskTimingReportHandleRef

typedef agx::ref_ptr< TaskTimingReportHandle > agx::TaskTimingReportHandleRef

Definition at line 79 of file Statistics.h.

◆ ThreadPtrVector

Definition at line 660 of file Thread.h.

◆ ThreadTaskConstObserver

Definition at line 24 of file ThreadTask.h.

◆ ThreadTaskConstRef

Definition at line 24 of file ThreadTask.h.

◆ ThreadTaskObserver

Definition at line 24 of file ThreadTask.h.

◆ ThreadTaskRef

Definition at line 24 of file ThreadTask.h.

◆ ThreadTimelineEntryModelConstObserver

◆ ThreadTimelineEntryModelConstRef

◆ ThreadTimelineEntryModelObserver

◆ ThreadTimelineEntryModelRef

◆ ThreadTimelineEntryPtrArray

◆ ThreadTimelineEntryPtrVector

◆ TimeGovernorRef

Definition at line 47 of file TimeGovernor.h.

◆ TimeStamp

Definition at line 26 of file TimeStamp.h.

◆ TwistRangeControllerRef

◆ TwistRef

Definition at line 1260 of file ElementaryConstraint.h.

◆ UInt

typedef uint32_t agx::UInt

Definition at line 34 of file Integer.h.

◆ UInt16

typedef uint16_t agx::UInt16

Definition at line 39 of file Integer.h.

◆ UInt16Vector

Definition at line 107 of file agx_vector_types.h.

◆ UInt32

typedef uint32_t agx::UInt32

Definition at line 40 of file Integer.h.

◆ UInt32Vector

Definition at line 106 of file agx_vector_types.h.

◆ UInt64

typedef uint64_t agx::UInt64

Definition at line 41 of file Integer.h.

◆ UInt64Vector

Definition at line 105 of file agx_vector_types.h.

◆ UInt8

typedef uint8_t agx::UInt8

Definition at line 38 of file Integer.h.

◆ UInt8Vector

Definition at line 108 of file agx_vector_types.h.

◆ UIntRealPtrTable

Definition at line 36 of file MLCP.h.

◆ UIntValarray

typedef std::valarray< agx::UInt > agx::UIntValarray

Definition at line 29 of file agx_valarray_types.h.

◆ UIntVector

Definition at line 104 of file agx_vector_types.h.

◆ UniformGravityFieldConstObserver

◆ UniformGravityFieldConstRef

◆ UniformGravityFieldObserver

◆ UniformGravityFieldRef

◆ UniformInt32Generator

typedef RandomGenerator<agx::Int32, std::uniform_int_distribution> agx::UniformInt32Generator

Definition at line 109 of file Random.h.

◆ UniformInt64Generator

typedef RandomGenerator<agx::Int64, std::uniform_int_distribution> agx::UniformInt64Generator

Definition at line 110 of file Random.h.

◆ UniformIntGenerator

typedef RandomGenerator<agx::Int, std::uniform_int_distribution> agx::UniformIntGenerator

Definition at line 108 of file Random.h.

◆ UniformReal32Generator

typedef RandomGenerator<agx::Real32, std::uniform_real_distribution> agx::UniformReal32Generator

Definition at line 104 of file Random.h.

◆ UniformReal64Generator

typedef RandomGenerator<agx::Real64, std::uniform_real_distribution> agx::UniformReal64Generator

Definition at line 105 of file Random.h.

◆ UniformRealGenerator

typedef RandomGenerator<agx::Real, std::uniform_real_distribution> agx::UniformRealGenerator

Definition at line 103 of file Random.h.

◆ UniqueIdStruct

Struct holding information about a Unique Id.

◆ UniversalJointRef

Definition at line 101 of file UniversalJoint.h.

◆ UnresolvedParameterConstObserver

◆ UnresolvedParameterConstRef

Definition at line 38 of file Parameter.h.

◆ UnresolvedParameterObserver

◆ UnresolvedParameterRef

◆ UnresolvedTaskConstObserver

◆ UnresolvedTaskConstRef

Definition at line 37 of file UnresolvedTask.h.

◆ UnresolvedTaskObserver

◆ UnresolvedTaskObserverVector

◆ UnresolvedTaskPtrVector

◆ UnresolvedTaskRef

Definition at line 37 of file UnresolvedTask.h.

◆ UnresolvedTaskRefVector

◆ Vec2

typedef Vec2T<Real> agx::Vec2

The object holding 2 dimensional vectors and providing basic arithmetic.

The 2D vector class holds an internal representations of vectors which can include padding and so on. At this level of the API, the object is provided for user convenience. In the internal representation used by the solvers, 2D vectors may be concatenated into larger vector blocks as seems fit.

Definition at line 35 of file Vec2.h.

◆ Vec2d

Definition at line 37 of file Vec2.h.

◆ Vec2dVector

Definition at line 73 of file agx_vector_types.h.

◆ Vec2f

Definition at line 36 of file Vec2.h.

◆ Vec2fVector

Definition at line 74 of file agx_vector_types.h.

◆ Vec2i

typedef Vec2T<Int> agx::Vec2i

Definition at line 40 of file Vec2.h.

◆ Vec2i16

Definition at line 42 of file Vec2.h.

◆ Vec2i16Vector

Definition at line 77 of file agx_vector_types.h.

◆ Vec2i32

Definition at line 43 of file Vec2.h.

◆ Vec2i32Vector

Definition at line 78 of file agx_vector_types.h.

◆ Vec2i64

Definition at line 44 of file Vec2.h.

◆ Vec2i64Vector

Definition at line 79 of file agx_vector_types.h.

◆ Vec2i8

Definition at line 41 of file Vec2.h.

◆ Vec2i8Vector

Definition at line 76 of file agx_vector_types.h.

◆ Vec2iVector

Definition at line 75 of file agx_vector_types.h.

◆ Vec2u

typedef Vec2T<UInt> agx::Vec2u

Definition at line 47 of file Vec2.h.

◆ Vec2u16

Definition at line 49 of file Vec2.h.

◆ Vec2u16Vector

Definition at line 82 of file agx_vector_types.h.

◆ Vec2u32

Definition at line 50 of file Vec2.h.

◆ Vec2u32Vector

Definition at line 83 of file agx_vector_types.h.

◆ Vec2u64

Definition at line 51 of file Vec2.h.

◆ Vec2u64Vector

Definition at line 84 of file agx_vector_types.h.

◆ Vec2u8

Definition at line 48 of file Vec2.h.

◆ Vec2u8Vector

Definition at line 81 of file agx_vector_types.h.

◆ Vec2uVector

Definition at line 80 of file agx_vector_types.h.

◆ Vec2Vector

Definition at line 72 of file agx_vector_types.h.

◆ Vec3

typedef Vec3T<Real> agx::Vec3

The object holding 3 dimensional vectors and providing basic arithmetic.

The 3D vector class holds an internal representations of vectors which can include padding and so on. At this level of the API, the object is provided for user convenience. In the internal representation used by the solvers, 3D vectors may be concatenated into larger vector blocks as seems fit.

Definition at line 36 of file agx/Vec3.h.

◆ Vec3d

Definition at line 40 of file agx/Vec3.h.

◆ Vec3dVector

Definition at line 59 of file agx_vector_types.h.

◆ Vec3f

Definition at line 39 of file agx/Vec3.h.

◆ Vec3fVector

Definition at line 60 of file agx_vector_types.h.

◆ Vec3i

typedef Vec3T<Int> agx::Vec3i

Definition at line 43 of file agx/Vec3.h.

◆ Vec3i16

Definition at line 48 of file agx/Vec3.h.

◆ Vec3i16Vector

Definition at line 63 of file agx_vector_types.h.

◆ Vec3i32

Definition at line 50 of file agx/Vec3.h.

◆ Vec3i32Vector

Definition at line 64 of file agx_vector_types.h.

◆ Vec3i64

Definition at line 52 of file agx/Vec3.h.

◆ Vec3i64Vector

Definition at line 65 of file agx_vector_types.h.

◆ Vec3i8

Definition at line 46 of file agx/Vec3.h.

◆ Vec3i8Vector

Definition at line 62 of file agx_vector_types.h.

◆ Vec3iVector

Definition at line 61 of file agx_vector_types.h.

◆ Vec3u

typedef Vec3T<UInt> agx::Vec3u

Definition at line 44 of file agx/Vec3.h.

◆ Vec3u16

Definition at line 49 of file agx/Vec3.h.

◆ Vec3u16Vector

Definition at line 68 of file agx_vector_types.h.

◆ Vec3u32

Definition at line 51 of file agx/Vec3.h.

◆ Vec3u32Vector

Definition at line 69 of file agx_vector_types.h.

◆ Vec3u64

Definition at line 53 of file agx/Vec3.h.

◆ Vec3u64Vector

Definition at line 70 of file agx_vector_types.h.

◆ Vec3u8

Definition at line 47 of file agx/Vec3.h.

◆ Vec3u8Vector

Definition at line 67 of file agx_vector_types.h.

◆ Vec3uVector

Definition at line 66 of file agx_vector_types.h.

◆ Vec3Vector

Definition at line 58 of file agx_vector_types.h.

◆ Vec4

typedef Vec4T<Real> agx::Vec4

Definition at line 25 of file Vec4.h.

◆ Vec4d

Definition at line 27 of file Vec4.h.

◆ Vec4dVector

Definition at line 45 of file agx_vector_types.h.

◆ Vec4f

Definition at line 26 of file Vec4.h.

◆ Vec4fVector

Definition at line 46 of file agx_vector_types.h.

◆ Vec4i

typedef Vec4T<Int> agx::Vec4i

Definition at line 30 of file Vec4.h.

◆ Vec4i16

Definition at line 32 of file Vec4.h.

◆ Vec4i16Vector

Definition at line 49 of file agx_vector_types.h.

◆ Vec4i32

Definition at line 33 of file Vec4.h.

◆ Vec4i32Vector

Definition at line 50 of file agx_vector_types.h.

◆ Vec4i64

Definition at line 34 of file Vec4.h.

◆ Vec4i64Vector

Definition at line 51 of file agx_vector_types.h.

◆ Vec4i8

Definition at line 31 of file Vec4.h.

◆ Vec4i8Vector

Definition at line 48 of file agx_vector_types.h.

◆ Vec4iVector

Definition at line 47 of file agx_vector_types.h.

◆ Vec4u

typedef Vec4T<UInt> agx::Vec4u

Definition at line 37 of file Vec4.h.

◆ Vec4u16

Definition at line 39 of file Vec4.h.

◆ Vec4u16Vector

Definition at line 54 of file agx_vector_types.h.

◆ Vec4u32

Definition at line 40 of file Vec4.h.

◆ Vec4u32Vector

Definition at line 55 of file agx_vector_types.h.

◆ Vec4u64

Definition at line 41 of file Vec4.h.

◆ Vec4u64Vector

Definition at line 56 of file agx_vector_types.h.

◆ Vec4u8

Definition at line 38 of file Vec4.h.

◆ Vec4u8Vector

Definition at line 53 of file agx_vector_types.h.

◆ Vec4uVector

Definition at line 52 of file agx_vector_types.h.

◆ Vec4Vector

Definition at line 44 of file agx_vector_types.h.

◆ VirtualConstraintInertiaConstObserver

◆ VirtualConstraintInertiaConstRef

◆ VirtualConstraintInertiaObserver

◆ VirtualConstraintInertiaRef

◆ WireContactBendConstraintRef

◆ WireContactConstraintRef

◆ WireContactConstraintRefVector

◆ WireContactDistanceConstraintRef

◆ WireContactFrictionConstraintRef

◆ WireContactSolverRef

◆ WireContactSpringConstraintRef

◆ WireMaterialConstObserver

Definition at line 58 of file Material.h.

◆ WireMaterialConstRef

Definition at line 58 of file Material.h.

◆ WireMaterialObserver

Definition at line 58 of file Material.h.

◆ WireMaterialRef

Definition at line 58 of file Material.h.

◆ WireParticleRef

Definition at line 105 of file WireContactSolver.h.

◆ WireParticleRefVector

◆ WorldFrameBallJointRef

Definition at line 258 of file BallJoint.h.

◆ XmlLoadFunction

typedef std::function<Object *(TiXmlElement *, Device *)> agx::XmlLoadFunction

Definition at line 31 of file XmlLoader.h.

◆ ZoneDependencyTable

typedef agx::HashTable< UInt64, agx::Physics::HierarchicalGrid::ContactZoneDependencyPtr > agx::ZoneDependencyTable

Definition at line 113 of file Common.h.

Enumeration Type Documentation

◆ BuildConfiguration

Specifies flags set at build time. Used when querying what is enabled in this current build.

Enumerator
USE_64BIT_ARCHITECTURE 
SABRE_USE_METIS 
USE_OPENGL_INSTANCING 
USE_PREFETCHING 
USE_SSE 
SABRE_USE_SSE3 
SABRE_USE_PADDING 
USE_TINYXML 
USE_OPENGL 
USE_OSG 
UNITTEST_ENABLED 
USE_AGXSENSOR 
USE_AGXCALLABLE 
USE_PARTICLE_SYSTEM 
USE_OPENCL 
USE_DEBUG 
USE_COMPOSITE 
WINDOWS_PLATFORM 
USE_ASSIMP 
NUM_BUILD_CONFIGURATIONS 

Definition at line 96 of file agx.h.

◆ CellState

Enumerator
CELL_DEAD 
CELL_UNINITIALIZED 
CELL_ACTIVE 

Definition at line 42 of file Common.h.

◆ PrefetchType

Enumerator
L1 
L2 
L3 
NTA 

Definition at line 126 of file Prefetch.h.

◆ RealModeEnum

The data type for basic floating point representation.

The floating point representation used here is used in passing data to and from the user. It is not necessarily identical to the floating point representation used inside the solver or in other parts of the internals.

Enumerator
REAL_32BIT 
REAL_64BIT 

Definition at line 35 of file Real.h.

Function Documentation

◆ __agx_Event_getActiveThread()

◆ _equivalent()

template<typename T >
bool agx::_equivalent ( lhs,
rhs,
epsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Compare two values for equality.

Meaning that the difference between them is less than an epsilon value

Returns
true if lhs and rhs are equivalent

Definition at line 111 of file Math.h.

Referenced by _relativelyEquivalent(), and equivalent().

◆ _relativelyEquivalent()

template<typename T >
bool agx::_relativelyEquivalent ( lhs,
rhs,
relativeEpsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Compare two values for relative equality.

Meaning that the difference between them is less than an epsilon value The epsilon value is scaled with the values compared, to a minimum of relativeEpsilon.

Returns
true if lhs and rhs are equivalent

Definition at line 154 of file Math.h.

References _equivalent().

Referenced by relativelyEquivalent().

◆ abort()

AGXCORE_EXPORT void agx::abort ( )

◆ absolute() [1/4]

template<typename T >
Vec2T< T > agx::absolute ( const agx::Vec2T< T > &  a)

Definition at line 411 of file Vec2Template.h.

◆ absolute() [2/4]

template<typename T >
Vec3T< T > agx::absolute ( const agx::Vec3T< T > &  a)

Definition at line 825 of file Vec3Template.h.

◆ absolute() [3/4]

template<typename T >
Vec4T< T > agx::absolute ( const agx::Vec4T< T > &  a)

Definition at line 730 of file Vec4Template.h.

◆ absolute() [4/4]

◆ addGranularImpactCustomBuffers()

AGXPHYSICS_EXPORT void agx::addGranularImpactCustomBuffers ( agx::ParticleSystem system)

◆ addSecondaryConstraints1DOF()

AGXPHYSICS_EXPORT void agx::addSecondaryConstraints1DOF ( agx::HighLevelConstraintImplementation constraint,
agx::Angle angle 
)

Add secondary controllers with default name to the constraint.

◆ addSecondaryConstraints2DOF()

AGXPHYSICS_EXPORT void agx::addSecondaryConstraints2DOF ( agx::HighLevelConstraintImplementation constraint,
agx::SeparationAngle sepAngle,
agx::RotationalAngle rotAngle 
)

Add secondary controllers with default name to the constraint.

◆ AGX_DECLARE_HASHSET_TYPES()

agx::AGX_DECLARE_HASHSET_TYPES ( Object  )

◆ align()

static Real agx::align ( Real  value,
Real  alignment 
)
static

Definition at line 76 of file CreateTier.h.

References align(), and alignPowerOfTwo().

Referenced by align(), and createMissingTiers().

◆ align_ceil() [1/2]

template<typename T1 , typename T2 >
T1 * agx::align_ceil ( const T1 *  ptr,
T2  alignment 
)

Definition at line 473 of file Math.h.

◆ align_ceil() [2/2]

template<typename T >
T agx::align_ceil ( value,
alignment 
)

Definition at line 466 of file Math.h.

References agxAssert.

◆ align_ceil2() [1/2]

template<typename T1 , typename T2 >
T1 * agx::align_ceil2 ( const T1 *  ptr,
T2  alignment 
)

Definition at line 513 of file Math.h.

◆ align_ceil2() [2/2]

template<typename T >
T agx::align_ceil2 ( value,
alignment 
)

Definition at line 505 of file Math.h.

References agxAssert, and isPowerOfTwo().

◆ align_floor() [1/2]

template<typename T1 , typename T2 >
T1 * agx::align_floor ( const T1 *  ptr,
T2  alignment 
)

Definition at line 487 of file Math.h.

◆ align_floor() [2/2]

template<typename T >
T agx::align_floor ( value,
alignment 
)

Definition at line 480 of file Math.h.

References agxAssert.

◆ align_floor2() [1/2]

template<typename T1 , typename T2 >
T1 * agx::align_floor2 ( const T1 *  ptr,
T2  alignment 
)

Definition at line 527 of file Math.h.

◆ align_floor2() [2/2]

template<typename T >
T agx::align_floor2 ( value,
alignment 
)

Definition at line 519 of file Math.h.

References agxAssert, and isPowerOfTwo().

◆ alignPowerOfTwo() [1/4]

Int32 agx::alignPowerOfTwo ( Int32  value)

Definition at line 425 of file Math.h.

◆ alignPowerOfTwo() [2/4]

Int64 agx::alignPowerOfTwo ( Int64  value)

Definition at line 451 of file Math.h.

◆ alignPowerOfTwo() [3/4]

UInt32 agx::alignPowerOfTwo ( UInt32  value)

Definition at line 413 of file Math.h.

Referenced by align().

◆ alignPowerOfTwo() [4/4]

UInt64 agx::alignPowerOfTwo ( UInt64  value)

Definition at line 438 of file Math.h.

◆ asin()

template<typename T >
Vec3T< T > agx::asin ( const agx::Vec3T< T > &  a)

Definition at line 833 of file Vec3Template.h.

◆ begin() [1/8]

template<typename T , size_t N>
const T * agx::begin ( const StackArray< T, N > &  array)

Definition at line 310 of file agx/StackArray.h.

References agx::StackArray< T, N >::begin().

◆ begin() [2/8]

template<typename T , typename A >
Vector< T, A >::const_iterator agx::begin ( const Vector< T, A > &  v)

Definition at line 1071 of file agx/Vector.h.

References agx::Vector< T, Allocator >::begin().

◆ begin() [3/8]

template<typename T , typename A >
VectorPOD< T, A >::const_iterator agx::begin ( const VectorPOD< T, A > &  v)

Definition at line 1637 of file agx/Vector.h.

References agx::VectorPOD< T, Allocator >::begin(), and begin().

◆ begin() [4/8]

◆ begin() [5/8]

template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::iterator agx::begin ( LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &  table)

◆ begin() [6/8]

template<typename T , size_t N>
T * agx::begin ( StackArray< T, N > &  array)

Definition at line 304 of file agx/StackArray.h.

References agx::StackArray< T, N >::begin().

◆ begin() [7/8]

template<typename T , typename A >
Vector< T, A >::iterator agx::begin ( Vector< T, A > &  v)

Definition at line 1068 of file agx/Vector.h.

References agx::Vector< T, Allocator >::begin().

◆ begin() [8/8]

template<typename T , typename A >
VectorPOD< T, A >::iterator agx::begin ( VectorPOD< T, A > &  v)

Definition at line 1634 of file agx/Vector.h.

References agx::VectorPOD< T, Allocator >::begin(), and begin().

◆ buildErrorString()

AGXCORE_EXPORT std::string agx::buildErrorString ( const char *  baseFormat,
std::string  msgFormat,
  ... 
)

◆ buildHashKey()

◆ ByteSwap16()

static uint16_t agx::ByteSwap16 ( uint16_t  x)
inlinestatic

Definition at line 71 of file byteswap.h.

◆ ByteSwap32()

static uint32_t agx::ByteSwap32 ( uint32_t  x)
inlinestatic

Definition at line 76 of file byteswap.h.

◆ ByteSwap64()

static uint64_t agx::ByteSwap64 ( uint64_t  x)
inlinestatic

Definition at line 81 of file byteswap.h.

◆ calculateBoundingRadius()

template<typename GridCellTableT >
Real agx::calculateBoundingRadius ( Real  )

Definition at line 37 of file CreateTier.h.

References agxAbort.

◆ calculateBoundingRadius< agx::GridCell2DTable >()

Definition at line 51 of file CreateTier.h.

◆ calculateBoundingRadius< agx::GridCellTable >()

Definition at line 44 of file CreateTier.h.

◆ calculateCellChildIndex() [1/2]

UInt agx::calculateCellChildIndex ( const Vec2i cellId)

Definition at line 135 of file Common.h.

◆ calculateCellChildIndex() [2/2]

UInt agx::calculateCellChildIndex ( const Vec3i cellId)

Definition at line 130 of file Common.h.

Referenced by connectToParentCell().

◆ calculateCellId() [1/6]

Vec2i agx::calculateCellId ( const Vec2 position,
Real  invCellSize 
)

Definition at line 84 of file Vec2.h.

References calculateCellId().

◆ calculateCellId() [2/6]

void agx::calculateCellId ( const Vec3 pos,
Real  invCellSize,
Vec2i id 
)

Definition at line 123 of file Common.h.

References calculateCellId().

◆ calculateCellId() [3/6]

void agx::calculateCellId ( const Vec3 pos,
Real  invCellSize,
Vec3i id 
)

Definition at line 118 of file Common.h.

References calculateCellId().

◆ calculateCellId() [4/6]

Vec2i agx::calculateCellId ( Real  x,
Real  y,
Real  invCellSize 
)

Definition at line 72 of file Vec2.h.

Referenced by agx::MarchingCubes::~MarchingCubes(), calculateCellId(), and getCornerId().

◆ calculateCellId() [5/6]

Vec3i agx::calculateCellId ( Real  x,
Real  y,
Real  z,
Real  invCellSize 
)

Definition at line 80 of file agx/Vec3.h.

◆ calculateCellId() [6/6]

Vec3i agx::calculateCellId ( Vec3  position,
Real  invCellSize 
)

Definition at line 94 of file agx/Vec3.h.

References calculateCellId().

◆ calculateChildCellId() [1/2]

Vec2i agx::calculateChildCellId ( const Vec2i cellId,
UInt8  childIndex 
)

Definition at line 164 of file Common.h.

◆ calculateChildCellId() [2/2]

Vec3i agx::calculateChildCellId ( const Vec3i cellId,
UInt8  childIndex 
)

Definition at line 155 of file Common.h.

◆ calculateNonNegativeId() [1/2]

Vec2i agx::calculateNonNegativeId ( const Vec2i cellId,
UInt8   
)

Definition at line 180 of file Common.h.

◆ calculateNonNegativeId() [2/2]

Vec3i agx::calculateNonNegativeId ( const Vec3i cellId,
UInt8   
)

Definition at line 174 of file Common.h.

◆ calculateParentCellId() [1/2]

Vec2i agx::calculateParentCellId ( const Vec2i cellId)

Definition at line 199 of file Common.h.

◆ calculateParentCellId() [2/2]

Vec3i agx::calculateParentCellId ( const Vec3i cellId)

Definition at line 188 of file Common.h.

Referenced by connectToParentCell(), and createCell().

◆ calculateRootCellIndex() [1/2]

UInt agx::calculateRootCellIndex ( const Vec2i cellId)

Definition at line 148 of file Common.h.

◆ calculateRootCellIndex() [2/2]

UInt agx::calculateRootCellIndex ( const Vec3i cellId)

Definition at line 143 of file Common.h.

Referenced by createCell().

◆ calculateTier()

UInt8 agx::calculateTier ( Real  minCellSize,
const agxData::Array< Real > &  gridTier_size 
)

Calculates the tier where the given object size will fit.

Returns
If a suitable tier is found, then its index is returned. If no grid is found, then InvalidIndex is returned.

Definition at line 216 of file Common.h.

References InvalidIndex, log2(), and agxData::AbstractArray::size().

◆ cbegin() [1/2]

◆ cbegin() [2/2]

template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::const_iterator agx::cbegin ( const LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &  table)

◆ cend() [1/2]

◆ cend() [2/2]

template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::const_iterator agx::cend ( const LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &  table)

◆ clamp() [1/4]

template<typename T >
Vec2T< T > agx::clamp ( const Vec2T< T > &  vec,
const Vec2T< T > &  minimum,
const Vec2T< T > &  maximum 
)

Definition at line 474 of file Vec2Template.h.

References agx::Vec2T< T >::clamp().

◆ clamp() [2/4]

template<typename T >
Vec3T< T > agx::clamp ( const Vec3T< T > &  vec,
const Vec3T< T > &  minimum,
const Vec3T< T > &  maximum 
)

Definition at line 923 of file Vec3Template.h.

References agx::Vec3T< T >::clamp().

◆ clamp() [3/4]

template<typename T >
Vec4T< T > agx::clamp ( const Vec4T< T > &  vec,
const Vec4T< T > &  minimum,
const Vec4T< T > &  maximum 
)

Definition at line 817 of file Vec4Template.h.

References agx::Vec4T< T >::clamp().

◆ clamp() [4/4]

◆ ClosePlugin()

AGXCORE_EXPORT bool agx::ClosePlugin ( PluginHandle  handle)

Closes a plugin.

Corresponds to FreeLibrary or dlclose.

Return values
trueon success, and false on error.

◆ compareCellSortEntries()

bool agx::compareCellSortEntries ( const CellSortEntry p1,
const CellSortEntry p2 
)

Definition at line 75 of file Common.h.

References agx::CellSortEntry::linearId, and agx::CellSortEntry::tier.

◆ computeEigenvalues()

AGXCORE_EXPORT void agx::computeEigenvalues ( agx::Matrix3x3  a,
agx::Vec3 realPart,
agx::Vec3 imgPart 
)

◆ computeVolume() [1/2]

template<typename T >
Real agx::computeVolume ( const T &  a,
const T &  b,
const T &  c,
const T &  d 
)

a, b, c, d sides of the tetrahedron

Returns
the volume of a tetrahedron.

Definition at line 571 of file Math.h.

Referenced by computeVolume().

◆ computeVolume() [2/2]

template<typename T >
Real agx::computeVolume ( const T &  f1,
const T &  f2,
const T &  f3,
const T &  b1,
const T &  b2,
const T &  b3 
)

compute the volume of a prism.

Definition at line 578 of file Math.h.

References computeVolume().

◆ connectToParentCell() [1/2]

template<typename GridTierDataT , typename CellDataT , typename CellT , typename CellIdT , typename CellPosT , typename GridCellTableT , size_t NumNeighbors>
UInt32 agx::connectToParentCell ( agxData::Array< agx::UInt32 > &  deadCells,
agxData::Array< Physics::HierarchicalGrid::ContactZonePtr > &  emptyZones,
Index  cellIndex,
UInt8  tier,
const CellIdT  cellId,
GridTierDataT &  gridTier,
CellDataT &  cell,
agxData::Array< CellT > &  rootCells,
const CellIdT *  NeighborTable,
agx::Bool hasNewTiers,
Physics::HierarchicalGrid::SolveBodyManager solveBodyManager,
const agx::UInt contactZoneAccumulationLevel 
)

Definition at line 296 of file CreateCell.h.

References calculateParentCellId(), createCell(), and InvalidIndex.

◆ connectToParentCell() [2/2]

template<typename CellDataT , typename CellIdT >
void agx::connectToParentCell ( Index  cellIndex,
const CellIdT  cellId,
Index  parentCellIndex,
CellDataT &  cell,
Physics::HierarchicalGrid::SolveBodyManager solveBodyManager,
const agx::UInt contactZoneAccumulationLevel 
)

◆ const_pointer_cast()

template<class T , class Y >
ref_ptr< T > agx::const_pointer_cast ( const ref_ptr< Y > &  rp)

Definition at line 340 of file ref_ptr.h.

References agx::ref_ptr< T >::get().

◆ cornerOffsets2D()

Vec3 agx::cornerOffsets2D ( Real32  radius,
size_t  corner 
)

Definition at line 82 of file Common.h.

Referenced by getCornerId().

◆ createBuiltinModel()

AGXCORE_EXPORT void agx::createBuiltinModel ( const char *  path,
Model parent,
Model *&  result 
)

◆ createCell()

template<typename GridTierDataT , typename CellDataT , typename CellT , typename CellIdT , typename CellPosT , typename GridCellTableT , size_t NumNeighbors>
UInt32 agx::createCell ( agxData::Array< agx::UInt32 > &  deadCells,
agxData::Array< Physics::HierarchicalGrid::ContactZonePtr > &  emptyZones,
UInt8  tier,
const CellIdT  cellId,
GridTierDataT &  gridTier,
CellDataT &  cell,
agxData::Array< CellT > &  rootCells,
const CellIdT *  NeighborTable,
agx::Bool hasNewTiers,
Physics::HierarchicalGrid::SolveBodyManager solveBodyManager,
const agx::UInt contactZoneAccumulationLevel 
)

Create and connect a cell.

Will create all parent cells as well.

Make sure top tier contain a single root cell for this 'quadrant'. Around the origin the cells on different sides will never have a common parent, therefore we have a separate root cell for each 'quadrant' (4 in 2d, 8 in 3d).

Definition at line 88 of file CreateCell.h.

References agxAssert, agxData::Array< T >::back(), agx::Physics::HierarchicalGrid::calculateNeighborIndex(), calculateParentCellId(), calculateRootCellIndex(), CELL_UNINITIALIZED, createCell(), createMissingTiers(), agxData::EntityPtr::createWithIndex(), agxData::AbstractArray::empty(), agx::IndexRangeT< T >::end(), InvalidIndex, agx::Physics::HierarchicalGrid::isNeighborOffset(), agxData::AbstractArray::range(), agx::Physics::HierarchicalGrid::SolveBodyManager::registerCell(), root(), and agxData::AbstractArray::size().

Referenced by connectToParentCell(), and createCell().

◆ createImplementedModel()

AGXCORE_EXPORT void agx::createImplementedModel ( const char *  path,
Model *&  result 
)

◆ createMissingTiers()

template<typename GridTierDataT , typename CellDataT , typename CellT , typename CellIdT , typename CellPosT , typename GridCellTableT , size_t NumNeighbors>
size_t agx::createMissingTiers ( Real  minCellSize,
agxData::Array< agx::UInt32 > &  deadCells,
agxData::Array< Physics::HierarchicalGrid::ContactZonePtr > &  emptyZones,
GridTierDataT &  gridTier,
CellDataT &  cell,
agxData::Array< CellT > &  rootCells,
const CellIdT *  NeighborTable,
agx::Bool hasNewTiers,
Physics::HierarchicalGrid::SolveBodyManager solveBodyManager,
const agx::UInt contactZoneAccumulationLevel 
)

The internal contact zones are bound to the corresponding grid cell, but in a larger sized tier, following parents links, with offset == contactZoneAccumulationLevel. However, if the zone tier is close to 0 the offset may be smaller (parent can not be above the root), which is ok, but when we get a new root tier we need to invalidate all such internal zones, so they can find a new ancestor connection.

The internal contact zones are bound to the corresponding grid cell, but in a larger sized tier, following parents links, with offset == contactZoneAccumulationLevel. However, if the zone tier is close to 0 the offset may be smaller (parent can not be above the root), which is ok, but when we get a new root tier we need to invalidate all such internal zones, so they can find a new ancestor connection.

Definition at line 94 of file CreateTier.h.

References agxAbort1, agxVerify, agxVerify1, align(), agx::HashSetImplementation< KeyT, HashT, AllocatorT >::contains(), agx::Container::empty(), agx::HashSetImplementation< KeyT, HashT, AllocatorT >::insert(), InvalidIndex, isPowerOfTwo(), agx::Vector< T, Allocator >::push_back(), and agx::Container::size().

Referenced by createCell().

◆ createTier()

template<typename GridTierDataT , typename GridCellTableT >
void agx::createTier ( size_t  tier,
Real  tierSize,
agxData::Buffer cellIdBuffer,
GridTierDataT &  gridTier 
)

Definition at line 58 of file CreateTier.h.

◆ cStr() [1/2]

AGXCORE_EXPORT const char * agx::cStr ( const char *  str)

◆ cStr() [2/2]

AGXCORE_EXPORT const char * agx::cStr ( const std::string &  str)

◆ degreesToRadians()

Real agx::degreesToRadians ( Real  angle)
Returns
Parameters
angleconverted from angle to radians

Definition at line 348 of file Math.h.

References DEG_TO_RAD.

◆ dynamic_pointer_cast()

template<class T , class Y >
ref_ptr< T > agx::dynamic_pointer_cast ( const ref_ptr< Y > &  rp)

Definition at line 334 of file ref_ptr.h.

References agx::ref_ptr< T >::get().

◆ end() [1/8]

template<typename T , size_t N>
const T * agx::end ( const StackArray< T, N > &  array)

Definition at line 322 of file agx/StackArray.h.

References agx::StackArray< T, N >::end().

◆ end() [2/8]

template<typename T , typename A >
Vector< T, A >::const_iterator agx::end ( const Vector< T, A > &  v)

Definition at line 1078 of file agx/Vector.h.

References agx::Vector< T, Allocator >::end().

◆ end() [3/8]

template<typename T , typename A >
VectorPOD< T, A >::const_iterator agx::end ( const VectorPOD< T, A > &  v)

Definition at line 1643 of file agx/Vector.h.

References agx::VectorPOD< T, Allocator >::end(), and end().

◆ end() [4/8]

◆ end() [5/8]

template<typename KeyT , typename ValueT , typename HashT , typename AllocatorT >
LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT >::iterator agx::end ( LinearProbingHashTableImplementation< KeyT, ValueT, HashT, AllocatorT > &  table)

◆ end() [6/8]

template<typename T , size_t N>
T * agx::end ( StackArray< T, N > &  array)

Definition at line 316 of file agx/StackArray.h.

References agx::StackArray< T, N >::end().

◆ end() [7/8]

template<typename T , typename A >
Vector< T, A >::iterator agx::end ( Vector< T, A > &  v)

Definition at line 1075 of file agx/Vector.h.

References agx::Vector< T, Allocator >::end().

◆ end() [8/8]

template<typename T , typename A >
VectorPOD< T, A >::iterator agx::end ( VectorPOD< T, A > &  v)

Definition at line 1640 of file agx/Vector.h.

References agx::VectorPOD< T, Allocator >::end(), and end().

◆ equalsZero() [1/3]

◆ equalsZero() [2/3]

bool agx::equalsZero ( double  d,
double  eps = DBL_EPSILON 
)
Returns
true if d is within the range of (-DBL_EPSILON, DBL_EPSILON).

Definition at line 282 of file Math.h.

◆ equalsZero() [3/3]

bool agx::equalsZero ( float  f,
float  eps = FLT_EPSILON 
)
Returns
true if f is within the range of (-FLT_EPSILON, FLT_EPSLION).

Definition at line 276 of file Math.h.

◆ equivalent() [1/11]

◆ equivalent() [2/11]

template<typename T >
bool agx::equivalent ( const agx::AffineMatrix4x4T< T > &  a,
const agx::AffineMatrix4x4T< T > &  b,
epsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Definition at line 914 of file AffineMatrix4x4.h.

References equivalent().

◆ equivalent() [3/11]

template<typename T >
bool agx::equivalent ( const agx::Matrix4x4T< T > &  a,
const agx::Matrix4x4T< T > &  b,
epsilon = 1e-6 
)

Definition at line 1064 of file Matrix4x4.h.

References equivalent().

◆ equivalent() [4/11]

template<typename T >
bool agx::equivalent ( const agx::QuatT< T > &  a,
const agx::QuatT< T > &  b,
epsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Definition at line 817 of file QuatTemplate.h.

References equivalent().

◆ equivalent() [5/11]

template<typename T >
bool agx::equivalent ( const agx::Vec2T< T > &  a,
const agx::Vec2T< T > &  b,
epsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Definition at line 404 of file Vec2Template.h.

References equivalent().

◆ equivalent() [6/11]

template<typename T >
bool agx::equivalent ( const agx::Vec3T< T > &  a,
const agx::Vec3T< T > &  b,
epsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Definition at line 817 of file Vec3Template.h.

References equivalent().

◆ equivalent() [7/11]

template<typename T >
bool agx::equivalent ( const agx::Vec4T< T > &  a,
const agx::Vec4T< T > &  b,
epsilon = T(AGX_EQUIVALENT_EPSILON) 
)

Definition at line 721 of file Vec4Template.h.

References equivalent().

◆ equivalent() [8/11]

bool agx::equivalent ( const SPDMatrix3x3 m1,
const SPDMatrix3x3 m2,
Real  epsilon = Real(AGX_EQUIVALENT_EPSILON) 
)

Definition at line 447 of file SPDMatrix3x3.h.

References equivalent().

◆ equivalent() [9/11]

bool agx::equivalent ( double  lhs,
double  rhs,
double  epsilon = (double)AGX_EQUIVALENT_EPSILON 
)

Compare two values for equality.

Meaning that the difference between them is less than an epsilon value

Returns
true if lhs and rhs are equivalent

Definition at line 131 of file Math.h.

◆ equivalent() [10/11]

bool agx::equivalent ( float  lhs,
float  rhs,
double  epsilon 
)

Compare two values for equality.

Meaning that the difference between them is less than an epsilon value

Returns
true if lhs and rhs are equivalent

Definition at line 141 of file Math.h.

References _equivalent().

◆ equivalent() [11/11]

bool agx::equivalent ( float  lhs,
float  rhs,
float  epsilon = (float)AGX_EQUIVALENT_EPSILON 
)

Compare two values for equality.

Meaning that the difference between them is less than an epsilon value

Returns
true if lhs and rhs are equivalent

Definition at line 121 of file Math.h.

◆ fmiInit()

fmiStatus agx::fmiInit ( nsFMI::Export::Module *  module)

◆ fmiInitApplication()

fmiStatus agx::fmiInitApplication ( nsFMI::Export::Module *  module)

◆ fmiShutdown()

fmiStatus agx::fmiShutdown ( nsFMI::Export::Module *  module)

◆ forcedShutdown()

AGXCORE_EXPORT bool agx::forcedShutdown ( )

◆ generateChromeTracing()

void AGXCORE_EXPORT agx::generateChromeTracing ( const String rootPath,
agxData::JournalArchive::Session journalSession 
)

A Chrome trace is a thread time line written in the chrome tracing format.

It can be viewed in any Chrome-style browser such Chrome, Chromium, and Brave. And possibly others as well.

The trace is written to a single file name ChromeTracing.json that contains the thread timelines for all frames stored in the profiling journal session.

Open chrome://tracing/ in your browser, click Load in the top-left, and select the ChromeTracing.json file.

◆ generateTaskProfiles()

void AGXCORE_EXPORT agx::generateTaskProfiles ( const String rootPath,
agxData::JournalArchive::Session journalSession 
)

◆ generateThreadTimeline()

void AGXCORE_EXPORT agx::generateThreadTimeline ( const String rootPath,
agxData::JournalArchive::Session journalSession 
)

◆ geq() [1/2]

bool agx::geq ( double  a,
double  b,
double  eps = (double)AGX_EQUIVALENT_EPSILON 
)
Returns
true if
Parameters
a>=
bwithin
eps

Definition at line 381 of file Math.h.

Referenced by agxSDK::findDistanceFromPointToLine(), agxCollide::Polynomial< N >::findRealRootsInInterval(), and agxSDK::findSegmentCircleIntersections2D().

◆ geq() [2/2]

bool agx::geq ( float  a,
float  b,
float  eps = (float)AGX_EQUIVALENT_EPSILON 
)
Returns
true if
Parameters
a>=
bwithin
eps

Definition at line 387 of file Math.h.

◆ get_pointer()

template<class T >
T * agx::get_pointer ( const ref_ptr< T > &  rp)

Definition at line 322 of file ref_ptr.h.

References agx::ref_ptr< T >::get().

◆ getAngle()

Real agx::getAngle ( const Vec3 a,
const Vec3 b,
const Vec3 c 
)

a and b should be orthogonal

Definition at line 1419 of file ConstraintImplementation.h.

Referenced by agx::ConstraintAngleBasedData::~ConstraintAngleBasedData().

◆ getBuildConfigurationString()

std::string AGXCORE_EXPORT agx::getBuildConfigurationString ( BuildConfiguration  config)
Parameters
config- configuration to be translated to a string
Returns
a string with the specified BuildConfiguration

◆ getCornerId() [1/2]

template<>
Vec2i agx::getCornerId ( size_t  corner,
Real32  radius,
Vec3f  centerPosition,
Real32  invCellSize 
)

◆ getCornerId() [2/2]

template<typename CellIdT >
CellIdT agx::getCornerId ( size_t  ,
Real32  ,
Vec3f  ,
Real32   
)

Definition at line 91 of file Common.h.

References agxAbortN.

◆ getCurrentThread()

AGXCORE_EXPORT Thread * agx::getCurrentThread ( )
Returns
The current thread.

Referenced by agx::Thread::getIndex().

◆ getEmptyString()

AGXCORE_EXPORT const agx::String & agx::getEmptyString ( )

Return a reference to an empty string that is owned by an AGX Dynamics shared library.

Such a string reference is required when returning to calling code that was build with allocator incompatible compiler or linker settings and thus exhibit memory errors when destroying strings allocated from within an AGX Dynamics shared library.

◆ getEntityCreationThreadSafe()

AGXCORE_EXPORT bool agx::getEntityCreationThreadSafe ( )
Returns
true iff it is safe to transfer ownership of an object to another thread. Default: false.

◆ getExceptionNotifyLevel()

AGXCORE_EXPORT int agx::getExceptionNotifyLevel ( )

◆ getModel() [1/7]

AGXCORE_EXPORT Model * agx::getModel ( const char *  path,
const Path _namespace = Path() 
)

◆ getModel() [2/7]

AGXCORE_EXPORT Model * agx::getModel ( const Path path,
const Name implementation,
const Path _namespace = Path() 
)

◆ getModel() [3/7]

template<typename T >
T * agx::getModel ( const Path path,
const Name implementation,
const Path _namespace = Path() 
)

Definition at line 366 of file Object.h.

References getModel().

◆ getModel() [4/7]

AGXCORE_EXPORT Model * agx::getModel ( const Path path,
const Path _namespace = Path() 
)
Returns
The model for a specified path. Path may be relative if a namespace is provided.

Referenced by getModel(), and agx::Object::setModel().

◆ getModel() [5/7]

template<typename T >
T * agx::getModel ( const Path path,
const Path _namespace = Path() 
)

Definition at line 363 of file Object.h.

References getModel().

◆ getModel() [6/7]

AGXCORE_EXPORT Model * agx::getModel ( const String path,
const Path _namespace = Path() 
)

◆ getModel() [7/7]

AGXCORE_EXPORT Model * agx::getModel ( TiXmlElement *  element)
Returns
The model for an xml element.

◆ getNumThreads()

agx::Index AGXCORE_EXPORT agx::getNumThreads ( )
Returns
The number of threads including the main thread but not including user threads registered with agx::Thread::registerAsAgxThread.

◆ getNumThreadsIncludingRegistered()

agx::Index AGXCORE_EXPORT agx::getNumThreadsIncludingRegistered ( )
Returns
The number of threads including the main thread and user threads registered with agx::Thread::registerAsAgxThread.

◆ getParticleGeometryImpacts()

AGXPHYSICS_EXPORT agx::Physics::ParticleGeometryContactData * agx::getParticleGeometryImpacts ( agx::Physics::GranularBodySystem system)

◆ getParticleGeometryImpactsStorage()

AGXPHYSICS_EXPORT agxData::EntityStorage * agx::getParticleGeometryImpactsStorage ( agx::Physics::GranularBodySystem system)

◆ getParticlePairImpacts()

AGXPHYSICS_EXPORT agx::Physics::ParticlePairContactData * agx::getParticlePairImpacts ( agx::Physics::GranularBodySystem system)

◆ getParticlePairImpactsStorage()

AGXPHYSICS_EXPORT agxData::EntityStorage * agx::getParticlePairImpactsStorage ( agx::Physics::GranularBodySystem system)

◆ GetPluginError()

AGXCORE_EXPORT agx::String agx::GetPluginError ( )

Get plugin error.

◆ getRandGenerator()

AGXCORE_EXPORT agx::UniformInt32Generator & agx::getRandGenerator ( )

Referenced by irandom(), and random().

◆ getStartTick()

UInt64 AGXCORE_EXPORT agx::getStartTick ( )
Returns
The CPU tick value when agx was initialized.

◆ getTypeSystemMutex()

AGXCORE_EXPORT agx::ReentrantMutex & agx::getTypeSystemMutex ( )

◆ hash() [1/4]

agx::UInt32 agx::hash ( agx::UInt32  x,
agx::UInt32  y,
agx::UInt32  z 
)

Definition at line 62 of file agx/Vec3.h.

◆ hash() [2/4]

◆ hash() [3/4]

◆ hash() [4/4]

UInt32 agx::hash ( UInt32  h1,
UInt32  h2 
)

Definition at line 71 of file HashFunction.h.

◆ hashKeyContains()

bool agx::hashKeyContains ( agx::UInt64  key,
agx::UInt32  id 
)

Definition at line 46 of file HashFunction.h.

◆ hashKeyEqual() [1/3]

bool agx::hashKeyEqual ( char *  key1,
char *  key2 
)

Definition at line 233 of file HashFunction.h.

◆ hashKeyEqual() [2/3]

bool agx::hashKeyEqual ( const char *  key1,
const char *  key2 
)

Definition at line 238 of file HashFunction.h.

◆ hashKeyEqual() [3/3]

◆ hashword()

AGXPHYSICS_EXPORT uint32_t agx::hashword ( const uint32_t *  k,
size_t  length,
uint32_t  initval 
)

This works on all machines. To be useful, it requires – that the key be an array of uint32_t's, and – that the length be the number of uint32_t's in the key

The function hashword() is identical to hashlittle() on little-endian machines, and identical to hashbig() on big-endian machines, except that the length has to be measured in uint32_ts rather than in bytes. hashlittle() is more complicated than hashword() only because

hashlittle() has to dance around fitting the key bytes into registers.

◆ hashword2()

AGXPHYSICS_EXPORT void agx::hashword2 ( const uint32_t *  k,
size_t  length,
uint32_t *  pc,
uint32_t *  pb 
)

hashword2() – same as hashword(), but take two seeds and return two 32-bit values. pc and pb must both be non-null, and *pc and *pb must both be initialized with seeds. If you pass in (*pb)==0, the output

(*pc) will be the same as the return value from hashword().

◆ highestBitToIndex()

template<typename T >
agx::UInt8 agx::highestBitToIndex ( n)
inline
Parameters
n- The value that will be tested for the highest set bit.

highestBitToIndex(0) - 0 highestBitToIndex(0x2) - 1 highestBitToIndex(0x3) - 1 highestBitToIndex(0x4) - 2 highestBitToIndex(0x8) - 3 ...

Returns
the index (0..) of the highest set bit in the value n

Definition at line 635 of file Math.h.

◆ init()

◆ innerProd_6() [1/2]

double agx::innerProd_6 ( const Vec3d v_01,
const Vec3d v_02,
const Vec3d v_11,
const Vec3d v_12 
)

Definition at line 41 of file agx/Jacobian.h.

References AGX_ALIGNED, and agx::Vec3T< T >::ptr().

Referenced by mult(), and agx::Jacobian6DOFElementT< T >::mult().

◆ innerProd_6() [2/2]

float agx::innerProd_6 ( const Vec3f v_01,
const Vec3f v_02,
const Vec3f v_11,
const Vec3f v_12 
)

Definition at line 76 of file agx/Jacobian.h.

References AGX_ALIGNED, and agx::Vec3T< T >::ptr().

◆ inverse()

template<typename T >
T agx::inverse ( const T &  value)

Definition at line 78 of file Math.h.

Referenced by agx::OrthoMatrix3x3::isIdentity().

◆ inverse< AffineMatrix4x4d >()

template<>
AffineMatrix4x4d agx::inverse< AffineMatrix4x4d > ( const AffineMatrix4x4d value)
inline

Definition at line 965 of file AffineMatrix4x4.h.

References agx::AffineMatrix4x4T< T >::inverse().

◆ inverse< AffineMatrix4x4f >()

template<>
AffineMatrix4x4f agx::inverse< AffineMatrix4x4f > ( const AffineMatrix4x4f value)
inline

Definition at line 958 of file AffineMatrix4x4.h.

References agx::AffineMatrix4x4T< T >::inverse().

◆ inverse< Matrix4x4d >()

template<>
Matrix4x4d agx::inverse< Matrix4x4d > ( const Matrix4x4d value)
inline

Definition at line 1228 of file Matrix4x4.h.

References agx::Matrix4x4T< T >::inverse().

◆ inverse< Matrix4x4f >()

template<>
Matrix4x4f agx::inverse< Matrix4x4f > ( const Matrix4x4f value)
inline

Definition at line 1221 of file Matrix4x4.h.

References agx::Matrix4x4T< T >::inverse().

◆ irandom()

int agx::irandom ( int  min,
int  max 
)
Returns
a random value in the range [min, max)

Definition at line 548 of file Math.h.

References getRandGenerator(), max(), min(), and agx::RandomGenerator< T, DistributionT, EngineT >::rand().

◆ isAligned() [1/2]

template<typename T1 , typename T2 >
bool agx::isAligned ( const T1 *  ptr,
T2  alignment 
)

Definition at line 499 of file Math.h.

References isAligned().

◆ isAligned() [2/2]

template<typename T >
bool agx::isAligned ( value,
alignment 
)

Definition at line 493 of file Math.h.

Referenced by isAligned().

◆ isASCII() [1/2]

bool AGXCORE_EXPORT agx::isASCII ( const char *  str)

◆ isASCII() [2/2]

bool AGXCORE_EXPORT agx::isASCII ( const std::string &  s)

◆ isBuiltWith()

bool AGXCORE_EXPORT agx::isBuiltWith ( BuildConfiguration  config)
Returns
true if the specified build configuration is enabled at build time

◆ isEven()

template<typename T >
bool agx::isEven ( val)

Definition at line 84 of file Math.h.

◆ isFinite()

template<typename T >
bool agx::isFinite ( v)

◆ isInf()

template<typename T >
bool agx::isInf ( v)

Definition at line 297 of file Math.h.

◆ isInitialized()

bool AGXPHYSICS_EXPORT agx::isInitialized ( )
Returns
true if agx has been successfully initialized.

◆ isNaN()

◆ isPowerOfTwo()

template<typename T >
bool agx::isPowerOfTwo ( value)
Returns
true if
Parameters
valueis a power of two

Definition at line 408 of file Math.h.

Referenced by align_ceil2(), align_floor2(), agx::BatchAllocator::allocate(), and createMissingTiers().

◆ isShutdown()

bool AGXPHYSICS_EXPORT agx::isShutdown ( )

This method indicates if agx::shutdown() has been started or already done.

This method is needed as some Singletons might be executed and need to know if it is part of a shutdown process.

Returns
true if shutdown has been initiated or done.

Referenced by agx::Model::setSourcePath().

◆ leq() [1/2]

bool agx::leq ( double  a,
double  b,
double  eps = (double)AGX_EQUIVALENT_EPSILON 
)
Returns
true if
Parameters
a<=
bwithin
eps

Definition at line 369 of file Math.h.

Referenced by agxSDK::findDistanceFromPointToLine(), agxSDK::findSegmentCircleIntersections2D(), agxWire::getNodeIterator(), and agxSDK::pointInsideCircle().

◆ leq() [2/2]

bool agx::leq ( float  a,
float  b,
float  eps = (float)AGX_EQUIVALENT_EPSILON 
)
Returns
true if
Parameters
a<=
bwithin
eps

Definition at line 375 of file Math.h.

◆ lerp()

template<typename T1 , typename T2 >
T1 const agx::lerp ( T1 const &  a,
T1 const &  b,
T2  s 
)

Linearly interpolate from a to b using s = {0,..1}.

Definition at line 588 of file Math.h.

Referenced by logInterpolate().

◆ log2()

Int32 agx::log2 ( size_t  val)

Definition at line 393 of file Math.h.

Referenced by calculateTier().

◆ log_throw()

AGXCORE_EXPORT void agx::log_throw ( const std::string &  where,
const char *  what 
)

◆ logInterpolate()

template<typename T >
T const agx::logInterpolate ( T const &  a,
T const &  b,
float  s 
)

logarithmic interpolation from a to b using s = {0,..1}

Definition at line 600 of file Math.h.

References lerp().

◆ makeIndexRange()

template<typename T >
IndexRangeT< T > agx::makeIndexRange ( const T  begin,
const T  end 
)

Definition at line 268 of file IndexRange.h.

References begin(), and end().

◆ MapPluginSymbol()

AGXCORE_EXPORT FunctionHandle agx::MapPluginSymbol ( PluginHandle  handle,
const char *  symbolName 
)

◆ max()

◆ microSleep()

void agx::microSleep ( Real  microSeconds)
inline

Sleep the current thread.

Timing is not exact, it is just a rough estimate.

Definition at line 54 of file Sleep.h.

References agx::SystemInformation::getCpuFrequency(), nanoSleep(), and noopLoop().

Referenced by nanoSleep().

◆ min()

◆ morton() [1/12]

UInt32 agx::morton ( const Vec2i32 vec)

Definition at line 125 of file Morton.h.

References agxAssert, and morton().

◆ morton() [2/12]

UInt64 agx::morton ( const Vec2i64 vec)

Definition at line 222 of file Morton.h.

References agxAssert, and morton().

◆ morton() [3/12]

UInt32 agx::morton ( const Vec2u32 vec)

Definition at line 124 of file Morton.h.

References morton().

◆ morton() [4/12]

UInt64 agx::morton ( const Vec2u64 vec)

Definition at line 221 of file Morton.h.

References morton().

◆ morton() [5/12]

UInt32 agx::morton ( const Vec3i32 vec)

Definition at line 118 of file Morton.h.

References agxAssert, and morton().

◆ morton() [6/12]

UInt64 agx::morton ( const Vec3i64 vec)

Definition at line 215 of file Morton.h.

References agxAssert, and morton().

◆ morton() [7/12]

UInt32 agx::morton ( const Vec3u32 vec)

Definition at line 117 of file Morton.h.

References morton().

◆ morton() [8/12]

UInt64 agx::morton ( const Vec3u64 vec)

Definition at line 214 of file Morton.h.

References morton().

◆ morton() [9/12]

UInt32 agx::morton ( UInt32  x,
UInt32  y 
)

Definition at line 90 of file Morton.h.

References agxAssert, morton_part1By1(), and morton_reference().

◆ morton() [10/12]

UInt32 agx::morton ( UInt32  x,
UInt32  y,
UInt32  z 
)

Definition at line 53 of file Morton.h.

References agxAssert, morton_part1By2(), and morton_reference().

Referenced by morton().

◆ morton() [11/12]

UInt64 agx::morton ( UInt64  x,
UInt64  y 
)

Definition at line 187 of file Morton.h.

References agxAssert, morton_part1By1(), and morton_reference().

◆ morton() [12/12]

UInt64 agx::morton ( UInt64  x,
UInt64  y,
UInt64  z 
)

Definition at line 150 of file Morton.h.

References agxAssert, morton_part1By2(), and morton_reference().

◆ morton_part1By1() [1/2]

UInt32 agx::morton_part1By1 ( UInt32  n)

Definition at line 80 of file Morton.h.

Referenced by morton().

◆ morton_part1By1() [2/2]

UInt64 agx::morton_part1By1 ( UInt64  n)

Definition at line 176 of file Morton.h.

References AGX_LONG_CONSTANT.

◆ morton_part1By2() [1/2]

UInt32 agx::morton_part1By2 ( UInt32  n)

Definition at line 42 of file Morton.h.

Referenced by morton().

◆ morton_part1By2() [2/2]

UInt64 agx::morton_part1By2 ( UInt64  n)

Definition at line 139 of file Morton.h.

References AGX_LONG_CONSTANT.

◆ morton_reference() [1/4]

UInt32 agx::morton_reference ( UInt32  x,
UInt32  y 
)

Definition at line 102 of file Morton.h.

◆ morton_reference() [2/4]

UInt32 agx::morton_reference ( UInt32  x,
UInt32  y,
UInt32  z 
)

Definition at line 65 of file Morton.h.

Referenced by morton().

◆ morton_reference() [3/4]

UInt64 agx::morton_reference ( UInt64  x,
UInt64  y 
)

Definition at line 199 of file Morton.h.

◆ morton_reference() [4/4]

UInt64 agx::morton_reference ( UInt64  x,
UInt64  y,
UInt64  z 
)

Definition at line 162 of file Morton.h.

◆ mult() [1/2]

◆ mult() [2/2]

Vec3f agx::mult ( const Matrix3x3f m,
const Vec3f v 
)

Definition at line 391 of file agx/Jacobian.h.

References AGX_ALIGNED, agx::Matrix3x3T< T >::ptr(), and agx::Vec3T< T >::ptr().

◆ nanoSleep()

void agx::nanoSleep ( long  nanoSeconds)
inline

Definition at line 65 of file Sleep.h.

References microSleep().

Referenced by microSleep().

◆ nextPrime()

◆ noopLoop()

void agx::noopLoop ( UInt64  numIterations)
inline

Definition at line 34 of file Sleep.h.

Referenced by microSleep().

◆ normalizedAngle()

AGXCORE_EXPORT Real agx::normalizedAngle ( Real  angle,
bool  positiveRange = false 
)

Normalize an angle.

Parameters
angle- The angle that will be transformed into the range
positiveRangetrue generates angle in interval [0, 2*Pi], false use interval [-Pi, Pi]
Returns
a specified angle in a range either:

◆ OpenPlugin()

AGXCORE_EXPORT PluginHandle agx::OpenPlugin ( const char *  path)

Opens a plugin. Corresponds to LoadLibrary or dlopen.

◆ operator!=() [1/7]

bool agx::operator!= ( const agx::String str,
const agx::Name name 
)

Definition at line 306 of file Name.h.

◆ operator!=() [2/7]

bool agx::operator!= ( const char *  str,
const agx::Name name 
)

Definition at line 307 of file Name.h.

◆ operator!=() [3/7]

bool agx::operator!= ( const std::string &  str,
const agx::Name name 
)

Definition at line 305 of file Name.h.

◆ operator!=() [4/7]

template<typename T >
bool agx::operator!= ( const SymmetricPair< T > &  a,
const SymmetricPair< T > &  b 
)

Definition at line 53 of file SymmetricPair.h.

◆ operator!=() [5/7]

template<typename T , typename U >
bool agx::operator!= ( T *  p,
ref_ptr< U > const &  rp 
)

Definition at line 138 of file ref_ptr.h.

◆ operator!=() [6/7]

template<typename T , typename U >
bool agx::operator!= ( T const *  p,
ref_ptr< U > const &  rp 
)

Definition at line 126 of file ref_ptr.h.

◆ operator!=() [7/7]

template<typename T >
bool agx::operator!= ( val,
InvalidIndexStruct   
)

Definition at line 207 of file agx.h.

◆ operator*() [1/13]

agx::Vec6 agx::operator* ( const agx::Real r,
const agx::Vec6 v 
)
inline

Definition at line 223 of file Vec6.h.

◆ operator*() [2/13]

SPDMatrix3x3 agx::operator* ( const Real r,
const SPDMatrix3x3 m 
)

Definition at line 439 of file SPDMatrix3x3.h.

References agx::SPDMatrix3x3::mult().

◆ operator*() [3/13]

template<typename T >
Matrix3x3T< T > agx::operator* ( const T &  r,
const Matrix3x3T< T > &  m 
)

Definition at line 812 of file Matrix3x3.h.

References agx::Matrix3x3T< T >::mult().

◆ operator*() [4/13]

Vec3 agx::operator* ( const Vec3 v,
const OrthoMatrix3x3 m 
)
inline

Definition at line 300 of file OrthoMatrix3x3.h.

References agx::OrthoMatrix3x3::preMult().

◆ operator*() [5/13]

Vec3 agx::operator* ( const Vec3 v,
const SPDMatrix3x3 m 
)

Definition at line 428 of file SPDMatrix3x3.h.

References agx::SPDMatrix3x3::preMult().

◆ operator*() [6/13]

template<typename T >
Real agx::operator* ( const Vec3T< T > &  lhs,
const Vec4T< T > &  rhs 
)

Compute the dot product of a (Vec3,1.0) and a Vec4.

Definition at line 748 of file Vec4Template.h.

◆ operator*() [7/13]

template<typename T >
Vec3T< T > agx::operator* ( const Vec3T< T > &  v,
const AffineMatrix4x4T< T > &  m 
)

Definition at line 870 of file AffineMatrix4x4.h.

References agx::AffineMatrix4x4T< T >::preMult().

◆ operator*() [8/13]

template<typename T >
Vec3T< T > agx::operator* ( const Vec3T< T > &  v,
const Matrix3x3T< T > &  m 
)

Definition at line 799 of file Matrix3x3.h.

References agx::Matrix3x3T< T >::preMult().

◆ operator*() [9/13]

template<typename T >
Vec3T< T > agx::operator* ( const Vec3T< T > &  v,
const Matrix4x4T< T > &  m 
)

Definition at line 940 of file Matrix4x4.h.

References agx::Matrix4x4T< T >::preMult().

◆ operator*() [10/13]

template<typename T >
Real agx::operator* ( const Vec4T< T > &  lhs,
const Vec3T< T > &  rhs 
)

Compute the dot product of a Vec4 and a (Vec3,1.0).

Definition at line 755 of file Vec4Template.h.

◆ operator*() [11/13]

template<typename T >
Vec4T< T > agx::operator* ( const Vec4T< T > &  v,
const AffineMatrix4x4T< T > &  m 
)

Definition at line 877 of file AffineMatrix4x4.h.

References agx::AffineMatrix4x4T< T >::preMult().

◆ operator*() [12/13]

template<typename T >
Vec4T< T > agx::operator* ( const Vec4T< T > &  v,
const Matrix4x4T< T > &  m 
)

Definition at line 945 of file Matrix4x4.h.

References agx::Matrix4x4T< T >::preMult().

◆ operator*() [13/13]

template<typename T >
Vec3T< T > agx::operator* ( val,
const Vec3T< T > &  vec 
)

Definition at line 849 of file Vec3Template.h.

◆ operator+() [1/3]

template<typename T >
AgXString< T > agx::operator+ ( const char *  str1,
const AgXString< T > &  str2 
)

Definition at line 634 of file String.h.

◆ operator+() [2/3]

template<typename T >
AgXString< T > agx::operator+ ( const char  elem,
const AgXString< T > &  str 
)

Definition at line 640 of file String.h.

◆ operator+() [3/3]

template<typename T >
AgXString< T > agx::operator+ ( const Indentation indentation,
const AgXString< T > &  str 
)

Definition at line 66 of file Indentation.h.

References agx::Indentation::str().

◆ operator<<() [1/33]

std::ostream & agx::operator<< ( std::ostream &  os,
const agx::AddedMassInteraction::Matrix6x6 m 
)
inline

Definition at line 441 of file AddedMassInteraction.h.

◆ operator<<() [2/33]

std::ostream & agx::operator<< ( std::ostream &  os,
const EulerAngles e 
)
inline

Definition at line 388 of file EulerAngles.h.

◆ operator<<() [3/33]

std::ostream & agx::operator<< ( std::ostream &  os,
const Matrix &  m 
)
inline

Definition at line 120 of file io_utils.h.

◆ operator<<() [4/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  os,
const Matrix3x3T< T > &  m 
)
inline

Definition at line 918 of file Matrix3x3.h.

◆ operator<<() [5/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  os,
const Matrix4x4T< T > &  m 
)

Definition at line 953 of file Matrix4x4.h.

◆ operator<<() [6/33]

std::ostream & agx::operator<< ( std::ostream &  os,
const OrthoMatrix3x3 m 
)
inline

Definition at line 309 of file OrthoMatrix3x3.h.

◆ operator<<() [7/33]

std::ostream & agx::operator<< ( std::ostream &  os,
const SPDMatrix3x3 m 
)
inline

Definition at line 468 of file SPDMatrix3x3.h.

◆ operator<<() [8/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const BoundT< T > &  bound 
)

Definition at line 339 of file Bound.h.

References agx::BoundT< T >::max(), and agx::BoundT< T >::min().

◆ operator<<() [9/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const IndexRangeT< T > &  range 
)

Definition at line 258 of file IndexRange.h.

References agx::IndexRangeT< T >::begin(), and agx::IndexRangeT< T >::end().

◆ operator<<() [10/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const LineT< T > &  line 
)

Definition at line 45 of file agx/Line.h.

References agx::LineT< T >::p1, and agx::LineT< T >::p2.

◆ operator<<() [11/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const PlaneT< T > &  plane 
)

Definition at line 132 of file agx/Plane.h.

References agx::PlaneT< T >::getDistance(), and agx::PlaneT< T >::getNormal().

◆ operator<<() [12/33]

std::ostream & agx::operator<< ( std::ostream &  output,
const Quat vec 
)
inline

Definition at line 135 of file io_utils.h.

◆ operator<<() [13/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const QuatT< T > &  quat 
)
inline

Definition at line 828 of file QuatTemplate.h.

◆ operator<<() [14/33]

template<typename T , size_t N>
std::ostream & agx::operator<< ( std::ostream &  output,
const StackArray< T, N > &  array 
)

Definition at line 281 of file agx/StackArray.h.

References agx::StackArray< T, N >::size().

◆ operator<<() [15/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const SymmetricPair< T > &  pair 
)

Definition at line 71 of file SymmetricPair.h.

◆ operator<<() [16/33]

std::ostream & agx::operator<< ( std::ostream &  output,
const Vec2 vec 
)
inline

Definition at line 31 of file io_utils.h.

◆ operator<<() [17/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const Vec2T< T > &  v 
)

Definition at line 419 of file Vec2Template.h.

◆ operator<<() [18/33]

std::ostream & agx::operator<< ( std::ostream &  output,
const Vec3d vec 
)
inline

Definition at line 63 of file io_utils.h.

◆ operator<<() [19/33]

std::ostream & agx::operator<< ( std::ostream &  output,
const Vec3f vec 
)
inline

Definition at line 80 of file io_utils.h.

◆ operator<<() [20/33]

std::ostream & agx::operator<< ( std::ostream &  output,
const Vec3i vec 
)
inline

Definition at line 46 of file io_utils.h.

◆ operator<<() [21/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const Vec3T< T > &  v 
)

Definition at line 868 of file Vec3Template.h.

◆ operator<<() [22/33]

std::ostream & agx::operator<< ( std::ostream &  output,
const Vec4 vec 
)
inline

Definition at line 98 of file io_utils.h.

◆ operator<<() [23/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  output,
const Vec4T< T > &  v 
)

Definition at line 739 of file Vec4Template.h.

◆ operator<<() [24/33]

template<typename T , typename A >
std::ostream & agx::operator<< ( std::ostream &  output,
const Vector< T, A > &  vec 
)

Definition at line 1026 of file agx/Vector.h.

References printVector().

◆ operator<<() [25/33]

template<typename T , typename A >
std::ostream & agx::operator<< ( std::ostream &  output,
const VectorPOD< T, A > &  vec 
)

Definition at line 1033 of file agx/Vector.h.

References printVector().

◆ operator<<() [26/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  stream,
const agx::EventT< T > &  e 
)

Definition at line 345 of file Event.h.

References agx::EventT< T >::getName().

◆ operator<<() [27/33]

template<class T >
std::ostream & agx::operator<< ( std::ostream &  stream,
const AtomicValueT< T > &  value 
)
inline

Definition at line 109 of file AtomicValue.h.

References agx::AtomicValueT< T >::get().

◆ operator<<() [28/33]

std::ostream & agx::operator<< ( std::ostream &  stream,
const Indentation indentation 
)
inline

Definition at line 72 of file Indentation.h.

References agx::Indentation::str().

◆ operator<<() [29/33]

AGXCORE_EXPORT std::ostream & agx::operator<< ( std::ostream &  stream,
const Name name 
)

◆ operator<<() [30/33]

AGXCORE_EXPORT std::ostream & agx::operator<< ( std::ostream &  stream,
const Path path 
)

◆ operator<<() [31/33]

template<typename T >
std::ostream & agx::operator<< ( std::ostream &  stream,
const Range< T > &  range 
)
inline

Definition at line 188 of file Range.h.

◆ operator<<() [32/33]

std::ostream & agx::operator<< ( std::ostream &  stream,
const SimpleContactMaterial  
)

Definition at line 40 of file MaterialTypes.h.

◆ operator<<() [33/33]

AGXCORE_EXPORT std::ostream & agx::operator<< ( std::ostream &  stream,
const Uuid uuid 
)

◆ operator==() [1/7]

bool agx::operator== ( const agx::String str,
const agx::Name name 
)

Definition at line 302 of file Name.h.

◆ operator==() [2/7]

bool agx::operator== ( const char *  str,
const agx::Name name 
)

Definition at line 303 of file Name.h.

◆ operator==() [3/7]

bool agx::operator== ( const std::string &  str,
const agx::Name name 
)

Definition at line 301 of file Name.h.

◆ operator==() [4/7]

template<typename T >
bool agx::operator== ( const SymmetricPair< T > &  a,
const SymmetricPair< T > &  b 
)

Definition at line 47 of file SymmetricPair.h.

◆ operator==() [5/7]

template<typename T , typename U >
bool agx::operator== ( T *  p,
ref_ptr< U > const &  rp 
)

Definition at line 132 of file ref_ptr.h.

◆ operator==() [6/7]

template<typename T , typename U >
bool agx::operator== ( T const *  p,
ref_ptr< U > const &  rp 
)

Definition at line 120 of file ref_ptr.h.

◆ operator==() [7/7]

template<typename T >
bool agx::operator== ( val,
InvalidIndexStruct   
)

Definition at line 201 of file agx.h.

◆ operator>>() [1/7]

template<typename ch , typename char_traits >
std::basic_istream< ch, char_traits > & agx::operator>> ( std::basic_istream< ch, char_traits > &  is,
Uuid u 
)

Definition at line 151 of file Uuid.h.

References agx::Uuid::data(), and agx::Uuid::size().

◆ operator>>() [2/7]

std::istream & agx::operator>> ( std::istream &  input,
Quat vec 
)
inline

Definition at line 144 of file io_utils.h.

◆ operator>>() [3/7]

std::istream & agx::operator>> ( std::istream &  input,
Vec2 vec 
)
inline

Definition at line 37 of file io_utils.h.

◆ operator>>() [4/7]

std::istream & agx::operator>> ( std::istream &  input,
Vec3d vec 
)
inline

Definition at line 71 of file io_utils.h.

◆ operator>>() [5/7]

std::istream & agx::operator>> ( std::istream &  input,
Vec3f vec 
)
inline

Definition at line 88 of file io_utils.h.

◆ operator>>() [6/7]

std::istream & agx::operator>> ( std::istream &  input,
Vec3i vec 
)
inline

Definition at line 54 of file io_utils.h.

◆ operator>>() [7/7]

std::istream & agx::operator>> ( std::istream &  input,
Vec4 vec 
)
inline

Definition at line 107 of file io_utils.h.

◆ PACK_UINT32()

uint32_t agx::PACK_UINT32 ( uint8_t  b0,
uint8_t  b1,
uint8_t  b2,
uint8_t  b3 
)
inline

Pack 4 8 bit unsigned integers into one 32bit unsigned integer.

Returns
a 32bit unsigned integer with 4 bytes packed into it

Definition at line 35 of file pack.h.

References agx::uint32_t_union::uint32_t_struct::byte0, agx::uint32_t_union::uint32_t_struct::byte1, agx::uint32_t_union::uint32_t_struct::byte2, agx::uint32_t_union::uint32_t_struct::byte3, agx::uint32_t_union::bytes, and agx::uint32_t_union::integer.

◆ parseAttribute()

template<typename T >
T agx::parseAttribute ( const TiXmlElement *  element,
const char *  attributeName 
)
inline

Definition at line 101 of file Xml.h.

References agxXmlVerifyN.

◆ parseAttribute< Name >()

template<>
Name agx::parseAttribute< Name > ( const TiXmlElement *  element,
const char *  attributeName 
)
inline

Definition at line 121 of file Xml.h.

References agxXmlVerifyN.

◆ parseAttribute< String >()

template<>
String agx::parseAttribute< String > ( const TiXmlElement *  element,
const char *  attributeName 
)
inline

Definition at line 114 of file Xml.h.

References agxXmlVerifyN.

◆ pow2Exponent()

template<typename T >
agx::UInt32 agx::pow2Exponent ( value)

Finds and returns n given value = 2^n.

Parameters
value- integer value such that value = 2^n
Returns
n in value = 2^n

Definition at line 611 of file Math.h.

Referenced by agxSDK::MergeSplitProperties::findCallbackIndex().

◆ prefetch()

template<int hint, typename T >
void agx::prefetch ( const T *  )

Definition at line 135 of file Prefetch.h.

◆ prefetch_128()

template<int hint, typename T >
void agx::prefetch_128 ( const T *  )

Definition at line 141 of file Prefetch.h.

◆ prefetch_256()

template<int hint, typename T >
void agx::prefetch_256 ( const T *  )

Definition at line 144 of file Prefetch.h.

◆ prefetch_64()

template<int hint, typename T >
void agx::prefetch_64 ( const T *  )

Definition at line 138 of file Prefetch.h.

◆ prefetchBytes()

template<int PrefetchT>
void agx::prefetchBytes ( const void *  ,
size_t   
)

Definition at line 148 of file Prefetch.h.

◆ prefetchL3()

template<typename T >
void agx::prefetchL3 ( const T *  ,
size_t   
)

Definition at line 156 of file Prefetch.h.

◆ prefetchNTA()

template<typename T >
void agx::prefetchNTA ( const T *  ,
size_t   
)

Definition at line 152 of file Prefetch.h.

◆ printBin() [1/6]

template<typename T >
agx::String agx::printBin ( const T &  val)

Definition at line 899 of file String.h.

References printBin().

Referenced by printBin().

◆ printBin() [2/6]

agx::String AGXCORE_EXPORT agx::printBin ( const void *  data,
UInt  numBytes 
)

◆ printBin() [3/6]

agx::String AGXCORE_EXPORT agx::printBin ( Real32  val)

◆ printBin() [4/6]

agx::String AGXCORE_EXPORT agx::printBin ( Real64  val)

◆ printBin() [5/6]

agx::String AGXCORE_EXPORT agx::printBin ( UInt32  val)

◆ printBin() [6/6]

agx::String AGXCORE_EXPORT agx::printBin ( UInt64  val)

◆ printHex() [1/6]

template<typename T >
agx::String agx::printHex ( const T &  val)

Definition at line 905 of file String.h.

References printHex().

Referenced by printHex().

◆ printHex() [2/6]

agx::String AGXCORE_EXPORT agx::printHex ( const void *  data,
UInt  numBytes 
)

◆ printHex() [3/6]

agx::String AGXCORE_EXPORT agx::printHex ( Real32  val)

◆ printHex() [4/6]

agx::String AGXCORE_EXPORT agx::printHex ( Real64  val)

◆ printHex() [5/6]

agx::String AGXCORE_EXPORT agx::printHex ( UInt32  val)

◆ printHex() [6/6]

agx::String AGXCORE_EXPORT agx::printHex ( UInt64  val)

◆ printNode()

AGXCORE_EXPORT void agx::printNode ( const char *  path)

Debugging.

◆ printVector()

template<typename VectorT >
std::ostream & agx::printVector ( std::ostream &  output,
const VectorT &  vec 
)

Definition at line 1012 of file agx/Vector.h.

Referenced by operator<<().

◆ radiansToDegrees()

Real agx::radiansToDegrees ( Real  angle)
Returns
Parameters
angleconverted from radians to degrees

Definition at line 354 of file Math.h.

References RAD_TO_DEG.

◆ random()

template<typename T >
T agx::random ( min,
max 
)
Returns
a random value in the range [min, max]

Definition at line 555 of file Math.h.

References getRandGenerator(), max(), min(), and agx::RandomGenerator< T, DistributionT, EngineT >::rand().

Referenced by agx::Vec2T< T >::random(), agx::Vec4T< T >::random(), and agx::Vec3T< T >::random().

◆ relativelyEquivalent() [1/3]

bool agx::relativelyEquivalent ( double  lhs,
double  rhs,
double  epsilon = (double)AGX_EQUIVALENT_EPSILON 
)

Compare two values for relative equality.

Meaning that the difference between them is less than an epsilon value The epsilon value is scaled with the values compared, to a minimum of relativeEpsilon^2.

Returns
true if lhs and rhs are equivalent

Definition at line 176 of file Math.h.

◆ relativelyEquivalent() [2/3]

bool agx::relativelyEquivalent ( float  lhs,
float  rhs,
double  epsilon 
)

Compare two values for relative equality.

Meaning that the difference between them is less than an epsilon value The epsilon value is scaled with the values compared, to a minimum of relativeEpsilon^2.

Returns
true if lhs and rhs are equivalent

Definition at line 187 of file Math.h.

References _relativelyEquivalent().

◆ relativelyEquivalent() [3/3]

bool agx::relativelyEquivalent ( float  lhs,
float  rhs,
float  epsilon = (float)AGX_EQUIVALENT_EPSILON 
)

Compare two values for relative equality.

Meaning that the difference between them is less than an epsilon value The epsilon value is scaled with the values compared, to a minimum of relativeEpsilon^2.

Returns
true if lhs and rhs are equivalent

Definition at line 165 of file Math.h.

◆ resetStartTick()

void AGXCORE_EXPORT agx::resetStartTick ( )

Reset the startTick value to the current tick.

◆ root()

◆ setEntityCreationThreadSafe()

AGXCORE_EXPORT void agx::setEntityCreationThreadSafe ( bool  )

Iff true you can move the entity to another thread (but you may only use it from one thread at the time).

Iff false you may only use and destroy an Entity in the same thread it was created in (!!!) UNLESS you transfer ownership to a simulation. Default: false

◆ setExceptionNotifyLevel()

AGXCORE_EXPORT int agx::setExceptionNotifyLevel ( int  level)

◆ setNumThreads()

void AGXCORE_EXPORT agx::setNumThreads ( size_t  numThreads)

Set the number of threads to use (including the main thread).

Parameters
numThreads- The total available number of threads. If 0, then all CPU:s/Cores will be used.

◆ shutdown()

void AGXPHYSICS_EXPORT agx::shutdown ( )

Shutdown of the AGX Dynamics API will be done when the number of shutdown matches the number of calls to init().

If a call to shutdown is performed (number of init/shutdown matches) then isShutdown() will return true. Must be called before end of main()/unload of dll:s etc.

Referenced by agx::Runtime::shutdown().

◆ sign()

template<typename T >
T agx::sign ( v)

◆ signedSquare()

template<typename T >
T agx::signedSquare ( v)
Returns
v*v*sign(v)

Definition at line 342 of file Math.h.

◆ sinc() [1/2]

template<typename T >
Vec3T< T > agx::sinc ( const agx::Vec3T< T > &  a)

Definition at line 841 of file Vec3Template.h.

References sinc().

◆ sinc() [2/2]

Real agx::sinc ( Real  x,
Real  nearZero = Real(1E-4) 
)
inline

Sinc function.

Definition at line 93 of file Math.h.

Referenced by sinc().

◆ sphereBoxOverlapTest()

bool agx::sphereBoxOverlapTest ( Real  sphereRadius,
const Vec3 spherePosition,
const Vec3 boxHalfExtents,
const AffineMatrix4x4 boxInvTransform 
)
inline

Definition at line 38 of file SphereBoxOverlapTest.h.

References AXIS_TEST, and agx::Vec3T< T >::length2().

◆ splitHashKey()

void agx::splitHashKey ( agx::UInt64  key,
agx::UInt32 id1,
agx::UInt32 id2 
)

Definition at line 51 of file HashFunction.h.

◆ square()

template<typename T >
T agx::square ( v)
Returns
v*v

Definition at line 335 of file Math.h.

◆ static_pointer_cast()

template<class T , class Y >
ref_ptr< T > agx::static_pointer_cast ( const ref_ptr< Y > &  rp)

Definition at line 328 of file ref_ptr.h.

References agx::ref_ptr< T >::get().

◆ stringHash()

template<typename T >
UInt32 agx::stringHash ( const T &  key,
UInt32  startValue = 0 
)

◆ strtod()

AGXCORE_EXPORT double agx::strtod ( const char *  nptr,
char **  endptr 
)

strtod ignoring global locale

◆ strtof()

AGXCORE_EXPORT float agx::strtof ( const char *  nptr,
char **  endptr 
)

strtod ignoring global locale

◆ swap() [1/2]

template<class T >
void agx::swap ( Vector< T > &  x,
Vector< T > &  y 
)

Definition at line 434 of file agx/Vector.h.

References agx::Vector< T, Allocator >::swap().

◆ swap() [2/2]

template<class T >
void agx::swap ( VectorPOD< T > &  x,
VectorPOD< T > &  y 
)

Definition at line 437 of file agx/Vector.h.

References agx::VectorPOD< T, Allocator >::swap().

◆ UnicodeName() [1/2]

AGXCORE_EXPORT const char * agx::UnicodeName ( const char *  s)
inline

Definition at line 49 of file Encoding.h.

◆ UnicodeName() [2/2]

AGXCORE_EXPORT const std::string & agx::UnicodeName ( const std::string &  s)
inline

Definition at line 54 of file Encoding.h.

◆ UNPACK_UINT32()

void agx::UNPACK_UINT32 ( uint32_t  val,
uint8_t &  c0,
uint8_t &  c1,
uint8_t &  c2,
uint8_t &  c3 
)
inline

◆ utf8ToWide() [1/2]

std::wstring AGXCORE_EXPORT agx::utf8ToWide ( const char *  str)

◆ utf8ToWide() [2/2]

std::wstring AGXCORE_EXPORT agx::utf8ToWide ( const std::string &  s)

◆ wideToUtf8()

std::string AGXCORE_EXPORT agx::wideToUtf8 ( const std::wstring &  wide)

◆ X_AXIS()

const Vec3 agx::X_AXIS ( 1.  0,
0.  0,
0.  0 
)

◆ X_AXIS_2D()

const Vec2 agx::X_AXIS_2D ( 1.  0,
0.  0 
)

◆ Y_AXIS()

const Vec3 agx::Y_AXIS ( 0.  0,
1.  0,
0.  0 
)

◆ Y_AXIS_2D()

const Vec2 agx::Y_AXIS_2D ( 0.  0,
1.  0 
)

◆ Z_AXIS()

const Vec3 agx::Z_AXIS ( 0.  0,
0.  0,
1.  0 
)

Variable Documentation

◆ AGX_EQUIVALENT_EPSILON

const Real agx::AGX_EQUIVALENT_EPSILON = (double)1E-9

Definition at line 57 of file Math.h.

◆ BUILD_TYPE

AGXCORE_EXPORT const char* const agx::BUILD_TYPE
extern

◆ C_BUILD_FLAGS

AGXCORE_EXPORT const char* const agx::C_BUILD_FLAGS
extern

◆ CPP_BUILD_FLAGS

AGXCORE_EXPORT const char* const agx::CPP_BUILD_FLAGS
extern

◆ DEG_TO_RAD

const Real agx::DEG_TO_RAD = agx::Real(0.017453292519943295769236907684886)

Definition at line 69 of file Math.h.

Referenced by degreesToRadians().

◆ GRAVITY_ACCELERATION

const Real agx::GRAVITY_ACCELERATION = Real(9.80665)

Definition at line 52 of file Math.h.

◆ Infinity

◆ Int16Max

const Int16 agx::Int16Max = std::numeric_limits<Int16>::max()

Definition at line 77 of file Integer.h.

◆ Int32Max

const Int32 agx::Int32Max = std::numeric_limits<Int32>::max()

Definition at line 78 of file Integer.h.

◆ Int64Max

const Int64 agx::Int64Max = std::numeric_limits<Int64>::max()

Definition at line 79 of file Integer.h.

◆ Int8Max

const Int8 agx::Int8Max = std::numeric_limits<Int8>::max()

Definition at line 76 of file Integer.h.

◆ IntMax

const Int agx::IntMax = std::numeric_limits<Int>::max()

Definition at line 75 of file Integer.h.

◆ InvalidIndex

◆ PI

◆ PI_2

const Real agx::PI_2 = agx::Real(M_PI_2)

Definition at line 64 of file Math.h.

◆ PI_4

const Real agx::PI_4 = agx::Real(M_PI_4)

Definition at line 65 of file Math.h.

◆ RAD_TO_DEG

const Real agx::RAD_TO_DEG = agx::Real(57.295779513082320876798154814105)

Definition at line 70 of file Math.h.

Referenced by radiansToDegrees().

◆ Real32Epsilon

AGXCORE_EXPORT const Real32 agx::Real32Epsilon
extern

◆ Real32Max

AGXCORE_EXPORT const Real32 agx::Real32Max
extern

◆ Real32Min

AGXCORE_EXPORT const Real32 agx::Real32Min
extern

◆ Real64Epsilon

AGXCORE_EXPORT const Real64 agx::Real64Epsilon
extern

◆ Real64Max

AGXCORE_EXPORT const Real64 agx::Real64Max
extern

◆ Real64Min

AGXCORE_EXPORT const Real64 agx::Real64Min
extern

◆ REAL_SQRT_EPSILON

◆ RealEpsilon

◆ RealMax

◆ RealMin

AGXCORE_EXPORT const Real agx::RealMin
extern

◆ RealMode

const RealModeEnum agx::RealMode = REAL_64BIT
static

Definition at line 41 of file Real.h.

◆ SizeMax

const Size agx::SizeMax = std::numeric_limits<Size>::max()

Definition at line 81 of file Integer.h.

◆ UInt16Max

const UInt16 agx::UInt16Max = std::numeric_limits<UInt16>::max()

Definition at line 71 of file Integer.h.

◆ UInt32Max

const UInt32 agx::UInt32Max = std::numeric_limits<UInt32>::max()

Definition at line 72 of file Integer.h.

◆ UInt64Max

const UInt64 agx::UInt64Max = std::numeric_limits<UInt64>::max()

Definition at line 73 of file Integer.h.

◆ UInt8Max

const UInt8 agx::UInt8Max = std::numeric_limits<UInt8>::max()

Definition at line 70 of file Integer.h.

◆ UIntMax

const UInt agx::UIntMax = std::numeric_limits<UInt>::max()

Definition at line 69 of file Integer.h.