►Cprecice::acceleration::Acceleration | |
Cprecice::acceleration::AitkenAcceleration | |
►Cprecice::acceleration::BaseQNAcceleration | Base Class for quasi-Newton acceleration schemes |
Cprecice::acceleration::IQNILSAcceleration | Interface quasi-Newton with interface least-squares approximation |
Cprecice::acceleration::IQNIMVJAcceleration | Multi vector quasi-Newton update scheme |
Cprecice::acceleration::ConstantRelaxationAcceleration | |
CAccelerationSerialTestsFixture | |
Cboost::geometry::traits::access< Eigen::VectorXd, Dimension > | |
Cboost::geometry::traits::access< pm::Vertex, Dimension > | |
Cboost::geometry::traits::access< pm::Vertex::RawCoords, Dimension > | |
►Cprecice::action::Action | Abstract base class for configurable actions on data and/or meshes |
Cprecice::action::PythonAction | Action whose implementation is given in a Python file |
Cprecice::action::RecorderAction | Action that records invocations for testing purposes |
Cprecice::action::ScaleByAreaAction | |
Cprecice::action::SummationAction | Action that adds multiple source data into target data |
CAlmostDegenerateTetrahedronFixture | |
Cprecice::com::AsVectorTag< T > | |
►CB1 | |
Cprecice::utils::conjunction< B1 > | |
Cprecice::logging::BackendConfiguration | Holds the configuration for one logging backend (sink) and takes care of default values |
►CBaseT | |
Cprecice::logging::precice_feature< BaseT > | A feature that adds LogLocation info to log attributes |
►Cboost::log::basic_formatter_factory | |
Cprecice::logging::timestamp_formatter_factory | A custom formatter that handles the TimeStamp format string |
►CBoostLogger | |
Cprecice::logging::Logger::LoggerImpl | |
Cprecice::mesh::BoundingBox | An axis-aligned bounding box around a (partition of a) mesh |
Cprecice::m2n::BoundM2N | An M2N between participants with a configured direction |
Cprecice::math::Bspline | |
Cprecice::mesh::Chain< n > | |
Cboost::geometry::traits::closure< pm::Triangle > | |
CColumn | |
Cprecice::utils::Parallel::CommState | |
►Cprecice::com::Communication | Interface for all interprocess communication classes |
►Cprecice::com::MPICommunication | Provides implementation for basic MPI point-to-point communication |
Cprecice::com::MPIDirectCommunication | Provides connection methods for processes located in one communicator |
Cprecice::com::MPIPortsCommunication | Provides connection methods based on MPI ports (part of MPI 2.0) |
Cprecice::com::MPISinglePortsCommunication | Provides connection methods based on MPI ports (part of MPI 2.0) |
Cprecice::com::SocketCommunication | Implements Communication by using sockets |
Cprecice::com::CommunicationConfiguration | Configuration for communication channels between a primary and its secondary ranks. The communication between two solvers is configured in m2n::M2NConfiguration |
►Cprecice::com::CommunicationFactory | |
Cprecice::com::MPIPortsCommunicationFactory | |
Cprecice::com::MPISinglePortsCommunicationFactory | |
Cprecice::com::SocketCommunicationFactory | |
►Cprecice::mapping::CompactSupportBase | Base class for RBF with compact support |
Cprecice::mapping::CompactPolynomialC0 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC2 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC4 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC6 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC8 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactThinPlateSplinesC2 | Radial basis function with compact support |
Cprecice::mapping::Gaussian | Radial basis function with global and compact support |
Cprecice::utils::ComponentWiseLess | |
Cprecice::cplscheme::CouplingSchemeConfiguration::Config | |
Cprecice::xml::ConfigParser | |
Cprecice::xml::ConfigurationContext | Tightly coupled to the parameters of Participant() |
Cprecice::acceleration::AccelerationConfiguration::ConfigurationData | |
Cprecice::action::ActionConfiguration::ConfiguredAction | Stores configuration information temporarily to create the Action |
Cprecice::mesh::DataConfiguration::ConfiguredData | |
Cprecice::m2n::M2NConfiguration::ConfiguredM2N | |
Cprecice::mapping::MappingConfiguration::ConfiguredMapping | Configuration data for one mapping |
Cprecice::m2n::PointToPointCommunication::ConnectionData | This data structure is used to store m2n communication information for the 1 step of bounding box initialization. It stores: |
►Cprecice::com::ConnectionInfoPublisher | |
Cprecice::com::ConnectionInfoReader | Reads the connection info for the given participant/rank information |
Cprecice::com::ConnectionInfoWriter | Writes the connection info for the given participant/rank information |
Cprecice::testing::ConnectionOptions | |
►Cprecice::cplscheme::impl::ConvergenceMeasure | Interface for measures checking the convergence of a series of datasets |
Cprecice::cplscheme::impl::AbsoluteConvergenceMeasure | Measures the convergence from an old data set to a new one |
Cprecice::cplscheme::impl::AbsoluteOrRelativeConvergenceMeasure | Measures the convergence from an old data set to a new one |
Cprecice::cplscheme::impl::RelativeConvergenceMeasure | Measures the convergence from an old data set to a new one |
Cprecice::cplscheme::impl::ResidualRelativeConvergenceMeasure | Measures the convergence from an old data set to a new one |
Cprecice::cplscheme::BaseCouplingScheme::ConvergenceMeasureContext | Holds meta information to perform a convergence measurement |
Cprecice::cplscheme::CouplingSchemeConfiguration::ConvergenceMeasureDefintion | |
Cprecice::math::geometry::ConvexityResult | |
Cboost::geometry::traits::coordinate_system< Eigen::VectorXd > | |
Cboost::geometry::traits::coordinate_system< pm::Vertex > | |
Cboost::geometry::traits::coordinate_system< pm::Vertex::RawCoords > | |
Cboost::geometry::traits::coordinate_type< Eigen::VectorXd > | |
Cboost::geometry::traits::coordinate_type< pm::Vertex > | |
Cboost::geometry::traits::coordinate_type< pm::Vertex::RawCoords > | |
Cprecice::cplscheme::CouplingData | |
►Cprecice::cplscheme::CouplingScheme | Interface for all coupling schemes |
►Cprecice::cplscheme::BaseCouplingScheme | Abstract base class for standard coupling schemes |
►Cprecice::cplscheme::BiCouplingScheme | Abstract base class for coupling schemes with two participants |
Cprecice::cplscheme::ParallelCouplingScheme | Coupling scheme for parallel coupling, i.e. simultaneous execution of two coupled participants |
Cprecice::cplscheme::SerialCouplingScheme | Coupling scheme for serial coupling, i.e. staggered execution of two coupled participants |
Cprecice::cplscheme::MultiCouplingScheme | A coupling scheme with multiple participants |
Cprecice::cplscheme::CompositionalCouplingScheme | Acts as one coupling scheme, but consists of several composed ones |
Cprecice::cplscheme::tests::DummyCouplingScheme | Used to test CompositionalCouplingScheme |
Cprecice::xml::ConfigParser::CTag | Struct holding the read tag from xml file |
Cprecice::io::TXTTableWriter::Data | Represents one data entry to be written |
Cprecice::mesh::Data | Describes a set of data values belonging to the vertices of a mesh |
►Cprecice::impl::DataContext | Stores one Data object with related mesh |
Cprecice::impl::ReadDataContext | Stores one Data object with related mesh. Context stores data to be read from and potentially provides a read mapping. Additionally stores Waveform object associated with _providedData |
Cprecice::impl::WriteDataContext | Stores one Data object with related mesh. Context stores data to be written to and potentially provides a write mapping |
Cprecice::testing::DataContextFixture | |
Cprecice::acceleration::AccelerationConfiguration::DefaultValuesIMVJ | |
Cprecice::acceleration::AccelerationConfiguration::DefaultValuesIQN | |
Cprecice::mapping::DefiniteFunction< isDefinite > | Base class for RBF functions to distinguish positive definite functions |
►Cprecice::mapping::DefiniteFunction< false > | |
Cprecice::mapping::Multiquadrics | Radial basis function with global support |
Cprecice::mapping::ThinPlateSplines | Radial basis function with global support |
Cprecice::mapping::VolumeSplines | Radial basis function with global support |
►Cprecice::mapping::DefiniteFunction< true > | |
Cprecice::mapping::CompactPolynomialC0 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC2 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC4 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC6 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactPolynomialC8 | Wendland radial basis function with compact support |
Cprecice::mapping::CompactThinPlateSplinesC2 | Radial basis function with compact support |
Cprecice::mapping::Gaussian | Radial basis function with global and compact support |
Cprecice::mapping::InverseMultiquadrics | Radial basis function with global support |
Cprecice::utils::statistics::DistanceAccumulator | |
►Cprecice::m2n::DistributedComFactory | |
Cprecice::m2n::GatherScatterComFactory | |
Cprecice::m2n::PointToPointComFactory | |
►Cprecice::m2n::DistributedCommunication | Interface for all distributed solver to solver communication classes |
Cprecice::m2n::GatherScatterCommunication | Implements DistributedCommunication by using a gathering/scattering methodology. Arrays of data are always gathered and scattered at the primary. No direct communication between secondary ranks is used. For more details see m2n/DistributedCommunication.hpp |
Cprecice::m2n::PointToPointCommunication | Point-to-point communication implementation of DistributedCommunication |
Cprecice::utils::DoubleAggregator | An accurate aggregator for doubles with usability in mind |
Cprecice::mesh::Edge | Linear edge of a mesh, defined by two Vertex objects |
Cprecice::profiling::Event | |
Cprecice::profiling::EventRegistry | |
►Cstd::exception [external] | STL class |
►Cstd::runtime_error [external] | STL class |
►Cprecice::utils::MultiLockException | |
Cprecice::utils::LockNotFoundException | |
Cprecice::cplscheme::CouplingSchemeConfiguration::Config::Exchange | |
Cprecice::mapping::MappingConfiguration::ExecutorConfiguration | |
►Cprecice::io::Export | Abstract base class of all classes exporting container data structures |
Cprecice::io::ExportCSV | |
Cprecice::io::ExportVTK | Writes polygonal, or triangle meshes to vtk files |
►Cprecice::io::ExportXML | Common class to generate the VTK XML-based formats |
Cprecice::io::ExportVTP | |
Cprecice::io::ExportVTU | |
Cprecice::io::ExportContext | |
►Cstd::false_type [external] | |
Cprecice::detail::has_size_and_data< typename, typename > | |
Cprecice::detail::is_complete< typename, typename > | |
Cprecice::detail::is_container_element_type_compatible< typename, typename, typename > | |
Cprecice::detail::is_span< typename > | |
Cprecice::detail::is_std_array< typename > | |
CFlippedTetrahedronFixture | |
►Cformatter | |
Cfmt::formatter< Eigen::Matrix< Scalar, RowsAtCompileTime, ColsAtCompileTime > > | |
Cfmt::formatter< precice::io::TXTTableWriter::DataType > | |
Cfmt::formatter< std::array< T, n > > | |
Cfmt::formatter< std::deque< T, Allocator > > | |
Cfmt::formatter< std::map< T, Compare, Allocator > > | |
Cfmt::formatter< std::pair< F, S > > | |
Cfmt::formatter< std::set< T, Compare, Allocator > > | |
Cfmt::formatter< std::vector< T, Allocator > > | |
►Cboost::log::formatter_factory | |
Cprecice::logging::colorized_severity_formatter_factory | A custom formatter that handles the colorized Severity formatting |
Cprecice::logging::severity_formatter_factory | A custom formatter that handles non-colorized Severity formatting |
Cprecice::profiling::FundamentalTag | Tag to annotate fundamental events |
CFunnyTetrahedronFixture | |
Cprecice::mapping::MappingConfiguration::GeoMultiscaleConfiguration | |
Cprecice::mapping::MappingConfiguration::GinkgoParameter | |
Cprecice::mapping::GinkgoRadialBasisFctSolver< RADIAL_BASIS_FUNCTION_T > | |
Cprecice::acceleration::impl::QRFactorization::givensRot | |
Cprecice::logging::GlobalLoggingConfig | Holds global logging data in a central place |
Cprecice::cplscheme::impl::TimeHandler::Impl | |
Cprecice::cplscheme::ImplicitData | |
Cprecice::query::Index | Class to query the index trees of the mesh |
Cboost::geometry::traits::indexed_access< pm::Edge, Index, Dimension > | |
Cprecice::query::Index::IndexImpl | |
Cprecice::utils::IndexMaps< dimension > | Provides mappings of indices for dimensions 2 and 3 |
Cprecice::utils::IndexMaps< 2 > | |
Cprecice::utils::IndexMaps< 3 > | |
►Cboost::mpl::int_ | |
Cboost::geometry::traits::dimension< Eigen::VectorXd > | |
Cboost::geometry::traits::dimension< pm::Vertex > | |
Cboost::geometry::traits::dimension< pm::Vertex::RawCoords > | |
►Cstd::integral_constant< size_t, Extent > [external] | |
Cstd::tuple_size< precice::span< ElementType, Extent > > | |
Cprecice::impl::ParticipantState::IntermediateExport | |
Cprecice::utils::IntraComm | Utility class for managing intra-participant communication operations |
Cprecice::detail::is_container< C, U > | |
Cprecice::query::impl::IsDirectIndexableHelper< Primitive > | |
►Cboost::iterator_facade | |
Cprecice::mesh::IndexRangeIterator< Source, Value > | |
Cprecice::utils::petsc::KSPSolver | |
►Cprecice::xml::XMLTag::Listener | Callback interface for configuration classes using XMLTag |
CCallbackHost | |
CCallbackHostAttr | |
CContextListener | |
Cprecice::acceleration::AccelerationConfiguration | |
Cprecice::action::ActionConfiguration | Configures an Action subclass object |
Cprecice::config::Configuration | Main class for preCICE XML configuration tree |
Cprecice::config::LogConfiguration | Configures the log config file to use |
Cprecice::config::ParticipantConfiguration | Performs XML configuration of a participant |
Cprecice::cplscheme::CouplingSchemeConfiguration | Configuration for coupling schemes |
Cprecice::io::ExportConfiguration | Configuration class for exports |
Cprecice::m2n::M2NConfiguration | Configuration for communication channels between solvers |
Cprecice::mapping::MappingConfiguration | Performs XML configuration and holds configured mappings |
Cprecice::mesh::DataConfiguration | Performs and provides configuration for Data objects from XML files |
Cprecice::mesh::MeshConfiguration | |
Cprecice::profiling::ProfilingConfiguration | Configuration class for exports |
Cprecice::xml::NoPListener | No operation listener for tests |
Cprecice::logging::Logger | This class provides a lightweight logger |
Cprecice::logging::LogLocation | Struct used to capture the original location of a log request |
Cprecice::m2n::M2N | M2N communication class. This layer is necessary since communication between two participants can be working via several meshes, each possibly with a different decomposition. In principle, this class is only a map from meshes to DistributedCommunications |
Cprecice::utils::ManageUniqueIDs | Manages a set of unique IDs |
Cprecice::impl::ParticipantImpl::MappedSamples | |
Cprecice::m2n::PointToPointCommunication::Mapping | Defines mapping between: |
►Cprecice::mapping::Mapping | Abstract base class for mapping of data from one mesh to another |
►Cprecice::mapping::RadialBasisFctBaseMapping< SOLVER_T::BASIS_FUNCTION_T > | |
Cprecice::mapping::RadialBasisFctMapping< SOLVER_T, Args > | Mapping with radial basis functions |
Cprecice::mapping::AxialGeoMultiscaleMapping | Geometric multiscale mapping in axial direction |
►Cprecice::mapping::BarycentricBaseMapping | Base class for interpolation based mappings, where mapping is done using a geometry-based linear combination of input values. Subclasses differ by the way computeMapping() fills the _interpolations and by mesh tagging. Mapping itself is shared |
Cprecice::mapping::LinearCellInterpolationMapping | Mapping using orthogonal projection to nearest triangle/edge/vertex and linear interpolation from projected point |
Cprecice::mapping::NearestProjectionMapping | Mapping using orthogonal projection to nearest triangle/edge/vertex and linear interpolation from projected point |
►Cprecice::mapping::NearestNeighborBaseMapping | |
Cprecice::mapping::NearestNeighborGradientMapping | Mapping using nearest neighboring vertices and their local gradient values |
Cprecice::mapping::NearestNeighborMapping | Mapping using nearest neighboring vertices |
Cprecice::mapping::PartitionOfUnityMapping< RADIAL_BASIS_FUNCTION_T > | |
►Cprecice::mapping::RadialBasisFctBaseMapping< RADIAL_BASIS_FUNCTION_T > | Mapping with radial basis functions |
Cprecice::mapping::PetRadialBasisFctMapping< RADIAL_BASIS_FUNCTION_T > | Mapping with radial basis functions using the Petsc library to solve the resulting system |
Cprecice::mapping::RadialGeoMultiscaleMapping | Geometric multiscale mapping in radial direction |
Cprecice::impl::MappingContext | Holds a data mapping and related information |
Cprecice::query::MatchType< Tag > | Struct to hold the index of a primitive match |
Cprecice::utils::petsc::Matrix | |
Cprecice::mesh::Mesh | Container and creator for meshes |
Cprecice::impl::MeshContext | Stores a mesh and related objects and data |
Cprecice::impl::MeshDataKey< T > | Type that represent a compound key of two values |
Cprecice::query::MeshIndices | |
CMeshSpecification | |
CMPI_Select_unsigned_integer_datatype< size_t > | |
CMPI_Select_unsigned_integer_datatype< 1 > | |
CMPI_Select_unsigned_integer_datatype< 2 > | |
CMPI_Select_unsigned_integer_datatype< 4 > | |
CMPI_Select_unsigned_integer_datatype< 8 > | |
Cprecice::utils::MPIResult | |
Cprecice::utils::MultiLock< Key > | Class handling multiple locks allowing global lock and unlock operations |
Cprecice::utils::MultiLock< std::string > | |
Cprecice::profiling::NameEntry | |
►Cprecice::mapping::NoCompactSupportBase | Base class for RBF without compact support |
Cprecice::mapping::InverseMultiquadrics | Radial basis function with global support |
Cprecice::mapping::Multiquadrics | Radial basis function with global support |
Cprecice::mapping::ThinPlateSplines | Radial basis function with global support |
Cprecice::mapping::VolumeSplines | Radial basis function with global support |
COneTetraFixture | |
Cprecice::profiling::Event::Options | |
►Costream_formatter | |
Cfmt::formatter< Eigen::WithFormat< ExpressionType > > | |
Cfmt::formatter< precice::mesh::BoundingBox > | |
Cfmt::formatter< precice::utils::Parallel::CommState > | |
Cfmt::formatter< precice::utils::RangePreview< Iter > > | |
Cfmt::formatter< precice::utils::statistics::DistanceAccumulator > | |
Cprecice::utils::Parallel | Utility class for managing MPI operations |
Cprecice::testing::ParallelCouplingSchemeFixture | |
CParallelImplicitCouplingSchemeFixture | |
Cprecice::acceleration::impl::ParallelMatrixOperations | |
Cprecice::Participant | Main Application Programming Interface of preCICE. Include using #include <precice/precice.hpp> |
Cprecice::impl::ParticipantImpl | Implementation of Participant. See also pimpl ideom (https://en.cppreference.com/w/cpp/language/pimpl) |
Cprecice::impl::ParticipantState | Holds coupling state of one participating solver in coupled simulation |
Cprecice::testing::ParticipantState | Represents a ParticipantState in a test |
►Cprecice::partition::Partition | Abstract base class for partitions |
Cprecice::partition::ProvidedPartition | A partition that is provided by the participant |
Cprecice::partition::ReceivedPartition | A partition that is computed from a mesh received from another participant |
Cprecice::utils::Petsc | Utility class for managing PETSc operations |
Cboost::geometry::traits::point_order< pm::Triangle > | |
Cboost::geometry::traits::point_type< pm::Edge > | |
Cprecice::mapping::Polation | Calculates the barycentric coordinates of a coordinate on the given vertex/edge/triangle and stores the corresponding weights If all barycentric coordinates are positive, the operation is interpolation. If not, it is an extrapolation |
CPreciceTestLoggingFixture | |
►Cprecice::acceleration::impl::Preconditioner | Interface for preconditioner variants that can be applied to quasi-Newton acceleration schemes |
Cprecice::acceleration::impl::ConstantPreconditioner | Preconditioner that uses the constant user-defined factors to scale the quasi-Newton system |
Cprecice::acceleration::impl::ResidualPreconditioner | Preconditioner that uses the recent residual to scale the quasi-Newton system |
Cprecice::acceleration::impl::ResidualSumPreconditioner | Preconditioner that uses the residuals of all iterations of the current time window summed up to scale the quasi-Newton system. This is somewhat similar to what is done in the Marks and Luke paper |
Cprecice::acceleration::impl::ValuePreconditioner | Preconditioner that uses the values from the previous time window to scale the quasi-Newton system |
Cprecice::query::impl::PrimitiveTraits< T > | Type trait to extract information based on the type of a Primitive |
Cprecice::query::impl::PrimitiveTraits< mesh::Edge > | |
Cprecice::query::impl::PrimitiveTraits< mesh::Tetrahedron > | |
Cprecice::query::impl::PrimitiveTraits< mesh::Triangle > | |
Cprecice::query::impl::PrimitiveTraits< pm::Vertex > | |
Cprecice::query::ProjectionMatch | Struct representing a projection match |
Cprecice::query::impl::PtrVectorIndexable< Container > | Makes a utils::PtrVector indexable and thus be usable in boost::geometry::rtree |
Cprecice::acceleration::impl::QRFactorization | Class that provides functionality for a dynamic QR-decomposition, that can be updated in O(mn) flops if a column is inserted or deleted. The new column is orthogonalized to the existing columns in Q using a modified GramSchmidt algorithm. The zero-elements are generated using suitable givens-roatations. The Interface provides fnctions such as insertColumn, deleteColumn at arbitrary position an push or pull column at front or back, resp |
►Cboost::mpl::quote1 | |
Cprecice::logging::precice_log | Required by BoostLogger to use precice_feature |
Cprecice::mapping::RadialBasisFctSolver< RADIAL_BASIS_FUNCTION_T > | |
Cprecice::mapping::RadialBasisParameters | Wrapper struct that is used to transfer RBF-specific parameters to the GPU |
Cprecice::utils::RangePreview< InputIter > | The RangePreview object used as a lazy proxy struct for proviewing the content of a Range |
Cprecice::testing::Ranks | |
Cprecice::mapping::MappingConfiguration::RBFConfiguration | |
Cprecice::partition::ReceivedPartitionFixture | |
Cprecice::action::RecorderAction::Record | |
►Cprecice::com::Request | |
Cprecice::com::MPIRequest | |
Cprecice::com::SocketRequest | |
CResPreconditionerFixture | |
Cprecice::query::impl::RTreeTraits< Primitive > | The type traits of a rtree based on a Primitive |
Cprecice::time::Sample | |
Cprecice::profiling::ScopedEventPrefix | Class that changes the prefix in its scope |
Cprecice::com::SocketSendQueue::SendItem | |
Cprecice::testing::SerialCouplingSchemeFixture | |
Cprecice::com::serialize::SerializedBoundingBox | Serialized representation of a mesh::BoundingBox |
Cprecice::com::serialize::SerializedBoundingBoxMap | Serialized representation of a BoundingBoxMap |
Cprecice::com::serialize::SerializedConnectionMap | Serialized representation of ConnectionMap |
Cprecice::com::serialize::SerializedMesh | Serialized representation of mesh::Mesh |
Cprecice::com::serialize::SerializedStamples | Serialized representation of CouplingData |
►Cboost::log::sinks::sink | |
Cprecice::logging::NullSink | A custom sink that does nothing. It is used to disable the default sink of boost.Log |
Cprecice::com::SocketSendQueue | |
Cprecice::span< ElementType, Extent > | A C++ 11 implementation of the non-owning C++20 std::span type |
Cprecice::detail::span_storage< E, S > | |
Cprecice::detail::span_storage< E, dynamic_extent > | |
Cprecice::detail::span_storage< ElementType, Extent > | |
Cprecice::mapping::SphericalVertexCluster< RADIAL_BASIS_FUNCTION_T > | |
Cprecice::time::Stample | Stample containing timestampled Sample |
Cprecice::time::Storage | |
Cprecice::utils::StringMaker< MAX > | Utility class to build a string from C functions with output pointers and static maximum length |
Cprecice::utils::StringMatch | |
Cprecice::acceleration::impl::SVDFactorization | Class that provides functionality to maintain a SVD decomposition of a matrix via successive rank-1 updates and truncation with respect to the truncation threshold eps |
Cprecice::profiling::SynchronizeTag | Tag to annotate synchronized events |
CTable | |
Cboost::geometry::traits::tag< Eigen::VectorXd > | Adapts Eigen::VectorXd to boost.geometry |
Cboost::geometry::traits::tag< pm::Edge > | Provides the necessary template specialisations to adapt precice's Edge to boost.geometry |
Cboost::geometry::traits::tag< pm::Triangle > | Provides the necessary template specialisations to adapt precice's Triangle to boost.geometry |
Cboost::geometry::traits::tag< pm::Vertex > | Provides the necessary template specialisations to adapt precice's Vertex to boost.geometry |
Cboost::geometry::traits::tag< pm::Vertex::RawCoords > | Adapts Vertex::RawCoords to boost.geometry |
►Cboost::unit_test::test_tree_visitor | |
Ctest_case_printer | |
Cprecice::testing::TestContext | |
Cprecice::mesh::Tetrahedron | Tetrahedron of a mesh, defined by 4 vertices |
CTetrahedronFixture | |
►Cboost::log::sinks::text_ostream_backend | |
Cprecice::logging::StreamBackend | A simple backends that outputs the message to a stream |
Cprecice::time::Time | |
►Cprecice::profiling::TimedEntry | An event that has been recorded and it waiting to be written to file |
Cprecice::profiling::DataEntry | |
Cprecice::profiling::StartEntry | |
Cprecice::profiling::StopEntry | |
Cprecice::cplscheme::impl::TimeHandler | |
Cprecice::logging::Tracer | |
Cprecice::utils::transform< P, A1, A > | |
Cprecice::mesh::Triangle | Triangle of a mesh, defined by three vertices |
►Cstd::true_type [external] | |
Cprecice::detail::has_size_and_data< T, void_t< decltype(detail::size(std::declval< T >())), decltype(detail::data(std::declval< T >()))> > | |
Cprecice::detail::is_complete< T, decltype(sizeof(T))> | |
Cprecice::detail::is_container_element_type_compatible< T, E, typename std::enable_if< !std::is_same< typename std::remove_cv< decltype(detail::data(std::declval< T >()))>::type, void >::value &&std::is_convertible< remove_pointer_t< decltype(detail::data(std::declval< T >()))>(*)[], E(*)[]>::value >::type > | |
Cprecice::detail::is_span< span< T, S > > | |
Cprecice::detail::is_std_array< std::array< T, N > > | |
Cprecice::utils::conjunction<... > | |
Cstd::tuple_element< I, precice::span< ElementType, Extent > > | |
Cprecice::io::TXTReader | File reader for matrix/vector in Matlab V7 ASCII format |
Cprecice::io::TXTTableWriter | File writer for table-data in text-format |
Cprecice::io::TXTWriter | File writer for matrix in Matlab V7 ASCII format |
►Cimpl::IsDirectIndexableHelper::type | |
Cprecice::query::impl::IsDirectIndexable< Primitive > | |
►Cstd::conditional::type | |
Cprecice::utils::conjunction< B1, Bn... > | |
Cprecice::utils::type_transform< F, Inputs > | |
CUnitSquareFixture | |
Cprecice::acceleration::AccelerationConfiguration::UserDefinitions | |
Cprecice::utils::petsc::Vector | |
Cprecice::query::impl::VectorIndexable< Container > | Makes a std::vector indexable and thus be usable in boost::geometry::rtree |
Cprecice::mesh::Vertex | Vertex of a mesh |
CVertexSpecification | Holds rank, owner, position and value of a single vertex |
Cprecice::utils::petsc::Viewer | |
Cprecice::impl::WatchIntegral | Track and output transient integral data on a mesh |
Cprecice::config::ParticipantConfiguration::WatchIntegralConfig | |
Cprecice::impl::WatchPoint | Observes and exports coordinates of a point on the geometry |
Cprecice::config::ParticipantConfiguration::WatchPointConfig | |
Cprecice::time::Waveform | Allows to perform interpolation on samples in storage of given data |
Cprecice::testing::WaveformFixture | |
Cprecice::mapping::WeightedElement | Struct that contains weight and index of a vertex |
►Cprecice::m2n::WhiteboxAccessor | Struct giving access _useOnlyPrimaryCom |
CCompositionalCouplingSchemeFixture | |
CExplicitCouplingSchemeFixture | |
CSerialImplicitCouplingSchemeFixture | |
►Cprecice::testing::WhiteboxAccessor | Struct giving access to the impl of a befriended class or struct |
CParallelTestFixture | |
Cprecice::xml::XMLAttribute< ATTRIBUTE_T > | |
Cprecice::xml::XMLTag | Represents an XML tag to be configured automatically |