IGLib  1.7.2
The IGLib base library for development of numerical, technical and business applications.
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Events Macros
Package IG.Num

Namespaces

package  Experimental
 

Classes

class  AffineTransformation
 Implementation of a general affine transformation where dimensions of the original and transformed space can be different. More...
 
class  AffineTransformationDiagonal
 Affine transformation with diagonal tansformation matrix. More...
 
class  AffineTransformationDiagonal0_TO_DELETE
 Implementation of a general affine transformation. More...
 
class  AffineTransformationSquare
 Invertible Affine transformation with square transformation matrix. More...
 
class  AnalysisBase
 Base class for direct analysis classes that define optimization problems. Represent the complete definition of the optimization problem (without initial parameters). Concrete analysis classes (e.g. representing optimization examples or complex direct problems solved through numerical simulation) should be derived from this class. More...
 
class  AnalysisComparer
 Compares two sets of analysis results in various different ways. More...
 
class  AnalysisRequestDto
 DTO (Data Transfer Objects) for storing contents of direct analysis request (in optimization problems). More...
 
class  AnalysisResults
 Single objective optimization analysis results. Used to transfer parameters input (e.g. vector of parameters, request flags) to the analysis function and to store analysis output results (e.g. objective and constraint functions, their gradients, error codes, and flags indicating what has actually been calculated). REMARKS: Property CopyReferences specifies whether only references are copied when individial object fields are assigned and set (when the property is true), or values are actually copied (when false - deep copy). Each setter method also has the variant that always copies only the reference (function name appended by "Reference"). This makes possible to avoid duplication of allocated data and also to avoid having different data with the same references. AGREEMENTS: Optimization problem is defined as minimize f(x), subject to: c_i(x) less or equal 0, i=0...NI-1 c_j(x)=0, j=NI...NI+NE-1. Here x is vector of parameters, f(x) is the objective function, and c_i(x) and c_j(c) are constraint functions. NI is number of inequality constraints and NE is number of equality constraints. If there are equality constraints then they are listed after inequality constraints. More...
 
class  AnalysisResultsDto
 DTO (Data Transfer Objects) for storing contents of direct analysis request (in optimization problems). More...
 
class  AnalysisResultsExtensions
 Extension methods for analysis results classes. More...
 
class  BoundingBox
 Bounding box, defines lower and upper bounds on vector quantities such as coordinates of geometrix objects, bounds of domains, etc. More...
 
class  BoundingBox1d
 An 1D bounding box. More...
 
class  BoundingBox2d
 A 2D bounding box. More...
 
class  BoundingBox3d
 A 3D bounding box. More...
 
class  BoundingBoxBase
 Base class for bounding boxes that define minimal and maximal co-ordinates of objects, groups of objects, and regions in space. More...
 
class  CholeskyDecomposition
 Cholesky decomposition of a matrix. Available for symmetric positive definite matrices. More...
 
class  ComposedFunction
 Composition of real functions. More...
 
class  ConstMath
 Mathematical and physical constants. More...
 
class  ConstMisc
 Miscellaneous constants. More...
 
class  ConstPhysical
 Physical constants including units and standard uncertainty. More...
 
struct  Counter
 Represents a real number. More...
 
class  DistanceComparer< PointContainerType, PointType >
 Class that is used to calculate and compare distances between point containers. More...
 
class  DistanceComparerSampledDataElement
 Distance comparer for point clouds where point type is SampledDataElement. More...
 
class  DistanceComparerVector
 
class  EigenValueDecomposition
 Eigenvalue decomposition of a matrix. More...
 
class  ExampleMathClass
 Example class that derives from the M class. Implements a method that uses basic mathematical functions implemented in M. More...
 
class  Field1< TElement >
 A generic field of values of any type. Values must be allocated at once. More...
 
class  Field< TElement >
 A generic field of values of any type. Values must be allocated at once. More...
 
class  FieldCollection2d< TField, TElement >
 Collection of structured 2D fields of the same type. Fields are identified by their names. More...
 
class  FieldCollection3d< TField, TElement >
 Collection of structured 3D fields of the same type. Fields are identified by their names. More...
 
class  FieldCollection< TField, TElement >
 Collection of fields of the same type. Fields are identified by their names. More...
 
class  Func
 Creation of a number of standard real mathematical functions in one dimension. Conttains subclasses for specific functions ans corresponding static creator methods. Creator methods come in 3 different version: for reference form of the function (e.g. just Exp[x]), for form shifted and stretched in x direction, and general form shifted and stretched in both directions. More...
 
class  Func2dBase
 Base class for scalar functions of 2 variables (base for implementation of IFunc2d interface). More...
 
class  Func2dBaseNoGradient
 Base class for scalar functions of 2 variables (implementations of the IFunc2d interface). that do not implement calculation of function Hessian (second derivatives) or gradient. More...
 
class  Func2dBaseNoHessian
 Base class for scalar functions of 2 variables (implementations of the IFunc2d interface). that do not implement calculation of the Hessian (second derivatives). More...
 
