| X3DTK::Qt::AbstractMField | A pure abstract multiple field |
| X3DTK::X3D::AnimalEngineNode< AnimalEngine > | Automatically connects the scene graph actions to an animal::Engine given as template parameter |
| animal::Argument< T > | Command line argument. Contains a pointer to a value which can be parsed by a ArgumentParser |
| animal::ArgumentBase | Abstract base class for all comand line arguments |
| animal::ArgumentParser | Command line parser |
| animal::Array< N, T > | Fixed-size array |
| BBox | |
| array | |
| array | |
| array | |
| array | |
| array | |
| array | |
| array | |
| animal::BoundingBox3D< Point, Real > | Axis-aligned bounding box in dimension 3 |
| animal::octree::Cell::vertex_connected_iterator | For each vertex connected to this vertex in a cell connected to this vertex At a maximum of the given depth Get the cell of minimum depth superior to the one given |
| animal::octree::animal::octree::CellData | Data in a cell |
| animal::octree::CellData | Data in a cell |
| animal::octree::animal::octree::CellInfluenceData | |
| animal::octree::CellInfluenceData | |
| animal::octree::CGData | |
| animal::octree::CGRenderingMachine | |
| animal::Chrono | A Chronometers class |
| animal::ConstrainedItem | Models something which can be selected and moved interactively |
| animal::octree::ConstrainedVertex | |
| animal::octree::ConstrainedVertexData | |
| animal::octree::animal::octree::ConstrainedVertexData | |
| animal::container_traits< Cont > | Abstraction of a container |
| animal::container_traits< Cont const > | Abstraction of a const container |
| animal::container_traits< T const[sz]> | Abstraction of a const container: overlaoded version for const arrays |
| animal::container_traits< T[sz]> | Abstraction of a container: overlaoded version for arrays |
| animal::container_traits< X3DTK::SFVec3f > | Abstraction of a SFVe3f |
| animal::container_traits< X3DTK::SFVec3f const > | Abstraction of a SFVe3f const |
| CoreVisitor | |
| DeformableOctreeDesigner | |
| X3DTK::X3D::DeformableOctreeNode | This class represents the x3d node in the x3d graph for an animal::SpinningObjectEngine |
| X3DTK::X3D::DeformableOctreeParticleSystemNode | |
| X3DTK::Qt::DeformableOctreeParticleSystemQt | |
| X3DTK::Qt::DeformableOctreeQt | |
| DeformableOctreeShapeDesigner | |
| X3DTK::X3D::DeformableOctreeShapeNode | |
| X3DTK::Qt::DeformableOctreeShapeQt | |
| animal::integration::Derivative_Function< TraitsT > | Define derivative D of state S |
| animal::Derivs< Vels, Accs > | Derivative: velocity, acceleration |
| DFSWalker | |
| nr::dlinmin< TraitsT > | Minimization of an n-dimensional function along a given line, using information on gradient |
| nr::dlinmin< TraitsT >::DF1dim< Real, Vector, DFunc > | Derivate of the one-dimensional function |
| nr::dlinmin< TraitsT >::F1dim< Real, Vector, Func > | Value of the one-dimensional function |
| animal::Engine | Abstract base class to represent an animation concept |
| animal::EngineGroup | Recursively apply the actions |
| X3DTK::X3D::EngineGroupNode | Recursively applies the methods to its children |
| X3DTK::Qt::EngineGUI | |
| X3DTK::X3D::EngineLoader | EngineLoader module |
| X3DTK::X3D::EngineLoaderVisitor | Visitor for registering and initializing nodes after creation |
| X3DTK::X3D::EngineNode | |
| X3DTK::X3D::EngineRemoverVisitor | Visitor for releasing engine nodes before deletion |
| X3DTK::X3D::EngineWalker | Concrete component walker for engines |
| animal::integration::Euler< DerivativeF, StepF, TraitsT > | Explicit Euler integration method |
| animal::Event | The AnimalEvent class is the base class of all event classes. Event objects contain event parameters |
| animal::ExplicitIntegrator< State, Deriv, Derivator, Real > | Apply explicit time integration of a given function |
| animal::ExplicitIntegrator2< Position, Velocity, ComputeAcceleration, Real, Acceleration > | Apply explicit time integration of a given function for second-order differential equation: acceleration(position, velocity) Handles auxiliary variables and their resizing |
| animal::ExplicitIntegrator2< Position, Velocity, ComputeAcceleration, Real, Acceleration >::Derivator | Compute a Derivative given a State |
| animal::octree::FastOctree< T, S, U > | |
| animal::octree::animal::octree::FastOctree< T, S, U > | |
| animal::octree::FastOctree< T, S, U >::Cell | |
| animal::octree::animal::octree::FastOctree< T, S, U >::Cell | |
| animal::octree::FastOctree< T, S, U >::Cell::vertex_iterator | To iterate through all the cell vertices |
| animal::octree::animal::octree::FastOctree< T, S, U >::Cell::vertex_iterator | To iterate through all the cell vertices |
| animal::octree::FastOctree< T, S, U >::Cell::vertex_width_iterator | |
| animal::octree::animal::octree::FastOctree< T, S, U >::Cell::vertex_width_iterator | |
| animal::octree::FastOctree< T, S, U >::Cell::vertex_width_neighbours_iterator | |
| animal::octree::animal::octree::FastOctree< T, S, U >::Cell::vertex_width_neighbours_iterator | |
| animal::octree::FastOctree< T, S, U >::dfs_iterator | |
| animal::octree::animal::octree::FastOctree< T, S, U >::dfs_iterator | |
| animal::octree::FastOctree< T, S, U >::dfs_iterator_data | |
| animal::octree::animal::octree::FastOctree< T, S, U >::dfs_iterator_data | |
| animal::octree::FastOctree< T, S, U >::dfs_leaf_iterator | |
| animal::octree::animal::octree::FastOctree< T, S, U >::dfs_leaf_iterator | |
| animal::octree::FastOctree< T, S, U >::Face | |
| animal::octree::animal::octree::FastOctree< T, S, U >::Face | |
| X3DTK::Qt::Field | A pure abstract field |
| Frame | |
| animal::octree::Frame | |
| animal::Frame< N, Real > | Origin and basis of a local frame (coordinate system) with respect to a reference frame (coordinate system) |
| X3DTK::X3D::FrameNode | This class represents a frame node which allows to control the frame of a X3DTK::X3D::Transform |
| animal::FrprMinimizer< ValueFunction, GradientFunction, Parameter, Real > | Function optimization using gradient |
| nr::frprmn< TraitsT > | Minimization of an n-dimensional function, using information on gradient |
| nr::frprmn< TraitsT >::TooManyIterations | Exception thrown when the maximum number of iterations is reached |
| animal::octree::GeoLink | |
| X3DTK::X3D::GLBuilderEngineNodeVisitor | Visitor for the Geometry3D component of the GLBuilder module |
| GLBuilderGroupingVisitor | |
| X3DTK::GL::GLEngineLeafNode | GL node with no child for an engine which must override the drawing of its children, e.g |
| X3DTK::GL::GLEngineNode | Class providing an implementation of the X3DTK::GL::X3DNode corresponding to the X3DTK::X3D::EngineNode |
| X3DTK::X3D::GLLeafEngineNode | Nodes which derive from this class have no children in the rendering graph |
| GlobalVariables | |
| Group | |
| GroupingCreator | |
| X3DTK::X3D::GroupingNodeCreator | Concrete component Creator for the Grouping component defining the X3D engines nodes |
| GroupingVisitor | |
| animal::octree::HermiteFunction | |
| animal::octree::animal::octree::HermiteFunction | |
| animal::History< Position, Velocity > | Base class for histories (single values or stl containers) |
| animal::History< Position, Velocity >::Key | Store a time stamp: time, position, velocity |
| animal::HistoryS< Position, Velocity > | History for single values with << and >> operators |
| animal::HistoryV< Position, Velocity > | History for STL containers |
| animal::integration::HLarger_Function< TraitsT > | New larger stepsize |
| animal::integration::HSmaller_Function< TraitsT > | New smaller stepsize |
| animal::integration::IsDifferent_Function< TraitsT > | Criterion for modifying time step value |
| animal::KeyEvent | The AnimalKeyEvent class describes a key event |
| nr::linmin< TraitsT > | Minimization of an n-dimensional function along a given line, without information on gradient |
| nr::linmin< TraitsT >::F1dim< Real, Vector, Func > | One-dimensional function along the search direction |
| animal::m_Input< T > | Matrix input. Sets the values of the elements |
| animal::m_Output< T > | Matrix output |
| MainController | This class is an interface in order to manage with the interaction between objects (for example, mouse event) and to maintain the coherence among the datas (for example, X3DTK::X3D::X3DNode and their respective QWidget...) |
| MainControllerDesigner | |
| X3DTK::MainScene | This class manages with the data structures, i.e |
| animal::octree::ManipulatedMeshVertex | Direct manipulation of a mesh vertex in an octree's cell |
| animal::octree::ManipulatedMeshVertexAnimated< t_Vector, t_Real, t_VecReal > | |
| map | |
| animal::MassSpringEngine< Inv_Masses, Velocities, SpringStiffness, IndexedSprings, Points, Real > | This class implements a physical engine which animates particules (defined with Inv_Masses, Velocities and Points) linked with springs (defined with SpringStiffness and IndexedSprings) |
| animal::MassSpringEngine< Inv_Masses, Velocities, SpringStiffness, IndexedSprings, Points, Real >::ConstrainedPoint | Models a selected point among a vector of points, using a pointer to the engine and the index of the point |
| animal::MassSpringEngine< Inv_Masses, Velocities, SpringStiffness, IndexedSprings, Points, Real >::rgb | |
| MassSpringEngineDesigner | |
| X3DTK::Qt::MassSpringEngineQt | Control widget for an animal::MassSpringEngine |
| X3DTK::X3D::MassSpringNode | This class represents the x3d node in the x3d graph for a mass-spring engine |
| animal::MassSpringSolver< t_Positions, t_Vector, t_InvMasses, t_VecReal, t_VecIndex > | A solver for mass-spring systems |
| animal::Matrix< T > | Dense 2d array stored as a dense 1d array |
| animal::matrix_traits< M > | Auxiliary class for the extraction of matrix entry type |
| animal::matrix_traits< Matrix< T > > | Entry type (specialize if necessary) |
| X3DTK::Qt::MFEditor | Open a dialog to edit an AbstractMField |
| X3DTK::Qt::MFFloat | A MField which represents a std::vector<float> |
| X3DTK::Qt::MField< TypeSField > | A pure abstract Multiple fields |
| X3DTK::Qt::MFInt | A MField which represents a std::vector<int> |
| X3DTK::Qt::MFVector2 | A MFieldR which represents a std::vector<animal::Vec2> |
| X3DTK::Qt::MFVector3 | A MField which represents a std::vector<animal::Vec3> |
| X3DTK::Qt::MFVector4 | A MField which represents a std::vector<animal::Vec4> |
| animal::integration::Modified_Midpoint< N, DerivativeF, StepF, TraitsT > | Modified midpoint method |
| animal::integration::Modified_Midpoint_V< NStepF, DerivativeF, StepF, TraitsT > | Modified midpoint_V method |
| animal::MorphingEngine< Morphings, Real > | This class computes an interpolation from given values which are defined at several keys |
| MorphingEngineDesigner | |
| X3DTK::Qt::MorphingEngineQt | This class handles the control of the key frame in the GUI |
| X3DTK::X3D::MorphingNode | This class represents the x3d node in the x3d graph for a key frame engine |
| X3DTK::Morphings | A key frame data structure for the key frame engine |
| animal::MouseEvent | The AnimalMouseEvent class describes a mouse event |
| X3DTK::GL::MyGLBbox | Class drawing a GLBbox |
| X3DTK::GL::MyGLBboxDrawArray | Class providing the arrays required by the glDrawElements() command for drawing a Bounding Box with corners |
| X3DTK::GL::MyRenderer | GLRenderer module |
| X3DTK::GL::MyRendererCoreVisitor | Visitor for the GLCore component of the GLRenderer module |
| X3DTK::GL::MyRendererGroupingVisitor | Class declared in <X3DTK/GL/renderer.h> providing a visitor for the Grouping component of the GL::Renderer processor |
| X3DTK::GL::MyRendererShapeVisitor | Class declared in <X3DTK/GL/renderer.h> providing a visitor for the Shape component of the GL::MyRenderer processor |
| X3DTK::GL::MyRendererStateVariables | StateVariables for the GLRenderer module |
| animal::integration::NStep_Function< TraitsT > | Return the number of substeps to be used |
| animal::Numerics< Number > | Numerics general template |
| animal::Numerics< double > | Numerics<double>: specialization of class Numerics<> |
| animal::Numerics< float > | Numerics<float>: specialization of class Numerics<> |
| X3DTK::Qt::ObjectGUI | Construct a QTabWidget in order to edit all the fields contain in the object |
| animal::octree::Octree | |
| animal::octree::OctreeEngine | Octree with animation capabilities |
| animal::octree::OctreeODEEngine | Base class of a physically-based octree |
| animal::octree::OctreeParticleSystemEngine< t_Vector, t_Real, t_Masses > | |
| animal::octree::OctreeSpringEngine | Octree with springs in the cells |
| animal::OdeImplicitSolver< t_Positions, t_Vector, t_Real > | Abstract class for implicit ODE solver |
| animal::OdeSolver< t_Positions, t_Vector, t_Real > | Abstract class for ODE solvers |
| nr::Old_Traits< RealT, VectorT, MatrixT > | Numerical Recipes methods: Traits for old-style programming |
| animal::octree::ParametersCalculus | |
| ParticleSystemEngine | |
| animal::PhysicalSolver< t_Positions, t_Vector, t_InvMasses, t_Real > | This is a base class for physically-based animation of points (gravity, air damping) |
| nr::powell< TraitsT > | Minimization of an n-dimensional function, without information on gradient |
| nr::powell< TraitsT >::TooManyIterations | Exception thrown when the maximum number of iterations is reached |
| QDialog | |
| QGLViewer | |
| QLineEdit | |
| QPlayButton | This class represents a play button |
| QTabWidget | |
| QToolButton | |
| animal::Quaternion< RealT, TraitsT > | Unit quaternion used to model a rotation in 3D |
| animal::Quaternion_Traits< RealT > | |
| QWidget | |
| Renderer | |
| animal::Rotation2d< RealT, TraitsT > | Matrix 2x2 used to model a rotation in 2D |
| animal::Rotation2d_Traits< Real > | Customization of class rotation in 2D |
| animal::integration::Runge_Kutta_2< DerivativeF, StepF, TraitsT > | Explicit second-order Runge-Kutta integration method (also called midpoint integration method) |
| animal::integration::Runge_Kutta_4< DerivativeF, StepF, TraitsT > | Explicit fourth-order Runge-Kutta integration method |
| X3DTK::Qt::SFBool | A SField which represents a boolean |
| X3DTK::Qt::SFBoolGUI | The GUI (Graphic User Interface) for a boolean SFBool |
| X3DTK::Qt::SFFloat | A SField which represents a float |
| X3DTK::Qt::SFFloatGUI | The GUI (Graphic User Interface) for a float SFFloat |
| X3DTK::Qt::SField< TypeSField > | A pure abstract single fields |
| X3DTK::Qt::SFInt | A SField which represents an integer |
| X3DTK::Qt::SFIntGUI | The GUI (Graphic User Interface) for an integer SFInt |
| X3DTK::Qt::SFString | A SField which represents a QString |
| X3DTK::Qt::SFStringGUI | The GUI (Graphic User Interface) for a QString SFString |
| animal::octree::SFVec3fCellConstrained | |
| X3DTK::Qt::SFVector2 | A SField which represents an animal::Vec2 |
| X3DTK::Qt::SFVector2GUI | The GUI (Graphic User Interface) for an animal::Vec2 SFVector2 |
| X3DTK::Qt::SFVector3 | A SField which represents an animal::Vec3 |
| X3DTK::Qt::SFVector3GUI | The GUI (Graphic User Interface) for an animal::Vec3 SFVector3 |
| X3DTK::Qt::SFVector4 | A SField which represents an animal::Vec4 |
| X3DTK::Qt::SFVector4GUI | The GUI (Graphic User Interface) for an animal::Vec4 SFVector4 |
| ShapeVisitor | |
| animal::SimpleSolver< t_Positions, t_Vector, t_InvMasses, t_Real > | This is a base class for physically-based animation of points (gravity, air damping) |
| animal::integration::Solver< DerivativeF, StepF, TraitsT > | Base class for all explicit Ordinary Differential Equation solvers |
| animal::integration::Solver_Traits< StateT, DerivativeT, CopyStateT, RealT, NumTraitsT, SizeTypeT > | Traits class for integration algorithms |
| animal::integration::Solver_Traits_M< StateT, DerivativeT, CopyStateT, RealT, NumTraitsT, SizeTypeT > | Traits class for integration algorithms |
| animal::integration::SolverBase | Base class for all time differential equation solvers |
| animal::States< Poss, Vels > | States: position, velocity |
| StateVariables | |
| animal::integration::Step_Back_And_Forth< SolverF, HSmallerF, HLargerF, IsDifferentF > | Adaptive stepsize control for explicit integration methods |
| animal::integration::Step_Doubling< SolverF, HSmallerF, HLargerF, IsDifferentF > | Adaptive stepsize control for explicit integration methods |
| animal::integration::Step_Function< TraitsT > | Move forward state S of length h in direction D |
| animal::integration::Stepper_Function< SolverF, HSmallerF, HLargerF, IsDifferentF > | Generic stepper class |
| nr::STL_Traits< RealT, VectorT, MatrixT > | Numerical Recipes methods: Traits for programming using STL vectors |
| animal::octree::UpdateChildrensPositionOptimizedData | Set the CV to a new position |
| animal::octree::UpdateChildrensPositionOptimizedDataLess | |
| animal::v_Input< T > | Vector input. Sets the values of the elements |
| animal::v_Output< T > | Vector output |
| animal::Value< T > | |
| animal::Value< Array< N, T > > | Null values |
| animal::Value< X3DTK::SFVec3f > | |
| animal::value_type< T > | |
| animal::value_type< X3DTK::SFVec3f > | |
| animal::octree::animal::octree::Vec3< DataType > | |
| animal::octree::Vec3< DataType > | |
| vector | |
| vector | |
| vector | |
| vector | |
| vector | |
| vector | |
| vector | |
| animal::vector< T, Alloc > | Same as std::vector, + range checking on operator[ ] |
| vector | |
| vector | |
| vector | |
| vector | |
| vector | |
| vector | |
| animal::VectorVec< Vec > | A vector of vectors |
| animal::octree::VertexWeight | |
| X3DTK::Qt::Viewer | Class providing an X3D Viewer by implementing QGLViewer |
| ViewerDesigner | |
| X3DTK::Qt::ViewerQt | This class is an interface in order to manage with the properties of the viewer (size of the window...) |
| WFloatLineEdit | |
| animal::World | Abstract base class to represent the world of a 3D scene |
| X3DBoundedObject | |
| X3DTK::GL::X3DGLMapBuilder | X3DGLMapBuilder builds a X3DTK::GL::X3DGLMap in order to remember which X3DTK::GL::X3DNode comes from an X3DTK::X3D::X3DNode |
| X3DTK::GL::X3DGLMapGlobalVariables | GlobalVariables for the X3DGLMapBuilder module |
| X3DTK::GL::X3DGLMapStateVariables | StateVariables for the X3DGLMapBuilder module |
| X3DTK::GL::X3DGLMapVisitor | Visitor for the Core component of the X3DGLMapBuilder module |
| X3DGroupingNode | |
| X3DTK::Qt::X3DMFRotation | A MField which represents a std::vector<X3DTK::SFRotation> |
| X3DTK::Qt::X3DMFVec2f | A MField which represents a std::vector<X3DTK::SFVec2f> |
| X3DTK::Qt::X3DMFVec3f | A MField which represents a std::vector<X3DTK::SFVec3f> |
| X3DOnePassProcessor | |
| X3DTK::Qt::X3DSFRotation | A SField which represents a X3DTK::SFRotation |
| X3DTK::Qt::X3DSFRotationGUI | The GUI (Graphic User Interface) for a X3DTK::SFRotation X3DSFRotation |
| X3DTK::Qt::X3DSFVec2f | A SField which represents a X3DTK::SFVec2f |
| X3DTK::Qt::X3DSFVec2fGUI | The GUI (Graphic User Interface) for an X3DTK::SFVec2f X3DSFVec2f |
| X3DTK::Qt::X3DSFVec3f | A SField which represents a X3DTK::SFVec3f |
| X3DTK::Qt::X3DSFVec3fGUI | The GUI (Graphic User Interface) for an X3DTK::SFVec3f X3DSFVec3f |
| X3DTK::Qt::X3DTransformQt | |
| X3DTreeDesigner | |
| X3DTK::Qt::X3DTreeQt | This class handles the control of the X3D tree in the GUI |
| X3DTK::Qt::X4DGUI | Base Widget for 4XD nodes |
| X3DTK::X3D::X4DNode | Abstract base class for all nodes added to the animated scene |