►Ndetail | Detail namespace with internal helper functions |
►Ncontainer_input_adapter_factory_impl | |
Ccontainer_input_adapter_factory | |
Ccontainer_input_adapter_factory< ContainerType, void_t< decltype(begin(std::declval< ContainerType >()), end(std::declval< ContainerType >()))> > | |
►Ndtoa_impl | Implements the Grisu2 algorithm for binary to decimal floating-point conversion |
Cboundaries | |
Ccached_power | |
Cdiyfp | |
►Nutility_internal | |
CExtend | |
CExtend< integer_sequence< T, Ints... >, SeqSize, 0 > | |
CExtend< integer_sequence< T, Ints... >, SeqSize, 1 > | |
CGen | |
CGen< T, 0 > | |
Cactual_object_comparator | |
Cbinary_reader | Deserialization of CBOR, MessagePack, and UBJSON values |
Cbinary_writer | Serialization to CBOR and MessagePack values |
Cchar_traits | |
Cchar_traits< signed char > | |
Cchar_traits< unsigned char > | |
Cconjunction | |
Cconjunction< B > | |
Cconjunction< B, Bn... > | |
Cdetector | |
Cdetector< Default, void_t< Op< Args... > >, Op, Args... > | |
Cexception | General exception of the basic_json class |
Cexternal_constructor | |
Cexternal_constructor< value_t::array > | |
Cexternal_constructor< value_t::binary > | |
Cexternal_constructor< value_t::boolean > | |
Cexternal_constructor< value_t::number_float > | |
Cexternal_constructor< value_t::number_integer > | |
Cexternal_constructor< value_t::number_unsigned > | |
Cexternal_constructor< value_t::object > | |
Cexternal_constructor< value_t::string > | |
Cfile_input_adapter | |
Cfrom_json_fn | |
Chas_from_json | |
Chas_from_json< BasicJsonType, T, enable_if_t< !is_basic_json< T >::value > > | |
Chas_key_compare | |
Chas_non_default_from_json | |
Chas_non_default_from_json< BasicJsonType, T, enable_if_t< !is_basic_json< T >::value > > | |
Chas_to_json | |
Chas_to_json< BasicJsonType, T, enable_if_t< !is_basic_json< T >::value > > | |
Cidentity_tag | |
Cinput_stream_adapter | |
Cinteger_sequence | |
Cinternal_iterator | Iterator value |
Cinvalid_iterator | Exception indicating errors with iterators |
Cis_basic_json | |
Cis_basic_json< NLOHMANN_BASIC_JSON_TPL > | |
Cis_basic_json_context | |
Cis_c_string | |
Cis_comparable | |
Cis_comparable< Compare, A, B, void_t< decltype(std::declval< Compare >()(std::declval< A >(), std::declval< B >())), decltype(std::declval< Compare >()(std::declval< B >(), std::declval< A >())) > > | |
Cis_compatible_array_type | |
Cis_compatible_array_type_impl | |
Cis_compatible_array_type_impl< BasicJsonType, CompatibleArrayType, enable_if_t< is_detected< iterator_t, CompatibleArrayType >::value &&is_iterator_traits< iterator_traits< detected_t< iterator_t, CompatibleArrayType > > >::value &&!std::is_same< CompatibleArrayType, detected_t< range_value_t, CompatibleArrayType > >::value > > | |
Cis_compatible_integer_type | |
Cis_compatible_integer_type_impl | |
Cis_compatible_integer_type_impl< RealIntegerType, CompatibleNumberIntegerType, enable_if_t< std::is_integral< RealIntegerType >::value &&std::is_integral< CompatibleNumberIntegerType >::value &&!std::is_same< bool, CompatibleNumberIntegerType >::value > > | |
Cis_compatible_object_type | |
Cis_compatible_object_type_impl | |
Cis_compatible_object_type_impl< BasicJsonType, CompatibleObjectType, enable_if_t< is_detected< mapped_type_t, CompatibleObjectType >::value &&is_detected< key_type_t, CompatibleObjectType >::value > > | |
Cis_compatible_string_type | |
Cis_compatible_type | |
Cis_compatible_type_impl | |
Cis_compatible_type_impl< BasicJsonType, CompatibleType, enable_if_t< is_complete_type< CompatibleType >::value > > | |
Cis_complete_type | |
Cis_complete_type< T, decltype(void(sizeof(T)))> | |
Cis_constructible | |
Cis_constructible< const std::pair< T1, T2 > > | |
Cis_constructible< const std::tuple< Ts... > > | |
Cis_constructible< std::pair< T1, T2 > > | |
Cis_constructible< std::tuple< Ts... > > | |
Cis_constructible_array_type | |
Cis_constructible_array_type_impl | |
Cis_constructible_array_type_impl< BasicJsonType, ConstructibleArrayType, enable_if_t< !std::is_same< ConstructibleArrayType, typename BasicJsonType::value_type >::value &&!is_compatible_string_type< BasicJsonType, ConstructibleArrayType >::value &&is_default_constructible< ConstructibleArrayType >::value &&(std::is_move_assignable< ConstructibleArrayType >::value||std::is_copy_assignable< ConstructibleArrayType >::value) &&is_detected< iterator_t, ConstructibleArrayType >::value &&is_iterator_traits< iterator_traits< detected_t< iterator_t, ConstructibleArrayType > > >::value &&is_detected< range_value_t, ConstructibleArrayType >::value &&!std::is_same< ConstructibleArrayType, detected_t< range_value_t, ConstructibleArrayType > >::value &&is_complete_type< detected_t< range_value_t, ConstructibleArrayType > >::value > > | |
Cis_constructible_array_type_impl< BasicJsonType, ConstructibleArrayType, enable_if_t< std::is_same< ConstructibleArrayType, typename BasicJsonType::value_type >::value > > | |
Cis_constructible_object_type | |
Cis_constructible_object_type_impl | |
Cis_constructible_object_type_impl< BasicJsonType, ConstructibleObjectType, enable_if_t< is_detected< mapped_type_t, ConstructibleObjectType >::value &&is_detected< key_type_t, ConstructibleObjectType >::value > > | |
Cis_constructible_string_type | |
Cis_constructible_tuple | |
Cis_constructible_tuple< T1, std::tuple< Args... > > | |
Cis_default_constructible | |
Cis_default_constructible< const std::pair< T1, T2 > > | |
Cis_default_constructible< const std::tuple< Ts... > > | |
Cis_default_constructible< std::pair< T1, T2 > > | |
Cis_default_constructible< std::tuple< Ts... > > | |
Cis_detected_lazy | |
Cis_getable | |
Cis_iterator_of_multibyte | |
Cis_iterator_traits | |
Cis_iterator_traits< iterator_traits< T > > | |
Cis_json_iterator_of | |
Cis_json_iterator_of< BasicJsonType, typename BasicJsonType::const_iterator > | |
Cis_json_iterator_of< BasicJsonType, typename BasicJsonType::iterator > | |
Cis_json_ref | |
Cis_json_ref< json_ref< T > > | |
►Cis_ordered_map | |
Ctwo | |
Cis_range | |
Cis_sax | |
Cis_sax_static_asserts | |
Cis_specialization_of | |
Cis_specialization_of< Primary, Primary< Args... > > | |
Cis_transparent | |
Citer_impl | Template for a bidirectional iterator for the basic_json class This class implements a both iterators (iterator and const_iterator) for the basic_json class |
Citeration_proxy | Proxy class for the items() function |
Citeration_proxy_value | |
Citerator_input_adapter | |
Citerator_input_adapter_factory | |
Citerator_input_adapter_factory< IteratorType, enable_if_t< is_iterator_of_multibyte< IteratorType >::value > > | |
Citerator_traits | |
Citerator_traits< T *, enable_if_t< std::is_object< T >::value > > | |
Citerator_traits< T, enable_if_t< !std::is_pointer< T >::value > > | |
Citerator_types | |
Citerator_types< It, void_t< typename It::difference_type, typename It::value_type, typename It::pointer, typename It::reference, typename It::iterator_category > > | |
Cjson_default_base | Default base class of the basic_json class |
Cjson_ref | |
Cjson_reverse_iterator | Template for a reverse iterator class |
Cjson_sax_acceptor | |
Cjson_sax_dom_callback_parser | |
Cjson_sax_dom_parser | SAX implementation to create a JSON value from SAX events |
Clexer | Lexical analysis |
Clexer_base | |
Cmake_void | |
Cnegation | |
Cnonesuch | |
Cother_error | Exception indicating other library errors |
Cout_of_range | Exception indicating access out of the defined range |
Coutput_adapter | |
Coutput_adapter_protocol | Abstract output adapter interface |
Coutput_stream_adapter | Output adapter for output streams |
Coutput_string_adapter | Output adapter for basic_string |
Coutput_vector_adapter | Output adapter for byte vectors |
Cparse_error | Exception indicating a parse error |
Cparser | Syntax analysis |
Cposition_t | Struct to capture the start position of the current token |
Cprimitive_iterator_t | |
Cpriority_tag | |
Cpriority_tag< 0 > | |
Cserializer | |
Cspan_input_adapter | |
Cstatic_const | |
Cto_json_fn | |
Ctype_error | Exception indicating executing a member function with a wrong type |
Cvalue_in_range_of_impl1 | |
Cvalue_in_range_of_impl1< OfType, T, false > | |
Cvalue_in_range_of_impl1< OfType, T, true > | |
Cvalue_in_range_of_impl2 | |
Cvalue_in_range_of_impl2< OfType, T, false, false > | |
Cvalue_in_range_of_impl2< OfType, T, false, true > | |
Cvalue_in_range_of_impl2< OfType, T, true, false > | |
Cvalue_in_range_of_impl2< OfType, T, true, true > | |
Cwide_string_input_adapter | |
Cwide_string_input_helper | |
Cwide_string_input_helper< BaseInputAdapter, 2 > | |
Cwide_string_input_helper< BaseInputAdapter, 4 > | |
►Ndyno | This is an implementation of AdditiveCCD based on peridyno |
CAction | |
CAdaptiveBoundary | |
CAdaptiveVolumeToTriangleSet | |
CAdd | |
CAdditiveCCD | |
CAddRealAndReal | |
CAnchorPointToPointSet | |
CAnimation2JointConfig | |
CAnimationCurve | |
CAnimationDriver | |
CAnimationPipeline | |
CAppBase | |
CApplyBumpMap2TriangleSet | |
CApproximateImplicitViscosity | |
CArithmetic | |
CArray | This class is designed to be elegant, so it can be directly passed to GPU as parameters |
CArray2D | |
CArray2DInfo | |
CArray3D | |
CArray3DInfo | |
CArrayList | |
CArrayList< ElementType, DeviceType::CPU > | |
CArrayList< T, DeviceType::GPU > | |
CArrayListInfo | |
CArrayMap | |
CArrayMap< ElementType, DeviceType::CPU > | |
CArrayMap< ElementType, DeviceType::GPU > | |
CArrudaBoyceModel | |
CArticulatedBody | |
CAssignFrameNumberAct | |
CAttribute | Particle attribute 0x00000000: [31-30]material; [29]motion; [28]Dynamic; [27-8]undefined yet, for future use; [7-0]correspondding to the id of a fluid phase in multiphase fluid or an object in a multibody system |
CAutoLayoutDAG | Automatic layout for directed acyclic graph Refer to "Sugiyama Algorithm" by Nikola S. Nikolov[2015] for details |
CBackgroundRenderer | |
CBallAndSocketJoint | |
CBasicShape | |
CBasicShapeToVolume | |
CBBoxRenderer | |
Cbinary_function | |
CBitAndFunc | |
CBitOrFunc | |
CBitXorFunc | |
CBone | |
CBool | |
CBoundaryConstraint | |
CBoundingBoxOfTextureMesh | A class to facilitate showing the shape information |
CBoundingBoxToEdgeSet | |
CBoxInfo | |
CBuffer | |
CBufferCopy | |
CBVHNode | |
CCalculateBoundingBox | A class implementation to calculate bounding box |
CCalculateMaximum | |
CCalculateMinimum | |
CCalculateNorm | |
CCalculateNormalSDF | |
CCamera | |
►CCanvas | |
CCoord2D | |
CEndPoint | |
COriginalCoord | |
CCapillaryWave | |
CCapsuleInfo | |
CCapsuleModel | |
CCarDriver | |
CCircularEmitter | |
CClassInfo | |
CClipVertex | |
CCloth | Peridynamics-based cloth |
CCodimensionalPD | |
CCollisionDetection | |
CCollisionDetectionBroadPhase | |
CCollisionDetector | |
CCollistionDetectionBoundingBox | |
CCollistionDetectionTriangleSet | |
CColor | |
CColorMapping | |
CComplex | |
CComputeModule | |
CComputeParticleAnisotropy | |
CComputeSurfaceLevelset | |
CConeModel | |
CConfigurableBody | |
CConstantKernel | |
CConstraintModule | |
CConstructTangentSpace | |
CContactRule | |
CContactsToEdgeSet | |
CContactsToPointSet | |
CContactsUnion | |
CConvertToTextureMesh | |
CCopyModel | |
CCopyToPoint | |
CCorrectedKernel | |
CCorrectedMPSKernel | |
CCorrectedQuaticKernel | |
CCoSemiImplicitHyperelasticitySolver | |
CCTimer | |
CCubeModel | |
CCubicKernel | |
CCurve | |
CCustomFileSystemModel | |
CCylinderModel | |
CDataSource | |
CDataTypes | |
CDebugInfo | |
CDevicePoissonDiskSampler | |
Cdim3 | |
CDirectedAcyclicGraph | Graph class represents a directed graph |
CDiscreteElementRenderer | |
CDiscreteElements | |
CDiscreteElementsToTriangleSet | |
CDistanceField3D | |
CDistanceJoint | |
CDivergenceFreeSphSolver | |
CDivide | |
CDivideFunc | |
CDivideRealAndReal | |
CDragSurfaceInteraction | |
CDragVertexInteraction | |
CDualParticleFluid | |
CDualParticleIsphModule | |
CDualParticleSystemInitializer | |
CEarClipper | |
CEdgeInteraction | |
CEdgePickerNode | |
CEdgeSet | |
CEditableMesh | |
CEigenValueWriter | |
CEKey | |
CElasticBody | |
CElastoplasticBody | |
CElastoplasticityModule | |
CElementOffset | |
CEnergyAnalysis | |
CEnergyModels | |
CEnvmap | |
CEqualFunc | |
CExtractEdgeSetFromPolygonSet | |
CExtractQaudSetFromPolygonSet | |
CExtractShape | A class to merge TextureMeshs |
CExtractTriangleSetFromPolygonSet | |
CExtractTriangleSets | |
CExtrudeModel | |
CFArray | |
CFArray2D | |
CFArray3D | |
CFastMarchingMethodGPU | This class implements a GPU-based fast marching method to do boolean between two distance fields |
CFastSweepingMethod | This is a CPU-based implementation of grid-based signed distance field (level set) generator for triangle meshes. For more details, please refer to Robert Bridson's website (www.cs.ubc.ca/~rbridson) |
CFastSweepingMethodGPU | This is a GPU-based fast sweeping method to generate signed distance field from a mesh |
CFBase | |
CFCallBackFunc | |
CFiberModel | |
CField_Type | |
CFieldSignal | |
CFilePath | |
CFInstance | Pointer of objects |
CFInstances | |
CFixedJoint | |
CFixedPoints | |
CFList | |
CFloatingNumber | |
CFluidSolverParams | |
CFractureModule | |
CFrame | A frame represents a point equipped with the orientation |
CFramebuffer | |
CFrameToPointSet | |
CFungModel | |
CFVar | |
CFXAA | |
CGatherVisualModuleAction | |
CGear | |
CGeometryLoader | |
CGhostFluid | Ghost fluid method |
CGhostParticles | |
CGLCommonPointVisualNode | |
CGlfwApp | |
CGlfwRenderWindow | |
CGLInstanceVisualModule | |
CGLInstanceVisualNode | |
CGLMaterial | |
CGLPhotorealisticInstanceRender | |
CGLPhotorealisticRender | |
CGLPointVisualModule | |
CGLPointVisualNode | |
►CGLRenderEngine | |
CRenderItem | |
CGLRenderHelper | |
CGLRenderMode | |
CGLShape | |
CGLSurfaceVisualModule | |
CGLSurfaceVisualNode | |
CGLTextureMesh | |
CGltfLoader | |
CGLVisualModule | |
CGLWireframeVisualModule | |
CGLWireframeVisualNode | |
CGmsh | |
CGranularMedia | This class implements the shallow sand equation to simulate dry granular flows. For more details, refer to "Shallow Sand Equations: Real-Time Height Field Simulation of Dry Granular Flows" by Zhu et al.[2021], IEEE TVCG |
CGranularModule | |
CGraphicsObject | |
CGraphicsPipeline | |
Cgreater | |
CGreaterEqualFunc | |
CGreaterFunc | |
CGridHash | |
CGridIndex | |
CGridInfo | |
CGridSet | |
CGroundRenderer | |
CGroup | |
CGroupModule | |
CHashGrid | |
CHeightField | |
CHeightFieldInitializer | |
CHeightFieldToTriangleSet | |
CHelmholtz | |
CHexahedronSet | |
CHierarchicalScene | |
CHingeJoint | |
CHostArray2DInfo | |
CHyperelasticBody | |
CHyperelasticityModel | |
CImageLoader | |
CImChart | |
CImColorbar | |
CImplicitISPH | This is an implementation of the Implicit Incompressible SPH (IISPH) solver based on PeriDyno. For details, refer to "Implicit Incompressible SPH" by Ihmsen et al., IEEE TVCG, 2015. The code was written by Shusen Liu, ISCAS, Sep, 2024 |
CImplicitViscosity | This class implements an implicit solver for artificial viscosity based on the XSPH method |
CImWidget | |
CImWindow | |
CIndex2D | |
CIndex2DPlane | |
CIndexCmp | |
CIndexNode | |
CInputModule | |
CInstanceBase | |
CInstanceTransform | |
CInteractionInitializer | |
CInterval | |
CIOInitializer | |
CIterativeDensitySolver | This is an implementation of the iterative density solver integrated into the Position Based Dynamics framework |
Citerator_traits | |
Citerator_traits< const T * > | |
Citerator_traits< T * > | |
CJeep | |
CJoint | |
CJointAnimationInfo | |
CJointDeform | A class to facilitate showing the shape information |
CJointInfo | |
CKernel | |
CKeyboardInputModule | |
CLandScape | |
CLargeOcean | |
Cless | |
CLessEqualFunc | |
CLessFunc | |
CLevelSet | |
CLinearBVH | |
CLinearDamping | A linear damping model |
CLinearElasticitySolver | This is an implementation of elasticity based on projective peridynamics. For more details, please refer to[He et al. 2017] "Projective Peridynamics for Modeling Versatile Elastoplastic Materials" |
CLinearModel | |
CList | Be aware do not use this structure on GPU if the data size is large |
►CLog | |
CMessage | |
CLogicalAndFunc | |
CLogicalNotFunc | |
CLogicalOrFunc | |
CMakeGhostParticles | |
CMakeParticleSystem | |
CMap | Be aware do not use this structure on GPU if the data size is large |
CMarchingCubes | |
CMarchingCubesHelper | |
CMaterial | |
CMatrixBase | |
CMaximumFunc | |
►CmDrawLabel | |
CCoord0_1 | |
CEndPoint | |
CMyCoord | |
CMerge | |
CMergeSimplexSet | |
CMergeTriangleSet | |
CMesh | |
CMeshInfo | |
CMinimumFunc | |
CMinusFunc | |
CmJointItemLayout | |
CModelEditing | |
CModelingInitializer | |
CModelObject | |
CModule | |
CModulePort | Input ports for Module |
CModulusFunc | |
CMooneyRivlinModel | |
CMountainTorrents | |
CMouseInputModule | |
CmPiecewiseDoubleSpinBox | |
CmQCheckBox | |
CmQDoubleSlider | |
CmQDoubleSpinner | |
CMultibodySystem | |
CMultiMap | An CPU/GPU implementation of the standard multimap suitable for small-size data |
CMultiphysicsInitializer | |
CMultipleModulePort | |
CMultipleNodePort | |
CMultiply | |
CMultiplyFunc | |
CMultiplyRealAndReal | |
CMultiSet | An CPU/GPU implementation of the standard multiset suitable for small-size data |
CmVec3fWidget | |
CmVectorItemLayout | |
CmVectorTransformItemLayout | |
CName_Shape | |
CNBoundingBox | |
CNegateFunc | |
CNeighborElementQuery | A class implementation to find neighboring elements for a given array of elements |
CNeighborPointQuery | |
CNeighborTriangleQuery | |
CNeoHookeanModel | |
CNode | |
CNodeAction | |
CNodeCmp | |
CNodeFactory | |
CNodeGroup | |
CNodeInfoAct | |
CNodeIterator | |
CNodePage | |
CNodePort | Input ports for Node |
CNormalForce | |
CNormalVisualization | |
CNotEqualFunc | |
COBase | |
CObject | |
COcean | |
COceanBase | |
COceanPatch | |
COctreeNode | |
COgdenModel | |
COrbitCamera | |
COriginalFaceId | |
COutputModule | |
COutputs | |
CPair | |
CPAnimationQSlider | |
CPAnimationWidget | |
CParameters | Implement functions for reorganizing ranges into sorted order |
CParametricModel | |
CParticleApproximation | |
CParticleEmitter | |
CParticleFluid | |
CParticleIntegrator | |
CParticleRelaxtionOnMesh | |
CParticleSkinning | |
CParticleSystem | This class represents the base class for more advanced particle-based nodes |
CParticleSystemHelper | |
CParticleSystemInitializer | |
CParticleWriter | |
CPaticleUniformAnalysis | |
CPCGConstraintSolver | |
CPConsoleWidget | |
CPdActor | |
CPDataViewerWidget | |
CPDockWidget | |
CPEnum | |
CPeridynamics | A base class for peridynamics-based computational paradigms |
CPeridynamicsInitializer | |
CPicture | |
CPIntegerViewerWidget | |
CPIODockWidget | |
CPIOTabWidget | |
CPipeline | |
CPJSConstraintSolver | |
CPJSNJSConstraintSolver | |
CPJSoftConstraintSolver | |
CPKeyboardEvent | |
CPlaneModel | |
CPLogWidget | |
CPlugin | Class form managing and encapsulating shared libraries loading |
CPluginEntry | |
CPluginManager | Repository of plugins. It can instantiate any class from any loaded plugin by its name |
CPlusFunc | |
CPMainToolBar | |
CPMainWindow | |
CPModuleEditor | |
CPModuleEditorToolBar | |
CPMouseEvent | |
CPointClip | |
CPointFromCurve | |
CPointInteraction | |
CPointJoint | |
CPointPickerNode | |
CPointsBehindMesh | |
CPointSet | A PointSet stores the coordinates for a set of independent points |
CPointSetToPointSet | |
CPointSetToTriangleSet | |
CPointsLoader | Load a triangular mesh |
CPoissionDiskPositionShifting | |
CPoissonDiskSampler | |
CPoissonEmitter | |
CPoissonPlane | |
►CPolyExtrude | |
Cpoint_layer | |
CPrim_point_Point | |
CPolygonSet | Class to store polygon whose vertex number is greater or equal than 3 |
CPolygonSetToTriangleSetModule | |
CPolygonSetToTriangleSetNode | |
CPolynomialModel | |
CPOpenGLWidget | |
CPose | |
CPositionBasedFluidModel | |
CPositionCmp | |
CPositionNode | |
CPostProcessing | |
CPOtherSetting | |
►CPPropertyWidget | |
CFieldWidgetMeta | |
CPPushButton | |
CPRealViewerWidget | |
Cpredicate | |
CPRenderSetting | |
CPrintFloat | |
CPrintInt | |
CPrintUnsigned | |
CPrintVector | |
Cpriority_queue | |
CProgram | |
CProjectedPoint3D | |
CProjectionBasedFluidModel | |
CProjectivePeridynamics | |
CPSceneSetting | |
CPScrollBarViewerWidget | |
CPSettingEditor | |
CPSettingWidget | |
CPSimulationThread | |
CPStatusBar | |
CPTableItemMessage | |
CPTableItemProgress | |
CPTransform3fViewerWidget | |
CPVec2FieldViewerWidget | |
CPVec3FieldViewerWidget | |
CQBoolFieldWidget | |
CQColorButton | |
CQColorWidget | |
CQContentBrowser | |
CQCurveLabel | |
CQCurveWidget | |
CQDoubleSlider | |
CQDoubleSpinner | |
CQDrawLabel | |
CQEnumFieldWidget | |
CQFieldPropertyWidget | |
CQFieldWidget | |
CQFilePathWidget | |
CQIntegerFieldWidget | |
CQJointBodyDetail | |
CQKey | |
CQPiecewiseDoubleSpinBox | |
CQPiecewiseSpinBox | |
CQRampWidget | |
CQRealFieldWidget | |
CQRigidBodyDetail | |
CQStateFieldWidget | |
CQStringFieldWidget | |
CQtApp | |
CQTimeTableWidgetItem | |
CQToggleButton | |
CQToggleLabel | |
CQuadPickerNode | |
CQuadSet | |
CQuadSetToTriangleSet | |
CQuarticKernel | |
CQuat | |
CQUIntegerFieldWidget | |
CQValueButton | |
CQValueDialog | |
CQVec3fWidget | |
CQVector3FieldWidget | |
CQVector3iFieldWidget | |
CQVectorIntFieldWidget | |
CQVectorTransform3FieldWidget | |
CQVehicleInfoWidget | |
CRamp | |
CRandNumber | |
CRandomAccessContainer | |
CReduction | |
CReduction< Vec3d > | |
CReduction< Vec3f > | |
Cremove_reference | |
Cremove_reference< T & > | |
Cremove_reference< T && > | |
CRenderEngine | |
►CRenderParams | |
CLight | |
CTransform | |
CRenderTools | |
CRenderWindow | |
CResetAct | |
CRigid | |
CRigid< T, 1 > | |
CRigid< T, 2 > | |
CRigid< T, 3 > | |
CRigidBody | |
CRigidBodyInfo | |
CRigidBodyInitializer | |
CRigidBodyItemLayout | |
CRigidBodySystem | Implementation of a rigid body system containing a variety of rigid bodies with different shapes |
CRigidMesh | |
CRigidSandCoupling | This class implements a coupling between a granular media and a rigid body system |
CRigidWaterCoupling | |
CSampler | |
CScan | |
CScanParameters | Implement functions for computing prefix sums |
CSceneGraph | |
CSceneGraphFactory | |
CSceneLoader | |
CSceneLoaderFactory | |
►CSceneLoaderXML | |
CConnectionInfo | |
CSdfSampler | |
►CSelection | |
CItem | |
CSemiAnalyticalIncompressibilityModule | |
CSemiAnalyticalIncompressibleFluidModel | |
CSemiAnalyticalParticleShifting | |
CSemiAnalyticalPBD | |
CSemiAnalyticalPositionBasedFluidModel | |
CSemiAnalyticalSchemeInitializer | |
CSemiAnalyticalSFINode | Semi-Analytical Solid Fluid Interaction |
CSemiAnalyticalSummationDensity | |
CSemiAnalyticalSurfaceTensionModel | Semi-Analytical Surface Tension Model for Free Surface Flows |
CSemiImplicitDensitySolver | This class implements a semi-implicit successive substitution method to solve incompressibility. For more details, refer to He et al. "A Semi-Implicit SPH Method for Compressible and Incompressible Flows with Improved Convergence", Eurographics 2025 |
CSemiImplicitHyperelasticitySolver | |
CSet | An CPU/GPU implementation of the standard set suitable for small-size data |
CShader | |
CShadowMap | |
CShape | |
CShapeSampler | |
CSimpleVechicleDriver | |
CSimpleVelocityConstraint | |
CSimplexSet | |
CSingleModulePort | |
CSingleNodePort | |
CSkinInfo | |
CSliderJoint | |
CSmesh | |
CSmoothKernel | |
CSparseGridHash | |
CSparseMarchingCubes | |
CSparseMatrix | |
CSparseOctree | |
CSparseVolumeClipper | |
CSphereInfo | |
CSphereModel | |
CSpikyKernel | |
CSplineConstraint | |
CSplitSimplexSet | |
CSquareEmitter | |
CSquareMatrix | |
CSquareMatrix< T, 2 > | |
CSquareMatrix< T, 3 > | |
CSquareMatrix< T, 4 > | |
CSSAO | |
CStack | Be aware do not use this structure on GPU if the data size is large |
CStates | |
CStaticMeshLoader | A node containing a TriangleSet object |
CSteer | |
CSTLBuffer | Be aware do not use this structure on GPU if the data size is large |
CStructuredPointSet | |
CStVKModel | |
CSubdivide | |
CSubtract | |
CSubtractRealAndReal | |
CSummationDensity | The standard summation density |
CSurfaceEnergyForce | An implementation of the energy-based surface model proposed by He et al.[2024]. Refer to "Robust Simulation of Sparsely Sampled Thin Features in SPH-Based Free Surface Flows", ACM TOG 2014, for more details |
CSurfaceInteraction | |
CSurfaceParticleTracking | |
CSurfaceTension | |
CSweepModel | |
CTAlignedBox2D | |
CTAlignedBox3D | |
CTank | |
CTBond | Definition of a bond in Peridynamics |
CTCapsule3D | |
CTCircle2D | |
CTCone3D | |
CTConstraintPair | |
CTContact | |
CTContactPair | |
CTCylinder3D | |
CTDisk2D | |
CTDisk3D | |
CTetInfo | |
CTetrahedralSystem | |
CTetrahedronSet | |
CTetrahedronSetToPointSet | |
CTetraMeshWriter | |
CTetraMeshWriterFracture | |
CTexture | |
CTexture2D | |
CTexture2DMultiSample | |
CTextureCube | |
CTextureMesh | |
CTextureMeshLoader | |
CTextureMeshMerge | A class to merge TextureMeshs |
CTextureMeshToTriangleSet | |
CTextureMeshToTriangleSetNode | |
CTGrid3D | |
CThread | Peridynamics-based Thread |
CThreadSystem | |
CTightCCD | |
CTimeStamp | Time stamp |
CTJConstraintSolver | |
CTJSoftConstraintSolver | |
CTKey | |
CTLine2D | 1D geometric primitives in two-dimensional space |
CTLine3D | 1D geometric primitives in three-dimensional space |
CTManifold | |
CToolBarIcoAndLabel | |
CToolBarPage | |
CTopologyMapping | |
CTopologyModule | |
CTOrientedBox3D | |
CTPlane3D | 2D geometric primitives in three-dimensional space |
CTPoint2D | 0D geometric primitive in two-dimensional space |
CTPoint3D | 0D geometric primitive in three-dimensional space |
CTPointSweep3D | |
CTPolygon2D | |
CTrackballCamera | |
CTrackedTank | |
CTransform | |
CTransform< T, 2 > | |
CTransform< T, 3 > | |
CTransformModel | |
►CTRay2D | |
CParam | |
►CTRay3D | |
CParam | |
CTRectangle2D | |
►CTRectangle3D | |
CParam | |
CTriangleMeshWriter | |
CTrianglePickerNode | |
CTriangleSet | |
►CTriangleSetRenderer | |
CGraphicsUBO | |
CTriangleSets | |
CTriangleSetToTriangleSets | |
CTriangularMeshBoundary | A triangular mesh boundary to prevent interpenetration for particles |
CTriangularMeshConstraint | |
CTriangularSystem | |
CTSegment2D | |
CTSegment3D | |
CTSeparationData | |
CTSphere3D | 3D geometric primitives in three-dimensional space |
CTTet3D | Vertices are ordered so that the normal vectors for the triangular faces point outwards 3 / | \ 0 - 2 - 1 |
CTTriangle2D | 2D geometric primitives in two-dimensional space |
►CTTriangle3D | |
CParam | |
CTTriangleSweep3D | |
CTurningModel | |
CUAV | |
CUbiApp | This class provides a unified representation for all three GUIs, including the GlfwGUI, QtGUI and WtGUI |
Cuint3 | |
Cunary_function | |
CUniformGrid3D | |
CUniformGridRenderer | |
CUnstructuredPointSet | |
CUUV | |
CVariationalApproximateProjection | Projection-based solver |
CVector | |
CVector3Source | |
CVector< T, 4 > | |
CVectorBase | |
CVectorND | |
CVectorVisualNode | |
CVehicleBind | Used to record information about created rigid bodies and joints. Rigid bodies information is stored in mVehicleRigidBodyInfo. Toints information is stored in mVehicleJointInfo |
CVehicleJointInfo | The joint information is stored in mVehicleJointInfo |
CVehicleRigidBodyInfo | The Rigid body information is stored in mVehicleJointInfo |
CVertex | |
CVertexArray | |
CVessel | |
CVirtualColocationStrategy | |
CVirtualParticleGenerator | |
CVirtualParticleShiftingStrategy | |
CVirtualSpatiallyAdaptiveStrategy | |
CVisualModule | |
CVkConstant | |
►CVkContext | |
CMemoryPoolInfo | |
CVkDeviceArray | |
CVkDeviceArray2D | |
CVkDeviceArray3D | |
CVkFFT | |
►CVkGraphicsPipeline | |
CGraphicsUBO | |
CVkHostArray | |
CVkHostArray2D | |
CVkMultiProgram | |
CVkProgram | |
CVkReduce | Implement functions for reducing a range to a single value |
CVkScan | |
CVkSort | |
CVkSystem | |
CVkUniform | |
CVkVariable | |
CVkVisualModule | |
CVolume | |
CVolumeBoolean | |
CVolumeBoundary | |
CVolumeClipper | |
CVolumeGenerator | |
CVolumeHelper | |
CVolumeInitializer | |
CVolumeLoader | |
CVolumeOctree | |
CVolumeOctreeBoolean | |
CVolumeOctreeGenerator | This is a GPU-based implementation of algebraic adaptive signed distance field (AASDF). For more details, please refer to "Algebraic Adaptive Signed Distance Field on GPU" by [Ren et.al. 2022] |
CVolumeToGridCell | |
CVolumeToTriangleSet | |
CVoxelOctree | |
CVoxelOctreeNode | |
CVtkFluidVisualModule | |
CVtkPointVisualModule | |
CVtkRenderEngine | |
CVtkSurfaceVisualModule | |
CVtkVisualModule | |
CWake | |
CWendlandC2Kernel | |
CWindParam | |
CWNode | |
CWtApp | |
CWtStates | |
CXBuffer | |
CXTexture2D | |
CXuModel | |
CYeohModel | |
►NImGuizmo | |
CContext | |
Cmatrix_t | |
Cvec_t | |
►Npx | |
CBox | |
CCapsule | |
CColor | |
CPlane3D | |
CRay3D | |
CSphere | |
CSphere3D | |
►NQt | |
CQtExportModule | |
CQtExportNode | |
CQtFieldData | |
CQtImportModule | |
CQtImportNode | |
CQtModuleFlowScene | Scene holds connections and nodes |
CQtModuleFlowWidget | |
CQtModuleWidget | |
CQtNodeFlowScene | Scene holds connections and nodes |
CQtNodeFlowView | |
CQtNodeFlowWidget | |
CQtNodeWidget | The model dictates the number of inputs and outputs for the Node |
CSceneGraph | |
►NQtImGui | |
CImGuiRenderer | |
CQWindowWrapper | |
CWindowWrapper | |
►Nstd | |
Chash< nlohmann::NLOHMANN_BASIC_JSON_TPL > | Hash value for JSON objects |
Chash< Wt::Guid > | |
Cless< ::nlohmann::detail::value_t > | |
Ctuple_element< N, ::nlohmann::detail::iteration_proxy_value< IteratorType > > | |
Ctuple_size<::nlohmann::detail::iteration_proxy_value< IteratorType > > | |
►Ntt | |
CBuilder | |
CColor | |
CColors | |
CCompactToolButton | |
CGroup | |
CPage | |
CStyleParams | |
►CSubGroup | |
CActionParams | |
CTabToolbar | |
CTTToolButtonStyle | |
►Nvg | |
CvirtualGizmo3DClass | |
CvirtualGizmoBaseClass | |
CvirtualGizmoClass | |
►Nvgm | |
CMat3 | |
CMat4 | |
CQuat | |
CVec2 | |
CVec3 | |
CVec4 | |
►NvkglTF | |
CAnimation | |
CAnimationChannel | |
CAnimationSampler | |
CMaterial | |
►CMesh | |
CUniformBlock | |
CUniformBuffer | |
►CModel | |
CDimensions | |
CIndices | |
CVertices | |
CNode | |
►CPrimitive | |
CDimensions | |
CSkin | |
CTexture | |
CVertex | |
►Nvks | |
CBuffer | Encapsulates access to a Vulkan buffer backed up by device memory |
CTexture | |
CTexture2D | |
CTexture2DArray | |
CTextureCubeMap | |
►CUIOverlay | |
CPushConstBlock | |
►NWt | |
►Ndetails | |
Chash | |
Chash< T > | |
Chash< T, Rest... > | |
CGuid | |
C_SwapChainBuffers | |
Cadl_serializer | Namespace for Niels Lohmann |
Cbasic_json | Namespace for Niels Lohmann |
Cbyte_container_with_subtype | Internal type for a backed binary type |
CCamera | |
CconnectionPointData | |
CCPD_ClothDrop | |
CdownloadResource | |
CFBase | |
CFluidMapper | |
CGeometry | Base class for other geometry loaders |
CImageEncoder | |
CImageEncoderNV | |
CImGui_ImplGlfw_Data | |
CImGuiBackendWt | |
CimguiGizmo | |
CIndex2D | |
►Cjson_pointer | JSON Pointer defines a string syntax for identifying a specific value within a JSON document |
Cstring_t_helper | |
Cstring_t_helper< NLOHMANN_BASIC_JSON_TPL > | |
Cjson_sax | SAX interface |
CLockerButton | |
CModule | |
CModulePort | Input ports for Module |
CNode | |
CNodeDataType | |
CNodePort | Input ports for Node |
CObjLoader | A node containing a TriangleSet object |
Cordered_map | Minimal map-like container that preserves insertion order |
CParticleEimitter | |
CParticleElasticBody | Peridynamics-based elastic object |
CParticleElastoplasticBody | Peridynamics-based elastoplastic particles |
CPipeline | |
CPointMapper | |
CPort | |
CQDataViewScrollBar | |
CSample | |
CSampleStore | |
CsceneConnection | |
CSceneGraph | |
CSharedMemory | |
CSharedMemory< bool > | |
CSharedMemory< char > | |
CSharedMemory< double > | |
CSharedMemory< float > | |
CSharedMemory< int > | |
CSharedMemory< long > | |
CSharedMemory< short > | |
CSharedMemory< unsigned char > | |
CSharedMemory< unsigned int > | |
CSharedMemory< unsigned long > | |
CSharedMemory< unsigned short > | |
CStyle | |
CSurfaceMapper | |
CTetSystem | This class represents the base class for more advanced particle-based nodes |
CTimeElapse | |
Cun | |
CVariable | Interface for all variables |
►CVkApp | |
CSettings | Example settings that can be changed e.g. by command line arguments |
CVkFFTApplication | |
CVkFFTAxis | |
CVkFFTConfiguration | |
CVkFFTLaunchParams | |
CVkFFTPlan | |
CVkFFTPushConstantsLayoutUint32 | |
CVkFFTPushConstantsLayoutUint64 | |
CVkFFTSpecializationConstantsLayout | |
CVkFFTUserSystemParameters | |
CVkGPU | |
CVulkanSwapChain | |
CWBoolFieldWidget | |
CWColorWidget | |
CWEnumFieldWidget | |
CWFileWidget | |
CWidgetQueue | |
CWIntegerFieldWidget | |
CWLogMessage | |
CWLogWidget | |
CWMainApp | |
CWMainWindow | |
CWModuleDataModel | |
CWModuleGraphics | |
►CWNodeDataModel | |
CNodeItem | |
CWNodeGraphics | |
►CWParameterDataNode | |
CFieldWidgetMeta | |
CWPythonWidget | |
CWRealFieldWidget | |
CWRenderParamsWidget | |
CWSampleWidget | |
CWSaveWidget | |
CWSimulationCanvas | |
CWSimulationControl | |
CWStateFieldWidget | |
CWtConnection | |
CWtConnectionGeometry | |
CWtConnectionGraphicsObject | Graphic Object for connection. Adds itself to scene |
CWtConnectionPainter | |
CWtConnectionState | |
CWtConnectionStyle | |
►CWtDataModelRegistry | |
CHasStaticMethodName | |
CHasStaticMethodName< T, typename std::enable_if< std::is_same< decltype(T::Name()), std::string >::value >::type > | |
CUnwrapUniquePtr | |
CUnwrapUniquePtr< std::unique_ptr< T > > | |
CWtExportNode | |
CWtFieldData | |
CWtFlowNodeData | |
CWtFlowScene | |
CWtFlowViewStyle | |
CWtFlowWidget | |
CWtImportNode | |
CWtInteraction | |
CWtModuleFlowScene | |
CWtModuleFlowWidget | |
CWtModuleWidget | |
CWtNode | |
CWtNodeData | |
CWtNodeDataModel | |
CWtNodeFlowScene | |
CWtNodeFlowWidget | |
CWtNodeGeometry | |
CWtNodeGraphicsObject | |
CWtNodePainter | |
CWtNodeState | |
CWtNodeStyle | |
CWtNodeWidget | |
CWtStyleCollection | |
CWUIntegerFieldWidget | |
CWVector3FieldWidget | |
CWVector3iFieldWidget | |