class  Func2dBasePlain_ToConsider
 Base class for scalar functions of 2 variables. More...
 
class  Func2dExamples
 Example classes of type Func2dBase. More...
 
class  Func2dFromScalarFunction
 Scalar function of 2 variables that is based on a general scalar function of vector argument. More...
 
class  Func2dFromScalarScript
 Scalar function of 2 variables that is generated from expressions for evaluation of function value, gradient components, etc. More...
 
class  Func2dLinear
 Linear (Affine) function of 2 variables. More...
 
class  Func2dQuadratic
 Quadratic function of 2 variables. More...
 
class  Func2dVectorFormBase
 Base class for scalar functions of 2 variables (base for implementation of IFunc2d interface). More...
 
class  Func3d2dBase
 Base class for 3D vector functions of 2 variables (base for implementation of IFunc3d2d interface). More...
 
class  Func3d2dBaseNoGradient
 Base class for 3D vector functions of 2 variables (implementations of the IFunc3d2d interface) that do not implement calculation of function Hessian (second derivatives) or gradient. More...
 
class  Func3d2dBaseNoHessian
 Base class for 3D vector functions of 2 variables (implementations of the IFunc3d2d interface) that do not implement calculation of the Hessian (second derivatives). More...
 
class  Func3d2dExamples
 Contains a number of example 3D vector functions of 2 variables. More...
 
class  Func3dBase
 Base class for scalar functions of 3 variables (base for implementation of IFunc3d interface). More...
 
class  Func3dBaseNoGradient
 Base class for scalar functions of 3 variables (implementations of the IFunc3d interface). that do not implement calculation of function Hessian (second derivatives) or gradient. More...
 
class  Func3dBaseNoHessian
 Base class for scalar functions of 3 variables (implementations of the IFunc3d interface). that do not implement calculation of the Hessian (second derivatives). More...
 
class  Func3dExamples
 Example classes of type Func3dBase. More...
 
class  Func3dFromScalarFunction
 Scalar function of 3 variables that is based on a general scalar function of vector argument. More...
 
class  Func3dFromScript
 Scalar function of 3 variables that is generated from expressions for evaluation of function value, gradient components, etc. More...
 
class  Func3dLinear
 Linear (Affine) function of 3 variables. More...
 
class  Func3dQuadratic
 Quadratic function of 3 variables. More...
 
class  Func3dVectorFormBase
 Base class for scalar functions of 3 variables (base for implementation of IFunc3d interface). More...
 
class  FunctionPolynomial
 Polynomial real functions of one variable. More...
 
struct  geom3
 Provides static methods used in 3D More...
 
class  Geometry3D
 Provides static methods of 3D analytic geometry. More...
 
class  GridGenerator1d
 Generates 1D grids with equidistant or geometrically grown intervals. More...
 
class  GridGenerator1dBase
 Base class for 1D grid generators. More...
 
class  GridGenerator1dFunc
 Generates 1D grids with equidistant or geometrically grown intervals. More...
 
interface  IAffineTransformation
 Affine Transformation. More...
 
interface  IAnalysis
 Interface for direct analysis classes used in optimization problems. More...
 
interface  IAnalysisResults
 Single objective optimization analysis results. Used to transfer parameters input (e.g. vector of parameters, request flags) to the analysis function and to store analysis output results (e.g. objective and constraint functions, their gradients, error codes, and flags indicating what has actually been calculated). REMARKS: Property CopyReferences specifies whether only references are copied when individial object fields are assigned and set (when the property is true), or values are actually copied (when false - deep copy). Each setter method also has the variant that always copies only the reference (function name appended by "Reference"). This makes possible to avoid duplication of allocated data and also to avoid having different data with the same references. In the beginning of analysis functions, call ResetResults(). More...
 
interface  IBoundingBox
 Bounding box, defines minimum and maximum co-ordinates of domains, geometric objects and their groups. More...
 
interface  IDistanceComparer< PointContainerType, PointType >
 Interface used for distance comparers in point clouds. More...
 
interface  IFunc2d
 Represents scalar functions of 2 variables. More...
 
interface  IFunc3d
 Represents scalar functions of 2 variables. More...
 
interface  IFunc3d2d
 Represents 3D vector functions of 2 variables. More...
 
interface  IGridGenerator1d
 Interface for 1d grid generators. More...
 
interface  ILinearSolver
 Classes that can be used for solution of linear systems of equations. More...
 
interface  IMatrix
 Real matrix interface. More...
 
interface  IMatrix< ComponentType >
 Generic Matrix interface. More...
 
interface  INeuralApproximator
 Approximator of response by using neural networks. $A Igor Mar11; More...
 
interface  INeuralModel
 Interface for artificial neural network -based models that we can operate on. More...
 
class  InputElementDefinition
 Input data element definition for vector functions, approximations, etc. More...
 
class  InputElementDefinitionDto
 DTO (data transfer object) for data input element definition. More...
 
class  InputOutputDataDefiniton
 Definition of input and output data for vector functions, approximations, etc. Contains descriptiove information about individual eleemnts of input and output, default values and eventual bounds of input parameters, etc. More...
 
class  InputOutputDataDefinitonDto
 DTO (data transfer object) for data definition that contains input and output elements. More...
 
class  InputOutputElementDefinition
 Base class for input or output data element definition for vector functions, approximations, etc. More...
 
class  InputOutputElementDefinitionDto< ElementType >
 DTO (data transfer object) for data element definition. More...
 
interface  IOptimizationData
 Information about optimization data and algorithm parameters. More...
 
interface  IOptimizationResults
 Storage of optimization results. Stores optimal results, best current guess, etc. More...
 
interface  IOptimizer
 Interface for optimization algorithms. $A Igor Feb10; More...
 
interface  IPenaltyEvaluator
 Classes that evaluates penalty terms corresponding to a specific penalty function. More...
 
interface  IPointContainer< PointType >
 Basic interface for point container classes. More...
 
interface  IRandomGenerator
 Uniform random number generator. More...
 
interface  IRealFunction
 Interface for real functions. More...
 
interface  IRealFunctionOneParametric
 Parameterized real-valued functions of single variable. More...
 
interface  IRealFunctionParametric
 Parameterized real-valued functions of single variable. More...
 
interface  IRealFunctionPenalty
 Interface that must be satisfied by penalty functions. Penalty functions have small values where argument is less than 0, and grow fast where their argument is positive. More...
 
interface  IResponseEvaluatorVectorSimple
 Interface for simulators and other systems (used e.g. for optimization) that can calculate vector response as a function of vector input parameters. More...
 
interface  IScalarFunction
 Scalar functions of vector arguments, with eventual affine transformation of parameters. If transformation is defined then actual function is evaluated as reference function evaluated at inverse affine transformed parameters. More...
 
interface  IScalarFunctionOneParametric
 
interface  IScalarFunctionParametric
 Parameterized scalar functions with affine transformation of coordinates. More...
 
interface  IScalarFunctionResults
 Storage for results of a scalar function. Includes parameters at which function was (or should be) evaluated, flags specifying what has been and what should be evaluated, calculated value, gradient and Hessian of the function in the specified point. More...
 
interface  IScalarFunctionUntransformed
 Scalar functions of vector arguments. More...
 
interface  IVector
 Real vector intrface. More...
 
interface  IVector< T >
 Generic Vector interface More...
 
interface  IVectorApproximator
 Interface for vector function approximators. More...
 
interface  IVectorFunction
 Vector function of a vector argument. More...
 
interface  IVectorFunctionResults
 Vector function results. Used to transfer parameters input (e.g. vector of parameters, request flags) to the vector function and to store function output results (e.g. values, their gradients, error codes, and flags indicating what has actually been calculated). REMARKS: Property CopyReferences specifies whether only references are copied when individial object fields are assigned and set (when the property is true), or values are actually copied (when false - deep copy). Each setter method also has the variant that always copies only the reference (function name appended by "Reference"). This makes possible to avoid duplication of allocated data and also to avoid having different data with the same references. In the beginning of analysis functions, call ResetResults(). More...
 
class  LinearBasis
 Vector function containing lineer basis in a n-dimensional vector space. Composed of n+1 functions: 1, x1, ..., xn. More...
 
class  LinearBasisSafer
 The same as LinearBasis, just that it has more meaningful error reporting (but is therefore slower). More...
 
class  LinearSolverBase
 
class  LUDecomposition
 LU decomposition of a matrix. More...
 
class  M
 Defines some mathematical functions to be used in derived and other classes. More...
 
struct  mat2
 2D matrix, struct implementation. More...
 
struct  mat3
 3D matrix, struct implementation. More...
 
class  Matrix
 Real matrix class. Some operations are performed by the MathNet.Numerics.LinearAlgebra.Matrix class. More...
 
class  Matrix2d
 Matrix in a 2 dimensional space. More...
 
class  Matrix3d
 Matrix in a 3 dimensional space. More...
 
class  MatrixBase
 Base class for matrices. More...
 
class  MatrixExtensions
 Extension methods for IMatrix interface. More...
 
class  MatrixStore
 Matrix store. More...
 
class  MatrixStore< T >
 Matrix store. More...
 
class  MExt
 Defines some mathematical functions to be used in derived classes. In addition to functions defined in the M class, functions are defined under other names, and some additional functions are also defined. More...
 
class  NamespaceDoc
 This namespace contains various numerical classes. More...
 
class  NeuralApproximatorAforgeFake
 
class  NeuralApproximatorAForgeFakeDto
 A data transfer object (DTO) for the NeuralApproximatorAforge class. $A Igor Mar11; More...
 
class  NeuralApproximatorAforgeIT
 Approximator of response by using neural networks, based on the AforgeDotNet library. $A Igor Mar11; More...
 
class  NeuralApproximatorBase
 Base class for neural network approximators. More...
 
class  NeuralApproximatorDtoBase
 A data transfer object (DTO) for neural approximation classes that implement the INeuralApproximator interface. $A Igor Mar11; More...
 
class  NeuralApproximatorDtoBase< Type >
 A data transfer object (DTO) for neural approximation classes that implement the INeuralApproximator interface. $A Igor Mar11; More...
 
class  NeuralTrainingLimits
 Contains Parameters that define neural network architecture limits and trainig parameter limits. More...
 
class  NeuralTrainingLimitsDto
 Transfer Object (DTO) for neural network training limits. More...
 
class  NeuralTrainingParameters
 Contains Parameters that define neural network architecture and trainig procedure, together with achieved results after training such as various error norms. More...
 
class  NeuralTrainingParametersDto
 Transfer Object (DTO) for neural network training set. More...
 
class  NeuralTrainingTable
 Contains Parameters that define neural network architecture and trainig limits, together with achieved results after training such as various error norms. More...
 
class  NeuralTrainingTableDto
 Transfer Object (DTO) for neural network training results. More...
 
class  NonSIUnit
 Non-SI units whose use is not encouraged or not allowed More...
 
class  Numeric
 
class  OptFileAnalysisClient
 File analysis client. Passes direct analysis request to the server and gets analysis results from it. More...
 
class  OptFileAnalysisServer
 File analysis server. Performs direct analyses by request. More...
 
class  OptFileConst
 Constants used in definition of optimization servers and clients working through file system. More...
 
class  OptFileManager
 Performs elementary operations for optimization and analysis servers and clients that exchange data and messages through files. Each such server can serve a single request at a time (single thread of execution). Client-server pair (or pairs, when both analysis and optimization are performed in this way) has (or have) a single directory for exchanging data and messages. If there is a need for analyses running in parallel, each thread must have its own directory and its own client-server pair. More...
 
class  OptimizationData
 Information about optimization data and algorithm parameters. More...
 
class  OptimizationDataBase
 Base class for holding information about optimization data and algorithm parameters. More...
 
class  OptimizationResults
 
class  OptimizationResultsBase
 Base class for storage of optimization results. Stores optimal analysis results, best current guess, etc. More...
 
class  OptimizerBase
 
class  OutputElementDefinition
 Input data element definition for vector functions, approximations, etc. More...
 
class  OutputElementDefinitionDto
 DTO (data transfer object) for data output element definition. More...
 
class  ParallelJobContainerBase
 Contains input data and results of a parallel job to be executed, oropertied indicating the state of the job, and methods for interaction with job performer and dispatcher. More...
 
class  ParallelJobContainerGen< InputType, ResultType >
 General purpose parallel job container that contains methods for running the job in on the same machine thread. Contains many auxiliary methods for testing and for adaptation of parallel jobs concepts to different tasks. More...
 
class  ParallelJobDispatcherBase
 Base class for parallel job dispatchers. Accepts job requests and dispatches jobs to parallel job servers when available and redy to run a job. More...
 
class  ParallelJobDispatcherBase< JobContainerType >
 Parallel job dispatcher. Accepts job requests and dispatches jobs to parallel job servers when available and redy to run a job. More...
 
class  ParallelJobDispatcherGen< InputType, ResultType >
 Parallel job jerver for job containers that inherit from ParallelJobContainerGen{InputType, ResultType}. More...
 
class  ParallelJobDispatcherGen< InputType, ResultType, JobContainerType >
 Parallel job dispatcher for job containers that inherit from ParallelJobContainerGen{InputType, ResultType}. More...
 
class  ParallelJobServerBase< JobContainerType >
 Parallel job server. Waits for job requests and executes them in a parallel thread. More...
 
class  ParallelJobServerGen< InputType, ResultType >
 Parallel job server for job containers that inherit from ParallelJobContainerGen{InputType, ResultType}. More...
 
class  ParallelJobServerGen< InputType, ResultType, JobContainerType >
 Parallel job server for job containers that inherit from ParallelJobContainerGen{IT,RT}. More...
 
class  PenaltyEvaluator
 Evaluation of penalty functions. More...
 
struct  PhysicalConstant
 Data of a physical constant, including its value, standard error, units, symbol and description. This is alro used for derived SI units and non-SI units. More...
 
class  PhysicalUnit
 SI units (basic and derived) More...
 
class  PointCloud< PointContainerType, PointType >
 Cloud of points, contains a list of containers of objects that include point coordinates. More...
 
class  PointCloud< PointLinkType, PointContainerType, PointType >
 Cloud of points, contains a list of containers of objects that include point coordinates. More...
 
class  PointCloudSampledDataElement
 Cloud of points where each point is represented by the IVector object, contains a list of containers of vector objects that include point coordinates. More...
 
class  PointCloudVector
 Cloud of points where each poinr is represented by the IVector object, contains a list of containers of vector objects that include point coordinates. More...
 
class  PointContainer< PointContainerType, PointType >
 Container class that contains a single point plus all the data that are necessary for searching and re-connecting operations on points. More...
 
class  PointContainer< PointLinkType, PointContainerType, PointType >
 Container class that contains a single point plus all the data that are necessary for searching and re-connecting operations on points. More...
 
class  PointContainerSampledDataElement
 Container class that contains a single vector point plus all the data that are necessary for searching and re-connecting operations on points. More...
 
class  PointContainerVector
 Container class that contains a single vector point plus all the data that are necessary for searching and re-connecting operations on points. More...
 
class  PointLink< PointContainerType, PointType >
 Contains a pointer (link) to another point container. More...
 
class  PointLink< PointLinkType, PointContainerType, PointType >
 Contains a pointer (link) to another point container. More...
 
class  QRDecomposition
 QR decomposition of a matrix. More...
 
class  QuadraticBasis
 Vector function containing quadratic basis in a n-dimensional vector space. Composed of (n+1)*(n+2)/2 functions: 1, x_1, ..., x_n, 0.5*x_1^2, 0.5*x_2^2, ..., 0.5*x_n^2, x_1*x_2, x_1*x_3, ..., x_1*x_n, ..., x_2*x_3, ..., x_2*x_n, ..., ..., x_n-1*x_n. More...
 
class  QuadraticBasisSafer
 The same as QuadraticBasis, just that it has more meaningful exceptions. More...
 
class  RandGeneratorThreadSafe
 Generator of uniformly distributed random numbers. Based on the default random generator. Instance members are thread safe! More...
 
class  RandomGaussian
 Gaussian random number generator. More...
 
class  RandomGenerator
 Default generator of uniformly distributed random numbers. Provides a global generator and a static function for generating new generators. Currently, the generator used is the system's generator built in C#. More...
 
class  RandomGeneratorSystem
 Generator of uniformly distributed random numbers. Based on system random generator. WARNING: Instance members are not guaranteed to be thread safe! More...
 
class  RealFunction
 Represents a real function of a real variabe. More...
 
class  RealFunctionBase
 Base class for real functions of real variable. More...
 
class  RealFunctionOneParametric
 Base class for one parametric families of real-valued functions of single variable. Parameters that completely define the function out of parametric family of functions can be queried or set. More...
 
class  RealFunctionParametric
 Base class for parameterized real-valued functions of single variable. Parameters that completely define the function out of parametric family of functions can be queried or set. Parameters are represented and stored as vector. More...
 
class  RealFunctionParametricBase
 Base class for parameterized real-valued functions of single variable. Parameters that completely define the function out of parametric family of functions can be queried or set. More...
 
class  SampledDataCsv
 Base class for CSV (comma separated files) representation, importer and exporter of sampled data and data definitions. More...
 
class  SampledDataElement
 A single element of a sampled data, contains vector of input parameters and vector of output values. More...
 
class  SampledDataElementDto
 DTO (data transfer object) for sampled data element (one point with vectors of input and output parameters). More...
 
class  SampledDataSet
 Sampled data consisting of elements of which each contains vector of input parameters and output values. More...
 
class  SampledDataSetDto
 Data Transfer Object (DTO) for sampled data set. More...
 
struct  Scalar
 Represents a real number. More...
 
class  ScalarFunctionBase
 Base class for scalar functions with affine transformation of co-ordinates. The reference function is defined while the actual function is defined as that reference function of transformed coordinates. If transformation is not specified then function reduces to the reference one. More...
 
class  ScalarFunctionConstant
 Constant scalar function of vector variable. Function is evaluated according to f(x) = c where x is vector of parameters, and c is the constant scalar term (function value at x=0). More...
 
class  ScalarFunctionExamples
 Various examples of scalar functions. More...
 
class  ScalarFunctionLinear
 Linear scalar function of vector variable. Function is evaluated according to q(x) = b^T*x + c where x is vector of parameters, b is vector of linear coefficients (gradient at x=0) and c is the scalar term (function value at x=0). More...
 
class  ScalarFunctionOneParametric
 Base class for one parametric families of scalar functions with affine transformation of co-ordinates. Parameters that completely define the function out of parametric family of functions can be queried or set. Affine transformation of coordinates is included: the reference function evaluation must be defined while the actual function is defined as that reference function of transformed coordinates. If transformation is not specified then function reduces to the reference one. More...
 
class  ScalarFunctionParametric
 Base class for parameterized scalar functions with affine transformation of co-ordinates. Parameters that completely define the function out of parametric family of functions can be queried or set. Parameters are represented and stored as vector. Affine transformation of coordinates is included: the reference function evaluation must be defined while the actual function is defined as that reference function of transformed coordinates. If transformation is not specified then function reduces to the reference one. More...
 
class  ScalarFunctionParametricBase
 Base class for parameterized scalar functions with affine transformation of co-ordinates. Parameters that completely define the function out of parametric family of functions can be queried or set. Affine transformation of coordinates is included: the reference function evaluation must be defined while the actual function is defined as that reference function of transformed coordinates. If transformation is not specified then function reduces to the reference one. More...
 
class  ScalarFunctionQuadratic
 Quadratic scalar function of vector variable. Function is evaluated according to q(x) = (1/2)*x^T*G*x + b^T*x + c where x is vector of parameters, G is constant Hessian matrix, b is vector of linear coefficients (gradient at x=0) and c is the scalar term (function value at x=0). More...
 
class  ScalarFunctionRadial
 Radial scalar functions. More...
 
class  ScalarFunctionRadialOneParametric
 Base class for one parametric families of radial scalar functions with affine transformation of co-ordinates. Parameters that completely define the function out of parametric family of functions can be queried or set. Affine transformation of coordinates is included: the reference function evaluation must be defined while the actual function is defined as that reference function of transformed coordinates. If transformation is not specified then function reduces to the reference one. More...
 
class  ScalarFunctionRadialParametric
 Parametric scalar function. More...
 
class  ScalarFunctionRadialUntransformed
 Radial scalar functions. More...
 
class  ScalarFunctionRadialUntransformedOneParametric
 One parametric radial scalar function (dependent on one tunning parameter). More...
 
class  ScalarFunctionResults
 Storage for results of a scalar function. Includes parameters at which function was (or should be) evaluated, flags specifying what has been and what should be evaluated, calculated value, gradient and Hessian of the function in the specified point. More...
 
class  ScalarFunctionScriptController
 Class for building scalar functions from scripts, used by GUI elements. More...
 
class  ScalarFunctionScriptControllerBase< ScalarFunctionType >
 Base class for building scalar functions from scripts. This is currently an interrmediate class between the DTO and scalar function, and will probably be gradually replaced. More...
 
class  ScalarFunctionScriptDto
 DTO (data transfer object) for vector interface (IVector). More...
 
class  ScalarFunctionScriptDtoBase< FunctionControllerType >
 Base class for various DTO (Data Transfer Objects) for scalar function controllers. Used to store a state of a scalar function. More...
 
class  ScalarFunctionTransformed
 Scalar function that is defined as some reference function evaluated at inverse affine-trasformed parameters. This class is typically used to convert scalar functions without affine transformation of coordinates (interface IScalarFunctionUntransformed) to those that support affine transformation of coordinates. More...
 
class  ScalarFunctionUntransformedBase
 Base class for defining scalar functions without possibility of affine transformation of parameters. More...
 
class  SimKosecConst
 Constants for (optimization) interface with the simulation code of Gregor Kosec. More...
 
class  SimKosecFileManagerBase
 File manager for interfacing (for optimization purposes) the simulation code of Gregor Kosec. More...
 
class  SimKosecFileManagerConv2
 Interface with simulator of G. Kosec for convection problems in a cave with 2 obstacles. More...
 
class  SimKosecFileManagerConv3
 Interface with simulator of G. Kosec for convection problems in a cave with 3 obstacles. More...
 
class  SimKosecFileManagerConvBase
 Base class for interface with simulator of G. Kosec for convection problems in a cave with obstacles. More...
 
class  SingularValueDecomposition
 Singular value decomposition of a matrix. More...
 
class  SIPrefix
 SI prefixes for producing multiples of the original units (such as kilo- or micro-). More...
 
class  SpeedTestCpu
 Various utilities for testing computational speed of the current system. More...
 
class  StructuredField2d< TElement >
 Field where field elements are arranged in a 2 dimensional array. Usually represents a field over a structured 2D mesh. More...
 
class  StructuredField3d< TElement >
 Field where field elements are arranged in a 3 dimensional array. Usually represents a field over a structured 3D mesh. More...
 
class  StructuredMesh2d3d
 2D structured mesh in 3D. More...
 
class  StructuredMesh2d< TCoord, TIndexField, TIndex, TScalarField, TScalar, TVectorField, TVector, TTensorField, TTensor >
 Generic 2D structured mesh with collections of named scalar, vector, tensor and index fields. More...
 
class  StructuredMesh3d
 Structured mesh in 3D. More...
 
class  StructuredMesh3d< TCoord, TIndexField, TIndex, TScalarField, TScalar, TVectorField, TVector, TTensorField, TTensor >
 Generic 3D structured mesh with collections of named scalar, vector, tensor and index fields. More...
 
class  StructuredMeshGeometry2d< TCoord >
 Structured mesh geometry in 2 dimensions. More...
 
class  StructuredMeshGeometry3d< TCoord >
 Structured mesh geometry in 3 dimensions. More...
 
class  TestClass
 
class  TestTrainingParametersComparers
 Class for testing of Comparers for NeuralTrainingParameters. More...
 
class  UnstructuredMesh1d2d
 Unstructured mesh in 1D embedded in 2D space. More...
 
class  UnstructuredMesh1d3d
 Unstructured mesh in 1D embedded in 3D space. More...
 
class  UnstructuredMesh1d< TCoord, TIndexField, TIndex, TScalarField, TScalar, TVectorField, TVector, TTensorField, TTensor >
 Generic 1D unstructured mesh with collections of named scalar, vector, tensor and index fields. More...
 
class  UnStructuredMesh2d
 2D structured mesh. More...
 
class  UnstructuredMesh2d
 Unstructured mesh in 2D. More...
 
class  UnstructuredMesh2d< TCoord, TIndexField, TIndex, TScalarField, TScalar, TVectorField, TVector, TTensorField, TTensor >
 Generic 2D unstructured mesh with collections of named scalar, vector, tensor and index fields. More...
 
class  UnstructuredMesh3d
 Unstructured mesh in 3D. More...
 
class  UnstructuredMesh3d< TCoord, TIndexField, TIndex, TScalarField, TScalar, TVectorField, TVector, TTensorField, TTensor >
 Generic 3D unstructured mesh with collections of named scalar, vector, tensor and index fields. More...
 
class  UnstructuredMeshGeometry1d< TCoord >
 Geometry and topology of an unstructured 1D mesh. Presents both connected meshes and unconnected sets of points. More...
 
class  UnstructuredMeshGeometry2d< TCoord >
 Geometry and topology of an unstructured 2D mesh. Presents both connected meshes and unconnected sets of points. More...
 
class  UnstructuredMeshGeometry3d< TCoord >
 Geometry and topology of an unstructured 2D mesh. Presents both connected meshes and unconnected sets of points. More...
 
class  UtilMath
 
struct  vec2
 2D vector, struct implementation. More...
 
struct  vec3
 3D vector, struct implementation. More...
 
class  Vector
 Real vector class. More...
 
class  Vector2d
 Vector or point in a 2 dimensional space. More...
 
class  Vector3d
 Vector or point in a 3 dimensional space. More...
 
class  VectorApproximatorBase
 Base class for vector function approximators. More...
 
class  VectorBase
 Base class for real vectors. More...
 
class  VectorExtensions
 Extension methods for vector classes. More...
 
class  VectorFunctionBase
 Base class for defining Vector functions whose evaluation is defined in bulk, and evaluation of individual components can not be performed directly. For these functioons, individual values and individual gradient or vector components are evaluated in such a way thet the function is first evaluated as whole, storing its results to an object implementing IVectorFunctionResults. More...
 
class  VectorFunctionBaseComponentWise
 Base class for defining Vector functions whose component-wise evaluation is defined directly. More...
 
class  VectorFunctionBaseGeneral
 Base class for VectorFunctionBase and VectorFunctionBaseComponentwise. In general, use and in order to derive from. More...
 
class  VectorFunctionExamples
 Various vector function examples. More...
 
class  VectorFunctionFromScalar
 
class  VectorFunctionRequestDTO
 DTO (Data Transfer Objects) for storing contents of vector function evaluation request. More...
 
class  VectorFunctionResults
 Vector function results. Used to transfer parameters input (e.g. vector of parameters, request flags) to the vector function and to store function output results (e.g. values, their gradients, error codes, and flags indicating what has actually been calculated). REMARKS: Property CopyReferences specifies whether only references are copied when individial object fields are assigned and set (when the property is true), or values are actually copied (when false - deep copy). Each setter method also has the variant that always copies only the reference (function name appended by "Reference"). This makes possible to avoid duplication of allocated data and also to avoid having different data with the same references. In the beginning of analysis functions, call ResetResults(). More...
 
class  VectorFunctionResultsDto
 DTO (Data Transfer Objects) for storing contents of vector function results. More...
 
class  VectorFunctionScriptController
 Class for building vector functions from scripts, used by GUI elements. More...
 
class  VectorFunctionScriptControllerBase< VectorFunctionType, ScalarFunctionControllerType, ScalarFunctionType >
 Base class for building vector functions from scripts. This is currently an interrmediate class between the DTO and a vector function, and will probably be gradually replaced. More...
 
class  VectorFunctionScriptDto
 DTO (data transfer object) for vector interface (IVector). More...
 
class  VectorFunctionScriptDtoBase< FunctionControllerType, ScalarFunctionControllerType, ScalarFunctionDtoType >
 Base class for various DTO (Data Transfer Objects) for scalar function controllers. Used to store a state of a scalar function. More...
 
class  VectorStore
 Vector store. More...
 
class  VectorStore< T >
 Vector store. More...
 

Enumerations

enum  SI {
  SI.m, SI.kg, SI.s, SI.A,
  SI.K, SI.cd, SI.mol
}
 SI base units (International system of units). More...
 
enum  Operation {
  Operation.None = 0, Operation.Addition, Operation.Subtraction, Operation.Multiplication,
  Operation.Division, Operation.Composition, Operation.UnaryPlus, Operation.UnaryMinus
}
 
enum  ParallelJobState {
  ParallelJobState.Uninitialized = 0, ParallelJobState.Initialized, ParallelJobState.Unemployed, ParallelJobState.DataReady,
  ParallelJobState.EnQueued, ParallelJobState.Executing, ParallelJobState.ResultsReady, ParallelJobState.Aborted,
  ParallelJobState.ResultsProcessed
}
 Job states. More...
 
enum  ParallelServerState { ParallelServerState.Uninitialized = 0, ParallelServerState.Idle, ParallelServerState.Executing, ParallelServerState.Inactive }
 Defines state of the parallel server. More...
 

Functions

delegate RealFunction DlgFunctionTransformation (RealFunction f)
 Operators on univariate real functions, transforms a function to obtain another one. More...
 
delegate double DlgFunctionValue (double x)
 Represents real function of real variable. More...
 
delegate double DlgFunctionHigherDerivative (double x, int order)
 Represents derivative of real function of real variable of arbitrary order. More...
 
delegate double DlgFunctionParametric (double x, Vector p)
 Reprents parametric family of real functions of real variable. More...
 
delegate double DlgFunctionParametricHigherDerivative (double x, Vector p, int order)
 Arbitrary order derivative of parametric family of real functions with respect to function argument. More...
 
delegate double DistanceDelegate< in PointType > (PointType pt1, PointType pt2)
 
delegate void ParallelJobCallback (ParallelJobContainerBase jobContainer)
 Callback delegate that can be assigned to job container for execution at various notification events (such as job started, etc.). More...
 
delegate ResultType SimpleFunctionDelegate< InputType, ResultType > (InputType input)
 A generic delegate that can contain simple functions that take one input argument of the specified type, and return result of another type. More...
 
delegate void ParallelJobCallbackGen< InputType, ResultType > (ParallelJobContainerGen< InputType, ResultType > jobContainer)
 Callback delegate that can be assigned to job container for execution at various notification events (such as job started, etc.). Used in simple events. More...
 

Enumeration Type Documentation

enum IG.Num.SI

SI base units (International system of units).

Enumerator

Metre, an SI unit for length.

kg 

Kilogram, an SI unit for mass.

Second, an SI unit for time.

Ampere, an SI unit for electric current.

Kelvin, an SI unit for thermodynamic temperature.

cd 

Candela, an SI unit for luminous intensity.

mol 

Mole, an SI unit for amount of substance.

Enumerator
None 
Addition 
Subtraction 
Multiplication 
Division 
Composition 
UnaryPlus 
UnaryMinus 

Job states.

$A Igor Mar08;

Enumerator
Uninitialized 
Initialized 
Unemployed 
DataReady 
EnQueued 
Executing 
ResultsReady 
Aborted 
ResultsProcessed 

Defines state of the parallel server.

Enumerator
Uninitialized 
Idle 
Executing 
Inactive 

Function Documentation

delegate RealFunction IG.Num.DlgFunctionTransformation ( RealFunction  f)

Operators on univariate real functions, transforms a function to obtain another one.

Parameters
fFunction that is transformed.
Returns
Transformed function.

$A Igor xx;

delegate double IG.Num.DlgFunctionValue ( double  x)

Represents real function of real variable.

$A Igor xx;

Referenced by IG.Num.Numeric.TestDifferentiation(), IG.Num.Numeric.TestIntegration(), and IG.Num.RealFunction.TestSpeed().

delegate double IG.Num.DlgFunctionHigherDerivative ( double  x,
int  order 
)

Represents derivative of real function of real variable of arbitrary order.

$A Igor xx;

delegate double IG.Num.DlgFunctionParametric ( double  x,
Vector  p 
)

Reprents parametric family of real functions of real variable.

$A Igor xx;

delegate double IG.Num.DlgFunctionParametricHigherDerivative ( double  x,
Vector  p,
int  order 
)

Arbitrary order derivative of parametric family of real functions with respect to function argument.

$A Igor xx;

delegate double IG.Num.DistanceDelegate< in PointType > ( PointType  pt1,
PointType  pt2 
)
delegate void IG.Num.ParallelJobCallback ( ParallelJobContainerBase  jobContainer)

Callback delegate that can be assigned to job container for execution at various notification events (such as job started, etc.).

Parameters
jobContainerJob container that executed the callback.
delegate ResultType IG.Num.SimpleFunctionDelegate< InputType, ResultType > ( InputType  input)

A generic delegate that can contain simple functions that take one input argument of the specified type, and return result of another type.

Template Parameters
InputTypeType of the function input argument.
ResultTypeType of function result (returned by the function).
Parameters
inputInput argument of the function.
Returns
Result of calculation performed by the function.
delegate void IG.Num.ParallelJobCallbackGen< InputType, ResultType > ( ParallelJobContainerGen< InputType, ResultType >  jobContainer)

Callback delegate that can be assigned to job container for execution at various notification events (such as job started, etc.). Used in simple events.

Template Parameters
InputTypeType of parallel jobs input data.
ResultTypeType of parallel jobs results data.
Parameters
jobContainerJob container that executed the callback.