From fe43b80536fe456a3c51c889aa1b062154026d34 Mon Sep 17 00:00:00 2001 From: Henry Weller <http://cfd.direct> Date: Sat, 30 Apr 2016 21:40:09 +0100 Subject: [PATCH] GeometricField: Renamed internalField() -> primitiveField() and dimensionedInternalField() -> internalField() These new names are more consistent and logical because: primitiveField(): primitiveFieldRef(): Provides low-level access to the Field<Type> (primitive field) without dimension or mesh-consistency checking. This should only be used in the low-level functions where dimensional consistency is ensured by careful programming and computational efficiency is paramount. internalField(): internalFieldRef(): Provides access to the DimensionedField<Type, GeoMesh> of values on the internal mesh-type for which the GeometricField is defined and supports dimension and checking and mesh-consistency checking. --- applications/solvers/DNS/dnsFoam/dnsFoam.C | 2 +- .../basicXiSubXiEq/basicXiSubXiEq.C | 4 +- .../XiGModels/basicXiSubG/basicXiSubG.C | 2 +- .../solvers/combustion/PDRFoam/StCourantNo.H | 4 +- .../XiModels/XiEqModels/Gulder/Gulder.C | 2 +- .../XiModels/XiEqModels/SCOPEXiEq/SCOPEXiEq.C | 2 +- .../XiModels/XiEqModels/XiEqModel/XiEqModel.C | 6 +- .../combustion/reactingFoam/setRDeltaT.H | 8 +- .../rhoCentralFoam/centralCourantNo.H | 2 +- .../rhoCentralFoam/createFields.H | 2 +- .../compressible/rhoCentralFoam/setRDeltaT.H | 4 +- .../compressible/rhoPimpleFoam/setRDeltaT.H | 12 +- .../fluid/compressibleCourantNo.C | 4 +- .../solid/createSolidFields.H | 2 +- .../solid/setRegionSolidFields.H | 2 +- .../solid/solidRegionDiffNo.C | 2 +- .../boundaryFoam/interrogateWallPatches.H | 2 +- .../shallowWaterFoam/CourantNo.H | 6 +- .../solvers/lagrangian/DPMFoam/CourantNo.H | 2 +- .../solvers/lagrangian/DPMFoam/DPMFoam.C | 2 +- .../lagrangian/coalChemistryFoam/setRDeltaT.H | 8 +- .../reactingParcelFoam/setRDeltaT.H | 8 +- .../multiphase/cavitatingFoam/CourantNo.H | 4 +- .../multiphase/interFoam/alphaCourantNo.H | 4 +- .../interMixingFoam/alphaEqnsSubCycle.H | 2 +- .../solvers/multiphase/interFoam/setRDeltaT.H | 12 +- .../multiphaseEulerFoam/CourantNo.H | 4 +- .../dragModels/segregated/segregated.C | 2 +- ...terfaceCompositionPhaseChangePhaseSystem.C | 6 +- .../ThermalPhaseChangePhaseSystem.C | 24 +-- .../reactingMultiphaseEulerFoam/CourantNo.H | 4 +- .../reactingMultiphaseEulerFoam/setRDeltaT.H | 4 +- .../reactingTwoPhaseEulerFoam/CourantNos.H | 2 +- .../reactingTwoPhaseEulerFoam/setRDeltaT.H | 4 +- ...ayatillekeWallFunctionFvPatchScalarField.C | 2 +- ...allBoilingWallFunctionFvPatchScalarField.C | 2 +- ...sonJacksonParticleSlipFvPatchVectorField.C | 2 +- ...onJacksonParticleThetaFvPatchScalarField.C | 2 +- .../twoLiquidMixingFoam/alphaCourantNo.H | 2 +- .../multiphase/twoPhaseEulerFoam/CourantNos.H | 2 +- .../dragModels/segregated/segregated.C | 2 +- ...sonJacksonParticleSlipFvPatchVectorField.C | 2 +- ...onJacksonParticleThetaFvPatchScalarField.C | 2 +- .../Test-GAMGAgglomeration.C | 4 +- .../test/fieldMapping/Test-fieldMapping.C | 4 +- applications/test/hexRef8/Test-hexRef8.C | 6 +- .../test/mappedPatch/Test-MappedPatch.C | 2 +- .../backgroundMeshDecomposition.C | 4 +- .../conformalVoronoiMeshIO.C | 14 +- .../conformalVoronoiMeshTemplates.C | 2 +- .../foamyHexMeshBackgroundMesh.C | 4 +- .../manipulation/deformedGeom/deformedGeom.C | 2 +- .../domainDecompositionDistribute.C | 2 +- .../pointFieldDecomposerDecomposeFields.C | 2 +- .../foamToEnsight/ensightField.C | 6 +- .../foamToTetDualMesh/foamToTetDualMesh.C | 2 +- .../foamToVTK/writeFunsTemplates.C | 2 +- .../vtkPV3Foam/vtkPV3FoamPointFields.H | 2 +- .../vtkPVFoam/vtkPVFoamPointFields.H | 2 +- .../utilities/preProcessing/boxTurb/boxTurb.C | 2 +- .../preProcessing/setFields/setFields.C | 2 +- .../GeometricField/GeometricField.C | 20 +-- .../GeometricField/GeometricField.H | 6 +- .../GeometricField/GeometricFieldFunctions.C | 28 +-- .../GeometricField/GeometricFieldFunctionsM.C | 20 +-- .../GeometricField/GeometricFieldI.H | 4 +- .../GeometricField/MapGeometricFields.H | 2 +- .../GeometricScalarField.C | 28 ++- .../SlicedGeometricField.C | 4 +- .../geometricOneField/geometricOneField.H | 2 +- .../geometricOneField/geometricOneFieldI.H | 2 +- .../transformGeometricField.C | 16 +- .../basicSymmetryPointPatchField.C | 2 +- .../basic/value/valuePointPatchField.C | 4 +- .../constraint/cyclic/cyclicPointPatchField.C | 2 +- .../cyclicSlip/cyclicSlipPointPatchField.C | 2 +- ...nonuniformTransformCyclicPointPatchField.C | 2 +- .../symmetryPlanePointPatchField.C | 2 +- .../constraint/wedge/wedgePointPatchField.C | 2 +- .../codedFixedValuePointPatchField.C | 4 +- .../fixedNormalSlipPointPatchField.C | 2 +- .../pointPatchField/pointPatchField.C | 18 +- .../pointPatchField/pointPatchField.H | 4 +- ...convectiveHeatTransferFvPatchScalarField.C | 2 +- ...oupledTemperatureMixedFvPatchScalarField.C | 2 +- ...allHeatFluxTemperatureFvPatchScalarField.C | 6 +- .../thermalBaffle1DFvPatchScalarField.C | 4 +- ...RateAdvectiveDiffusiveFvPatchScalarField.C | 4 +- ...tureCoupledBaffleMixedFvPatchScalarField.C | 8 +- ...eratureRadCoupledMixedFvPatchScalarField.C | 8 +- ...ayatillekeWallFunctionFvPatchScalarField.C | 2 +- .../alphatWallFunctionFvPatchScalarField.C | 2 +- .../wallHeatTransferFvPatchScalarField.C | 2 +- ...ayatillekeWallFunctionFvPatchScalarField.C | 2 +- .../LES/LESdeltas/IDDESDelta/IDDESDelta.C | 4 +- .../cubeRootVolDelta/cubeRootVolDelta.C | 4 +- .../LES/LESdeltas/maxDeltaxyz/maxDeltaxyz.C | 4 +- .../anisotropicFilter/anisotropicFilter.C | 8 +- ...thDissipationRateInletFvPatchScalarField.C | 2 +- ...ngLengthFrequencyInletFvPatchScalarField.C | 2 +- .../fixedShearStressFvPatchVectorField.C | 2 +- .../porousBafflePressureFvPatchField.C | 4 +- .../epsilonWallFunctionFvPatchScalarField.C | 20 +-- .../fWallFunctionFvPatchScalarField.C | 2 +- .../kLowReWallFunctionFvPatchScalarField.C | 2 +- .../nutLowReWallFunctionFvPatchScalarField.C | 2 +- .../nutURoughWallFunctionFvPatchScalarField.C | 6 +- ...tUSpaldingWallFunctionFvPatchScalarField.C | 6 +- ...UTabulatedWallFunctionFvPatchScalarField.C | 4 +- .../nutUWallFunctionFvPatchScalarField.C | 6 +- ...tkAtmRoughWallFunctionFvPatchScalarField.C | 2 +- .../nutkRoughWallFunctionFvPatchScalarField.C | 2 +- .../nutkWallFunctionFvPatchScalarField.C | 4 +- .../omegaWallFunctionFvPatchScalarField.C | 20 +-- .../v2WallFunctionFvPatchScalarField.C | 2 +- .../dynamicRefineFvMesh/dynamicRefineFvMesh.C | 2 +- src/dynamicFvMesh/include/meshCourantNo.H | 2 +- .../fvMeshAdder/fvMeshAdderTemplates.C | 8 +- .../motionSmoother/motionSmootherAlgo.C | 6 +- .../compressible/compressibleCourantNo.H | 4 +- .../cfdTools/general/MRF/MRFZone.C | 2 +- .../cfdTools/general/MRF/MRFZoneTemplates.C | 4 +- .../general/SRF/SRFModel/SRFModel/SRFModel.C | 2 +- .../SRFFreestreamVelocityFvPatchVectorField.C | 4 +- .../cfdTools/general/bound/bound.C | 10 +- .../cfdTools/general/include/volContinuity.H | 2 +- .../cfdTools/incompressible/CourantNo.H | 2 +- .../basic/calculated/calculatedFvPatchField.C | 16 +- .../basic/sliced/slicedFvPatchField.C | 2 +- .../constraint/cyclic/cyclicFvPatchField.C | 12 +- .../cyclicACMI/cyclicACMIFvPatchField.C | 14 +- .../cyclicAMI/cyclicAMIFvPatchField.C | 12 +- .../constraint/empty/emptyFvPatchField.C | 10 +- .../jumpCyclic/jumpCyclicFvPatchField.C | 4 +- .../jumpCyclic/jumpCyclicFvPatchFields.C | 2 +- .../jumpCyclicAMI/jumpCyclicAMIFvPatchField.C | 4 +- .../jumpCyclicAMIFvPatchFields.C | 2 +- .../processor/processorFvPatchField.C | 8 +- .../processorCyclicFvPatchField.C | 8 +- .../symmetry/symmetryFvPatchField.C | 8 +- .../symmetryPlane/symmetryPlaneFvPatchField.C | 8 +- .../constraint/wedge/wedgeFvPatchField.C | 8 +- .../derived/advective/advectiveFvPatchField.C | 18 +- .../codedFixedValueFvPatchField.C | 4 +- .../codedMixed/codedMixedFvPatchField.C | 4 +- .../externalCoupledMixedFvPatchField.C | 12 +- .../fanPressureFvPatchScalarField.C | 4 +- .../fluxCorrectedVelocityFvPatchVectorField.C | 4 +- .../freestreamPressureFvPatchScalarField.C | 4 +- .../mappedField/mappedFieldFvPatchField.C | 2 +- .../mappedField/mappedPatchFieldBase.C | 8 +- .../mappedFixedInternalValueFvPatchField.C | 2 +- ...ppedFixedPushedInternalValueFvPatchField.C | 2 +- .../mappedFixedValueFvPatchField.C | 2 +- .../mappedFlowRateFvPatchVectorField.C | 8 +- ...mappedVelocityFluxFixedValueFvPatchField.C | 14 +- .../movingWallVelocityFvPatchVectorField.C | 4 +- .../outletMappedUniformInletFvPatchField.C | 2 +- .../plenumPressureFvPatchScalarField.C | 10 +- ...tedInletOutletVelocityFvPatchVectorField.C | 4 +- ...eDirectedInletVelocityFvPatchVectorField.C | 4 +- ...tOutletParSlipVelocityFvPatchVectorField.C | 4 +- .../pressureInletVelocityFvPatchVectorField.C | 4 +- ...malInletOutletVelocityFvPatchVectorField.C | 4 +- .../supersonicFreestreamFvPatchVectorField.C | 12 +- ...lFlowRateInletVelocityFvPatchVectorField.C | 4 +- .../syringePressureFvPatchScalarField.C | 4 +- .../timeVaryingMappedFixedValueFvPatchField.C | 2 +- .../totalPressureFvPatchScalarField.C | 4 +- ...sityKineticEnergyInletFvPatchScalarField.C | 4 +- .../uniformTotalPressureFvPatchScalarField.C | 4 +- .../waveSurfacePressureFvPatchScalarField.C | 4 +- .../fvPatchFields/fvPatchField/fvPatchField.H | 4 +- .../basic/sliced/slicedFvsPatchField.C | 2 +- .../constraint/empty/emptyFvsPatchField.C | 2 +- .../fvsPatchField/fvsPatchField.H | 4 +- .../gaussConvectionScheme.C | 4 +- .../EulerD2dt2Scheme/EulerD2dt2Scheme.C | 56 +++--- .../CoEulerDdtScheme/CoEulerDdtScheme.C | 79 ++++----- .../CrankNicolsonDdtScheme.C | 164 +++++++++--------- .../EulerDdtScheme/EulerDdtScheme.C | 61 +++---- .../ddtSchemes/SLTSDdtScheme/SLTSDdtScheme.C | 87 +++++----- .../backwardDdtScheme/backwardDdtScheme.C | 102 +++++------ .../ddtSchemes/ddtScheme/ddtScheme.C | 6 +- .../localEulerDdtScheme/localEulerDdtScheme.C | 71 ++++---- .../finiteVolume/fvc/fvcAverage.C | 6 +- .../finiteVolume/fvc/fvcSurfaceIntegrate.C | 2 +- .../finiteVolume/fvc/fvcVolumeIntegrate.C | 4 +- src/finiteVolume/finiteVolume/fvm/fvmSup.C | 2 +- .../cellLimitedGrad/cellLimitedGrads.C | 16 +- .../cellMDLimitedGrad/cellMDLimitedGrads.C | 8 +- .../faceLimitedGrad/faceLimitedGrads.C | 8 +- .../gaussLaplacianScheme.C | 4 +- .../gaussLaplacianSchemes.C | 6 +- .../faceCorrectedSnGrad/faceCorrectedSnGrad.C | 2 +- .../limitedSnGrad/limitedSnGrad.C | 6 +- .../fvMatrices/fvMatrix/fvMatrix.C | 54 +++--- .../fvMatrices/fvMatrix/fvMatrixSolve.C | 6 +- .../fvScalarMatrix/fvScalarMatrix.C | 20 +-- .../faceAreaPairGAMGAgglomeration.C | 6 +- .../solvers/MULES/CMULESTemplates.C | 12 +- .../solvers/MULES/IMULESTemplates.C | 4 +- src/finiteVolume/fvMesh/fvMesh.C | 5 +- .../fvMeshSubset/fvMeshSubsetInterpolate.C | 10 +- .../LimitedScheme/LimitedScheme.C | 2 +- .../limitedSchemes/PhiScheme/PhiScheme.C | 2 +- .../limitedSurfaceInterpolationScheme.C | 2 +- .../schemes/cellCoBlended/cellCoBlended.H | 4 +- .../schemes/clippedLinear/clippedLinear.H | 4 +- .../schemes/pointLinear/pointLinear.C | 2 +- .../schemes/reverseLinear/reverseLinear.H | 4 +- .../skewCorrected/skewCorrectionVectors.C | 2 +- .../surfaceInterpolation.C | 2 +- .../surfaceInterpolationScheme.C | 4 +- .../volPointInterpolation/pointConstraints.C | 4 +- .../pointConstraintsTemplates.C | 2 +- .../volPointInterpolate.C | 2 +- ...lacementComponentLaplacianFvMotionSolver.C | 12 +- ...velocityComponentLaplacianFvMotionSolver.C | 2 +- .../displacementSBRStressFvMotionSolver.C | 2 +- .../displacementLaplacianFvMotionSolver.C | 10 +- .../displacementLayeredMotionMotionSolver.C | 2 +- .../velocityLaplacianFvMotionSolver.C | 2 +- .../cellMotion/cellMotionFvPatchField.C | 4 +- .../inverseDistanceDiffusivity.C | 2 +- .../inverseVolume/inverseVolumeDiffusivity.C | 2 +- ...llatingDisplacementPointPatchVectorField.C | 2 +- ...OscillatingVelocityPointPatchVectorField.C | 2 +- ...llatingDisplacementPointPatchVectorField.C | 2 +- ...oscillatingVelocityPointPatchVectorField.C | 2 +- ...aceSlipDisplacementPointPatchVectorField.C | 2 +- ...meVaryingMappedFixedValuePointPatchField.C | 2 +- ...polatedDisplacementPointPatchVectorField.C | 6 +- .../waveDisplacementPointPatchVectorField.C | 2 +- .../limitTemperature/limitTemperature.C | 2 +- .../derived/rotorDiskSource/rotorDiskSource.C | 4 +- .../rotorDiskSourceTemplates.C | 2 +- .../interRegionExplicitPorositySource.C | 16 +- .../interRegionHeatTransferModel.C | 2 +- .../tabulatedHeatTransfer.C | 2 +- .../variableHeatTransfer.C | 2 +- .../genericFvPatchField/genericFvPatchField.C | 54 +++--- .../genericPointPatchField.C | 28 +-- .../clouds/Templates/DSMCCloud/DSMCCloud.C | 16 +- .../KinematicCloud/KinematicCloudI.H | 8 +- .../clouds/Templates/MPPICCloud/MPPICCloud.C | 4 +- .../Templates/ReactingCloud/ReactingCloudI.H | 2 +- .../Templates/ThermoCloud/ThermoCloudI.H | 6 +- .../ParticleErosion/ParticleErosion.C | 2 +- .../ParticleTrap/ParticleTrap.C | 2 +- .../VoidFraction/VoidFraction.C | 4 +- .../AveragingMethod/AveragingMethod.C | 8 +- .../AveragingMethod/AveragingMethod.H | 2 +- .../MPPIC/AveragingMethods/Basic/Basic.C | 6 +- .../MPPIC/AveragingMethods/Basic/Basic.H | 2 +- .../MPPIC/AveragingMethods/Dual/Dual.C | 2 +- .../MPPIC/AveragingMethods/Dual/Dual.H | 2 +- .../MPPIC/AveragingMethods/Moment/Moment.C | 2 +- .../MPPIC/AveragingMethods/Moment/Moment.H | 2 +- .../MPPIC/PackingModels/Implicit/Implicit.C | 18 +- .../molecule/mdTools/averageMDFields.H | 18 +- .../molecule/mdTools/createMDFields.H | 20 +-- .../GradientDispersionRAS.C | 6 +- .../StochasticDispersionRAS.C | 4 +- .../medialAxisMeshMover.C | 2 +- .../cyclicACMIPointPatchField.C | 2 +- .../cyclicAMIPointPatchField.C | 2 +- .../fvFieldDecomposerDecomposeFields.C | 14 +- .../fvFieldReconstructorReconstructFields.C | 4 +- ...pointFieldReconstructorReconstructFields.C | 2 +- .../regionSizeDistribution.C | 6 +- src/randomProcesses/Kmesh/Kmesh.C | 2 +- src/randomProcesses/fft/calcEk.C | 2 +- .../energyRegionCoupledFvPatchScalarField.C | 12 +- .../reactingOneDim/reactingOneDim.C | 6 +- ...sRadiativeCoupledMixedFvPatchScalarField.C | 8 +- ...rolysisVelocityCoupledFvPatchVectorField.C | 4 +- ...alphatFilmWallFunctionFvPatchScalarField.C | 2 +- .../nutkFilmWallFunctionFvPatchScalarField.C | 6 +- .../kinematicSingleLayer.C | 6 +- .../constantFilmThermo/constantFilmThermo.C | 10 +- .../liquidFilmThermo/liquidFilmThermo.C | 10 +- .../contactAngleForce/contactAngleForce.C | 2 +- .../curvatureSeparation/curvatureSeparation.C | 6 +- .../standardRadiation/standardRadiation.C | 2 +- .../phaseChangeModel/phaseChangeModel.C | 2 +- src/rigidBodyMeshMotion/rigidBodyMeshMotion.C | 14 +- src/sampling/graphField/makeGraph.C | 2 +- src/sampling/graphField/writeCellGraph.C | 4 +- src/sampling/meshToMesh/meshToMeshTemplates.C | 4 +- .../distanceSurface/distanceSurface.C | 4 +- .../sampledSurface/isoSurface/isoSurface.C | 4 +- .../isoSurface/sampledIsoSurface.C | 8 +- .../isoSurface/sampledIsoSurfaceCell.C | 8 +- .../sampledCuttingPlane/sampledCuttingPlane.C | 4 +- .../sampledPatchInternalFieldTemplates.C | 2 +- .../sampledThresholdCellFaces.C | 2 +- ...gidBodyDisplacementPointPatchVectorField.C | 2 +- ...gidBodyDisplacementPointPatchVectorField.C | 2 +- .../sixDoFRigidBodyMotionSolver.C | 12 +- .../basic/basicThermo/basicThermo.C | 4 +- .../basic/heThermo/heThermo.C | 6 +- .../basic/psiThermo/hePsiThermo.C | 8 +- .../basic/rhoThermo/heRhoThermo.C | 10 +- ...iffusiveRadiationMixedFvPatchScalarField.C | 2 +- ...veViewFactorFixedValueFvPatchScalarField.C | 2 +- ...iffusiveRadiationMixedFvPatchScalarField.C | 2 +- .../greyMeanAbsorptionEmission.C | 6 +- .../greyMeanSolidAbsorptionEmission.C | 6 +- .../wideBandAbsorptionEmission.C | 16 +- .../psiuReactionThermo/heheuPsiThermo.C | 22 +-- .../pyrolysisChemistryModel.C | 2 +- .../solidThermo/solidThermo/heSolidThermo.C | 8 +- 313 files changed, 1182 insertions(+), 1157 deletions(-) diff --git a/applications/solvers/DNS/dnsFoam/dnsFoam.C b/applications/solvers/DNS/dnsFoam/dnsFoam.C index 720e01f542..b889c38674 100644 --- a/applications/solvers/DNS/dnsFoam/dnsFoam.C +++ b/applications/solvers/DNS/dnsFoam/dnsFoam.C @@ -61,7 +61,7 @@ int main(int argc, char *argv[]) { Info<< "Time = " << runTime.timeName() << nl << endl; - force.internalFieldRef() = ReImSum + force.primitiveFieldRef() = ReImSum ( fft::reverseTransform ( diff --git a/applications/solvers/combustion/PDRFoam/PDRModels/XiEqModels/basicXiSubXiEq/basicXiSubXiEq.C b/applications/solvers/combustion/PDRFoam/PDRModels/XiEqModels/basicXiSubXiEq/basicXiSubXiEq.C index 82bbbede1f..befc3f3b59 100644 --- a/applications/solvers/combustion/PDRFoam/PDRModels/XiEqModels/basicXiSubXiEq/basicXiSubXiEq.C +++ b/applications/solvers/combustion/PDRFoam/PDRModels/XiEqModels/basicXiSubXiEq/basicXiSubXiEq.C @@ -105,7 +105,7 @@ Foam::tmp<Foam::volScalarField> Foam::XiEqModels::basicSubGrid::XiEq() const mesh, dimensionedScalar("zero", Nv.dimensions(), 0.0) ); - N.internalFieldRef() = Nv.internalField()*Cw; + N.primitiveFieldRef() = Nv.primitiveField()*Cw; volSymmTensorField ns ( @@ -125,7 +125,7 @@ Foam::tmp<Foam::volScalarField> Foam::XiEqModels::basicSubGrid::XiEq() const Zero ) ); - ns.internalFieldRef() = nsv.internalField()*Cw; + ns.primitiveFieldRef() = nsv.primitiveField()*Cw; volScalarField n(max(N - (Uhat & ns & Uhat), scalar(1e-4))); volScalarField b((Uhat & B_ & Uhat)/sqrt(n)); diff --git a/applications/solvers/combustion/PDRFoam/PDRModels/XiGModels/basicXiSubG/basicXiSubG.C b/applications/solvers/combustion/PDRFoam/PDRModels/XiGModels/basicXiSubG/basicXiSubG.C index 45050a171b..26104e40ab 100644 --- a/applications/solvers/combustion/PDRFoam/PDRModels/XiGModels/basicXiSubG/basicXiSubG.C +++ b/applications/solvers/combustion/PDRFoam/PDRModels/XiGModels/basicXiSubG/basicXiSubG.C @@ -73,7 +73,7 @@ Foam::tmp<Foam::volScalarField> Foam::XiGModels::basicSubGrid::G() const volScalarField& Gtot = tGtot.ref(); const scalarField Cw = pow(Su_.mesh().V(), 2.0/3.0); - scalarField N(Nv.internalField()*Cw); + scalarField N(Nv.primitiveField()*Cw); forAll(N, celli) { diff --git a/applications/solvers/combustion/PDRFoam/StCourantNo.H b/applications/solvers/combustion/PDRFoam/StCourantNo.H index ab12c922f7..738f9d33ea 100644 --- a/applications/solvers/combustion/PDRFoam/StCourantNo.H +++ b/applications/solvers/combustion/PDRFoam/StCourantNo.H @@ -36,8 +36,8 @@ Description { scalarField sumPhi ( - fvc::surfaceSum(mag(phiSt))().internalField() - / rho.internalField() + fvc::surfaceSum(mag(phiSt))().primitiveField() + / rho.primitiveField() ); StCoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/Gulder/Gulder.C b/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/Gulder/Gulder.C index 20ae2215cd..c2b863087c 100644 --- a/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/Gulder/Gulder.C +++ b/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/Gulder/Gulder.C @@ -74,7 +74,7 @@ Foam::tmp<Foam::volScalarField> Foam::XiEqModels::Gulder::XiEq() const if (subGridSchelkin_) { - up.internalFieldRef() += calculateSchelkinEffect(uPrimeCoef_); + up.primitiveFieldRef() += calculateSchelkinEffect(uPrimeCoef_); } volScalarField tauEta(sqrt(mag(thermo_.muu()/(thermo_.rhou()*epsilon)))); diff --git a/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/SCOPEXiEq/SCOPEXiEq.C b/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/SCOPEXiEq/SCOPEXiEq.C index 6a585e3881..d91f1b9e31 100644 --- a/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/SCOPEXiEq/SCOPEXiEq.C +++ b/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/SCOPEXiEq/SCOPEXiEq.C @@ -82,7 +82,7 @@ Foam::tmp<Foam::volScalarField> Foam::XiEqModels::SCOPEXiEq::XiEq() const volScalarField up(sqrt((2.0/3.0)*k)); if (subGridSchelkin_) { - up.internalFieldRef() += calculateSchelkinEffect(uPrimeCoef_); + up.primitiveFieldRef() += calculateSchelkinEffect(uPrimeCoef_); } volScalarField l(lCoef_*sqrt(3.0/2.0)*up*k/epsilon); diff --git a/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/XiEqModel/XiEqModel.C b/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/XiEqModel/XiEqModel.C index b436b1b0a8..a6301ba973 100644 --- a/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/XiEqModel/XiEqModel.C +++ b/applications/solvers/combustion/PDRFoam/XiModels/XiEqModels/XiEqModel/XiEqModel.C @@ -114,7 +114,7 @@ Foam::XiEqModel::calculateSchelkinEffect(const scalar uPrimeCoef) const ) ); volScalarField& N = tN.ref(); - N.internalFieldRef() = Nv.internalField()*pow(mesh.V(), 2.0/3.0); + N.primitiveFieldRef() = Nv.primitiveField()*pow(mesh.V(), 2.0/3.0); volSymmTensorField ns ( @@ -134,7 +134,7 @@ Foam::XiEqModel::calculateSchelkinEffect(const scalar uPrimeCoef) const Zero ) ); - ns.internalFieldRef() = nsv.internalField()*pow(mesh.V(), 2.0/3.0); + ns.primitiveFieldRef() = nsv.primitiveField()*pow(mesh.V(), 2.0/3.0); const volVectorField Uhat ( @@ -150,7 +150,7 @@ Foam::XiEqModel::calculateSchelkinEffect(const scalar uPrimeCoef) const const scalarField deltaUp(upLocal*(max(scalar(1.0), pow(nr, 0.5)) - 1.0)); // Re use tN - N.internalFieldRef() = upLocal*(max(scalar(1.0), pow(nr, 0.5)) - 1.0); + N.primitiveFieldRef() = upLocal*(max(scalar(1.0), pow(nr, 0.5)) - 1.0); return tN; } diff --git a/applications/solvers/combustion/reactingFoam/setRDeltaT.H b/applications/solvers/combustion/reactingFoam/setRDeltaT.H index d83e129717..5c24294ef6 100644 --- a/applications/solvers/combustion/reactingFoam/setRDeltaT.H +++ b/applications/solvers/combustion/reactingFoam/setRDeltaT.H @@ -68,8 +68,8 @@ License rDeltaT.max(1/maxDeltaT); Info<< " Flow = " - << gMin(1/rDeltaT.internalField()) << ", " - << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) << ", " + << gMax(1/rDeltaT.primitiveField()) << endl; } // Reaction source time scale @@ -120,8 +120,8 @@ License rDeltaT.correctBoundaryConditions(); Info<< " Overall = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } diff --git a/applications/solvers/compressible/rhoCentralFoam/centralCourantNo.H b/applications/solvers/compressible/rhoCentralFoam/centralCourantNo.H index d915d29ace..a0bc0ffaf0 100644 --- a/applications/solvers/compressible/rhoCentralFoam/centralCourantNo.H +++ b/applications/solvers/compressible/rhoCentralFoam/centralCourantNo.H @@ -31,7 +31,7 @@ Description if (mesh.nInternalFaces()) { - scalarField sumAmaxSf(fvc::surfaceSum(amaxSf)().internalField()); + scalarField sumAmaxSf(fvc::surfaceSum(amaxSf)().primitiveField()); CoNum = 0.5*gMax(sumAmaxSf/mesh.V().field())*runTime.deltaTValue(); diff --git a/applications/solvers/compressible/rhoCentralFoam/createFields.H b/applications/solvers/compressible/rhoCentralFoam/createFields.H index 538e936e39..6ea26ef404 100644 --- a/applications/solvers/compressible/rhoCentralFoam/createFields.H +++ b/applications/solvers/compressible/rhoCentralFoam/createFields.H @@ -13,7 +13,7 @@ const volScalarField& psi = thermo.psi(); const volScalarField& mu = thermo.mu(); bool inviscid(true); -if (max(mu.internalField()) > 0.0) +if (max(mu.primitiveField()) > 0.0) { inviscid = false; } diff --git a/applications/solvers/compressible/rhoCentralFoam/setRDeltaT.H b/applications/solvers/compressible/rhoCentralFoam/setRDeltaT.H index 4ebe06a6f5..4ad54b23ba 100644 --- a/applications/solvers/compressible/rhoCentralFoam/setRDeltaT.H +++ b/applications/solvers/compressible/rhoCentralFoam/setRDeltaT.H @@ -24,6 +24,6 @@ fvc::smooth(rDeltaT, rDeltaTSmoothingCoeff); Info<< "Flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } diff --git a/applications/solvers/compressible/rhoPimpleFoam/setRDeltaT.H b/applications/solvers/compressible/rhoPimpleFoam/setRDeltaT.H index 8591a74b9a..db42fb0221 100644 --- a/applications/solvers/compressible/rhoPimpleFoam/setRDeltaT.H +++ b/applications/solvers/compressible/rhoPimpleFoam/setRDeltaT.H @@ -53,8 +53,8 @@ rDeltaT.correctBoundaryConditions(); Info<< "Flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; if (rDeltaTSmoothingCoeff < 1.0) { @@ -62,8 +62,8 @@ } Info<< "Smoothed flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; // Limit rate of change of time scale // - reduce as much as required @@ -79,7 +79,7 @@ *max(rDeltaT/rDeltaT0, scalar(1) - rDeltaTDampingCoeff); Info<< "Damped flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } } diff --git a/applications/solvers/heatTransfer/chtMultiRegionFoam/fluid/compressibleCourantNo.C b/applications/solvers/heatTransfer/chtMultiRegionFoam/fluid/compressibleCourantNo.C index 7190828081..1f06ccfbd5 100644 --- a/applications/solvers/heatTransfer/chtMultiRegionFoam/fluid/compressibleCourantNo.C +++ b/applications/solvers/heatTransfer/chtMultiRegionFoam/fluid/compressibleCourantNo.C @@ -36,8 +36,8 @@ Foam::scalar Foam::compressibleCourantNo { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() - / rho.internalField() + fvc::surfaceSum(mag(phi))().primitiveField() + / rho.primitiveField() ); scalar CoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/createSolidFields.H b/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/createSolidFields.H index 13d95cf01a..ab10b81f9e 100644 --- a/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/createSolidFields.H +++ b/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/createSolidFields.H @@ -61,7 +61,7 @@ ) ); - aniAlphas[i].internalFieldRef() = + aniAlphas[i].primitiveFieldRef() = coordinates[i].R().transformVector(tkappaByCp()); aniAlphas[i].correctBoundaryConditions(); diff --git a/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/setRegionSolidFields.H b/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/setRegionSolidFields.H index d96c34e364..98b081952c 100644 --- a/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/setRegionSolidFields.H +++ b/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/setRegionSolidFields.H @@ -14,7 +14,7 @@ if (!thermo.isotropic()) tmp<volVectorField> tkappaByCp = thermo.Kappa()/cp; const coordinateSystem& coodSys = coordinates[i]; - aniAlpha.internalFieldRef() = + aniAlpha.primitiveFieldRef() = coodSys.R().transformVector(tkappaByCp()); aniAlpha.correctBoundaryConditions(); diff --git a/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/solidRegionDiffNo.C b/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/solidRegionDiffNo.C index 0753cd3163..eafde0cbc3 100644 --- a/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/solidRegionDiffNo.C +++ b/applications/solvers/heatTransfer/chtMultiRegionFoam/solid/solidRegionDiffNo.C @@ -46,7 +46,7 @@ Foam::scalar Foam::solidRegionDiffNo / fvc::interpolate(Cprho) ); - DiNum = gMax(kapparhoCpbyDelta.internalField())*runTime.deltaT().value(); + DiNum = gMax(kapparhoCpbyDelta.primitiveField())*runTime.deltaT().value(); meanDiNum = (average(kapparhoCpbyDelta)).value()*runTime.deltaT().value(); diff --git a/applications/solvers/incompressible/boundaryFoam/interrogateWallPatches.H b/applications/solvers/incompressible/boundaryFoam/interrogateWallPatches.H index ca337512dc..24351828eb 100644 --- a/applications/solvers/incompressible/boundaryFoam/interrogateWallPatches.H +++ b/applications/solvers/incompressible/boundaryFoam/interrogateWallPatches.H @@ -70,7 +70,7 @@ label cellId = patches[patchId].faceCells()[faceId]; scalarField y ( wallNormal - & (mesh.C().internalField() - mesh.C().boundaryField()[patchId][faceId]) + & (mesh.C().primitiveField() - mesh.C().boundaryField()[patchId][faceId]) ); Info<< " Height to first cell centre y0 = " << y[cellId] << endl; diff --git a/applications/solvers/incompressible/shallowWaterFoam/CourantNo.H b/applications/solvers/incompressible/shallowWaterFoam/CourantNo.H index 50959832e5..ffdcae91b4 100644 --- a/applications/solvers/incompressible/shallowWaterFoam/CourantNo.H +++ b/applications/solvers/incompressible/shallowWaterFoam/CourantNo.H @@ -38,8 +38,8 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() - / h.internalField() + fvc::surfaceSum(mag(phi))().primitiveField() + / h.primitiveField() ); CoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); @@ -53,7 +53,7 @@ if (mesh.nInternalFaces()) fvc::surfaceSum ( fvc::interpolate(sqrt(h))*mesh.magSf() - )().internalField()/mesh.V().field() + )().primitiveField()/mesh.V().field() )*sqrt(magg).value()*runTime.deltaTValue(); } diff --git a/applications/solvers/lagrangian/DPMFoam/CourantNo.H b/applications/solvers/lagrangian/DPMFoam/CourantNo.H index 9ff53ed401..4cf132e3ba 100644 --- a/applications/solvers/lagrangian/DPMFoam/CourantNo.H +++ b/applications/solvers/lagrangian/DPMFoam/CourantNo.H @@ -36,7 +36,7 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phic))().internalField() + fvc::surfaceSum(mag(phic))().primitiveField() ); CoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/applications/solvers/lagrangian/DPMFoam/DPMFoam.C b/applications/solvers/lagrangian/DPMFoam/DPMFoam.C index 9aa262d9b8..772c80bf1c 100644 --- a/applications/solvers/lagrangian/DPMFoam/DPMFoam.C +++ b/applications/solvers/lagrangian/DPMFoam/DPMFoam.C @@ -107,7 +107,7 @@ int main(int argc, char *argv[]) zeroGradientFvPatchVectorField::typeName ); - cloudVolSUSu.internalFieldRef() = -cloudSU.source()/mesh.V(); + cloudVolSUSu.primitiveFieldRef() = -cloudSU.source()/mesh.V(); cloudVolSUSu.correctBoundaryConditions(); cloudSU.source() = Zero; diff --git a/applications/solvers/lagrangian/coalChemistryFoam/setRDeltaT.H b/applications/solvers/lagrangian/coalChemistryFoam/setRDeltaT.H index 403ed28bac..7e2ed6074d 100644 --- a/applications/solvers/lagrangian/coalChemistryFoam/setRDeltaT.H +++ b/applications/solvers/lagrangian/coalChemistryFoam/setRDeltaT.H @@ -68,8 +68,8 @@ License rDeltaT.max(1/maxDeltaT); Info<< " Flow = " - << gMin(1/rDeltaT.internalField()) << ", " - << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) << ", " + << gMax(1/rDeltaT.primitiveField()) << endl; } // Reaction source time scale @@ -127,8 +127,8 @@ License } Info<< " Overall = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } diff --git a/applications/solvers/lagrangian/reactingParcelFoam/setRDeltaT.H b/applications/solvers/lagrangian/reactingParcelFoam/setRDeltaT.H index 3b52192386..63398fb001 100644 --- a/applications/solvers/lagrangian/reactingParcelFoam/setRDeltaT.H +++ b/applications/solvers/lagrangian/reactingParcelFoam/setRDeltaT.H @@ -68,8 +68,8 @@ License rDeltaT.max(1/maxDeltaT); Info<< " Flow = " - << gMin(1/rDeltaT.internalField()) << ", " - << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) << ", " + << gMax(1/rDeltaT.primitiveField()) << endl; } // Reaction source time scale @@ -126,8 +126,8 @@ License } Info<< " Overall = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } diff --git a/applications/solvers/multiphase/cavitatingFoam/CourantNo.H b/applications/solvers/multiphase/cavitatingFoam/CourantNo.H index a5bae74528..4a339f9960 100644 --- a/applications/solvers/multiphase/cavitatingFoam/CourantNo.H +++ b/applications/solvers/multiphase/cavitatingFoam/CourantNo.H @@ -37,7 +37,7 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() + fvc::surfaceSum(mag(phi))().primitiveField() ); CoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); @@ -50,7 +50,7 @@ if (mesh.nInternalFaces()) fvc::surfaceSum ( fvc::interpolate(scalar(1)/sqrt(psi))*mesh.magSf() - )().internalField()/mesh.V().field() + )().primitiveField()/mesh.V().field() )*runTime.deltaTValue(); } diff --git a/applications/solvers/multiphase/interFoam/alphaCourantNo.H b/applications/solvers/multiphase/interFoam/alphaCourantNo.H index 95ad609a51..24d08b9eaf 100644 --- a/applications/solvers/multiphase/interFoam/alphaCourantNo.H +++ b/applications/solvers/multiphase/interFoam/alphaCourantNo.H @@ -41,8 +41,8 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - mixture.nearInterface()().internalField() - *fvc::surfaceSum(mag(phi))().internalField() + mixture.nearInterface()().primitiveField() + *fvc::surfaceSum(mag(phi))().primitiveField() ); alphaCoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/applications/solvers/multiphase/interFoam/interMixingFoam/alphaEqnsSubCycle.H b/applications/solvers/multiphase/interFoam/interMixingFoam/alphaEqnsSubCycle.H index 72a9af2c66..6025b60069 100644 --- a/applications/solvers/multiphase/interFoam/interMixingFoam/alphaEqnsSubCycle.H +++ b/applications/solvers/multiphase/interFoam/interMixingFoam/alphaEqnsSubCycle.H @@ -35,7 +35,7 @@ else //solve(fvm::ddt(rho) + fvc::div(rhoPhi)); //Info<< "density error = " - // << max((mag(rho - rhoNew)/mag(rhoNew))().internalField()) << endl; + // << max((mag(rho - rhoNew)/mag(rhoNew))().primitiveField()) << endl; rho == rhoNew; } diff --git a/applications/solvers/multiphase/interFoam/setRDeltaT.H b/applications/solvers/multiphase/interFoam/setRDeltaT.H index 86b7dd9d23..697e6588e2 100644 --- a/applications/solvers/multiphase/interFoam/setRDeltaT.H +++ b/applications/solvers/multiphase/interFoam/setRDeltaT.H @@ -84,8 +84,8 @@ rDeltaT.correctBoundaryConditions(); Info<< "Flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; if (rDeltaTSmoothingCoeff < 1.0) { @@ -111,8 +111,8 @@ } Info<< "Smoothed flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; // Limit rate of change of time scale // - reduce as much as required @@ -130,7 +130,7 @@ ); Info<< "Damped flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } } diff --git a/applications/solvers/multiphase/multiphaseEulerFoam/CourantNo.H b/applications/solvers/multiphase/multiphaseEulerFoam/CourantNo.H index a85e136eaa..6ea90af095 100644 --- a/applications/solvers/multiphase/multiphaseEulerFoam/CourantNo.H +++ b/applications/solvers/multiphase/multiphaseEulerFoam/CourantNo.H @@ -36,7 +36,7 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() + fvc::surfaceSum(mag(phi))().primitiveField() ); forAllIter(PtrDictionary<phaseModel>, fluid.phases(), iter) @@ -44,7 +44,7 @@ if (mesh.nInternalFaces()) sumPhi = max ( sumPhi, - fvc::surfaceSum(mag(iter().phi()))().internalField() + fvc::surfaceSum(mag(iter().phi()))().primitiveField() ); } diff --git a/applications/solvers/multiphase/reactingEulerFoam/interfacialModels/dragModels/segregated/segregated.C b/applications/solvers/multiphase/reactingEulerFoam/interfacialModels/dragModels/segregated/segregated.C index a1e50a16f4..fa2bccdcf4 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/interfacialModels/dragModels/segregated/segregated.C +++ b/applications/solvers/multiphase/reactingEulerFoam/interfacialModels/dragModels/segregated/segregated.C @@ -104,7 +104,7 @@ Foam::tmp<Foam::volScalarField> Foam::dragModels::segregated::K() const dimensionedScalar("L", dimLength, 0), zeroGradientFvPatchField<scalar>::typeName ); - L.internalFieldRef() = cbrt(mesh.V()); + L.primitiveFieldRef() = cbrt(mesh.V()); L.correctBoundaryConditions(); volScalarField I diff --git a/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/InterfaceCompositionPhaseChangePhaseSystem/InterfaceCompositionPhaseChangePhaseSystem.C b/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/InterfaceCompositionPhaseChangePhaseSystem/InterfaceCompositionPhaseChangePhaseSystem.C index fe0343b2ac..624ee667c0 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/InterfaceCompositionPhaseChangePhaseSystem/InterfaceCompositionPhaseChangePhaseSystem.C +++ b/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/InterfaceCompositionPhaseChangePhaseSystem/InterfaceCompositionPhaseChangePhaseSystem.C @@ -292,9 +292,9 @@ correctThermo() Tf.correctBoundaryConditions(); Info<< "Tf." << pair.name() - << ": min = " << min(Tf.internalField()) - << ", mean = " << average(Tf.internalField()) - << ", max = " << max(Tf.internalField()) + << ": min = " << min(Tf.primitiveField()) + << ", mean = " << average(Tf.primitiveField()) + << ", max = " << max(Tf.primitiveField()) << endl; // Update the interface compositions diff --git a/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/ThermalPhaseChangePhaseSystem/ThermalPhaseChangePhaseSystem.C b/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/ThermalPhaseChangePhaseSystem/ThermalPhaseChangePhaseSystem.C index 8ba5a4a502..fec8114fc1 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/ThermalPhaseChangePhaseSystem/ThermalPhaseChangePhaseSystem.C +++ b/applications/solvers/multiphase/reactingEulerFoam/phaseSystems/PhaseSystems/ThermalPhaseChangePhaseSystem/ThermalPhaseChangePhaseSystem.C @@ -337,9 +337,9 @@ void Foam::ThermalPhaseChangePhaseSystem<BasePhaseSystem>::correctThermo() ); Info<< "iDmdt." << pair.name() - << ": min = " << min(iDmdt.internalField()) - << ", mean = " << average(iDmdt.internalField()) - << ", max = " << max(iDmdt.internalField()) + << ": min = " << min(iDmdt.primitiveField()) + << ", mean = " << average(iDmdt.primitiveField()) + << ", max = " << max(iDmdt.primitiveField()) << ", integral = " << fvc::domainIntegrate(iDmdt).value() << endl; } @@ -370,9 +370,9 @@ void Foam::ThermalPhaseChangePhaseSystem<BasePhaseSystem>::correctThermo() Tf = (H1*T1 + H2*T2 + mDotL)/(H1 + H2); Info<< "Tf." << pair.name() - << ": min = " << min(Tf.internalField()) - << ", mean = " << average(Tf.internalField()) - << ", max = " << max(Tf.internalField()) + << ": min = " << min(Tf.primitiveField()) + << ", mean = " << average(Tf.primitiveField()) + << ", max = " << max(Tf.primitiveField()) << endl; // Accumulate dmdt contributions from boundaries @@ -433,9 +433,9 @@ void Foam::ThermalPhaseChangePhaseSystem<BasePhaseSystem>::correctThermo() } Info<< "wDmdt." << pair.name() - << ": min = " << min(wDmdt.internalField()) - << ", mean = " << average(wDmdt.internalField()) - << ", max = " << max(wDmdt.internalField()) + << ": min = " << min(wDmdt.primitiveField()) + << ", mean = " << average(wDmdt.primitiveField()) + << ", max = " << max(wDmdt.primitiveField()) << ", integral = " << fvc::domainIntegrate(wDmdt).value() << endl; } @@ -443,9 +443,9 @@ void Foam::ThermalPhaseChangePhaseSystem<BasePhaseSystem>::correctThermo() dmdt = wDmdt + iDmdt; Info<< "dmdt." << pair.name() - << ": min = " << min(dmdt.internalField()) - << ", mean = " << average(dmdt.internalField()) - << ", max = " << max(dmdt.internalField()) + << ": min = " << min(dmdt.primitiveField()) + << ", mean = " << average(dmdt.primitiveField()) + << ", max = " << max(dmdt.primitiveField()) << ", integral = " << fvc::domainIntegrate(dmdt).value() << endl; } diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/CourantNo.H b/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/CourantNo.H index d7d1cc66d8..b85ec4395e 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/CourantNo.H +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/CourantNo.H @@ -36,7 +36,7 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() + fvc::surfaceSum(mag(phi))().primitiveField() ); forAll(phases, phasei) @@ -44,7 +44,7 @@ if (mesh.nInternalFaces()) sumPhi = max ( sumPhi, - fvc::surfaceSum(mag(phases[phasei].phi()))().internalField() + fvc::surfaceSum(mag(phases[phasei].phi()))().primitiveField() ); } diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/setRDeltaT.H b/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/setRDeltaT.H index 052f704cbd..d89c09f9dc 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/setRDeltaT.H +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingMultiphaseEulerFoam/setRDeltaT.H @@ -39,6 +39,6 @@ fvc::smooth(rDeltaT, rDeltaTSmoothingCoeff); Info<< "Flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/CourantNos.H b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/CourantNos.H index 7ab578dd3f..13c45ad51c 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/CourantNos.H +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/CourantNos.H @@ -3,7 +3,7 @@ { scalar UrCoNum = 0.5*gMax ( - fvc::surfaceSum(mag(phi1 - phi2))().internalField()/mesh.V().field() + fvc::surfaceSum(mag(phi1 - phi2))().primitiveField()/mesh.V().field() )*runTime.deltaTValue(); Info<< "Max Ur Courant Number = " << UrCoNum << endl; diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/setRDeltaT.H b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/setRDeltaT.H index f8e880a474..4cb3de01e9 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/setRDeltaT.H +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/setRDeltaT.H @@ -32,6 +32,6 @@ fvc::smooth(rDeltaT, rDeltaTSmoothingCoeff); Info<< "Flow time scale min/max = " - << gMin(1/rDeltaT.internalField()) - << ", " << gMax(1/rDeltaT.internalField()) << endl; + << gMin(1/rDeltaT.primitiveField()) + << ", " << gMax(1/rDeltaT.primitiveField()) << endl; } diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatPhaseChangeJayatillekeWallFunction/alphatPhaseChangeJayatillekeWallFunctionFvPatchScalarField.C b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatPhaseChangeJayatillekeWallFunction/alphatPhaseChangeJayatillekeWallFunctionFvPatchScalarField.C index 46de9ec4f1..7b854df507 100755 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatPhaseChangeJayatillekeWallFunction/alphatPhaseChangeJayatillekeWallFunctionFvPatchScalarField.C +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatPhaseChangeJayatillekeWallFunction/alphatPhaseChangeJayatillekeWallFunctionFvPatchScalarField.C @@ -139,7 +139,7 @@ alphatPhaseChangeJayatillekeWallFunctionFvPatchScalarField::calcAlphat const phaseModel& liquid ( - fluid.phase1().name() == dimensionedInternalField().group() + fluid.phase1().name() == internalField().group() ? fluid.phase1() : fluid.phase2() ); diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatWallBoilingWallFunction/alphatWallBoilingWallFunctionFvPatchScalarField.C b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatWallBoilingWallFunction/alphatWallBoilingWallFunctionFvPatchScalarField.C index 4aac384117..15e7727bc8 100755 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatWallBoilingWallFunction/alphatWallBoilingWallFunctionFvPatchScalarField.C +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/derivedFvPatchFields/alphatWallBoilingWallFunction/alphatWallBoilingWallFunctionFvPatchScalarField.C @@ -172,7 +172,7 @@ void alphatWallBoilingWallFunctionFvPatchScalarField::updateCoeffs() const phaseModel& liquid ( - fluid.phase1().name() == dimensionedInternalField().group() + fluid.phase1().name() == internalField().group() ? fluid.phase1() : fluid.phase2() ); diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C index 04715ecbe7..651de2ea03 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C @@ -160,7 +160,7 @@ void Foam::JohnsonJacksonParticleSlipFvPatchVectorField::updateCoeffs() const phaseModel& phased ( - fluid.phase1().name() == dimensionedInternalField().group() + fluid.phase1().name() == internalField().group() ? fluid.phase1() : fluid.phase2() ); diff --git a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C index 220c4c05eb..2d8a5cce8e 100644 --- a/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C +++ b/applications/solvers/multiphase/reactingEulerFoam/reactingTwoPhaseEulerFoam/twoPhaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C @@ -181,7 +181,7 @@ void Foam::JohnsonJacksonParticleThetaFvPatchScalarField::updateCoeffs() const phaseModel& phased ( - fluid.phase1().name() == dimensionedInternalField().group() + fluid.phase1().name() == internalField().group() ? fluid.phase1() : fluid.phase2() ); diff --git a/applications/solvers/multiphase/twoLiquidMixingFoam/alphaCourantNo.H b/applications/solvers/multiphase/twoLiquidMixingFoam/alphaCourantNo.H index 6ea204b00b..0ff918e39f 100644 --- a/applications/solvers/multiphase/twoLiquidMixingFoam/alphaCourantNo.H +++ b/applications/solvers/multiphase/twoLiquidMixingFoam/alphaCourantNo.H @@ -42,7 +42,7 @@ if (mesh.nInternalFaces()) scalarField sumPhi ( pos(alpha1 - 0.01)*pos(0.99 - alpha1) - *fvc::surfaceSum(mag(phi))().internalField() + *fvc::surfaceSum(mag(phi))().primitiveField() ); alphaCoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/applications/solvers/multiphase/twoPhaseEulerFoam/CourantNos.H b/applications/solvers/multiphase/twoPhaseEulerFoam/CourantNos.H index 248f4c0602..d828f32769 100644 --- a/applications/solvers/multiphase/twoPhaseEulerFoam/CourantNos.H +++ b/applications/solvers/multiphase/twoPhaseEulerFoam/CourantNos.H @@ -3,7 +3,7 @@ { scalar UrCoNum = 0.5*gMax ( - fvc::surfaceSum(mag(phi1 - phi2))().internalField()/mesh.V().field() + fvc::surfaceSum(mag(phi1 - phi2))().primitiveField()/mesh.V().field() )*runTime.deltaTValue(); Info<< "Max Ur Courant Number = " << UrCoNum << endl; diff --git a/applications/solvers/multiphase/twoPhaseEulerFoam/interfacialModels/dragModels/segregated/segregated.C b/applications/solvers/multiphase/twoPhaseEulerFoam/interfacialModels/dragModels/segregated/segregated.C index d7b156da80..a538ba6364 100644 --- a/applications/solvers/multiphase/twoPhaseEulerFoam/interfacialModels/dragModels/segregated/segregated.C +++ b/applications/solvers/multiphase/twoPhaseEulerFoam/interfacialModels/dragModels/segregated/segregated.C @@ -104,7 +104,7 @@ Foam::tmp<Foam::volScalarField> Foam::dragModels::segregated::K() const dimensionedScalar("L", dimLength, 0), zeroGradientFvPatchField<scalar>::typeName ); - L.internalFieldRef() = cbrt(mesh.V()); + L.primitiveFieldRef() = cbrt(mesh.V()); L.correctBoundaryConditions(); volScalarField I diff --git a/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C b/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C index 4aa484cb5f..32d6431b6c 100644 --- a/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C +++ b/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleSlip/JohnsonJacksonParticleSlipFvPatchVectorField.C @@ -160,7 +160,7 @@ void Foam::JohnsonJacksonParticleSlipFvPatchVectorField::updateCoeffs() const phaseModel& phased ( - fluid.phase1().name() == dimensionedInternalField().group() + fluid.phase1().name() == internalField().group() ? fluid.phase1() : fluid.phase2() ); diff --git a/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C b/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C index 95fc5b41bf..84303276ec 100644 --- a/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C +++ b/applications/solvers/multiphase/twoPhaseEulerFoam/phaseCompressibleTurbulenceModels/kineticTheoryModels/derivedFvPatchFields/JohnsonJacksonParticleTheta/JohnsonJacksonParticleThetaFvPatchScalarField.C @@ -180,7 +180,7 @@ void Foam::JohnsonJacksonParticleThetaFvPatchScalarField::updateCoeffs() const phaseModel& phased ( - fluid.phase1().name() == dimensionedInternalField().group() + fluid.phase1().name() == internalField().group() ? fluid.phase1() : fluid.phase2() ); diff --git a/applications/test/GAMGAgglomeration/Test-GAMGAgglomeration.C b/applications/test/GAMGAgglomeration/Test-GAMGAgglomeration.C index a3b6e68213..611c8163bc 100644 --- a/applications/test/GAMGAgglomeration/Test-GAMGAgglomeration.C +++ b/applications/test/GAMGAgglomeration/Test-GAMGAgglomeration.C @@ -87,7 +87,7 @@ int main(int argc, char *argv[]) mesh, dimensionedScalar("aggomeration", dimless, 0.0) ); - scalarField& fld = scalarAgglomeration.internalFieldRef(); + scalarField& fld = scalarAgglomeration.primitiveFieldRef(); forAll(fld, celli) { fld[celli] = cellToCoarse[celli]; @@ -166,7 +166,7 @@ int main(int argc, char *argv[]) mesh, dimensionedScalar("aggomeration", dimless, 0.0) ); - scalarField& fld = scalarAgglomeration.internalFieldRef(); + scalarField& fld = scalarAgglomeration.primitiveFieldRef(); forAll(fld, celli) { fld[celli] = cellToCoarse[celli]; diff --git a/applications/test/fieldMapping/Test-fieldMapping.C b/applications/test/fieldMapping/Test-fieldMapping.C index 061290cf8c..d0545b7bb8 100644 --- a/applications/test/fieldMapping/Test-fieldMapping.C +++ b/applications/test/fieldMapping/Test-fieldMapping.C @@ -300,8 +300,8 @@ int main(int argc, char *argv[]) // Check face field mapping if (surfaceOne.size()) { - const scalar max = gMax(surfaceOne.internalField()); - const scalar min = gMin(surfaceOne.internalField()); + const scalar max = gMax(surfaceOne.primitiveField()); + const scalar min = gMin(surfaceOne.primitiveField()); Info<< "Uniform surface field min = " << min << " max = " << max << endl; diff --git a/applications/test/hexRef8/Test-hexRef8.C b/applications/test/hexRef8/Test-hexRef8.C index 737401a627..f5a4b7c66d 100644 --- a/applications/test/hexRef8/Test-hexRef8.C +++ b/applications/test/hexRef8/Test-hexRef8.C @@ -164,7 +164,7 @@ int main(int argc, char *argv[]) dimensionedScalar("one", dimless, 1.0), calculatedPointPatchScalarField::typeName ); - pointX.internalFieldRef() = mesh.points().component(0); + pointX.primitiveFieldRef() = mesh.points().component(0); pointX.correctBoundaryConditions(); Info<< "Writing x-component field " << pointX.name() << " in " << runTime.timeName() << endl; @@ -381,8 +381,8 @@ int main(int argc, char *argv[]) // Check face field mapping if (surfaceOne.size()) { - const scalar max = gMax(surfaceOne.internalField()); - const scalar min = gMin(surfaceOne.internalField()); + const scalar max = gMax(surfaceOne.primitiveField()); + const scalar min = gMin(surfaceOne.primitiveField()); Info<< "Uniform surface field min = " << min << " max = " << max << endl; diff --git a/applications/test/mappedPatch/Test-MappedPatch.C b/applications/test/mappedPatch/Test-MappedPatch.C index 46577e4c8b..1349cf3a1f 100644 --- a/applications/test/mappedPatch/Test-MappedPatch.C +++ b/applications/test/mappedPatch/Test-MappedPatch.C @@ -86,7 +86,7 @@ int main(int argc, char *argv[]) patchFieldTypes ); - cc.internalFieldRef() = mesh.C().internalField(); + cc.primitiveFieldRef() = mesh.C().primitiveField(); cc.boundaryFieldRef().updateCoeffs(); forAll(cc.boundaryField(), patchi) diff --git a/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/backgroundMeshDecomposition/backgroundMeshDecomposition.C b/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/backgroundMeshDecomposition/backgroundMeshDecomposition.C index 6d72760f75..b0ef8a48b0 100644 --- a/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/backgroundMeshDecomposition/backgroundMeshDecomposition.C +++ b/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/backgroundMeshDecomposition/backgroundMeshDecomposition.C @@ -904,8 +904,8 @@ Foam::backgroundMeshDecomposition::distribute { Info<< " cellWeightLimit " << cellWeightLimit << endl; - Pout<< " sum(cellWeights) " << sum(cellWeights.internalField()) - << " max(cellWeights) " << max(cellWeights.internalField()) + Pout<< " sum(cellWeights) " << sum(cellWeights.primitiveField()) + << " max(cellWeights) " << max(cellWeights.primitiveField()) << endl; } diff --git a/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshIO.C b/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshIO.C index 1873af19e2..39beaedd2d 100644 --- a/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshIO.C +++ b/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshIO.C @@ -1137,7 +1137,7 @@ void Foam::conformalVoronoiMesh::writeCellSizes zeroGradientFvPatchScalarField::typeName ); - scalarField& cellSize = targetCellSize.internalFieldRef(); + scalarField& cellSize = targetCellSize.primitiveFieldRef(); const vectorField& C = mesh.cellCentres(); @@ -1163,7 +1163,7 @@ void Foam::conformalVoronoiMesh::writeCellSizes // zeroGradientFvPatchScalarField::typeName // ); - // targetCellVolume.internalFieldRef() = pow3(cellSize); + // targetCellVolume.primitiveFieldRef() = pow3(cellSize); // Info<< nl << "Create actualCellVolume volScalarField" << endl; @@ -1182,7 +1182,7 @@ void Foam::conformalVoronoiMesh::writeCellSizes // zeroGradientFvPatchScalarField::typeName // ); - // actualCellVolume.internalFieldRef() = mesh.cellVolumes(); + // actualCellVolume.primitiveFieldRef() = mesh.cellVolumes(); // Info<< nl << "Create equivalentCellSize volScalarField" << endl; @@ -1201,9 +1201,9 @@ void Foam::conformalVoronoiMesh::writeCellSizes // zeroGradientFvPatchScalarField::typeName // ); - // equivalentCellSize.internalFieldRef() = pow + // equivalentCellSize.primitiveFieldRef() = pow // ( - // actualCellVolume.internalField(), + // actualCellVolume.primitiveField(), // 1.0/3.0 // ); @@ -1247,7 +1247,7 @@ void Foam::conformalVoronoiMesh::writeCellSizes // pointPatchVectorField::calculatedType() // ); - // scalarField& cellSize = ptTargetCellSize.internalFieldRef(); + // scalarField& cellSize = ptTargetCellSize.primitiveFieldRef(); // const vectorField& P = tetMesh.points(); @@ -1283,7 +1283,7 @@ void Foam::conformalVoronoiMesh::writeCellAlignments // zeroGradientFvPatchTensorField::typeName // ); // -// tensorField& cellAlignment = cellAlignments.internalFieldRef(); +// tensorField& cellAlignment = cellAlignments.primitiveFieldRef(); // // const vectorField& C = mesh.cellCentres(); // diff --git a/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshTemplates.C b/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshTemplates.C index 4167cb61db..c4fdca83d8 100644 --- a/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshTemplates.C +++ b/applications/utilities/mesh/generation/foamyMesh/conformalVoronoiMesh/conformalVoronoiMesh/conformalVoronoiMeshTemplates.C @@ -117,7 +117,7 @@ bool Foam::conformalVoronoiMesh::distributeBackground(const Triangulation& mesh) } } - scalarField& cwi = cellWeights.internalFieldRef(); + scalarField& cwi = cellWeights.primitiveFieldRef(); forAll(cellVertices, cI) { diff --git a/applications/utilities/mesh/generation/foamyMesh/foamyHexMeshBackgroundMesh/foamyHexMeshBackgroundMesh.C b/applications/utilities/mesh/generation/foamyMesh/foamyHexMeshBackgroundMesh/foamyHexMeshBackgroundMesh.C index 9887130f4b..bd02554c88 100644 --- a/applications/utilities/mesh/generation/foamyMesh/foamyHexMeshBackgroundMesh/foamyHexMeshBackgroundMesh.C +++ b/applications/utilities/mesh/generation/foamyMesh/foamyHexMeshBackgroundMesh/foamyHexMeshBackgroundMesh.C @@ -636,7 +636,7 @@ int main(int argc, char *argv[]) { // Internal field - cellDistance.internalFieldRef() = signedDistance + cellDistance.primitiveFieldRef() = signedDistance ( distSqr, fvm.C(), @@ -701,7 +701,7 @@ int main(int argc, char *argv[]) -sqr(GREAT) // null value ); - pointDistance.internalFieldRef() = signedDistance + pointDistance.primitiveFieldRef() = signedDistance ( pointDistSqr, fvm.points(), diff --git a/applications/utilities/mesh/manipulation/deformedGeom/deformedGeom.C b/applications/utilities/mesh/manipulation/deformedGeom/deformedGeom.C index a542323874..be0b1d4066 100644 --- a/applications/utilities/mesh/manipulation/deformedGeom/deformedGeom.C +++ b/applications/utilities/mesh/manipulation/deformedGeom/deformedGeom.C @@ -82,7 +82,7 @@ int main(int argc, char *argv[]) pointField newPoints ( zeroPoints - + scaleFactor*pInterp.interpolate(U)().internalField() + + scaleFactor*pInterp.interpolate(U)().primitiveField() ); mesh.polyMesh::movePoints(newPoints); diff --git a/applications/utilities/parallelProcessing/decomposePar/domainDecompositionDistribute.C b/applications/utilities/parallelProcessing/decomposePar/domainDecompositionDistribute.C index 944853ad95..c997f58074 100644 --- a/applications/utilities/parallelProcessing/decomposePar/domainDecompositionDistribute.C +++ b/applications/utilities/parallelProcessing/decomposePar/domainDecompositionDistribute.C @@ -61,7 +61,7 @@ void Foam::domainDecomposition::distributeCells() ), *this ); - cellWeights = weights.internalField(); + cellWeights = weights.primitiveField(); } cellToProc_ = decomposePtr().decompose(*this, cellWeights); diff --git a/applications/utilities/parallelProcessing/decomposePar/pointFieldDecomposerDecomposeFields.C b/applications/utilities/parallelProcessing/decomposePar/pointFieldDecomposerDecomposeFields.C index 52f1576331..55961704f4 100644 --- a/applications/utilities/parallelProcessing/decomposePar/pointFieldDecomposerDecomposeFields.C +++ b/applications/utilities/parallelProcessing/decomposePar/pointFieldDecomposerDecomposeFields.C @@ -36,7 +36,7 @@ Foam::pointFieldDecomposer::decomposeField ) const { // Create and map the internal field values - Field<Type> internalField(field.internalField(), pointAddressing_); + Field<Type> internalField(field.primitiveField(), pointAddressing_); // Create a list of pointers for the patchFields PtrList<pointPatchField<Type>> patchFields(boundaryAddressing_.size()); diff --git a/applications/utilities/postProcessing/dataConversion/foamToEnsight/ensightField.C b/applications/utilities/postProcessing/dataConversion/foamToEnsight/ensightField.C index 1221193c15..eaf5a99afe 100644 --- a/applications/utilities/postProcessing/dataConversion/foamToEnsight/ensightField.C +++ b/applications/utilities/postProcessing/dataConversion/foamToEnsight/ensightField.C @@ -603,7 +603,7 @@ void ensightPointField writeField ( "coordinates", - Field<Type>(pf.internalField(), eMesh.uniquePointMap()), + Field<Type>(pf.primitiveField(), eMesh.uniquePointMap()), ensightFile ); } @@ -646,7 +646,7 @@ void ensightPointField writeField ( "coordinates", - Field<Type>(pf.internalField(), uniqueMeshPointLabels), + Field<Type>(pf.primitiveField(), uniqueMeshPointLabels), ensightFile ); @@ -692,7 +692,7 @@ void ensightPointField "coordinates", Field<Type> ( - pf.internalField(), + pf.primitiveField(), uniqueMeshPointLabels ), ensightFile diff --git a/applications/utilities/postProcessing/dataConversion/foamToTetDualMesh/foamToTetDualMesh.C b/applications/utilities/postProcessing/dataConversion/foamToTetDualMesh/foamToTetDualMesh.C index 6017e27fe2..19f2097efb 100644 --- a/applications/utilities/postProcessing/dataConversion/foamToTetDualMesh/foamToTetDualMesh.C +++ b/applications/utilities/postProcessing/dataConversion/foamToTetDualMesh/foamToTetDualMesh.C @@ -91,7 +91,7 @@ void ReadAndMapFields ) ); - Field<Type>& fld = tetFields[i].internalFieldRef(); + Field<Type>& fld = tetFields[i].primitiveFieldRef(); // Map from read field. Set unmapped entries to nullValue. fld.setSize(map.size(), nullValue); diff --git a/applications/utilities/postProcessing/dataConversion/foamToVTK/writeFunsTemplates.C b/applications/utilities/postProcessing/dataConversion/foamToVTK/writeFunsTemplates.C index 5f5ddd2630..4dcf09ae2c 100644 --- a/applications/utilities/postProcessing/dataConversion/foamToVTK/writeFunsTemplates.C +++ b/applications/utilities/postProcessing/dataConversion/foamToVTK/writeFunsTemplates.C @@ -79,7 +79,7 @@ void Foam::writeFuns::write DynamicList<floatScalar> fField(pTraits<Type>::nComponents*nValues); - insert(vvf.internalField(), fField); + insert(vvf.primitiveField(), fField); forAll(superCells, superCelli) { diff --git a/applications/utilities/postProcessing/graphics/PV3Readers/PV3FoamReader/vtkPV3Foam/vtkPV3FoamPointFields.H b/applications/utilities/postProcessing/graphics/PV3Readers/PV3FoamReader/vtkPV3Foam/vtkPV3FoamPointFields.H index e74937cd2f..885e26e003 100644 --- a/applications/utilities/postProcessing/graphics/PV3Readers/PV3FoamReader/vtkPV3Foam/vtkPV3FoamPointFields.H +++ b/applications/utilities/postProcessing/graphics/PV3Readers/PV3FoamReader/vtkPV3Foam/vtkPV3FoamPointFields.H @@ -152,7 +152,7 @@ void Foam::vtkPV3Foam::convertPointFields // Extract the field on the zone Field<Type> fld ( - ptf.internalField(), + ptf.primitiveField(), mesh.faceZones()[zoneId]().meshPoints() ); diff --git a/applications/utilities/postProcessing/graphics/PVReaders/PVFoamReader/vtkPVFoam/vtkPVFoamPointFields.H b/applications/utilities/postProcessing/graphics/PVReaders/PVFoamReader/vtkPVFoam/vtkPVFoamPointFields.H index 2e83520e44..fc22aca9a1 100644 --- a/applications/utilities/postProcessing/graphics/PVReaders/PVFoamReader/vtkPVFoam/vtkPVFoamPointFields.H +++ b/applications/utilities/postProcessing/graphics/PVReaders/PVFoamReader/vtkPVFoam/vtkPVFoamPointFields.H @@ -152,7 +152,7 @@ void Foam::vtkPVFoam::convertPointFields // Extract the field on the zone Field<Type> fld ( - ptf.internalField(), + ptf.primitiveField(), mesh.faceZones()[zoneId]().meshPoints() ); diff --git a/applications/utilities/preProcessing/boxTurb/boxTurb.C b/applications/utilities/preProcessing/boxTurb/boxTurb.C index 3eb161016e..945a5a6d52 100644 --- a/applications/utilities/preProcessing/boxTurb/boxTurb.C +++ b/applications/utilities/preProcessing/boxTurb/boxTurb.C @@ -57,7 +57,7 @@ int main(int argc, char *argv[]) turbGen Ugen(K, Ea, k0); - U.internalFieldRef() = Ugen.U(); + U.primitiveFieldRef() = Ugen.U(); U.correctBoundaryConditions(); Info<< "k(" diff --git a/applications/utilities/preProcessing/setFields/setFields.C b/applications/utilities/preProcessing/setFields/setFields.C index 59eebecd48..ab009d8378 100644 --- a/applications/utilities/preProcessing/setFields/setFields.C +++ b/applications/utilities/preProcessing/setFields/setFields.C @@ -88,7 +88,7 @@ bool setCellFieldType if (selectedCells.size() == field.size()) { - field.internalFieldRef() = value; + field.primitiveFieldRef() = value; } else { diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.C b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.C index 6edd7cf428..aa454dcafe 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.C +++ b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.C @@ -725,7 +725,7 @@ Foam::GeometricField<Type, PatchField, GeoMesh>::ref() template<class Type, template<class> class PatchField, class GeoMesh> typename Foam::GeometricField<Type, PatchField, GeoMesh>::Internal::FieldType& -Foam::GeometricField<Type, PatchField, GeoMesh>::internalFieldRef() +Foam::GeometricField<Type, PatchField, GeoMesh>::primitiveFieldRef() { this->setUpToDate(); storeOldTimes(); @@ -1016,7 +1016,7 @@ Foam::GeometricField<Type, PatchField, GeoMesh>::T() const ) ); - Foam::T(result.ref().internalFieldRef(), internalField()); + Foam::T(result.ref().primitiveFieldRef(), primitiveField()); Foam::T(result.ref().boundaryFieldRef(), boundaryField()); return result; @@ -1053,7 +1053,7 @@ Foam::GeometricField<Type, PatchField, GeoMesh>::component ) ); - Foam::component(Component.ref().internalFieldRef(), internalField(), d); + Foam::component(Component.ref().primitiveFieldRef(), primitiveField(), d); Foam::component(Component.ref().boundaryFieldRef(), boundaryField(), d); return Component; @@ -1072,7 +1072,7 @@ void Foam::GeometricField<Type, PatchField, GeoMesh>::replace >& gcf ) { - internalFieldRef().replace(d, gcf.internalField()); + primitiveFieldRef().replace(d, gcf.primitiveField()); boundaryFieldRef().replace(d, gcf.boundaryField()); } @@ -1084,7 +1084,7 @@ void Foam::GeometricField<Type, PatchField, GeoMesh>::replace const dimensioned<cmptType>& ds ) { - internalFieldRef().replace(d, ds.value()); + primitiveFieldRef().replace(d, ds.value()); boundaryFieldRef().replace(d, ds.value()); } @@ -1095,7 +1095,7 @@ void Foam::GeometricField<Type, PatchField, GeoMesh>::max const dimensioned<Type>& dt ) { - Foam::max(internalFieldRef(), internalField(), dt.value()); + Foam::max(primitiveFieldRef(), primitiveField(), dt.value()); Foam::max(boundaryFieldRef(), boundaryField(), dt.value()); } @@ -1106,7 +1106,7 @@ void Foam::GeometricField<Type, PatchField, GeoMesh>::min const dimensioned<Type>& dt ) { - Foam::min(internalFieldRef(), internalField(), dt.value()); + Foam::min(primitiveFieldRef(), primitiveField(), dt.value()); Foam::min(boundaryFieldRef(), boundaryField(), dt.value()); } @@ -1114,7 +1114,7 @@ void Foam::GeometricField<Type, PatchField, GeoMesh>::min template<class Type, template<class> class PatchField, class GeoMesh> void Foam::GeometricField<Type, PatchField, GeoMesh>::negate() { - internalFieldRef().negate(); + primitiveFieldRef().negate(); boundaryFieldRef().negate(); } @@ -1165,9 +1165,9 @@ void Foam::GeometricField<Type, PatchField, GeoMesh>::operator= this->dimensions() = gf.dimensions(); // Transfer the storage from the tmp - internalFieldRef().transfer + primitiveFieldRef().transfer ( - const_cast<Field<Type>&>(gf.internalField()) + const_cast<Field<Type>&>(gf.primitiveField()) ); boundaryFieldRef() = gf.boundaryField(); diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.H b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.H index c9b83b4589..43bd25c5fe 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.H +++ b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricField.H @@ -450,7 +450,7 @@ public: Internal& ref(); //- Return a const-reference to the dimensioned internal field - inline const Internal& dimensionedInternalField() const; + inline const Internal& internalField() const; //- Return a const-reference to the dimensioned internal field // of a "vol" field. Useful in the formulation of source-terms @@ -460,10 +460,10 @@ public: //- Return a reference to the internal field // Note: this increments the event counter and checks the // old-time fields; avoid in loops. - typename Internal::FieldType& internalFieldRef(); + typename Internal::FieldType& primitiveFieldRef(); //- Return a const-reference to the internal field - inline const typename Internal::FieldType& internalField() const; + inline const typename Internal::FieldType& primitiveField() const; //- Return a reference to the boundary field // Note: this increments the event counter and checks the diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctions.C b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctions.C index 70e0e5f29b..49a7ce2d62 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctions.C +++ b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctions.C @@ -49,7 +49,7 @@ void component const direction d ) { - component(gcf.internalFieldRef(), gf.internalField(), d); + component(gcf.primitiveFieldRef(), gf.primitiveField(), d); component(gcf.boundaryFieldRef(), gf.boundaryField(), d); } @@ -61,7 +61,7 @@ void T const GeometricField<Type, PatchField, GeoMesh>& gf1 ) { - T(gf.internalFieldRef(), gf1.internalField()); + T(gf.primitiveFieldRef(), gf1.primitiveField()); T(gf.boundaryFieldRef(), gf1.boundaryField()); } @@ -79,7 +79,7 @@ void pow const GeometricField<Type, PatchField, GeoMesh>& gf1 ) { - pow(gf.internalFieldRef(), gf1.internalField(), r); + pow(gf.primitiveFieldRef(), gf1.primitiveField(), r); pow(gf.boundaryFieldRef(), gf1.boundaryField(), r); } @@ -173,7 +173,7 @@ void sqr const GeometricField<Type, PatchField, GeoMesh>& gf1 ) { - sqr(gf.internalFieldRef(), gf1.internalField()); + sqr(gf.primitiveFieldRef(), gf1.primitiveField()); sqr(gf.boundaryFieldRef(), gf1.boundaryField()); } @@ -261,7 +261,7 @@ void magSqr const GeometricField<Type, PatchField, GeoMesh>& gf ) { - magSqr(gsf.internalFieldRef(), gf.internalField()); + magSqr(gsf.primitiveFieldRef(), gf.primitiveField()); magSqr(gsf.boundaryFieldRef(), gf.boundaryField()); } @@ -333,7 +333,7 @@ void mag const GeometricField<Type, PatchField, GeoMesh>& gf ) { - mag(gsf.internalFieldRef(), gf.internalField()); + mag(gsf.primitiveFieldRef(), gf.primitiveField()); mag(gsf.boundaryFieldRef(), gf.boundaryField()); } @@ -410,7 +410,7 @@ void cmptAv const GeometricField<Type, PatchField, GeoMesh>& gf ) { - cmptAv(gcf.internalFieldRef(), gf.internalField()); + cmptAv(gcf.primitiveFieldRef(), gf.primitiveField()); cmptAv(gcf.boundaryFieldRef(), gf.boundaryField()); } @@ -505,7 +505,7 @@ dimensioned<returnType> func \ ( \ #func "(" + gf.name() + ')', \ gf.dimensions(), \ - Foam::func(gFunc(gf.internalField()), gFunc(gf.boundaryField())) \ + Foam::func(gFunc(gf.primitiveField()), gFunc(gf.boundaryField())) \ ); \ } \ \ @@ -538,7 +538,7 @@ dimensioned<returnType> func \ ( \ #func "(" + gf.name() + ')', \ gf.dimensions(), \ - gFunc(gf.internalField()) \ + gFunc(gf.primitiveField()) \ ); \ } \ \ @@ -601,9 +601,9 @@ void opFunc \ { \ Foam::opFunc \ ( \ - gf.internalFieldRef(), \ - gf1.internalField(), \ - gf2.internalField() \ + gf.primitiveFieldRef(), \ + gf1.primitiveField(), \ + gf2.primitiveField() \ ); \ Foam::opFunc \ ( \ @@ -755,7 +755,7 @@ void opFunc \ const dimensioned<Form>& dvs \ ) \ { \ - Foam::opFunc(gf.internalFieldRef(), gf1.internalField(), dvs.value()); \ + Foam::opFunc(gf.primitiveFieldRef(), gf1.primitiveField(), dvs.value()); \ Foam::opFunc(gf.boundaryFieldRef(), gf1.boundaryField(), dvs.value()); \ } \ \ @@ -868,7 +868,7 @@ void opFunc \ const GeometricField<Type, PatchField, GeoMesh>& gf1 \ ) \ { \ - Foam::opFunc(gf.internalFieldRef(), dvs.value(), gf1.internalField()); \ + Foam::opFunc(gf.primitiveFieldRef(), dvs.value(), gf1.primitiveField()); \ Foam::opFunc(gf.boundaryFieldRef(), dvs.value(), gf1.boundaryField()); \ } \ \ diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctionsM.C b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctionsM.C index 774b89c753..377339dae9 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctionsM.C +++ b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldFunctionsM.C @@ -41,7 +41,7 @@ void Func \ const GeometricField<Type1, PatchField, GeoMesh>& gf1 \ ) \ { \ - Foam::Func(res.internalFieldRef(), gf1.internalField()); \ + Foam::Func(res.primitiveFieldRef(), gf1.primitiveField()); \ Foam::Func(res.boundaryFieldRef(), gf1.boundaryField()); \ } \ \ @@ -110,7 +110,7 @@ void OpFunc \ const GeometricField<Type1, PatchField, GeoMesh>& gf1 \ ) \ { \ - Foam::OpFunc(res.internalFieldRef(), gf1.internalField()); \ + Foam::OpFunc(res.primitiveFieldRef(), gf1.primitiveField()); \ Foam::OpFunc(res.boundaryFieldRef(), gf1.boundaryField()); \ } \ \ @@ -182,9 +182,9 @@ void Func \ { \ Foam::Func \ ( \ - res.internalFieldRef(), \ - gf1.internalField(), \ - gf2.internalField() \ + res.primitiveFieldRef(), \ + gf1.primitiveField(), \ + gf2.primitiveField() \ ); \ Foam::Func \ ( \ @@ -318,7 +318,7 @@ void Func \ const GeometricField<Type2, PatchField, GeoMesh>& gf2 \ ) \ { \ - Foam::Func(res.internalFieldRef(), dt1.value(), gf2.internalField()); \ + Foam::Func(res.primitiveFieldRef(), dt1.value(), gf2.primitiveField()); \ Foam::Func(res.boundaryFieldRef(), dt1.value(), gf2.boundaryField()); \ } \ \ @@ -409,7 +409,7 @@ void Func \ const dimensioned<Type2>& dt2 \ ) \ { \ - Foam::Func(res.internalFieldRef(), gf1.internalField(), dt2.value()); \ + Foam::Func(res.primitiveFieldRef(), gf1.primitiveField(), dt2.value()); \ Foam::Func(res.boundaryFieldRef(), gf1.boundaryField(), dt2.value()); \ } \ \ @@ -508,7 +508,7 @@ void OpFunc \ ) \ { \ Foam::OpFunc \ - (res.internalFieldRef(), gf1.internalField(), gf2.internalField()); \ + (res.primitiveFieldRef(), gf1.primitiveField(), gf2.primitiveField()); \ Foam::OpFunc \ (res.boundaryFieldRef(), gf1.boundaryField(), gf2.boundaryField()); \ } \ @@ -637,7 +637,7 @@ void OpFunc \ const GeometricField<Type2, PatchField, GeoMesh>& gf2 \ ) \ { \ - Foam::OpFunc(res.internalFieldRef(), dt1.value(), gf2.internalField()); \ + Foam::OpFunc(res.primitiveFieldRef(), dt1.value(), gf2.primitiveField()); \ Foam::OpFunc(res.boundaryFieldRef(), dt1.value(), gf2.boundaryField()); \ } \ \ @@ -728,7 +728,7 @@ void OpFunc \ const dimensioned<Type2>& dt2 \ ) \ { \ - Foam::OpFunc(res.internalFieldRef(), gf1.internalField(), dt2.value()); \ + Foam::OpFunc(res.primitiveFieldRef(), gf1.primitiveField(), dt2.value()); \ Foam::OpFunc(res.boundaryFieldRef(), gf1.boundaryField(), dt2.value()); \ } \ \ diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldI.H b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldI.H index 697da6e598..3339ffd136 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldI.H +++ b/src/OpenFOAM/fields/GeometricFields/GeometricField/GeometricFieldI.H @@ -38,7 +38,7 @@ inline const typename Foam::GeometricField<Type, PatchField, GeoMesh>::Internal& Foam::GeometricField<Type, PatchField, GeoMesh>:: -dimensionedInternalField() const +internalField() const { return *this; } @@ -48,7 +48,7 @@ template<class Type, template<class> class PatchField, class GeoMesh> inline const typename Foam::GeometricField<Type, PatchField, GeoMesh>::Internal::FieldType& -Foam::GeometricField<Type, PatchField, GeoMesh>::internalField() const +Foam::GeometricField<Type, PatchField, GeoMesh>::primitiveField() const { return *this; } diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricField/MapGeometricFields.H b/src/OpenFOAM/fields/GeometricFields/GeometricField/MapGeometricFields.H index eac89f8142..93a47eda9f 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricField/MapGeometricFields.H +++ b/src/OpenFOAM/fields/GeometricFields/GeometricField/MapGeometricFields.H @@ -126,7 +126,7 @@ void MapGeometricFields // Map the internal field MapInternalField<Type, MeshMapper, GeoMesh>() ( - field.internalFieldRef(), + field.primitiveFieldRef(), mapper ); diff --git a/src/OpenFOAM/fields/GeometricFields/GeometricScalarField/GeometricScalarField.C b/src/OpenFOAM/fields/GeometricFields/GeometricScalarField/GeometricScalarField.C index cb3ec9aff7..f05d3c5cb0 100644 --- a/src/OpenFOAM/fields/GeometricFields/GeometricScalarField/GeometricScalarField.C +++ b/src/OpenFOAM/fields/GeometricFields/GeometricScalarField/GeometricScalarField.C @@ -43,7 +43,7 @@ void stabilise const dimensioned<scalar>& ds ) { - stabilise(result.internalFieldRef(), gsf.internalField(), ds.value()); + stabilise(result.primitiveFieldRef(), gsf.primitiveField(), ds.value()); stabilise(result.boundaryFieldRef(), gsf.boundaryField(), ds.value()); } @@ -126,7 +126,7 @@ void pow const GeometricField<scalar, PatchField, GeoMesh>& gsf2 ) { - pow(Pow.internalFieldRef(), gsf1.internalField(), gsf2.internalField()); + pow(Pow.primitiveFieldRef(), gsf1.primitiveField(), gsf2.primitiveField()); pow(Pow.boundaryFieldRef(), gsf1.boundaryField(), gsf2.boundaryField()); } @@ -269,7 +269,7 @@ void pow const dimensioned<scalar>& ds ) { - pow(tPow.internalFieldRef(), gsf.internalField(), ds.value()); + pow(tPow.primitiveFieldRef(), gsf.primitiveField(), ds.value()); pow(tPow.boundaryFieldRef(), gsf.boundaryField(), ds.value()); } @@ -358,7 +358,7 @@ void pow const GeometricField<scalar, PatchField, GeoMesh>& gsf ) { - pow(tPow.internalFieldRef(), ds.value(), gsf.internalField()); + pow(tPow.primitiveFieldRef(), ds.value(), gsf.primitiveField()); pow(tPow.boundaryFieldRef(), ds.value(), gsf.boundaryField()); } @@ -450,8 +450,18 @@ void atan2 const GeometricField<scalar, PatchField, GeoMesh>& gsf2 ) { - atan2(Atan2.internalFieldRef(), gsf1.internalField(), gsf2.internalField()); - atan2(Atan2.boundaryFieldRef(), gsf1.boundaryField(), gsf2.boundaryField()); + atan2 + ( + Atan2.primitiveFieldRef(), + gsf1.primitiveField(), + gsf2.primitiveField() + ); + atan2 + ( + Atan2.boundaryFieldRef(), + gsf1.boundaryField(), + gsf2.boundaryField() + ); } @@ -577,7 +587,7 @@ void atan2 const dimensioned<scalar>& ds ) { - atan2(tAtan2.internalFieldRef(), gsf.internalField(), ds.value()); + atan2(tAtan2.primitiveFieldRef(), gsf.primitiveField(), ds.value()); atan2(tAtan2.boundaryFieldRef(), gsf.boundaryField(), ds.value()); } @@ -666,7 +676,7 @@ void atan2 const GeometricField<scalar, PatchField, GeoMesh>& gsf ) { - atan2(tAtan2.internalFieldRef(), ds.value(), gsf.internalField()); + atan2(tAtan2.primitiveFieldRef(), ds.value(), gsf.primitiveField()); atan2(tAtan2.boundaryFieldRef(), ds.value(), gsf.boundaryField()); } @@ -799,7 +809,7 @@ void func \ const GeometricField<scalar, PatchField, GeoMesh>& gsf1 \ ) \ { \ - func(gsf.internalFieldRef(), n, gsf1.internalField()); \ + func(gsf.primitiveFieldRef(), n, gsf1.primitiveField()); \ func(gsf.boundaryFieldRef(), n, gsf1.boundaryField()); \ } \ \ diff --git a/src/OpenFOAM/fields/GeometricFields/SlicedGeometricField/SlicedGeometricField.C b/src/OpenFOAM/fields/GeometricFields/SlicedGeometricField/SlicedGeometricField.C index a3a42d71da..8bc8c195b2 100644 --- a/src/OpenFOAM/fields/GeometricFields/SlicedGeometricField/SlicedGeometricField.C +++ b/src/OpenFOAM/fields/GeometricFields/SlicedGeometricField/SlicedGeometricField.C @@ -305,7 +305,7 @@ SlicedGeometricField ) { // Set the internalField to the supplied internal field - UList<Type>::shallowCopy(gf.internalField()); + UList<Type>::shallowCopy(gf.primitiveField()); correctBoundaryConditions(); } @@ -334,7 +334,7 @@ SlicedGeometricField ) { // Set the internalField to the supplied internal field - UList<Type>::shallowCopy(gf.internalField()); + UList<Type>::shallowCopy(gf.primitiveField()); } diff --git a/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneField.H b/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneField.H index b1d2530c2a..7f7a352f78 100644 --- a/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneField.H +++ b/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneField.H @@ -85,7 +85,7 @@ public: inline Internal v() const; - inline typename Internal::FieldType internalField() const; + inline typename Internal::FieldType primitiveField() const; inline Boundary boundaryField() const; }; diff --git a/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneFieldI.H b/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneFieldI.H index 1608e0bf5e..4364f26500 100644 --- a/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneFieldI.H +++ b/src/OpenFOAM/fields/GeometricFields/geometricOneField/geometricOneFieldI.H @@ -66,7 +66,7 @@ Foam::geometricOneField::v() const inline typename Foam::geometricOneField::Internal::FieldType -Foam::geometricOneField::internalField() const +Foam::geometricOneField::primitiveField() const { return typename Internal::FieldType(); } diff --git a/src/OpenFOAM/fields/GeometricFields/transformGeometricField/transformGeometricField.C b/src/OpenFOAM/fields/GeometricFields/transformGeometricField/transformGeometricField.C index 31c70df1c3..4146644bf5 100644 --- a/src/OpenFOAM/fields/GeometricFields/transformGeometricField/transformGeometricField.C +++ b/src/OpenFOAM/fields/GeometricFields/transformGeometricField/transformGeometricField.C @@ -45,8 +45,18 @@ void transform const GeometricField<Type, PatchField, GeoMesh>& tf ) { - transform(rtf.internalFieldRef(), trf.internalField(), tf.internalField()); - transform(rtf.boundaryFieldRef(), trf.boundaryField(), tf.boundaryField()); + transform + ( + rtf.primitiveFieldRef(), + trf.primitiveField(), + tf.primitiveField() + ); + transform + ( + rtf.boundaryFieldRef(), + trf.boundaryField(), + tf.boundaryField() + ); } @@ -131,7 +141,7 @@ void transform const GeometricField<Type, PatchField, GeoMesh>& tf ) { - transform(rtf.internalFieldRef(), t.value(), tf.internalField()); + transform(rtf.primitiveFieldRef(), t.value(), tf.primitiveField()); transform(rtf.boundaryFieldRef(), t.value(), tf.boundaryField()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/basic/basicSymmetry/basicSymmetryPointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/basic/basicSymmetry/basicSymmetryPointPatchField.C index c4e7b18a0c..2253f241af 100644 --- a/src/OpenFOAM/fields/pointPatchFields/basic/basicSymmetry/basicSymmetryPointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/basic/basicSymmetry/basicSymmetryPointPatchField.C @@ -96,7 +96,7 @@ void Foam::basicSymmetryPointPatchField<Type>::evaluate ); // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, tvalues()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/basic/value/valuePointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/basic/value/valuePointPatchField.C index e7c7dacb85..09927c0494 100644 --- a/src/OpenFOAM/fields/pointPatchFields/basic/value/valuePointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/basic/value/valuePointPatchField.C @@ -155,7 +155,7 @@ void Foam::valuePointPatchField<Type>::updateCoeffs() } // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, *this); @@ -167,7 +167,7 @@ template<class Type> void Foam::valuePointPatchField<Type>::evaluate(const Pstream::commsTypes) { // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, *this); diff --git a/src/OpenFOAM/fields/pointPatchFields/constraint/cyclic/cyclicPointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/constraint/cyclic/cyclicPointPatchField.C index ff745bf315..02e66ce22e 100644 --- a/src/OpenFOAM/fields/pointPatchFields/constraint/cyclic/cyclicPointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/constraint/cyclic/cyclicPointPatchField.C @@ -123,7 +123,7 @@ void Foam::cyclicPointPatchField<Type>::swapAddSeparated const GeometricField<Type, pointPatchField, pointMesh>& fld = refCast<const GeometricField<Type, pointPatchField, pointMesh>> ( - this->dimensionedInternalField() + this->internalField() ); const cyclicPointPatchField<Type>& nbr = diff --git a/src/OpenFOAM/fields/pointPatchFields/constraint/cyclicSlip/cyclicSlipPointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/constraint/cyclicSlip/cyclicSlipPointPatchField.C index 8bceca0831..ae457ffbcc 100644 --- a/src/OpenFOAM/fields/pointPatchFields/constraint/cyclicSlip/cyclicSlipPointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/constraint/cyclicSlip/cyclicSlipPointPatchField.C @@ -93,7 +93,7 @@ void Foam::cyclicSlipPointPatchField<Type>::evaluate(const Pstream::commsTypes) ); // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, tvalues()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/constraint/nonuniformTransformCyclic/nonuniformTransformCyclicPointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/constraint/nonuniformTransformCyclic/nonuniformTransformCyclicPointPatchField.C index f2d0ac7b2d..83903ce32f 100644 --- a/src/OpenFOAM/fields/pointPatchFields/constraint/nonuniformTransformCyclic/nonuniformTransformCyclicPointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/constraint/nonuniformTransformCyclic/nonuniformTransformCyclicPointPatchField.C @@ -100,7 +100,7 @@ void Foam::nonuniformTransformCyclicPointPatchField<Type>::evaluate ); // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, tvalues()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/constraint/symmetryPlane/symmetryPlanePointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/constraint/symmetryPlane/symmetryPlanePointPatchField.C index e90c1454fd..9351dac4bd 100644 --- a/src/OpenFOAM/fields/pointPatchFields/constraint/symmetryPlane/symmetryPlanePointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/constraint/symmetryPlane/symmetryPlanePointPatchField.C @@ -117,7 +117,7 @@ void Foam::symmetryPlanePointPatchField<Type>::evaluate ); // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, tvalues()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/constraint/wedge/wedgePointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/constraint/wedge/wedgePointPatchField.C index 8a5c7f2da2..0c93ef5905 100644 --- a/src/OpenFOAM/fields/pointPatchFields/constraint/wedge/wedgePointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/constraint/wedge/wedgePointPatchField.C @@ -109,7 +109,7 @@ void Foam::wedgePointPatchField<Type>::evaluate(const Pstream::commsTypes) transform(I - nHat*nHat, this->patchInternalField()); // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, tvalues()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/derived/codedFixedValue/codedFixedValuePointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/derived/codedFixedValue/codedFixedValuePointPatchField.C index f56a8cf1e7..2c6327fa17 100644 --- a/src/OpenFOAM/fields/pointPatchFields/derived/codedFixedValue/codedFixedValuePointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/derived/codedFixedValue/codedFixedValuePointPatchField.C @@ -161,7 +161,7 @@ Foam::string Foam::codedFixedValuePointPatchField<Type>::description() const "patch " + this->patch().name() + " on field " - + this->dimensionedInternalField().name(); + + this->internalField().name(); } @@ -276,7 +276,7 @@ Foam::codedFixedValuePointPatchField<Type>::redirectPatchField() const pointPatchField<Type>::New ( this->patch(), - this->dimensionedInternalField(), + this->internalField(), dict ).ptr() ); diff --git a/src/OpenFOAM/fields/pointPatchFields/derived/fixedNormalSlip/fixedNormalSlipPointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/derived/fixedNormalSlip/fixedNormalSlipPointPatchField.C index 00454c22d8..cd99728ca5 100644 --- a/src/OpenFOAM/fields/pointPatchFields/derived/fixedNormalSlip/fixedNormalSlipPointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/derived/fixedNormalSlip/fixedNormalSlipPointPatchField.C @@ -90,7 +90,7 @@ void Foam::fixedNormalSlipPointPatchField<Type>::evaluate transform(I - n_*n_, this->patchInternalField()); // Get internal field to insert values into - Field<Type>& iF = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& iF = const_cast<Field<Type>&>(this->primitiveField()); this->setInInternalField(iF, tvalues()); } diff --git a/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.C b/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.C index fdd069525d..aef8c59c99 100644 --- a/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.C +++ b/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.C @@ -127,7 +127,7 @@ template<class Type> Foam::tmp<Foam::Field<Type>> Foam::pointPatchField<Type>::patchInternalField() const { - return patchInternalField(internalField()); + return patchInternalField(primitiveField()); } @@ -141,12 +141,12 @@ Foam::pointPatchField<Type>::patchInternalField ) const { // Check size - if (iF.size() != internalField().size()) + if (iF.size() != primitiveField().size()) { FatalErrorInFunction << "given internal field does not correspond to the mesh. " << "Field size: " << iF.size() - << " mesh size: " << internalField().size() + << " mesh size: " << primitiveField().size() << abort(FatalError); } @@ -175,12 +175,12 @@ void Foam::pointPatchField<Type>::addToInternalField ) const { // Check size - if (iF.size() != internalField().size()) + if (iF.size() != primitiveField().size()) { FatalErrorInFunction << "given internal field does not correspond to the mesh. " << "Field size: " << iF.size() - << " mesh size: " << internalField().size() + << " mesh size: " << primitiveField().size() << abort(FatalError); } @@ -213,12 +213,12 @@ void Foam::pointPatchField<Type>::addToInternalField ) const { // Check size - if (iF.size() != internalField().size()) + if (iF.size() != primitiveField().size()) { FatalErrorInFunction << "given internal field does not correspond to the mesh. " << "Field size: " << iF.size() - << " mesh size: " << internalField().size() + << " mesh size: " << primitiveField().size() << abort(FatalError); } @@ -252,12 +252,12 @@ void Foam::pointPatchField<Type>::setInInternalField ) const { // Check size - if (iF.size() != internalField().size()) + if (iF.size() != primitiveField().size()) { FatalErrorInFunction << "given internal field does not correspond to the mesh. " << "Field size: " << iF.size() - << " mesh size: " << internalField().size() + << " mesh size: " << primitiveField().size() << abort(FatalError); } diff --git a/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.H b/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.H index d69b75f37f..5db051b1dc 100644 --- a/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.H +++ b/src/OpenFOAM/fields/pointPatchFields/pointPatchField/pointPatchField.H @@ -279,13 +279,13 @@ public: //- Return dimensioned internal field reference const DimensionedField<Type, pointMesh>& - dimensionedInternalField() const + internalField() const { return internalField_; } //- Return internal field reference - const Field<Type>& internalField() const + const Field<Type>& primitiveField() const { return internalField_; } diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/convectiveHeatTransfer/convectiveHeatTransferFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/convectiveHeatTransfer/convectiveHeatTransferFvPatchScalarField.C index 2bf7bf969c..2d372fca7e 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/convectiveHeatTransfer/convectiveHeatTransferFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/convectiveHeatTransfer/convectiveHeatTransferFvPatchScalarField.C @@ -116,7 +116,7 @@ void convectiveHeatTransferFvPatchScalarField::updateCoeffs() IOobject::groupName ( compressible::turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalCoupledTemperatureMixed/externalCoupledTemperatureMixedFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalCoupledTemperatureMixed/externalCoupledTemperatureMixedFvPatchScalarField.C index 9ab7aba693..aa2367468a 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalCoupledTemperatureMixed/externalCoupledTemperatureMixedFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalCoupledTemperatureMixed/externalCoupledTemperatureMixedFvPatchScalarField.C @@ -133,7 +133,7 @@ void Foam::externalCoupledTemperatureMixedFvPatchScalarField::transferData IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalWallHeatFluxTemperature/externalWallHeatFluxTemperatureFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalWallHeatFluxTemperature/externalWallHeatFluxTemperatureFvPatchScalarField.C index e0f2f2cba5..7401f27460 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalWallHeatFluxTemperature/externalWallHeatFluxTemperatureFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/externalWallHeatFluxTemperature/externalWallHeatFluxTemperatureFvPatchScalarField.C @@ -147,8 +147,8 @@ externalWallHeatFluxTemperatureFvPatchScalarField << "\n patch type '" << p.type() << "' either q or h and Ta were not found '" << "\n for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } @@ -319,7 +319,7 @@ void Foam::externalWallHeatFluxTemperatureFvPatchScalarField::updateCoeffs() Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " :" + << this->internalField().name() << " :" << " heat transfer rate:" << Q << " walltemperature " << " min:" << gMin(*this) diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/thermalBaffle1D/thermalBaffle1DFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/thermalBaffle1D/thermalBaffle1DFvPatchScalarField.C index e2cdfdfc0d..41d4fbfc9e 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/thermalBaffle1D/thermalBaffle1DFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/thermalBaffle1D/thermalBaffle1DFvPatchScalarField.C @@ -403,9 +403,9 @@ void thermalBaffle1DFvPatchScalarField<solidType>::updateCoeffs() scalar Q = gAverage(kappaw*snGrad()); Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " <- " + << this->internalField().name() << " <- " << nbrPatch.name() << ':' - << this->dimensionedInternalField().name() << " :" + << this->internalField().name() << " :" << " heat[W]:" << Q << " walltemperature " << " min:" << gMin(*this) diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/totalFlowRateAdvectiveDiffusive/totalFlowRateAdvectiveDiffusiveFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/totalFlowRateAdvectiveDiffusive/totalFlowRateAdvectiveDiffusiveFvPatchScalarField.C index 576793f6aa..9a265c87ab 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/totalFlowRateAdvectiveDiffusive/totalFlowRateAdvectiveDiffusiveFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/totalFlowRateAdvectiveDiffusive/totalFlowRateAdvectiveDiffusiveFvPatchScalarField.C @@ -163,7 +163,7 @@ void Foam::totalFlowRateAdvectiveDiffusiveFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -191,7 +191,7 @@ void Foam::totalFlowRateAdvectiveDiffusiveFvPatchScalarField::updateCoeffs() Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " :" + << this->internalField().name() << " :" << " mass flux[Kg/s]:" << phi << endl; } diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureCoupledBaffleMixed/turbulentTemperatureCoupledBaffleMixedFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureCoupledBaffleMixed/turbulentTemperatureCoupledBaffleMixedFvPatchScalarField.C index 2cf9ed03d5..1548c37e62 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureCoupledBaffleMixed/turbulentTemperatureCoupledBaffleMixedFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureCoupledBaffleMixed/turbulentTemperatureCoupledBaffleMixedFvPatchScalarField.C @@ -96,8 +96,8 @@ turbulentTemperatureCoupledBaffleMixedFvPatchScalarField FatalErrorInFunction << "' not type '" << mappedPatchBase::typeName << "'" << "\n for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } @@ -237,10 +237,10 @@ void turbulentTemperatureCoupledBaffleMixedFvPatchScalarField::updateCoeffs() Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " <- " + << this->internalField().name() << " <- " << nbrMesh.name() << ':' << nbrPatch.name() << ':' - << this->dimensionedInternalField().name() << " :" + << this->internalField().name() << " :" << " heat transfer rate:" << Q << " walltemperature " << " min:" << gMin(*this) diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureRadCoupledMixed/turbulentTemperatureRadCoupledMixedFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureRadCoupledMixed/turbulentTemperatureRadCoupledMixedFvPatchScalarField.C index 72605f8b9f..d69c96ee2c 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureRadCoupledMixed/turbulentTemperatureRadCoupledMixedFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/turbulentTemperatureRadCoupledMixed/turbulentTemperatureRadCoupledMixedFvPatchScalarField.C @@ -102,8 +102,8 @@ turbulentTemperatureRadCoupledMixedFvPatchScalarField FatalErrorInFunction << "' not type '" << mappedPatchBase::typeName << "'" << "\n for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } @@ -237,10 +237,10 @@ void turbulentTemperatureRadCoupledMixedFvPatchScalarField::updateCoeffs() Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " <- " + << this->internalField().name() << " <- " << nbrMesh.name() << ':' << nbrPatch.name() << ':' - << this->dimensionedInternalField().name() << " :" + << this->internalField().name() << " :" << " heat transfer rate:" << Q << " walltemperature " << " min:" << gMin(Tp) diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C index e91e4fde2b..2ebd97528d 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C @@ -203,7 +203,7 @@ void alphatJayatillekeWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( compressible::turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatWallFunction/alphatWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatWallFunction/alphatWallFunctionFvPatchScalarField.C index ece3ac9e36..56e6c489a0 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatWallFunction/alphatWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatWallFunction/alphatWallFunctionFvPatchScalarField.C @@ -113,7 +113,7 @@ void alphatWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( compressibleTurbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallHeatTransfer/wallHeatTransferFvPatchScalarField.C b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallHeatTransfer/wallHeatTransferFvPatchScalarField.C index bc5f23ced4..19a9eafe67 100644 --- a/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallHeatTransfer/wallHeatTransferFvPatchScalarField.C +++ b/src/TurbulenceModels/compressible/turbulentFluidThermoModels/derivedFvPatchFields/wallHeatTransfer/wallHeatTransferFvPatchScalarField.C @@ -154,7 +154,7 @@ void Foam::wallHeatTransferFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/incompressible/turbulentTransportModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/incompressible/turbulentTransportModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C index 4fc4a08fb8..eece304601 100644 --- a/src/TurbulenceModels/incompressible/turbulentTransportModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/incompressible/turbulentTransportModels/derivedFvPatchFields/wallFunctions/alphatWallFunctions/alphatJayatillekeWallFunction/alphatJayatillekeWallFunctionFvPatchScalarField.C @@ -206,7 +206,7 @@ void alphatJayatillekeWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/IDDESDelta/IDDESDelta.C b/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/IDDESDelta/IDDESDelta.C index 8526b58280..af812a6f46 100644 --- a/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/IDDESDelta/IDDESDelta.C +++ b/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/IDDESDelta/IDDESDelta.C @@ -66,7 +66,7 @@ void Foam::LESModels::IDDESDelta::calcDelta() ) ); - scalarField& faceToFacenMax = tfaceToFacenMax.ref().internalFieldRef(); + scalarField& faceToFacenMax = tfaceToFacenMax.ref().primitiveFieldRef(); const cellList& cells = mesh.cells(); const vectorField& faceCentres = mesh.faceCentres(); @@ -113,7 +113,7 @@ void Foam::LESModels::IDDESDelta::calcDelta() << "Case must be either 2D or 3D" << exit(FatalError); } - delta_.internalFieldRef() = + delta_.primitiveFieldRef() = min ( max diff --git a/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/cubeRootVolDelta/cubeRootVolDelta.C b/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/cubeRootVolDelta/cubeRootVolDelta.C index c322119d90..053c365a2f 100644 --- a/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/cubeRootVolDelta/cubeRootVolDelta.C +++ b/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/cubeRootVolDelta/cubeRootVolDelta.C @@ -48,7 +48,7 @@ void Foam::LESModels::cubeRootVolDelta::calcDelta() if (nD == 3) { - delta_.internalFieldRef() = deltaCoeff_*pow(mesh.V(), 1.0/3.0); + delta_.primitiveFieldRef() = deltaCoeff_*pow(mesh.V(), 1.0/3.0); } else if (nD == 2) { @@ -68,7 +68,7 @@ void Foam::LESModels::cubeRootVolDelta::calcDelta() } } - delta_.internalFieldRef() = deltaCoeff_*sqrt(mesh.V()/thickness); + delta_.primitiveFieldRef() = deltaCoeff_*sqrt(mesh.V()/thickness); } else { diff --git a/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/maxDeltaxyz/maxDeltaxyz.C b/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/maxDeltaxyz/maxDeltaxyz.C index 4b0b708a1b..2163a3201c 100644 --- a/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/maxDeltaxyz/maxDeltaxyz.C +++ b/src/TurbulenceModels/turbulenceModels/LES/LESdeltas/maxDeltaxyz/maxDeltaxyz.C @@ -71,7 +71,7 @@ void Foam::LESModels::maxDeltaxyz::calcDelta() if (nD == 3) { - delta_.internalFieldRef() = hmax; + delta_.primitiveFieldRef() = hmax; } else if (nD == 2) { @@ -79,7 +79,7 @@ void Foam::LESModels::maxDeltaxyz::calcDelta() << "Case is 2D, LES is not strictly applicable\n" << endl; - delta_.internalFieldRef() = hmax; + delta_.primitiveFieldRef() = hmax; } else { diff --git a/src/TurbulenceModels/turbulenceModels/LES/LESfilters/anisotropicFilter/anisotropicFilter.C b/src/TurbulenceModels/turbulenceModels/LES/LESfilters/anisotropicFilter/anisotropicFilter.C index 75dc5ef9e7..a23cadce9b 100644 --- a/src/TurbulenceModels/turbulenceModels/LES/LESfilters/anisotropicFilter/anisotropicFilter.C +++ b/src/TurbulenceModels/turbulenceModels/LES/LESfilters/anisotropicFilter/anisotropicFilter.C @@ -63,14 +63,14 @@ Foam::anisotropicFilter::anisotropicFilter { for (direction d=0; d<vector::nComponents; d++) { - coeff_.internalFieldRef().replace + coeff_.primitiveFieldRef().replace ( d, (1/widthCoeff_)* sqr ( 2.0*mesh.V() - /fvc::surfaceSum(mag(mesh.Sf().component(d)))().internalField() + /fvc::surfaceSum(mag(mesh.Sf().component(d)))().primitiveField() ) ); } @@ -100,14 +100,14 @@ Foam::anisotropicFilter::anisotropicFilter { for (direction d=0; d<vector::nComponents; d++) { - coeff_.internalFieldRef().replace + coeff_.primitiveFieldRef().replace ( d, (1/widthCoeff_)* sqr ( 2.0*mesh.V() - /fvc::surfaceSum(mag(mesh.Sf().component(d)))().internalField() + /fvc::surfaceSum(mag(mesh.Sf().component(d)))().primitiveField() ) ); } diff --git a/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthDissipationRateInlet/turbulentMixingLengthDissipationRateInletFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthDissipationRateInlet/turbulentMixingLengthDissipationRateInletFvPatchScalarField.C index 50fa5ac9bf..fd8796b036 100644 --- a/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthDissipationRateInlet/turbulentMixingLengthDissipationRateInletFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthDissipationRateInlet/turbulentMixingLengthDissipationRateInletFvPatchScalarField.C @@ -131,7 +131,7 @@ void turbulentMixingLengthDissipationRateInletFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthFrequencyInlet/turbulentMixingLengthFrequencyInletFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthFrequencyInlet/turbulentMixingLengthFrequencyInletFvPatchScalarField.C index f082bd6eae..3f81539494 100644 --- a/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthFrequencyInlet/turbulentMixingLengthFrequencyInletFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/RAS/derivedFvPatchFields/turbulentMixingLengthFrequencyInlet/turbulentMixingLengthFrequencyInletFvPatchScalarField.C @@ -127,7 +127,7 @@ void turbulentMixingLengthFrequencyInletFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/fixedShearStress/fixedShearStressFvPatchVectorField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/fixedShearStress/fixedShearStressFvPatchVectorField.C index db3e262477..17050f28d5 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/fixedShearStress/fixedShearStressFvPatchVectorField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/fixedShearStress/fixedShearStressFvPatchVectorField.C @@ -105,7 +105,7 @@ void Foam::fixedShearStressFvPatchVectorField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/porousBafflePressure/porousBafflePressureFvPatchField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/porousBafflePressure/porousBafflePressureFvPatchField.C index b7b49ca3f4..ecf6573140 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/porousBafflePressure/porousBafflePressureFvPatchField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/porousBafflePressure/porousBafflePressureFvPatchField.C @@ -142,7 +142,7 @@ void Foam::porousBafflePressureFvPatchField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -153,7 +153,7 @@ void Foam::porousBafflePressureFvPatchField::updateCoeffs() + I_*0.5*magUn )*magUn*length_; - if (dimensionedInternalField().dimensions() == dimPressure) + if (internalField().dimensions() == dimPressure) { jump_ *= patch().lookupPatchField<volScalarField, scalar>(rhoName_); } diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/epsilonWallFunctions/epsilonWallFunction/epsilonWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/epsilonWallFunctions/epsilonWallFunction/epsilonWallFunctionFvPatchScalarField.C index b21e1de1bd..8cd4cdb045 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/epsilonWallFunctions/epsilonWallFunction/epsilonWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/epsilonWallFunctions/epsilonWallFunction/epsilonWallFunctionFvPatchScalarField.C @@ -70,7 +70,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::setMaster() } const volScalarField& epsilon = - static_cast<const volScalarField&>(this->dimensionedInternalField()); + static_cast<const volScalarField&>(this->internalField()); const volScalarField::Boundary& bf = epsilon.boundaryField(); @@ -95,7 +95,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::setMaster() void Foam::epsilonWallFunctionFvPatchScalarField::createAveragingWeights() { const volScalarField& epsilon = - static_cast<const volScalarField&>(this->dimensionedInternalField()); + static_cast<const volScalarField&>(this->internalField()); const volScalarField::Boundary& bf = epsilon.boundaryField(); @@ -144,8 +144,8 @@ void Foam::epsilonWallFunctionFvPatchScalarField::createAveragingWeights() cornerWeights_[patchi] = 1.0/wf.patchInternalField(); } - G_.setSize(dimensionedInternalField().size(), 0.0); - epsilon_.setSize(dimensionedInternalField().size(), 0.0); + G_.setSize(internalField().size(), 0.0); + epsilon_.setSize(internalField().size(), 0.0); initialised_ = true; } @@ -155,7 +155,7 @@ Foam::epsilonWallFunctionFvPatchScalarField& Foam::epsilonWallFunctionFvPatchScalarField::epsilonPatch(const label patchi) { const volScalarField& epsilon = - static_cast<const volScalarField&>(this->dimensionedInternalField()); + static_cast<const volScalarField&>(this->internalField()); const volScalarField::Boundary& bf = epsilon.boundaryField(); @@ -408,7 +408,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -431,7 +431,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::updateCoeffs() db().lookupObject<FieldType>(turbModel.GName()) ); - FieldType& epsilon = const_cast<FieldType&>(dimensionedInternalField()); + FieldType& epsilon = const_cast<FieldType&>(internalField()); forAll(*this, facei) { @@ -460,7 +460,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::updateCoeffs IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -483,7 +483,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::updateCoeffs db().lookupObject<FieldType>(turbModel.GName()) ); - FieldType& epsilon = const_cast<FieldType&>(dimensionedInternalField()); + FieldType& epsilon = const_cast<FieldType&>(internalField()); scalarField& epsilonf = *this; @@ -538,7 +538,7 @@ void Foam::epsilonWallFunctionFvPatchScalarField::manipulateMatrix const labelUList& faceCells = patch().faceCells(); const DimensionedField<scalar, volMesh>& epsilon - = dimensionedInternalField(); + = internalField(); label nConstrainedCells = 0; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/fWallFunctions/fWallFunction/fWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/fWallFunctions/fWallFunction/fWallFunctionFvPatchScalarField.C index c5d141376c..ca7f10a123 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/fWallFunctions/fWallFunction/fWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/fWallFunctions/fWallFunction/fWallFunctionFvPatchScalarField.C @@ -178,7 +178,7 @@ void fWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const v2fBase& v2fModel = refCast<const v2fBase>(turbModel); diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/kqRWallFunctions/kLowReWallFunction/kLowReWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/kqRWallFunctions/kLowReWallFunction/kLowReWallFunctionFvPatchScalarField.C index 70236ec9eb..9ec85dad32 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/kqRWallFunctions/kLowReWallFunction/kLowReWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/kqRWallFunctions/kLowReWallFunction/kLowReWallFunctionFvPatchScalarField.C @@ -175,7 +175,7 @@ void kLowReWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutLowReWallFunction/nutLowReWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutLowReWallFunction/nutLowReWallFunctionFvPatchScalarField.C index 36dde1c33e..c4f8b24ee0 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutLowReWallFunction/nutLowReWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutLowReWallFunction/nutLowReWallFunctionFvPatchScalarField.C @@ -106,7 +106,7 @@ tmp<scalarField> nutLowReWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutURoughWallFunction/nutURoughWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutURoughWallFunction/nutURoughWallFunctionFvPatchScalarField.C index 0f4bff28a6..02844be1a8 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutURoughWallFunction/nutURoughWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutURoughWallFunction/nutURoughWallFunctionFvPatchScalarField.C @@ -45,7 +45,7 @@ tmp<scalarField> nutURoughWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; @@ -87,7 +87,7 @@ tmp<scalarField> nutURoughWallFunctionFvPatchScalarField::calcYPlus IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; @@ -280,7 +280,7 @@ tmp<scalarField> nutURoughWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const fvPatchVectorField& Uw = turbModel.U().boundaryField()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUSpaldingWallFunction/nutUSpaldingWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUSpaldingWallFunction/nutUSpaldingWallFunctionFvPatchScalarField.C index 8541b5f300..3b32e3faea 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUSpaldingWallFunction/nutUSpaldingWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUSpaldingWallFunction/nutUSpaldingWallFunctionFvPatchScalarField.C @@ -45,7 +45,7 @@ tmp<scalarField> nutUSpaldingWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const fvPatchVectorField& Uw = turbModel.U().boundaryField()[patchi]; @@ -73,7 +73,7 @@ tmp<scalarField> nutUSpaldingWallFunctionFvPatchScalarField::calcUTau IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; @@ -197,7 +197,7 @@ tmp<scalarField> nutUSpaldingWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUTabulatedWallFunction/nutUTabulatedWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUTabulatedWallFunction/nutUTabulatedWallFunctionFvPatchScalarField.C index 376cad151b..ee322ce34b 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUTabulatedWallFunction/nutUTabulatedWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUTabulatedWallFunction/nutUTabulatedWallFunctionFvPatchScalarField.C @@ -45,7 +45,7 @@ tmp<scalarField> nutUTabulatedWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; @@ -187,7 +187,7 @@ tmp<scalarField> nutUTabulatedWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUWallFunction/nutUWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUWallFunction/nutUWallFunctionFvPatchScalarField.C index 8a85d72267..e281b04d69 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUWallFunction/nutUWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutUWallFunction/nutUWallFunctionFvPatchScalarField.C @@ -45,7 +45,7 @@ tmp<scalarField> nutUWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const fvPatchVectorField& Uw = turbModel.U().boundaryField()[patchi]; @@ -84,7 +84,7 @@ tmp<scalarField> nutUWallFunctionFvPatchScalarField::calcYPlus IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; @@ -182,7 +182,7 @@ tmp<scalarField> nutUWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const fvPatchVectorField& Uw = turbModel.U().boundaryField()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkAtmRoughWallFunction/nutkAtmRoughWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkAtmRoughWallFunction/nutkAtmRoughWallFunctionFvPatchScalarField.C index a80208cd35..5762610fe9 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkAtmRoughWallFunction/nutkAtmRoughWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkAtmRoughWallFunction/nutkAtmRoughWallFunctionFvPatchScalarField.C @@ -45,7 +45,7 @@ tmp<scalarField> nutkAtmRoughWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkRoughWallFunction/nutkRoughWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkRoughWallFunction/nutkRoughWallFunctionFvPatchScalarField.C index 34144857c0..b1ac17bd57 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkRoughWallFunction/nutkRoughWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkRoughWallFunction/nutkRoughWallFunctionFvPatchScalarField.C @@ -68,7 +68,7 @@ tmp<scalarField> nutkRoughWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkWallFunction/nutkWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkWallFunction/nutkWallFunctionFvPatchScalarField.C index 264681538c..08aea98d49 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkWallFunction/nutkWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/nutWallFunctions/nutkWallFunction/nutkWallFunctionFvPatchScalarField.C @@ -46,7 +46,7 @@ tmp<scalarField> nutkWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -142,7 +142,7 @@ tmp<scalarField> nutkWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/omegaWallFunctions/omegaWallFunction/omegaWallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/omegaWallFunctions/omegaWallFunction/omegaWallFunctionFvPatchScalarField.C index e91ec4e7be..3c131a0884 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/omegaWallFunctions/omegaWallFunction/omegaWallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/omegaWallFunctions/omegaWallFunction/omegaWallFunctionFvPatchScalarField.C @@ -74,7 +74,7 @@ void omegaWallFunctionFvPatchScalarField::setMaster() } const volScalarField& omega = - static_cast<const volScalarField&>(this->dimensionedInternalField()); + static_cast<const volScalarField&>(this->internalField()); const volScalarField::Boundary& bf = omega.boundaryField(); @@ -99,7 +99,7 @@ void omegaWallFunctionFvPatchScalarField::setMaster() void omegaWallFunctionFvPatchScalarField::createAveragingWeights() { const volScalarField& omega = - static_cast<const volScalarField&>(this->dimensionedInternalField()); + static_cast<const volScalarField&>(this->internalField()); const volScalarField::Boundary& bf = omega.boundaryField(); @@ -149,8 +149,8 @@ void omegaWallFunctionFvPatchScalarField::createAveragingWeights() cornerWeights_[patchi] = 1.0/wf.patchInternalField(); } - G_.setSize(dimensionedInternalField().size(), 0.0); - omega_.setSize(dimensionedInternalField().size(), 0.0); + G_.setSize(internalField().size(), 0.0); + omega_.setSize(internalField().size(), 0.0); initialised_ = true; } @@ -160,7 +160,7 @@ omegaWallFunctionFvPatchScalarField& omegaWallFunctionFvPatchScalarField::omegaPatch(const label patchi) { const volScalarField& omega = - static_cast<const volScalarField&>(this->dimensionedInternalField()); + static_cast<const volScalarField&>(this->internalField()); const volScalarField::Boundary& bf = omega.boundaryField(); @@ -418,7 +418,7 @@ void omegaWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -441,7 +441,7 @@ void omegaWallFunctionFvPatchScalarField::updateCoeffs() db().lookupObject<FieldType>(turbModel.GName()) ); - FieldType& omega = const_cast<FieldType&>(dimensionedInternalField()); + FieldType& omega = const_cast<FieldType&>(internalField()); forAll(*this, facei) { @@ -470,7 +470,7 @@ void omegaWallFunctionFvPatchScalarField::updateCoeffs IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -493,7 +493,7 @@ void omegaWallFunctionFvPatchScalarField::updateCoeffs db().lookupObject<FieldType>(turbModel.GName()) ); - FieldType& omega = const_cast<FieldType&>(dimensionedInternalField()); + FieldType& omega = const_cast<FieldType&>(internalField()); scalarField& omegaf = *this; @@ -548,7 +548,7 @@ void omegaWallFunctionFvPatchScalarField::manipulateMatrix const labelUList& faceCells = patch().faceCells(); const DimensionedField<scalar, volMesh>& omega - = dimensionedInternalField(); + = internalField(); label nConstrainedCells = 0; diff --git a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/v2WallFunctions/v2WallFunction/v2WallFunctionFvPatchScalarField.C b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/v2WallFunctions/v2WallFunction/v2WallFunctionFvPatchScalarField.C index d91f849194..1d938c851a 100644 --- a/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/v2WallFunctions/v2WallFunction/v2WallFunctionFvPatchScalarField.C +++ b/src/TurbulenceModels/turbulenceModels/derivedFvPatchFields/wallFunctions/v2WallFunctions/v2WallFunction/v2WallFunctionFvPatchScalarField.C @@ -178,7 +178,7 @@ void v2WallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); const scalarField& y = turbModel.y()[patchi]; diff --git a/src/dynamicFvMesh/dynamicRefineFvMesh/dynamicRefineFvMesh.C b/src/dynamicFvMesh/dynamicRefineFvMesh/dynamicRefineFvMesh.C index 29b14966ea..e647c93e85 100644 --- a/src/dynamicFvMesh/dynamicRefineFvMesh/dynamicRefineFvMesh.C +++ b/src/dynamicFvMesh/dynamicRefineFvMesh/dynamicRefineFvMesh.C @@ -344,7 +344,7 @@ Foam::dynamicRefineFvMesh::refine surfaceScalarField& phi = *iter(); - sigFpe::fillNan(phi.internalFieldRef()); + sigFpe::fillNan(phi.primitiveFieldRef()); continue; } diff --git a/src/dynamicFvMesh/include/meshCourantNo.H b/src/dynamicFvMesh/include/meshCourantNo.H index c2567d95c1..5ab57cdc6b 100644 --- a/src/dynamicFvMesh/include/meshCourantNo.H +++ b/src/dynamicFvMesh/include/meshCourantNo.H @@ -36,7 +36,7 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(mesh.phi()))().internalField() + fvc::surfaceSum(mag(mesh.phi()))().primitiveField() ); meshCoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/src/dynamicMesh/fvMeshAdder/fvMeshAdderTemplates.C b/src/dynamicMesh/fvMeshAdder/fvMeshAdderTemplates.C index 03a9779533..fba219117d 100644 --- a/src/dynamicMesh/fvMeshAdder/fvMeshAdderTemplates.C +++ b/src/dynamicMesh/fvMeshAdder/fvMeshAdderTemplates.C @@ -46,15 +46,15 @@ void Foam::fvMeshAdder::MapVolField { // Store old internal field - Field<Type> oldInternalField(fld.internalField()); + Field<Type> oldInternalField(fld.primitiveField()); // Modify internal field - Field<Type>& intFld = fld.internalFieldRef(); + Field<Type>& intFld = fld.primitiveFieldRef(); intFld.setSize(mesh.nCells()); intFld.rmap(oldInternalField, meshMap.oldCellMap()); - intFld.rmap(fldToAdd.internalField(), meshMap.addedCellMap()); + intFld.rmap(fldToAdd.primitiveField(), meshMap.addedCellMap()); } @@ -340,7 +340,7 @@ void Foam::fvMeshAdder::MapSurfaceField Field<Type> oldField(fld); // Modify internal field - Field<Type>& intFld = fld.internalFieldRef(); + Field<Type>& intFld = fld.primitiveFieldRef(); intFld.setSize(mesh.nInternalFaces()); diff --git a/src/dynamicMesh/motionSmoother/motionSmootherAlgo.C b/src/dynamicMesh/motionSmoother/motionSmootherAlgo.C index 978fc3e6ba..a3f0d7a8ed 100644 --- a/src/dynamicMesh/motionSmoother/motionSmootherAlgo.C +++ b/src/dynamicMesh/motionSmoother/motionSmootherAlgo.C @@ -818,7 +818,7 @@ Foam::tmp<Foam::pointField> Foam::motionSmootherAlgo::curPoints() const ); } - tmp<pointField> tnewPoints(oldPoints_ + totalDisplacement.internalField()); + tmp<pointField> tnewPoints(oldPoints_ + totalDisplacement.primitiveField()); // Correct for 2-D motion modifyMotionPoints(tnewPoints.ref()); @@ -886,8 +886,8 @@ bool Foam::motionSmootherAlgo::scaleMesh ); Info<< "Moving mesh using displacement scaling :" - << " min:" << gMin(scale_.internalField()) - << " max:" << gMax(scale_.internalField()) + << " min:" << gMin(scale_.primitiveField()) + << " max:" << gMax(scale_.primitiveField()) << endl; // Get points using current displacement and scale. Optionally 2D corrected. diff --git a/src/finiteVolume/cfdTools/compressible/compressibleCourantNo.H b/src/finiteVolume/cfdTools/compressible/compressibleCourantNo.H index 846c8ac9db..bf9d5db19a 100644 --- a/src/finiteVolume/cfdTools/compressible/compressibleCourantNo.H +++ b/src/finiteVolume/cfdTools/compressible/compressibleCourantNo.H @@ -36,8 +36,8 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() - / rho.internalField() + fvc::surfaceSum(mag(phi))().primitiveField() + / rho.primitiveField() ); CoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/src/finiteVolume/cfdTools/general/MRF/MRFZone.C b/src/finiteVolume/cfdTools/general/MRF/MRFZone.C index a92fac8937..bcda098524 100644 --- a/src/finiteVolume/cfdTools/general/MRF/MRFZone.C +++ b/src/finiteVolume/cfdTools/general/MRF/MRFZone.C @@ -319,7 +319,7 @@ void Foam::MRFZone::addCoriolis } const labelList& cells = mesh_.cellZones()[cellZoneID_]; - vectorField& ddtUc = ddtU.internalFieldRef(); + vectorField& ddtUc = ddtU.primitiveFieldRef(); const vectorField& Uc = U; const vector Omega = this->Omega(); diff --git a/src/finiteVolume/cfdTools/general/MRF/MRFZoneTemplates.C b/src/finiteVolume/cfdTools/general/MRF/MRFZoneTemplates.C index b915f46ca3..a5feb783de 100644 --- a/src/finiteVolume/cfdTools/general/MRF/MRFZoneTemplates.C +++ b/src/finiteVolume/cfdTools/general/MRF/MRFZoneTemplates.C @@ -45,7 +45,7 @@ void Foam::MRFZone::makeRelativeRhoFlux const vectorField& Cfi = Cf; const vectorField& Sfi = Sf; - scalarField& phii = phi.internalFieldRef(); + scalarField& phii = phi.primitiveFieldRef(); // Internal faces forAll(internalFaces_, i) @@ -145,7 +145,7 @@ void Foam::MRFZone::makeAbsoluteRhoFlux const vectorField& Cfi = Cf; const vectorField& Sfi = Sf; - scalarField& phii = phi.internalFieldRef(); + scalarField& phii = phi.primitiveFieldRef(); // Internal faces forAll(internalFaces_, i) diff --git a/src/finiteVolume/cfdTools/general/SRF/SRFModel/SRFModel/SRFModel.C b/src/finiteVolume/cfdTools/general/SRF/SRFModel/SRFModel/SRFModel.C index e8605ac57a..d865fa8c2b 100644 --- a/src/finiteVolume/cfdTools/general/SRF/SRFModel/SRFModel/SRFModel.C +++ b/src/finiteVolume/cfdTools/general/SRF/SRFModel/SRFModel/SRFModel.C @@ -228,7 +228,7 @@ Foam::tmp<Foam::volVectorField> Foam::SRF::SRFModel::Uabs() const volVectorField& Uabs = tUabs.ref(); // Add SRF contribution to internal field - Uabs.internalFieldRef() += Urel_.internalField(); + Uabs.primitiveFieldRef() += Urel_.primitiveField(); // Add Urel boundary contributions volVectorField::Boundary& Uabsbf = Uabs.boundaryFieldRef(); diff --git a/src/finiteVolume/cfdTools/general/SRF/derivedFvPatchFields/SRFFreestreamVelocityFvPatchVectorField/SRFFreestreamVelocityFvPatchVectorField.C b/src/finiteVolume/cfdTools/general/SRF/derivedFvPatchFields/SRFFreestreamVelocityFvPatchVectorField/SRFFreestreamVelocityFvPatchVectorField.C index bfb1caf470..29fd691ef7 100644 --- a/src/finiteVolume/cfdTools/general/SRF/derivedFvPatchFields/SRFFreestreamVelocityFvPatchVectorField/SRFFreestreamVelocityFvPatchVectorField.C +++ b/src/finiteVolume/cfdTools/general/SRF/derivedFvPatchFields/SRFFreestreamVelocityFvPatchVectorField/SRFFreestreamVelocityFvPatchVectorField.C @@ -120,8 +120,8 @@ void Foam::SRFFreestreamVelocityFvPatchVectorField::updateCoeffs() word ddtScheme ( - this->dimensionedInternalField().mesh() - .ddtScheme(this->dimensionedInternalField().name()) + this->internalField().mesh() + .ddtScheme(this->internalField().name()) ); if (ddtScheme == fv::steadyStateDdtScheme<scalar>::typeName) diff --git a/src/finiteVolume/cfdTools/general/bound/bound.C b/src/finiteVolume/cfdTools/general/bound/bound.C index 074a66f7a8..a63891166b 100644 --- a/src/finiteVolume/cfdTools/general/bound/bound.C +++ b/src/finiteVolume/cfdTools/general/bound/bound.C @@ -39,16 +39,16 @@ Foam::bound(volScalarField& vsf, const dimensionedScalar& lowerBound) Info<< "bounding " << vsf.name() << ", min: " << minVsf << " max: " << max(vsf).value() - << " average: " << gAverage(vsf.internalField()) + << " average: " << gAverage(vsf.primitiveField()) << endl; - vsf.internalFieldRef() = max + vsf.primitiveFieldRef() = max ( max ( - vsf.internalField(), - fvc::average(max(vsf, lowerBound))().internalField() - * pos(-vsf.internalField()) + vsf.primitiveField(), + fvc::average(max(vsf, lowerBound))().primitiveField() + * pos(-vsf.primitiveField()) ), lowerBound.value() ); diff --git a/src/finiteVolume/cfdTools/general/include/volContinuity.H b/src/finiteVolume/cfdTools/general/include/volContinuity.H index 4d53eeebab..6375e118a7 100644 --- a/src/finiteVolume/cfdTools/general/include/volContinuity.H +++ b/src/finiteVolume/cfdTools/general/include/volContinuity.H @@ -3,7 +3,7 @@ // The ddt term constructed by hand because it would be wrong for // Backward Differencing in time. - conserve.internalFieldRef() += + conserve.primitiveFieldRef() += (1.0 - mesh.V0()/mesh.V())/runTime.deltaTValue(); scalar sumLocalContErr = runTime.deltaTValue()* diff --git a/src/finiteVolume/cfdTools/incompressible/CourantNo.H b/src/finiteVolume/cfdTools/incompressible/CourantNo.H index 4bfc58978e..dce04fbdb1 100644 --- a/src/finiteVolume/cfdTools/incompressible/CourantNo.H +++ b/src/finiteVolume/cfdTools/incompressible/CourantNo.H @@ -36,7 +36,7 @@ if (mesh.nInternalFaces()) { scalarField sumPhi ( - fvc::surfaceSum(mag(phi))().internalField() + fvc::surfaceSum(mag(phi))().primitiveField() ); CoNum = 0.5*gMax(sumPhi/mesh.V().field())*runTime.deltaTValue(); diff --git a/src/finiteVolume/fields/fvPatchFields/basic/calculated/calculatedFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/basic/calculated/calculatedFvPatchField.C index a7b003dd03..c3677cc0d0 100644 --- a/src/finiteVolume/fields/fvPatchFields/basic/calculated/calculatedFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/basic/calculated/calculatedFvPatchField.C @@ -150,8 +150,8 @@ Foam::calculatedFvPatchField<Type>::valueInternalCoeffs FatalErrorInFunction << "cannot be called for a calculatedFvPatchField" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "default boundary condition." << abort(FatalError); @@ -170,8 +170,8 @@ Foam::calculatedFvPatchField<Type>::valueBoundaryCoeffs FatalErrorInFunction << "cannot be called for a calculatedFvPatchField" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "default boundary condition." << abort(FatalError); @@ -187,8 +187,8 @@ Foam::calculatedFvPatchField<Type>::gradientInternalCoeffs() const FatalErrorInFunction << "cannot be called for a calculatedFvPatchField" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "default boundary condition." << abort(FatalError); @@ -204,8 +204,8 @@ Foam::calculatedFvPatchField<Type>::gradientBoundaryCoeffs() const FatalErrorInFunction << "cannot be called for a calculatedFvPatchField" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "default boundary condition." << abort(FatalError); diff --git a/src/finiteVolume/fields/fvPatchFields/basic/sliced/slicedFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/basic/sliced/slicedFvPatchField.C index 5e489ae07f..04e3477918 100644 --- a/src/finiteVolume/fields/fvPatchFields/basic/sliced/slicedFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/basic/sliced/slicedFvPatchField.C @@ -116,7 +116,7 @@ Foam::slicedFvPatchField<Type>::slicedFvPatchField fvPatchField<Type> ( ptf.patch(), - ptf.dimensionedInternalField(), + ptf.internalField(), Field<Type>() ) { diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/cyclic/cyclicFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/cyclic/cyclicFvPatchField.C index a80f6c0786..4513dc4da6 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/cyclic/cyclicFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/cyclic/cyclicFvPatchField.C @@ -59,8 +59,8 @@ Foam::cyclicFvPatchField<Type>::cyclicFvPatchField ) << " patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } @@ -85,8 +85,8 @@ Foam::cyclicFvPatchField<Type>::cyclicFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -122,7 +122,7 @@ template<class Type> Foam::tmp<Foam::Field<Type>> Foam::cyclicFvPatchField<Type>::patchNeighbourField() const { - const Field<Type>& iField = this->internalField(); + const Field<Type>& iField = this->primitiveField(); const labelUList& nbrFaceCells = cyclicPatch().cyclicPatch().neighbPatch().faceCells(); @@ -159,7 +159,7 @@ Foam::cyclicFvPatchField<Type>::neighbourPatchField() const const GeometricField<Type, fvPatchField, volMesh>& fld = static_cast<const GeometricField<Type, fvPatchField, volMesh>&> ( - this->internalField() + this->primitiveField() ); return refCast<const cyclicFvPatchField<Type>> diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/cyclicACMI/cyclicACMIFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/cyclicACMI/cyclicACMIFvPatchField.C index 0ded42fdf7..bb8608de1d 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/cyclicACMI/cyclicACMIFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/cyclicACMI/cyclicACMIFvPatchField.C @@ -59,8 +59,8 @@ Foam::cyclicACMIFvPatchField<Type>::cyclicACMIFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -86,8 +86,8 @@ Foam::cyclicACMIFvPatchField<Type>::cyclicACMIFvPatchField ) << " patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } @@ -136,7 +136,7 @@ template<class Type> Foam::tmp<Foam::Field<Type>> Foam::cyclicACMIFvPatchField<Type>::patchNeighbourField() const { - const Field<Type>& iField = this->internalField(); + const Field<Type>& iField = this->primitiveField(); const labelUList& nbrFaceCellsCoupled = cyclicACMIPatch_.cyclicACMIPatch().neighbPatch().faceCells(); const labelUList& faceCellsNonOverlap = @@ -173,7 +173,7 @@ Foam::cyclicACMIFvPatchField<Type>::neighbourPatchField() const const GeometricField<Type, fvPatchField, volMesh>& fld = static_cast<const GeometricField<Type, fvPatchField, volMesh>&> ( - this->internalField() + this->primitiveField() ); return refCast<const cyclicACMIFvPatchField<Type>> @@ -190,7 +190,7 @@ Foam::cyclicACMIFvPatchField<Type>::nonOverlapPatchField() const const GeometricField<Type, fvPatchField, volMesh>& fld = static_cast<const GeometricField<Type, fvPatchField, volMesh>&> ( - this->internalField() + this->primitiveField() ); return fld.boundaryField()[cyclicACMIPatch_.nonOverlapPatchID()]; diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/cyclicAMI/cyclicAMIFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/cyclicAMI/cyclicAMIFvPatchField.C index a241a8071c..f97985b115 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/cyclicAMI/cyclicAMIFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/cyclicAMI/cyclicAMIFvPatchField.C @@ -56,8 +56,8 @@ Foam::cyclicAMIFvPatchField<Type>::cyclicAMIFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -83,8 +83,8 @@ Foam::cyclicAMIFvPatchField<Type>::cyclicAMIFvPatchField ) << " patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } @@ -133,7 +133,7 @@ template<class Type> Foam::tmp<Foam::Field<Type>> Foam::cyclicAMIFvPatchField<Type>::patchNeighbourField() const { - const Field<Type>& iField = this->internalField(); + const Field<Type>& iField = this->primitiveField(); const labelUList& nbrFaceCells = cyclicAMIPatch_.cyclicAMIPatch().neighbPatch().faceCells(); @@ -165,7 +165,7 @@ Foam::cyclicAMIFvPatchField<Type>::neighbourPatchField() const const GeometricField<Type, fvPatchField, volMesh>& fld = static_cast<const GeometricField<Type, fvPatchField, volMesh>&> ( - this->internalField() + this->primitiveField() ); return refCast<const cyclicAMIFvPatchField<Type>> diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/empty/emptyFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/empty/emptyFvPatchField.C index 49357e3bf7..c8d4c3cd9c 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/empty/emptyFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/empty/emptyFvPatchField.C @@ -55,8 +55,8 @@ Foam::emptyFvPatchField<Type>::emptyFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -80,8 +80,8 @@ Foam::emptyFvPatchField<Type>::emptyFvPatchField ) << "\n patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -96,7 +96,7 @@ Foam::emptyFvPatchField<Type>::emptyFvPatchField fvPatchField<Type> ( ptf.patch(), - ptf.dimensionedInternalField(), + ptf.internalField(), Field<Type>(0) ) {} diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchField.C index 07764053fc..801d446627 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchField.C @@ -93,7 +93,7 @@ template<class Type> Foam::tmp<Foam::Field<Type>> Foam::jumpCyclicFvPatchField<Type>::patchNeighbourField() const { - const Field<Type>& iField = this->internalField(); + const Field<Type>& iField = this->primitiveField(); const labelUList& nbrFaceCells = this->cyclicPatch().neighbFvPatch().faceCells(); @@ -157,7 +157,7 @@ void Foam::jumpCyclicFvPatchField<Type>::updateInterfaceMatrix this->cyclicPatch().neighbFvPatch().faceCells(); // only apply jump to original field - if (&psiInternal == &this->internalField()) + if (&psiInternal == &this->primitiveField()) { Field<Type> jf(this->jump()); diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchFields.C b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchFields.C index 2001e1e2f4..15fca725a9 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchFields.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclic/jumpCyclicFvPatchFields.C @@ -52,7 +52,7 @@ void Foam::jumpCyclicFvPatchField<Foam::scalar>::updateInterfaceMatrix this->cyclicPatch().neighbFvPatch().faceCells(); // only apply jump to original field - if (&psiInternal == &this->internalField()) + if (&psiInternal == &this->primitiveField()) { Field<scalar> jf(this->jump()); diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchField.C index 5f2495f4a6..2947bb5656 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchField.C @@ -94,7 +94,7 @@ template<class Type> Foam::tmp<Foam::Field<Type>> Foam::jumpCyclicAMIFvPatchField<Type>::patchNeighbourField() const { - const Field<Type>& iField = this->internalField(); + const Field<Type>& iField = this->primitiveField(); const labelUList& nbrFaceCells = this->cyclicAMIPatch().cyclicAMIPatch().neighbPatch().faceCells(); @@ -174,7 +174,7 @@ void Foam::jumpCyclicAMIFvPatchField<Type>::updateInterfaceMatrix } // only apply jump to original field - if (&psiInternal == &this->internalField()) + if (&psiInternal == &this->primitiveField()) { Field<Type> jf(this->jump()); if (!this->cyclicAMIPatch().owner()) diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchFields.C b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchFields.C index b7349812da..d7a9021efb 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchFields.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/jumpCyclicAMI/jumpCyclicAMIFvPatchFields.C @@ -56,7 +56,7 @@ void Foam::jumpCyclicAMIFvPatchField<scalar>::updateInterfaceMatrix pnf = this->cyclicAMIPatch().interpolate(pnf); // only apply jump to original field - if (&psiInternal == &this->internalField()) + if (&psiInternal == &this->primitiveField()) { Field<scalar> jf(this->jump()); diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/processor/processorFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/processor/processorFvPatchField.C index 75d5e710ce..acd103c212 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/processor/processorFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/processor/processorFvPatchField.C @@ -90,8 +90,8 @@ Foam::processorFvPatchField<Type>::processorFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } if (debug && !ptf.ready()) @@ -128,8 +128,8 @@ Foam::processorFvPatchField<Type>::processorFvPatchField ) << "\n patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/processorCyclic/processorCyclicFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/processorCyclic/processorCyclicFvPatchField.C index c3092af3e5..4da794509c 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/processorCyclic/processorCyclicFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/processorCyclic/processorCyclicFvPatchField.C @@ -72,8 +72,8 @@ Foam::processorCyclicFvPatchField<Type>::processorCyclicFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -98,8 +98,8 @@ Foam::processorCyclicFvPatchField<Type>::processorCyclicFvPatchField ) << "\n patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/symmetry/symmetryFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/symmetry/symmetryFvPatchField.C index 4f27422ccd..5211988c0f 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/symmetry/symmetryFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/symmetry/symmetryFvPatchField.C @@ -56,8 +56,8 @@ Foam::symmetryFvPatchField<Type>::symmetryFvPatchField ) << "\n patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -79,8 +79,8 @@ Foam::symmetryFvPatchField<Type>::symmetryFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/symmetryPlane/symmetryPlaneFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/symmetryPlane/symmetryPlaneFvPatchField.C index 3515d3c061..57d21f8f94 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/symmetryPlane/symmetryPlaneFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/symmetryPlane/symmetryPlaneFvPatchField.C @@ -57,8 +57,8 @@ Foam::symmetryPlaneFvPatchField<Type>::symmetryPlaneFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -83,8 +83,8 @@ Foam::symmetryPlaneFvPatchField<Type>::symmetryPlaneFvPatchField ) << "\n patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/constraint/wedge/wedgeFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/constraint/wedge/wedgeFvPatchField.C index 7fbdafde61..9a9700ff55 100644 --- a/src/finiteVolume/fields/fvPatchFields/constraint/wedge/wedgeFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/constraint/wedge/wedgeFvPatchField.C @@ -59,8 +59,8 @@ Foam::wedgeFvPatchField<Type>::wedgeFvPatchField FatalErrorInFunction << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -84,8 +84,8 @@ Foam::wedgeFvPatchField<Type>::wedgeFvPatchField ) << "\n patch type '" << p.type() << "' not constraint type '" << typeName << "'" << "\n for patch " << p.name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/advective/advectiveFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/advective/advectiveFvPatchField.C index 6d17c75187..aa86f9936c 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/advective/advectiveFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/advective/advectiveFvPatchField.C @@ -112,8 +112,8 @@ Foam::advectiveFvPatchField<Type>::advectiveFvPatchField dict ) << "unphysical lInf specified (lInf < 0)" << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -190,11 +190,11 @@ void Foam::advectiveFvPatchField<Type>::updateCoeffs() return; } - const fvMesh& mesh = this->dimensionedInternalField().mesh(); + const fvMesh& mesh = this->internalField().mesh(); word ddtScheme ( - mesh.ddtScheme(this->dimensionedInternalField().name()) + mesh.ddtScheme(this->internalField().name()) ); scalar deltaT = this->db().time().deltaTValue(); @@ -202,7 +202,7 @@ void Foam::advectiveFvPatchField<Type>::updateCoeffs() this->db().objectRegistry::template lookupObject<GeometricField<Type, fvPatchField, volMesh>> ( - this->dimensionedInternalField().name() + this->internalField().name() ); // Calculate the advection speed of the field wave @@ -274,8 +274,8 @@ void Foam::advectiveFvPatchField<Type>::updateCoeffs() FatalErrorInFunction << ddtScheme << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } } @@ -324,8 +324,8 @@ void Foam::advectiveFvPatchField<Type>::updateCoeffs() FatalErrorInFunction << ddtScheme << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/codedFixedValue/codedFixedValueFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/codedFixedValue/codedFixedValueFvPatchField.C index cfd6945420..ed5c093d0d 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/codedFixedValue/codedFixedValueFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/codedFixedValue/codedFixedValueFvPatchField.C @@ -160,7 +160,7 @@ Foam::string Foam::codedFixedValueFvPatchField<Type>::description() const "patch " + this->patch().name() + " on field " - + this->dimensionedInternalField().name(); + + this->internalField().name(); } @@ -274,7 +274,7 @@ Foam::codedFixedValueFvPatchField<Type>::redirectPatchField() const fvPatchField<Type>::New ( this->patch(), - this->dimensionedInternalField(), + this->internalField(), dict ).ptr() ); diff --git a/src/finiteVolume/fields/fvPatchFields/derived/codedMixed/codedMixedFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/codedMixed/codedMixedFvPatchField.C index d1b53e144d..fe9036878e 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/codedMixed/codedMixedFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/codedMixed/codedMixedFvPatchField.C @@ -160,7 +160,7 @@ Foam::string Foam::codedMixedFvPatchField<Type>::description() const "patch " + this->patch().name() + " on field " - + this->dimensionedInternalField().name(); + + this->internalField().name(); } @@ -280,7 +280,7 @@ Foam::codedMixedFvPatchField<Type>::redirectPatchField() const fvPatchField<Type>::New ( this->patch(), - this->dimensionedInternalField(), + this->internalField(), dict ).ptr() ) diff --git a/src/finiteVolume/fields/fvPatchFields/derived/externalCoupledMixed/externalCoupledMixedFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/externalCoupledMixed/externalCoupledMixedFvPatchField.C index bd4220b874..eab71dc17b 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/externalCoupledMixed/externalCoupledMixedFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/externalCoupledMixed/externalCoupledMixedFvPatchField.C @@ -44,7 +44,7 @@ Foam::externalCoupledMixedFvPatchField<Type>::patchKey = "# Patch: "; template<class Type> Foam::fileName Foam::externalCoupledMixedFvPatchField<Type>::baseDir() const { - word regionName(this->dimensionedInternalField().mesh().name()); + word regionName(this->internalField().mesh().name()); if (regionName == polyMesh::defaultRegion) { regionName = "."; @@ -64,7 +64,7 @@ void Foam::externalCoupledMixedFvPatchField<Type>::setMaster ) { const volFieldType& cvf = - static_cast<const volFieldType&>(this->dimensionedInternalField()); + static_cast<const volFieldType&>(this->internalField()); volFieldType& vf = const_cast<volFieldType&>(cvf); @@ -242,7 +242,7 @@ void Foam::externalCoupledMixedFvPatchField<Type>::startWait() const // only wait on master patch const volFieldType& cvf = - static_cast<const volFieldType&>(this->dimensionedInternalField()); + static_cast<const volFieldType&>(this->internalField()); const typename volFieldType::Boundary& bf = cvf.boundaryField(); @@ -406,7 +406,7 @@ void Foam::externalCoupledMixedFvPatchField<Type>::writeData writeHeader(os); const volFieldType& cvf = - static_cast<const volFieldType&>(this->dimensionedInternalField()); + static_cast<const volFieldType&>(this->internalField()); const typename volFieldType::Boundary& bf = cvf.boundaryField(); @@ -608,7 +608,7 @@ void Foam::externalCoupledMixedFvPatchField<Type>::initialise } const volFieldType& cvf = - static_cast<const volFieldType&>(this->dimensionedInternalField()); + static_cast<const volFieldType&>(this->internalField()); volFieldType& vf = const_cast<volFieldType&>(cvf); @@ -777,7 +777,7 @@ template<class Type> void Foam::externalCoupledMixedFvPatchField<Type>::writeGeometry() const { const volFieldType& cvf = - static_cast<const volFieldType&>(this->dimensionedInternalField()); + static_cast<const volFieldType&>(this->internalField()); const typename volFieldType::Boundary& bf = cvf.boundaryField(); diff --git a/src/finiteVolume/fields/fvPatchFields/derived/fanPressure/fanPressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/fanPressure/fanPressureFvPatchScalarField.C index dab9977118..44bc914fd1 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/fanPressure/fanPressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/fanPressure/fanPressureFvPatchScalarField.C @@ -151,8 +151,8 @@ void Foam::fanPressureFvPatchScalarField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << patch().name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() << nl + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << nl << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/fluxCorrectedVelocity/fluxCorrectedVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/fluxCorrectedVelocity/fluxCorrectedVelocityFvPatchVectorField.C index ac76973cb3..a6ac71b622 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/fluxCorrectedVelocity/fluxCorrectedVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/fluxCorrectedVelocity/fluxCorrectedVelocityFvPatchVectorField.C @@ -127,8 +127,8 @@ void Foam::fluxCorrectedVelocityFvPatchVectorField::evaluate FatalErrorInFunction << "dimensions of phi are incorrect\n" << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/freestreamPressure/freestreamPressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/freestreamPressure/freestreamPressureFvPatchScalarField.C index a32d667709..5b045359ef 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/freestreamPressure/freestreamPressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/freestreamPressure/freestreamPressureFvPatchScalarField.C @@ -144,8 +144,8 @@ void Foam::freestreamPressureFvPatchScalarField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedFieldFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedFieldFvPatchField.C index 06047dcebd..9ad24063b2 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedFieldFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedFieldFvPatchField.C @@ -150,7 +150,7 @@ void Foam::mappedFieldFvPatchField<Type>::updateCoeffs() if (debug) { - Info<< "operating on field:" << this->dimensionedInternalField().name() + Info<< "operating on field:" << this->internalField().name() << " patch:" << this->patch().name() << " avg:" << gAverage(*this) << " min:" << gMin(*this) diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedPatchFieldBase.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedPatchFieldBase.C index 020393e839..001fa4ab17 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedPatchFieldBase.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedField/mappedPatchFieldBase.C @@ -69,7 +69,7 @@ mappedPatchFieldBase<Type>::mappedPatchFieldBase dict.template lookupOrDefault<word> ( "fieldName", - patchField_.dimensionedInternalField().name() + patchField_.internalField().name() ) ), setAverage_(readBool(dict.lookup("setAverage"))), @@ -92,7 +92,7 @@ mappedPatchFieldBase<Type>::mappedPatchFieldBase : mapper_(mapper), patchField_(patchField), - fieldName_(patchField_.dimensionedInternalField().name()), + fieldName_(patchField_.internalField().name()), setAverage_(false), average_(Zero), interpolationScheme_(interpolationCell<Type>::typeName) @@ -143,13 +143,13 @@ mappedPatchFieldBase<Type>::sampleField() const if (mapper_.sameRegion()) { - if (fieldName_ == patchField_.dimensionedInternalField().name()) + if (fieldName_ == patchField_.internalField().name()) { // Optimisation: bypass field lookup return dynamic_cast<const fieldType&> ( - patchField_.dimensionedInternalField() + patchField_.internalField() ); } else diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedInternalValue/mappedFixedInternalValueFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedInternalValue/mappedFixedInternalValueFvPatchField.C index c0afd6b15f..d0ddaaeb40 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedInternalValue/mappedFixedInternalValueFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedInternalValue/mappedFixedInternalValueFvPatchField.C @@ -179,7 +179,7 @@ void Foam::mappedFixedInternalValueFvPatchField<Type>::updateCoeffs() UPstream::msgType() = oldTag; // Assign to (this) patch internal field its neighbour values - Field<Type>& intFld = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& intFld = const_cast<Field<Type>&>(this->primitiveField()); UIndirectList<Type>(intFld, this->patch().faceCells()) = nbrIntFld; } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedPushedInternalValue/mappedFixedPushedInternalValueFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedPushedInternalValue/mappedFixedPushedInternalValueFvPatchField.C index 3550e414cf..964d85cfc1 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedPushedInternalValue/mappedFixedPushedInternalValueFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedPushedInternalValue/mappedFixedPushedInternalValueFvPatchField.C @@ -104,7 +104,7 @@ void Foam::mappedFixedPushedInternalValueFvPatchField<Type>::updateCoeffs() mappedFixedValueFvPatchField<Type>::updateCoeffs(); // Assign the patch internal field to its boundary value - Field<Type>& intFld = const_cast<Field<Type>&>(this->internalField()); + Field<Type>& intFld = const_cast<Field<Type>&>(this->primitiveField()); UIndirectList<Type>(intFld, this->patch().faceCells()) = *this; } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedValue/mappedFixedValueFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedValue/mappedFixedValueFvPatchField.C index a1a80c7342..82a7d26729 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedValue/mappedFixedValueFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedFixedValue/mappedFixedValueFvPatchField.C @@ -126,7 +126,7 @@ void Foam::mappedFixedValueFvPatchField<Type>::updateCoeffs() if (debug) { Info<< "mapped on field:" - << this->dimensionedInternalField().name() + << this->internalField().name() << " patch:" << this->patch().name() << " avg:" << gAverage(*this) << " min:" << gMin(*this) diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedFlowRate/mappedFlowRateFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedFlowRate/mappedFlowRateFvPatchVectorField.C index ecd04b5e70..37ad1d7d07 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedFlowRate/mappedFlowRateFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedFlowRate/mappedFlowRateFvPatchVectorField.C @@ -155,10 +155,10 @@ void Foam::mappedFlowRateFvPatchVectorField::updateCoeffs() scalar phi = gSum(rhop*(*this) & patch().Sf()); Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " <- " + << this->internalField().name() << " <- " << nbrMesh.name() << ':' << nbrPatch.name() << ':' - << this->dimensionedInternalField().name() << " :" + << this->internalField().name() << " :" << " mass flux[Kg/s]:" << -phi << endl; } @@ -168,8 +168,8 @@ void Foam::mappedFlowRateFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of " << phiName_ << " are incorrect" << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << nl << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/mappedVelocityFluxFixedValue/mappedVelocityFluxFixedValueFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/mappedVelocityFluxFixedValue/mappedVelocityFluxFixedValueFvPatchField.C index c6ce22d446..89c0c11bf7 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/mappedVelocityFluxFixedValue/mappedVelocityFluxFixedValueFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/mappedVelocityFluxFixedValue/mappedVelocityFluxFixedValueFvPatchField.C @@ -63,8 +63,8 @@ mappedVelocityFluxFixedValueFvPatchField << "Patch type '" << p.type() << "' not type '" << mappedPatchBase::typeName << "'" << " for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } } @@ -87,8 +87,8 @@ mappedVelocityFluxFixedValueFvPatchField << "Patch type '" << p.type() << "' not type '" << mappedPatchBase::typeName << "'" << " for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } @@ -102,8 +102,8 @@ mappedVelocityFluxFixedValueFvPatchField << "Patch " << p.name() << " of type '" << p.type() << "' can not be used in 'nearestCell' mode" - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } } @@ -152,7 +152,7 @@ void Foam::mappedVelocityFluxFixedValueFvPatchField::updateCoeffs() mappedVelocityFluxFixedValueFvPatchField::patch().patch() ); const fvMesh& nbrMesh = refCast<const fvMesh>(mpp.sampleMesh()); - const word& fieldName = dimensionedInternalField().name(); + const word& fieldName = internalField().name(); const volVectorField& UField = nbrMesh.lookupObject<volVectorField>(fieldName); diff --git a/src/finiteVolume/fields/fvPatchFields/derived/movingWallVelocity/movingWallVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/movingWallVelocity/movingWallVelocityFvPatchVectorField.C index 46a7c7a90f..6c0bba6263 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/movingWallVelocity/movingWallVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/movingWallVelocity/movingWallVelocityFvPatchVectorField.C @@ -99,7 +99,7 @@ void Foam::movingWallVelocityFvPatchVectorField::updateCoeffs() return; } - const fvMesh& mesh = dimensionedInternalField().mesh(); + const fvMesh& mesh = internalField().mesh(); if (mesh.moving()) { @@ -119,7 +119,7 @@ void Foam::movingWallVelocityFvPatchVectorField::updateCoeffs() const vectorField Up((pp.faceCentres() - oldFc)/deltaT); const volVectorField& U = - static_cast<const volVectorField&>(dimensionedInternalField()); + static_cast<const volVectorField&>(internalField()); scalarField phip ( diff --git a/src/finiteVolume/fields/fvPatchFields/derived/outletMappedUniformInlet/outletMappedUniformInletFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/outletMappedUniformInlet/outletMappedUniformInletFvPatchField.C index 7804ed43f2..296690a96a 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/outletMappedUniformInlet/outletMappedUniformInletFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/outletMappedUniformInlet/outletMappedUniformInletFvPatchField.C @@ -116,7 +116,7 @@ void Foam::outletMappedUniformInletFvPatchField<Type>::updateCoeffs() ( dynamic_cast<const GeometricField<Type, fvPatchField, volMesh>&> ( - this->dimensionedInternalField() + this->internalField() ) ); diff --git a/src/finiteVolume/fields/fvPatchFields/derived/plenumPressure/plenumPressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/plenumPressure/plenumPressureFvPatchScalarField.C index 13c9af6a54..19476f5e7f 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/plenumPressure/plenumPressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/plenumPressure/plenumPressureFvPatchScalarField.C @@ -184,7 +184,7 @@ void Foam::plenumPressureFvPatchScalarField::updateCoeffs() const fvPatchField<scalar>& p_old = db().lookupObject<volScalarField> ( - dimensionedInternalField().name() + internalField().name() ).oldTime().boundaryField()[patch().index()]; const fvPatchField<vector>& U = patch().lookupPatchField<volVectorField, vector>(UName_); @@ -205,7 +205,7 @@ void Foam::plenumPressureFvPatchScalarField::updateCoeffs() // Calculate the current mass flow rate scalar massFlowRate(1.0); - if (phi.dimensionedInternalField().dimensions() == dimVelocity*dimArea) + if (phi.internalField().dimensions() == dimVelocity*dimArea) { if (hasRho_) { @@ -220,7 +220,7 @@ void Foam::plenumPressureFvPatchScalarField::updateCoeffs() } else if ( - phi.dimensionedInternalField().dimensions() + phi.internalField().dimensions() == dimDensity*dimVelocity*dimArea ) { @@ -240,8 +240,8 @@ void Foam::plenumPressureFvPatchScalarField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << patch().name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() << nl + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << nl << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletOutletVelocity/pressureDirectedInletOutletVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletOutletVelocity/pressureDirectedInletOutletVelocityFvPatchVectorField.C index a8b69d0040..377408a867 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletOutletVelocity/pressureDirectedInletOutletVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletOutletVelocity/pressureDirectedInletOutletVelocityFvPatchVectorField.C @@ -172,8 +172,8 @@ void Foam::pressureDirectedInletOutletVelocityFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletVelocity/pressureDirectedInletVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletVelocity/pressureDirectedInletVelocityFvPatchVectorField.C index d5a74f7a98..ee934fe9af 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletVelocity/pressureDirectedInletVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/pressureDirectedInletVelocity/pressureDirectedInletVelocityFvPatchVectorField.C @@ -165,8 +165,8 @@ void Foam::pressureDirectedInletVelocityFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/pressureInletOutletParSlipVelocity/pressureInletOutletParSlipVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/pressureInletOutletParSlipVelocity/pressureInletOutletParSlipVelocityFvPatchVectorField.C index e691e374b0..0bfeff65ac 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/pressureInletOutletParSlipVelocity/pressureInletOutletParSlipVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/pressureInletOutletParSlipVelocity/pressureInletOutletParSlipVelocityFvPatchVectorField.C @@ -146,8 +146,8 @@ void Foam::pressureInletOutletParSlipVelocityFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/pressureInletVelocity/pressureInletVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/pressureInletVelocity/pressureInletVelocityFvPatchVectorField.C index 08a6334eca..64ee8d8d07 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/pressureInletVelocity/pressureInletVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/pressureInletVelocity/pressureInletVelocityFvPatchVectorField.C @@ -133,8 +133,8 @@ void Foam::pressureInletVelocityFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/pressureNormalInletOutletVelocity/pressureNormalInletOutletVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/pressureNormalInletOutletVelocity/pressureNormalInletOutletVelocityFvPatchVectorField.C index 79dd6a8c92..13ab7e6e18 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/pressureNormalInletOutletVelocity/pressureNormalInletOutletVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/pressureNormalInletOutletVelocity/pressureNormalInletOutletVelocityFvPatchVectorField.C @@ -142,8 +142,8 @@ void Foam::pressureNormalInletOutletVelocityFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/supersonicFreestream/supersonicFreestreamFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/supersonicFreestream/supersonicFreestreamFvPatchVectorField.C index d2cf3bff2b..3f32156386 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/supersonicFreestream/supersonicFreestreamFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/supersonicFreestream/supersonicFreestreamFvPatchVectorField.C @@ -92,8 +92,8 @@ supersonicFreestreamFvPatchVectorField dict ) << " unphysical pInf specified (pInf <= 0.0)" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalIOError); } } @@ -182,8 +182,8 @@ void Foam::supersonicFreestreamFvPatchVectorField::updateCoeffs() { FatalErrorInFunction << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } @@ -280,9 +280,9 @@ void Foam::supersonicFreestreamFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "unphysical subsonic inflow has been generated" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() + << " of field " << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/swirlFlowRateInletVelocity/swirlFlowRateInletVelocityFvPatchVectorField.C b/src/finiteVolume/fields/fvPatchFields/derived/swirlFlowRateInletVelocity/swirlFlowRateInletVelocityFvPatchVectorField.C index 7acfaf45ec..2576d5ef0e 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/swirlFlowRateInletVelocity/swirlFlowRateInletVelocityFvPatchVectorField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/swirlFlowRateInletVelocity/swirlFlowRateInletVelocityFvPatchVectorField.C @@ -158,8 +158,8 @@ void Foam::swirlFlowRateInletVelocityFvPatchVectorField::updateCoeffs() FatalErrorInFunction << "dimensions of " << phiName_ << " are incorrect" << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << nl << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/syringePressure/syringePressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/syringePressure/syringePressureFvPatchScalarField.C index 3407e259ab..43e6259c18 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/syringePressure/syringePressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/syringePressure/syringePressureFvPatchScalarField.C @@ -216,8 +216,8 @@ void Foam::syringePressureFvPatchScalarField::updateCoeffs() FatalErrorInFunction << "dimensions of phi are not correct" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValueFvPatchField.C b/src/finiteVolume/fields/fvPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValueFvPatchField.C index 94c090296a..bf9bf57392 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValueFvPatchField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValueFvPatchField.C @@ -563,7 +563,7 @@ void Foam::timeVaryingMappedFixedValueFvPatchField<Type>::write os.writeKeyword("perturb") << perturb_ << token::END_STATEMENT << nl; } - if (fieldTableName_ != this->dimensionedInternalField().name()) + if (fieldTableName_ != this->internalField().name()) { os.writeKeyword("fieldTableName") << fieldTableName_ << token::END_STATEMENT << nl; diff --git a/src/finiteVolume/fields/fvPatchFields/derived/totalPressure/totalPressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/totalPressure/totalPressureFvPatchScalarField.C index b7b46003c9..fb0f32612a 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/totalPressure/totalPressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/totalPressure/totalPressureFvPatchScalarField.C @@ -211,8 +211,8 @@ void Foam::totalPressureFvPatchScalarField::updateCoeffs "definition of total pressure." << nl << " Set the unused variable(s) to 'none'.\n" << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/turbulentIntensityKineticEnergyInlet/turbulentIntensityKineticEnergyInletFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/turbulentIntensityKineticEnergyInlet/turbulentIntensityKineticEnergyInletFvPatchScalarField.C index 432d1e908d..e44ebdc88f 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/turbulentIntensityKineticEnergyInlet/turbulentIntensityKineticEnergyInletFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/turbulentIntensityKineticEnergyInlet/turbulentIntensityKineticEnergyInletFvPatchScalarField.C @@ -82,8 +82,8 @@ turbulentIntensityKineticEnergyInletFvPatchScalarField "of the mean velocity\n" " value given is " << intensity_ << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/uniformTotalPressure/uniformTotalPressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/uniformTotalPressure/uniformTotalPressureFvPatchScalarField.C index 29841b6932..d812a80a3d 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/uniformTotalPressure/uniformTotalPressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/uniformTotalPressure/uniformTotalPressureFvPatchScalarField.C @@ -199,8 +199,8 @@ void Foam::uniformTotalPressureFvPatchScalarField::updateCoeffs "definition of total pressure.\n" << " Set the unused variables to 'none'.\n" << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << exit(FatalError); } diff --git a/src/finiteVolume/fields/fvPatchFields/derived/waveSurfacePressure/waveSurfacePressureFvPatchScalarField.C b/src/finiteVolume/fields/fvPatchFields/derived/waveSurfacePressure/waveSurfacePressureFvPatchScalarField.C index 551d544b17..f156caf7e8 100644 --- a/src/finiteVolume/fields/fvPatchFields/derived/waveSurfacePressure/waveSurfacePressureFvPatchScalarField.C +++ b/src/finiteVolume/fields/fvPatchFields/derived/waveSurfacePressure/waveSurfacePressureFvPatchScalarField.C @@ -213,8 +213,8 @@ void Foam::waveSurfacePressureFvPatchScalarField::updateCoeffs() FatalErrorInFunction << ddtSchemeName << nl << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << abort(FatalError); } } diff --git a/src/finiteVolume/fields/fvPatchFields/fvPatchField/fvPatchField.H b/src/finiteVolume/fields/fvPatchFields/fvPatchField/fvPatchField.H index f91107ab1e..cf462267f0 100644 --- a/src/finiteVolume/fields/fvPatchFields/fvPatchField/fvPatchField.H +++ b/src/finiteVolume/fields/fvPatchFields/fvPatchField/fvPatchField.H @@ -344,13 +344,13 @@ public: //- Return dimensioned internal field reference const DimensionedField<Type, volMesh>& - dimensionedInternalField() const + internalField() const { return internalField_; } //- Return internal field reference - const Field<Type>& internalField() const + const Field<Type>& primitiveField() const { return internalField_; } diff --git a/src/finiteVolume/fields/fvsPatchFields/basic/sliced/slicedFvsPatchField.C b/src/finiteVolume/fields/fvsPatchFields/basic/sliced/slicedFvsPatchField.C index 34750c979a..ef3246303d 100644 --- a/src/finiteVolume/fields/fvsPatchFields/basic/sliced/slicedFvsPatchField.C +++ b/src/finiteVolume/fields/fvsPatchFields/basic/sliced/slicedFvsPatchField.C @@ -116,7 +116,7 @@ Foam::slicedFvsPatchField<Type>::slicedFvsPatchField fvsPatchField<Type> ( ptf.patch(), - ptf.dimensionedInternalField(), + ptf.internalField(), Field<Type>() ) { diff --git a/src/finiteVolume/fields/fvsPatchFields/constraint/empty/emptyFvsPatchField.C b/src/finiteVolume/fields/fvsPatchFields/constraint/empty/emptyFvsPatchField.C index 160d3e9365..f8df70e3d8 100644 --- a/src/finiteVolume/fields/fvsPatchFields/constraint/empty/emptyFvsPatchField.C +++ b/src/finiteVolume/fields/fvsPatchFields/constraint/empty/emptyFvsPatchField.C @@ -94,7 +94,7 @@ Foam::emptyFvsPatchField<Type>::emptyFvsPatchField fvsPatchField<Type> ( ptf.patch(), - ptf.dimensionedInternalField(), + ptf.internalField(), Field<Type>(0) ) {} diff --git a/src/finiteVolume/fields/fvsPatchFields/fvsPatchField/fvsPatchField.H b/src/finiteVolume/fields/fvsPatchFields/fvsPatchField/fvsPatchField.H index 6bfd32ec06..6c2f12a436 100644 --- a/src/finiteVolume/fields/fvsPatchFields/fvsPatchField/fvsPatchField.H +++ b/src/finiteVolume/fields/fvsPatchFields/fvsPatchField/fvsPatchField.H @@ -287,13 +287,13 @@ public: //- Return dimensioned internal field reference const DimensionedField<Type, surfaceMesh>& - dimensionedInternalField() const + internalField() const { return internalField_; } //- Return internal field reference - const Field<Type>& internalField() const + const Field<Type>& primitiveField() const { return internalField_; } diff --git a/src/finiteVolume/finiteVolume/convectionSchemes/gaussConvectionScheme/gaussConvectionScheme.C b/src/finiteVolume/finiteVolume/convectionSchemes/gaussConvectionScheme/gaussConvectionScheme.C index 5b5d1fdf9b..0e876daa40 100644 --- a/src/finiteVolume/finiteVolume/convectionSchemes/gaussConvectionScheme/gaussConvectionScheme.C +++ b/src/finiteVolume/finiteVolume/convectionSchemes/gaussConvectionScheme/gaussConvectionScheme.C @@ -92,8 +92,8 @@ gaussConvectionScheme<Type>::fvmDiv ); fvMatrix<Type>& fvm = tfvm.ref(); - fvm.lower() = -weights.internalField()*faceFlux.internalField(); - fvm.upper() = fvm.lower() + faceFlux.internalField(); + fvm.lower() = -weights.primitiveField()*faceFlux.primitiveField(); + fvm.upper() = fvm.lower() + faceFlux.primitiveField(); fvm.negSumDiag(); forAll(vf.boundaryField(), patchi) diff --git a/src/finiteVolume/finiteVolume/d2dt2Schemes/EulerD2dt2Scheme/EulerD2dt2Scheme.C b/src/finiteVolume/finiteVolume/d2dt2Schemes/EulerD2dt2Scheme/EulerD2dt2Scheme.C index 44ee364964..c400227adf 100644 --- a/src/finiteVolume/finiteVolume/d2dt2Schemes/EulerD2dt2Scheme/EulerD2dt2Scheme.C +++ b/src/finiteVolume/finiteVolume/d2dt2Schemes/EulerD2dt2Scheme/EulerD2dt2Scheme.C @@ -81,12 +81,12 @@ EulerD2dt2Scheme<Type>::fvcD2dt2 rDeltaT2.dimensions()*vf.dimensions(), halfRdeltaT2* ( - coefft*VV0*vf.internalField() + coefft*VV0*vf.primitiveField() - (coefft*VV0 + coefft00*V0V00) - *vf.oldTime().internalField() + *vf.oldTime().primitiveField() - + (coefft00*V0V00)*vf.oldTime().oldTime().internalField() + + (coefft00*V0V00)*vf.oldTime().oldTime().primitiveField() )/mesh().V(), rDeltaT2.value()* ( @@ -150,15 +150,15 @@ EulerD2dt2Scheme<Type>::fvcD2dt2 const scalarField VV0rhoRho0 ( (mesh().V() + mesh().V0()) - * (rho.internalField() + rho.oldTime().internalField()) + * (rho.primitiveField() + rho.oldTime().primitiveField()) ); const scalarField V0V00rho0Rho00 ( (mesh().V0() + mesh().V00()) * ( - rho.oldTime().internalField() - + rho.oldTime().oldTime().internalField() + rho.oldTime().primitiveField() + + rho.oldTime().oldTime().primitiveField() ) ); @@ -171,13 +171,13 @@ EulerD2dt2Scheme<Type>::fvcD2dt2 rDeltaT2.dimensions()*rho.dimensions()*vf.dimensions(), quarterRdeltaT2* ( - coefft*VV0rhoRho0*vf.internalField() + coefft*VV0rhoRho0*vf.primitiveField() - (coefft*VV0rhoRho0 + coefft00*V0V00rho0Rho00) - *vf.oldTime().internalField() + *vf.oldTime().primitiveField() + (coefft00*V0V00rho0Rho00) - *vf.oldTime().oldTime().internalField() + *vf.oldTime().oldTime().primitiveField() )/mesh().V(), halfRdeltaT2* ( @@ -270,9 +270,9 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 fvm.source() = halfRdeltaT2* ( (coefft*VV0 + coefft00*V0V00) - *vf.oldTime().internalField() + *vf.oldTime().primitiveField() - - (coefft00*V0V00)*vf.oldTime().oldTime().internalField() + - (coefft00*V0V00)*vf.oldTime().oldTime().primitiveField() ); } else @@ -281,8 +281,8 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 fvm.source() = rDeltaT2*mesh().V()* ( - coefft0*vf.oldTime().internalField() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField() + - coefft00*vf.oldTime().oldTime().primitiveField() ); } @@ -330,9 +330,9 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 fvm.source() = halfRdeltaT2*rho.value()* ( (coefft*VV0 + coefft00*V0V00) - *vf.oldTime().internalField() + *vf.oldTime().primitiveField() - - (coefft00*V0V00)*vf.oldTime().oldTime().internalField() + - (coefft00*V0V00)*vf.oldTime().oldTime().primitiveField() ); } else @@ -341,8 +341,8 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 fvm.source() = rDeltaT2*mesh().V()*rho.value()* ( - (coefft + coefft00)*vf.oldTime().internalField() - - coefft00*vf.oldTime().oldTime().internalField() + (coefft + coefft00)*vf.oldTime().primitiveField() + - coefft00*vf.oldTime().oldTime().primitiveField() ); } @@ -385,15 +385,15 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 const scalarField VV0rhoRho0 ( (mesh().V() + mesh().V0()) - *(rho.internalField() + rho.oldTime().internalField()) + *(rho.primitiveField() + rho.oldTime().primitiveField()) ); const scalarField V0V00rho0Rho00 ( (mesh().V0() + mesh().V00()) *( - rho.oldTime().internalField() - + rho.oldTime().oldTime().internalField() + rho.oldTime().primitiveField() + + rho.oldTime().oldTime().primitiveField() ) ); @@ -402,10 +402,10 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 fvm.source() = quarterRdeltaT2* ( (coefft*VV0rhoRho0 + coefft00*V0V00rho0Rho00) - *vf.oldTime().internalField() + *vf.oldTime().primitiveField() - (coefft00*V0V00rho0Rho00) - *vf.oldTime().oldTime().internalField() + *vf.oldTime().oldTime().primitiveField() ); } else @@ -414,14 +414,14 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 const scalarField rhoRho0 ( - rho.internalField() - + rho.oldTime().internalField() + rho.primitiveField() + + rho.oldTime().primitiveField() ); const scalarField rho0Rho00 ( - rho.oldTime().internalField() - + rho.oldTime().oldTime().internalField() + rho.oldTime().primitiveField() + + rho.oldTime().oldTime().primitiveField() ); fvm.diag() = (coefft*halfRdeltaT2)*mesh().V()*rhoRho0; @@ -429,10 +429,10 @@ EulerD2dt2Scheme<Type>::fvmD2dt2 fvm.source() = halfRdeltaT2*mesh().V()* ( (coefft*rhoRho0 + coefft00*rho0Rho00) - *vf.oldTime().internalField() + *vf.oldTime().primitiveField() - (coefft00*rho0Rho00) - *vf.oldTime().oldTime().internalField() + *vf.oldTime().oldTime().primitiveField() ); } diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/CoEulerDdtScheme/CoEulerDdtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/CoEulerDdtScheme/CoEulerDdtScheme.C index baedf3de3e..53004b4786 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/CoEulerDdtScheme/CoEulerDdtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/CoEulerDdtScheme/CoEulerDdtScheme.C @@ -179,8 +179,8 @@ CoEulerDdtScheme<Type>::fvcDdt ) ); - tdtdt.ref().internalFieldRef() = - rDeltaT.internalField()*dt.value() + tdtdt.ref().primitiveFieldRef() = + rDeltaT.primitiveField()*dt.value() *(1.0 - mesh().Vsc0()/mesh().Vsc()); return tdtdt; @@ -231,10 +231,10 @@ CoEulerDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -283,10 +283,10 @@ CoEulerDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()*rho.value()* + rDeltaT.primitiveField()*rho.value()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()*rho.value()* ( @@ -335,11 +335,11 @@ CoEulerDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - rho.internalField()*vf.internalField() - - rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + rho.primitiveField()*vf.primitiveField() + - rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -392,15 +392,15 @@ CoEulerDdtScheme<Type>::fvcDdt mesh(), rDeltaT.dimensions() *alpha.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - alpha.internalField() - *rho.internalField() - *vf.internalField() + alpha.primitiveField() + *rho.primitiveField() + *vf.primitiveField() - - alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + - alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -451,17 +451,17 @@ CoEulerDdtScheme<Type>::fvmDdt fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(CorDeltaT()().internalField()); + scalarField rDeltaT(CorDeltaT()().primitiveField()); fvm.diag() = rDeltaT*mesh().Vsc(); if (mesh().moving()) { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().Vsc0(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().Vsc0(); } else { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().Vsc(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -486,19 +486,19 @@ CoEulerDdtScheme<Type>::fvmDdt ); fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(CorDeltaT()().internalField()); + scalarField rDeltaT(CorDeltaT()().primitiveField()); fvm.diag() = rDeltaT*rho.value()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().Vsc0(); + *rho.value()*vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().Vsc(); + *rho.value()*vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -523,21 +523,21 @@ CoEulerDdtScheme<Type>::fvmDdt ); fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(CorDeltaT()().internalField()); + scalarField rDeltaT(CorDeltaT()().primitiveField()); - fvm.diag() = rDeltaT*rho.internalField()*mesh().Vsc(); + fvm.diag() = rDeltaT*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -563,23 +563,24 @@ CoEulerDdtScheme<Type>::fvmDdt ); fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(CorDeltaT()().internalField()); + scalarField rDeltaT(CorDeltaT()().primitiveField()); - fvm.diag() = rDeltaT*alpha.internalField()*rho.internalField()*mesh().Vsc(); + fvm.diag() = + rDeltaT*alpha.primitiveField()*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/CrankNicolsonDdtScheme/CrankNicolsonDdtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/CrankNicolsonDdtScheme/CrankNicolsonDdtScheme.C index 6461c0dfe4..20aa8cd91f 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/CrankNicolsonDdtScheme/CrankNicolsonDdtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/CrankNicolsonDdtScheme/CrankNicolsonDdtScheme.C @@ -326,14 +326,14 @@ CrankNicolsonDdtScheme<Type>::fvcDdt ddt0.ref() = ( (rDtCoef0*dt)*(mesh().V0() - mesh().V00()) - - mesh().V00()*offCentre_(ddt0.dimensionedInternalField()) + - mesh().V00()*offCentre_(ddt0.internalField()) )/mesh().V0(); } tdtdt.ref().ref() = ( (rDtCoef*dt)*(mesh().V() - mesh().V0()) - - mesh().V0()*offCentre_(ddt0.dimensionedInternalField()) + - mesh().V0()*offCentre_(ddt0.internalField()) )/mesh().V(); } @@ -373,13 +373,13 @@ CrankNicolsonDdtScheme<Type>::fvcDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0* ( - mesh().V0()*vf.oldTime().internalField() - - mesh().V00()*vf.oldTime().oldTime().internalField() - ) - mesh().V00()*offCentre_(ddt0.internalField()) + mesh().V0()*vf.oldTime().primitiveField() + - mesh().V00()*vf.oldTime().oldTime().primitiveField() + ) - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -464,13 +464,13 @@ CrankNicolsonDdtScheme<Type>::fvcDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0*rho.value()* ( - mesh().V0()*vf.oldTime().internalField() - - mesh().V00()*vf.oldTime().oldTime().internalField() - ) - mesh().V00()*offCentre_(ddt0.internalField()) + mesh().V0()*vf.oldTime().primitiveField() + - mesh().V00()*vf.oldTime().oldTime().primitiveField() + ) - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -493,9 +493,9 @@ CrankNicolsonDdtScheme<Type>::fvcDdt ( rDtCoef.value()*rho.value()* ( - mesh().V()*vf.internalField() - - mesh().V0()*vf.oldTime().internalField() - ) - mesh().V0()*offCentre_(ddt0.internalField()) + mesh().V()*vf.primitiveField() + - mesh().V0()*vf.oldTime().primitiveField() + ) - mesh().V0()*offCentre_(ddt0.primitiveField()) )/mesh().V(), rDtCoef.value()*rho.value()* ( @@ -557,15 +557,15 @@ CrankNicolsonDdtScheme<Type>::fvcDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0* ( - mesh().V0()*rho.oldTime().internalField() - *vf.oldTime().internalField() - - mesh().V00()*rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField() - ) - mesh().V00()*offCentre_(ddt0.internalField()) + mesh().V0()*rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + - mesh().V00()*rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField() + ) - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -590,10 +590,10 @@ CrankNicolsonDdtScheme<Type>::fvcDdt ( rDtCoef.value()* ( - mesh().V()*rho.internalField()*vf.internalField() - - mesh().V0()*rho.oldTime().internalField() - *vf.oldTime().internalField() - ) - mesh().V00()*offCentre_(ddt0.internalField()) + mesh().V()*rho.primitiveField()*vf.primitiveField() + - mesh().V0()*rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + ) - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V(), rDtCoef.value()* ( @@ -661,20 +661,20 @@ CrankNicolsonDdtScheme<Type>::fvcDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0* ( mesh().V0() - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField() + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() - mesh().V00() - *alpha.oldTime().oldTime().internalField() - *rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField() - ) - mesh().V00()*offCentre_(ddt0.internalField()) + *alpha.oldTime().oldTime().primitiveField() + *rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField() + ) - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -704,15 +704,15 @@ CrankNicolsonDdtScheme<Type>::fvcDdt rDtCoef.value()* ( mesh().V() - *alpha.internalField() - *rho.internalField() - *vf.internalField() + *alpha.primitiveField() + *rho.primitiveField() + *vf.primitiveField() - mesh().V0() - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField() - ) - mesh().V00()*offCentre_(ddt0.internalField()) + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + ) - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V(), rDtCoef.value()* ( @@ -799,14 +799,14 @@ CrankNicolsonDdtScheme<Type>::fvmDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0* ( - mesh().V0()*vf.oldTime().internalField() - - mesh().V00()*vf.oldTime().oldTime().internalField() + mesh().V0()*vf.oldTime().primitiveField() + - mesh().V00()*vf.oldTime().oldTime().primitiveField() ) - - mesh().V00()*offCentre_(ddt0.internalField()) + - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -822,8 +822,8 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( - rDtCoef*vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + rDtCoef*vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V0(); } else @@ -836,8 +836,8 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( - rDtCoef*vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + rDtCoef*vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V(); } @@ -884,14 +884,14 @@ CrankNicolsonDdtScheme<Type>::fvmDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0*rho.value()* ( - mesh().V0()*vf.oldTime().internalField() - - mesh().V00()*vf.oldTime().oldTime().internalField() + mesh().V0()*vf.oldTime().primitiveField() + - mesh().V00()*vf.oldTime().oldTime().primitiveField() ) - - mesh().V00()*offCentre_(ddt0.internalField()) + - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -907,8 +907,8 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( - rDtCoef*rho.value()*vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + rDtCoef*rho.value()*vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V0(); } else @@ -921,8 +921,8 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( - rDtCoef*rho.value()*vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + rDtCoef*rho.value()*vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V(); } @@ -956,7 +956,7 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvMatrix<Type>& fvm = tfvm.ref(); scalar rDtCoef = rDtCoef_(ddt0).value(); - fvm.diag() = rDtCoef*rho.internalField()*mesh().V(); + fvm.diag() = rDtCoef*rho.primitiveField()*mesh().V(); vf.oldTime().oldTime(); rho.oldTime().oldTime(); @@ -970,16 +970,16 @@ CrankNicolsonDdtScheme<Type>::fvmDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0* ( - mesh().V0()*rho.oldTime().internalField() - *vf.oldTime().internalField() - - mesh().V00()*rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField() + mesh().V0()*rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + - mesh().V00()*rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField() ) - - mesh().V00()*offCentre_(ddt0.internalField()) + - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -997,8 +997,8 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( - rDtCoef*rho.oldTime().internalField()*vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + rDtCoef*rho.oldTime().primitiveField()*vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V0(); } else @@ -1014,8 +1014,8 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( - rDtCoef*rho.oldTime().internalField()*vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + rDtCoef*rho.oldTime().primitiveField()*vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V(); } @@ -1050,7 +1050,7 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvMatrix<Type>& fvm = tfvm.ref(); scalar rDtCoef = rDtCoef_(ddt0).value(); - fvm.diag() = rDtCoef*alpha.internalField()*rho.internalField()*mesh().V(); + fvm.diag() = rDtCoef*alpha.primitiveField()*rho.primitiveField()*mesh().V(); vf.oldTime().oldTime(); alpha.oldTime().oldTime(); @@ -1065,21 +1065,21 @@ CrankNicolsonDdtScheme<Type>::fvmDdt { scalar rDtCoef0 = rDtCoef0_(ddt0).value(); - ddt0.internalFieldRef() = + ddt0.primitiveFieldRef() = ( rDtCoef0* ( mesh().V0() - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField() + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() - mesh().V00() - *alpha.oldTime().oldTime().internalField() - *rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField() + *alpha.oldTime().oldTime().primitiveField() + *rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField() ) - - mesh().V00()*offCentre_(ddt0.internalField()) + - mesh().V00()*offCentre_(ddt0.primitiveField()) )/mesh().V0(); ddt0bf = @@ -1101,10 +1101,10 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( rDtCoef - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V0(); } else @@ -1126,10 +1126,10 @@ CrankNicolsonDdtScheme<Type>::fvmDdt fvm.source() = ( rDtCoef - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField() - + offCentre_(ddt0.internalField()) + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + + offCentre_(ddt0.primitiveField()) )*mesh().V(); } diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/EulerDdtScheme/EulerDdtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/EulerDdtScheme/EulerDdtScheme.C index 3e08057772..ffef9994d4 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/EulerDdtScheme/EulerDdtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/EulerDdtScheme/EulerDdtScheme.C @@ -73,7 +73,7 @@ EulerDdtScheme<Type>::fvcDdt ) ); - tdtdt.ref().internalFieldRef() = + tdtdt.ref().primitiveFieldRef() = rDeltaT.value()*dt.value()*(1.0 - mesh().Vsc0()/mesh().Vsc()); return tdtdt; @@ -126,8 +126,8 @@ EulerDdtScheme<Type>::fvcDdt rDeltaT.dimensions()*vf.dimensions(), rDeltaT.value()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.value()* ( @@ -178,8 +178,8 @@ EulerDdtScheme<Type>::fvcDdt rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), rDeltaT.value()*rho.value()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.value()*rho.value()* ( @@ -230,9 +230,9 @@ EulerDdtScheme<Type>::fvcDdt rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), rDeltaT.value()* ( - rho.internalField()*vf.internalField() - - rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + rho.primitiveField()*vf.primitiveField() + - rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.value()* ( @@ -287,13 +287,13 @@ EulerDdtScheme<Type>::fvcDdt *alpha.dimensions()*rho.dimensions()*vf.dimensions(), rDeltaT.value()* ( - alpha.internalField() - *rho.internalField() - *vf.internalField() + alpha.primitiveField() + *rho.primitiveField() + *vf.primitiveField() - - alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + - alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.value()* ( @@ -350,11 +350,11 @@ EulerDdtScheme<Type>::fvmDdt if (mesh().moving()) { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().Vsc0(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().Vsc0(); } else { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().Vsc(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -386,12 +386,12 @@ EulerDdtScheme<Type>::fvmDdt if (mesh().moving()) { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().Vsc0(); + *rho.value()*vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().Vsc(); + *rho.value()*vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -418,19 +418,19 @@ EulerDdtScheme<Type>::fvmDdt scalar rDeltaT = 1.0/mesh().time().deltaTValue(); - fvm.diag() = rDeltaT*rho.internalField()*mesh().Vsc(); + fvm.diag() = rDeltaT*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -458,21 +458,22 @@ EulerDdtScheme<Type>::fvmDdt scalar rDeltaT = 1.0/mesh().time().deltaTValue(); - fvm.diag() = rDeltaT*alpha.internalField()*rho.internalField()*mesh().Vsc(); + fvm.diag() = + rDeltaT*alpha.primitiveField()*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/SLTSDdtScheme/SLTSDdtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/SLTSDdtScheme/SLTSDdtScheme.C index dbe8ccb9d1..9aba9f0f67 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/SLTSDdtScheme/SLTSDdtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/SLTSDdtScheme/SLTSDdtScheme.C @@ -117,9 +117,9 @@ tmp<volScalarField> SLTSDdtScheme<Type>::SLrDeltaT() const if (phi.dimensions() == dimensionSet(0, 3, -1, 0, 0)) { - rDeltaT.internalFieldRef() = max + rDeltaT.primitiveFieldRef() = max ( - rDeltaT.internalField()/mesh().V(), + rDeltaT.primitiveField()/mesh().V(), scalar(1)/deltaT.value() ); } @@ -131,9 +131,9 @@ tmp<volScalarField> SLTSDdtScheme<Type>::SLrDeltaT() const rhoName_ ).oldTime(); - rDeltaT.internalFieldRef() = max + rDeltaT.primitiveFieldRef() = max ( - rDeltaT.internalField()/(rho.internalField()*mesh().V()), + rDeltaT.primitiveField()/(rho.primitiveField()*mesh().V()), scalar(1)/deltaT.value() ); } @@ -183,8 +183,8 @@ SLTSDdtScheme<Type>::fvcDdt ) ); - tdtdt.ref().internalFieldRef() = - rDeltaT.internalField()*dt.value()*(1.0 - mesh().V0()/mesh().V()); + tdtdt.ref().primitiveFieldRef() = + rDeltaT.primitiveField()*dt.value()*(1.0 - mesh().V0()/mesh().V()); return tdtdt; } @@ -234,10 +234,10 @@ SLTSDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().V0()/mesh().V() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().V0()/mesh().V() ), rDeltaT.boundaryField()* ( @@ -286,10 +286,10 @@ SLTSDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()*rho.value()* + rDeltaT.primitiveField()*rho.value()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().V0()/mesh().V() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().V0()/mesh().V() ), rDeltaT.boundaryField()*rho.value()* ( @@ -338,11 +338,11 @@ SLTSDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - rho.internalField()*vf.internalField() - - rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V0()/mesh().V() + rho.primitiveField()*vf.primitiveField() + - rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V0()/mesh().V() ), rDeltaT.boundaryField()* ( @@ -395,15 +395,15 @@ SLTSDdtScheme<Type>::fvcDdt mesh(), rDeltaT.dimensions() *alpha.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - alpha.internalField() - *rho.internalField() - *vf.internalField() + alpha.primitiveField() + *rho.primitiveField() + *vf.primitiveField() - - alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + - alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -454,17 +454,17 @@ SLTSDdtScheme<Type>::fvmDdt fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(SLrDeltaT()().internalField()); + scalarField rDeltaT(SLrDeltaT()().primitiveField()); fvm.diag() = rDeltaT*mesh().V(); if (mesh().moving()) { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().V0(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().V0(); } else { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().V(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().V(); } return tfvm; @@ -489,19 +489,19 @@ SLTSDdtScheme<Type>::fvmDdt ); fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(SLrDeltaT()().internalField()); + scalarField rDeltaT(SLrDeltaT()().primitiveField()); fvm.diag() = rDeltaT*rho.value()*mesh().V(); if (mesh().moving()) { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().V0(); + *rho.value()*vf.oldTime().primitiveField()*mesh().V0(); } else { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().V(); + *rho.value()*vf.oldTime().primitiveField()*mesh().V(); } return tfvm; @@ -526,21 +526,21 @@ SLTSDdtScheme<Type>::fvmDdt ); fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(SLrDeltaT()().internalField()); + scalarField rDeltaT(SLrDeltaT()().primitiveField()); - fvm.diag() = rDeltaT*rho.internalField()*mesh().V(); + fvm.diag() = rDeltaT*rho.primitiveField()*mesh().V(); if (mesh().moving()) { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V0(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V0(); } else { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V(); } return tfvm; @@ -566,23 +566,24 @@ SLTSDdtScheme<Type>::fvmDdt ); fvMatrix<Type>& fvm = tfvm.ref(); - scalarField rDeltaT(SLrDeltaT()().internalField()); + scalarField rDeltaT(SLrDeltaT()().primitiveField()); - fvm.diag() = rDeltaT*alpha.internalField()*rho.internalField()*mesh().Vsc(); + fvm.diag() = + rDeltaT*alpha.primitiveField()*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/backwardDdtScheme/backwardDdtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/backwardDdtScheme/backwardDdtScheme.C index 14279eea01..641a645132 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/backwardDdtScheme/backwardDdtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/backwardDdtScheme/backwardDdtScheme.C @@ -111,7 +111,7 @@ backwardDdtScheme<Type>::fvcDdt ) ); - tdtdt.ref().internalFieldRef() = rDeltaT.value()*dt.value()* + tdtdt.ref().primitiveFieldRef() = rDeltaT.value()*dt.value()* ( coefft - (coefft0*mesh().V0() - coefft00*mesh().V00())/mesh().V() ); @@ -173,10 +173,10 @@ backwardDdtScheme<Type>::fvcDdt rDeltaT.dimensions()*vf.dimensions(), rDeltaT.value()* ( - coefft*vf.internalField() - + coefft*vf.primitiveField() - ( - coefft0*vf.oldTime().internalField()*mesh().V0() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField()*mesh().V0() + - coefft00*vf.oldTime().oldTime().primitiveField() *mesh().V00() )/mesh().V() ), @@ -245,10 +245,10 @@ backwardDdtScheme<Type>::fvcDdt rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), rDeltaT.value()*rho.value()* ( - coefft*vf.internalField() - + coefft*vf.primitiveField() - ( - coefft0*vf.oldTime().internalField()*mesh().V0() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField()*mesh().V0() + - coefft00*vf.oldTime().oldTime().primitiveField() *mesh().V00() )/mesh().V() ), @@ -317,12 +317,12 @@ backwardDdtScheme<Type>::fvcDdt rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), rDeltaT.value()* ( - coefft*rho.internalField()*vf.internalField() - + coefft*rho.primitiveField()*vf.primitiveField() - ( - coefft0*rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V0() - - coefft00*rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField()*mesh().V00() + coefft0*rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V0() + - coefft00*rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField()*mesh().V00() )/mesh().V() ), rDeltaT.value()* @@ -395,19 +395,19 @@ backwardDdtScheme<Type>::fvcDdt rDeltaT.value()* ( coefft - *alpha.internalField() - *rho.internalField() - *vf.internalField() - + *alpha.primitiveField() + *rho.primitiveField() + *vf.primitiveField() - ( coefft0 - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V0() + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V0() - coefft00 - *alpha.oldTime().oldTime().internalField() - *rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField()*mesh().V00() + *alpha.oldTime().oldTime().primitiveField() + *rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField()*mesh().V00() )/mesh().V() ), rDeltaT.value()* @@ -484,8 +484,8 @@ backwardDdtScheme<Type>::fvmDdt { fvm.source() = rDeltaT* ( - coefft0*vf.oldTime().internalField()*mesh().V0() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField()*mesh().V0() + - coefft00*vf.oldTime().oldTime().primitiveField() *mesh().V00() ); } @@ -493,8 +493,8 @@ backwardDdtScheme<Type>::fvmDdt { fvm.source() = rDeltaT*mesh().V()* ( - coefft0*vf.oldTime().internalField() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField() + - coefft00*vf.oldTime().oldTime().primitiveField() ); } @@ -535,8 +535,8 @@ backwardDdtScheme<Type>::fvmDdt { fvm.source() = rDeltaT*rho.value()* ( - coefft0*vf.oldTime().internalField()*mesh().V0() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField()*mesh().V0() + - coefft00*vf.oldTime().oldTime().primitiveField() *mesh().V00() ); } @@ -544,8 +544,8 @@ backwardDdtScheme<Type>::fvmDdt { fvm.source() = rDeltaT*mesh().V()*rho.value()* ( - coefft0*vf.oldTime().internalField() - - coefft00*vf.oldTime().oldTime().internalField() + coefft0*vf.oldTime().primitiveField() + - coefft00*vf.oldTime().oldTime().primitiveField() ); } @@ -580,26 +580,26 @@ backwardDdtScheme<Type>::fvmDdt scalar coefft00 = deltaT*deltaT/(deltaT0*(deltaT + deltaT0)); scalar coefft0 = coefft + coefft00; - fvm.diag() = (coefft*rDeltaT)*rho.internalField()*mesh().V(); + fvm.diag() = (coefft*rDeltaT)*rho.primitiveField()*mesh().V(); if (mesh().moving()) { fvm.source() = rDeltaT* ( - coefft0*rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V0() - - coefft00*rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField()*mesh().V00() + coefft0*rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V0() + - coefft00*rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField()*mesh().V00() ); } else { fvm.source() = rDeltaT*mesh().V()* ( - coefft0*rho.oldTime().internalField() - *vf.oldTime().internalField() - - coefft00*rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField() + coefft0*rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() + - coefft00*rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField() ); } @@ -636,21 +636,21 @@ backwardDdtScheme<Type>::fvmDdt scalar coefft0 = coefft + coefft00; fvm.diag() = - (coefft*rDeltaT)*alpha.internalField()*rho.internalField()*mesh().V(); + (coefft*rDeltaT)*alpha.primitiveField()*rho.primitiveField()*mesh().V(); if (mesh().moving()) { fvm.source() = rDeltaT* ( coefft0 - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().V0() + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().V0() - coefft00 - *alpha.oldTime().oldTime().internalField() - *rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField()*mesh().V00() + *alpha.oldTime().oldTime().primitiveField() + *rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField()*mesh().V00() ); } else @@ -658,14 +658,14 @@ backwardDdtScheme<Type>::fvmDdt fvm.source() = rDeltaT*mesh().V()* ( coefft0 - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField() + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField() - coefft00 - *alpha.oldTime().oldTime().internalField() - *rho.oldTime().oldTime().internalField() - *vf.oldTime().oldTime().internalField() + *alpha.oldTime().oldTime().primitiveField() + *rho.oldTime().oldTime().primitiveField() + *vf.oldTime().oldTime().primitiveField() ); } diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/ddtScheme/ddtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/ddtScheme/ddtScheme.C index 499f167569..41024f831c 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/ddtScheme/ddtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/ddtScheme/ddtScheme.C @@ -169,9 +169,9 @@ tmp<surfaceScalarField> ddtScheme<Type>::fvcDdtPhiCoeff { InfoInFunction << "ddtCouplingCoeff mean max min = " - << gAverage(ddtCouplingCoeff.internalField()) - << " " << gMax(ddtCouplingCoeff.internalField()) - << " " << gMin(ddtCouplingCoeff.internalField()) + << gAverage(ddtCouplingCoeff.primitiveField()) + << " " << gMax(ddtCouplingCoeff.primitiveField()) + << " " << gMin(ddtCouplingCoeff.primitiveField()) << endl; } diff --git a/src/finiteVolume/finiteVolume/ddtSchemes/localEulerDdtScheme/localEulerDdtScheme.C b/src/finiteVolume/finiteVolume/ddtSchemes/localEulerDdtScheme/localEulerDdtScheme.C index 4a4d59827b..2dcdb83bb6 100644 --- a/src/finiteVolume/finiteVolume/ddtSchemes/localEulerDdtScheme/localEulerDdtScheme.C +++ b/src/finiteVolume/finiteVolume/ddtSchemes/localEulerDdtScheme/localEulerDdtScheme.C @@ -79,8 +79,8 @@ localEulerDdtScheme<Type>::fvcDdt ) ); - tdtdt.ref().internalFieldRef() = - rDeltaT.internalField()*dt.value() + tdtdt.ref().primitiveFieldRef() = + rDeltaT.primitiveField()*dt.value() *(1.0 - mesh().Vsc0()/mesh().Vsc()); return tdtdt; @@ -131,10 +131,10 @@ localEulerDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -183,10 +183,10 @@ localEulerDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()*rho.value()* + rDeltaT.primitiveField()*rho.value()* ( - vf.internalField() - - vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + vf.primitiveField() + - vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()*rho.value()* ( @@ -235,11 +235,11 @@ localEulerDdtScheme<Type>::fvcDdt ddtIOobject, mesh(), rDeltaT.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - rho.internalField()*vf.internalField() - - rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + rho.primitiveField()*vf.primitiveField() + - rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -292,15 +292,15 @@ localEulerDdtScheme<Type>::fvcDdt mesh(), rDeltaT.dimensions() *alpha.dimensions()*rho.dimensions()*vf.dimensions(), - rDeltaT.internalField()* + rDeltaT.primitiveField()* ( - alpha.internalField() - *rho.internalField() - *vf.internalField() + alpha.primitiveField() + *rho.primitiveField() + *vf.primitiveField() - - alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0()/mesh().Vsc() + - alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0()/mesh().Vsc() ), rDeltaT.boundaryField()* ( @@ -357,11 +357,11 @@ localEulerDdtScheme<Type>::fvmDdt if (mesh().moving()) { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().Vsc0(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().Vsc0(); } else { - fvm.source() = rDeltaT*vf.oldTime().internalField()*mesh().Vsc(); + fvm.source() = rDeltaT*vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -393,12 +393,12 @@ localEulerDdtScheme<Type>::fvmDdt if (mesh().moving()) { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().Vsc0(); + *rho.value()*vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *rho.value()*vf.oldTime().internalField()*mesh().Vsc(); + *rho.value()*vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -425,19 +425,19 @@ localEulerDdtScheme<Type>::fvmDdt const scalarField& rDeltaT = localRDeltaT(); - fvm.diag() = rDeltaT*rho.internalField()*mesh().Vsc(); + fvm.diag() = rDeltaT*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; @@ -465,21 +465,22 @@ localEulerDdtScheme<Type>::fvmDdt const scalarField& rDeltaT = localRDeltaT(); - fvm.diag() = rDeltaT*alpha.internalField()*rho.internalField()*mesh().Vsc(); + fvm.diag() = + rDeltaT*alpha.primitiveField()*rho.primitiveField()*mesh().Vsc(); if (mesh().moving()) { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc0(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc0(); } else { fvm.source() = rDeltaT - *alpha.oldTime().internalField() - *rho.oldTime().internalField() - *vf.oldTime().internalField()*mesh().Vsc(); + *alpha.oldTime().primitiveField() + *rho.oldTime().primitiveField() + *vf.oldTime().primitiveField()*mesh().Vsc(); } return tfvm; diff --git a/src/finiteVolume/finiteVolume/fvc/fvcAverage.C b/src/finiteVolume/finiteVolume/fvc/fvcAverage.C index 0fcc4b2fd3..2df82a88e6 100644 --- a/src/finiteVolume/finiteVolume/fvc/fvcAverage.C +++ b/src/finiteVolume/finiteVolume/fvc/fvcAverage.C @@ -67,10 +67,10 @@ average ); GeometricField<Type, fvPatchField, volMesh>& av = taverage.ref(); - av.internalFieldRef() = + av.primitiveFieldRef() = ( - surfaceSum(mesh.magSf()*ssf)().internalField() - /surfaceSum(mesh.magSf())().internalField() + surfaceSum(mesh.magSf()*ssf)().primitiveField() + /surfaceSum(mesh.magSf())().primitiveField() ); typename GeometricField<Type, fvPatchField, volMesh>:: diff --git a/src/finiteVolume/finiteVolume/fvc/fvcSurfaceIntegrate.C b/src/finiteVolume/finiteVolume/fvc/fvcSurfaceIntegrate.C index 34e5b37d1a..bb38614e00 100644 --- a/src/finiteVolume/finiteVolume/fvc/fvcSurfaceIntegrate.C +++ b/src/finiteVolume/finiteVolume/fvc/fvcSurfaceIntegrate.C @@ -109,7 +109,7 @@ surfaceIntegrate ); GeometricField<Type, fvPatchField, volMesh>& vf = tvf.ref(); - surfaceIntegrate(vf.internalFieldRef(), ssf); + surfaceIntegrate(vf.primitiveFieldRef(), ssf); vf.correctBoundaryConditions(); return tvf; diff --git a/src/finiteVolume/finiteVolume/fvc/fvcVolumeIntegrate.C b/src/finiteVolume/finiteVolume/fvc/fvcVolumeIntegrate.C index 77dc814902..e56b0a693e 100644 --- a/src/finiteVolume/finiteVolume/fvc/fvcVolumeIntegrate.C +++ b/src/finiteVolume/finiteVolume/fvc/fvcVolumeIntegrate.C @@ -46,7 +46,7 @@ volumeIntegrate const GeometricField<Type, fvPatchField, volMesh>& vf ) { - return vf.mesh().V()*vf.internalField(); + return vf.mesh().V()*vf.primitiveField(); } @@ -57,7 +57,7 @@ volumeIntegrate const tmp<GeometricField<Type, fvPatchField, volMesh>>& tvf ) { - tmp<Field<Type>> tvivf = tvf().mesh().V()*tvf().internalField(); + tmp<Field<Type>> tvivf = tvf().mesh().V()*tvf().primitiveField(); tvf.clear(); return tvivf; } diff --git a/src/finiteVolume/finiteVolume/fvm/fvmSup.C b/src/finiteVolume/finiteVolume/fvm/fvmSup.C index 97d33bd609..eba28b2b45 100644 --- a/src/finiteVolume/finiteVolume/fvm/fvmSup.C +++ b/src/finiteVolume/finiteVolume/fvm/fvmSup.C @@ -210,7 +210,7 @@ Foam::fvm::SuSp fvm.diag() += mesh.V()*max(susp.field(), scalar(0)); fvm.source() -= mesh.V()*min(susp.field(), scalar(0)) - *vf.internalField(); + *vf.primitiveField(); return tfvm; } diff --git a/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellLimitedGrad/cellLimitedGrads.C b/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellLimitedGrad/cellLimitedGrads.C index e35327363e..7a13f98077 100644 --- a/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellLimitedGrad/cellLimitedGrads.C +++ b/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellLimitedGrad/cellLimitedGrads.C @@ -62,8 +62,8 @@ Foam::fv::cellLimitedGrad<Foam::scalar>::calcGrad const volVectorField& C = mesh.C(); const surfaceVectorField& Cf = mesh.Cf(); - scalarField maxVsf(vsf.internalField()); - scalarField minVsf(vsf.internalField()); + scalarField maxVsf(vsf.primitiveField()); + scalarField minVsf(vsf.primitiveField()); forAll(owner, facei) { @@ -130,7 +130,7 @@ Foam::fv::cellLimitedGrad<Foam::scalar>::calcGrad // create limiter - scalarField limiter(vsf.internalField().size(), 1.0); + scalarField limiter(vsf.primitiveField().size(), 1.0); forAll(owner, facei) { @@ -183,7 +183,7 @@ Foam::fv::cellLimitedGrad<Foam::scalar>::calcGrad << " average: " << gAverage(limiter) << endl; } - g.internalFieldRef() *= limiter; + g.primitiveFieldRef() *= limiter; g.correctBoundaryConditions(); gaussGrad<scalar>::correctBoundaryConditions(vsf, g); @@ -216,8 +216,8 @@ Foam::fv::cellLimitedGrad<Foam::vector>::calcGrad const volVectorField& C = mesh.C(); const surfaceVectorField& Cf = mesh.Cf(); - vectorField maxVsf(vsf.internalField()); - vectorField minVsf(vsf.internalField()); + vectorField maxVsf(vsf.primitiveField()); + vectorField minVsf(vsf.primitiveField()); forAll(owner, facei) { @@ -283,7 +283,7 @@ Foam::fv::cellLimitedGrad<Foam::vector>::calcGrad // create limiter - vectorField limiter(vsf.internalField().size(), vector::one); + vectorField limiter(vsf.primitiveField().size(), vector::one); forAll(owner, facei) { @@ -336,7 +336,7 @@ Foam::fv::cellLimitedGrad<Foam::vector>::calcGrad << " average: " << gAverage(limiter) << endl; } - tensorField& gIf = g.internalFieldRef(); + tensorField& gIf = g.primitiveFieldRef(); forAll(gIf, celli) { diff --git a/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellMDLimitedGrad/cellMDLimitedGrads.C b/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellMDLimitedGrad/cellMDLimitedGrads.C index 3ed5113ee0..a9c230b757 100644 --- a/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellMDLimitedGrad/cellMDLimitedGrads.C +++ b/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/cellMDLimitedGrad/cellMDLimitedGrads.C @@ -62,8 +62,8 @@ Foam::fv::cellMDLimitedGrad<Foam::scalar>::calcGrad const volVectorField& C = mesh.C(); const surfaceVectorField& Cf = mesh.Cf(); - scalarField maxVsf(vsf.internalField()); - scalarField minVsf(vsf.internalField()); + scalarField maxVsf(vsf.primitiveField()); + scalarField minVsf(vsf.primitiveField()); forAll(owner, facei) { @@ -205,8 +205,8 @@ Foam::fv::cellMDLimitedGrad<Foam::vector>::calcGrad const volVectorField& C = mesh.C(); const surfaceVectorField& Cf = mesh.Cf(); - vectorField maxVsf(vsf.internalField()); - vectorField minVsf(vsf.internalField()); + vectorField maxVsf(vsf.primitiveField()); + vectorField minVsf(vsf.primitiveField()); forAll(owner, facei) { diff --git a/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/faceLimitedGrad/faceLimitedGrads.C b/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/faceLimitedGrad/faceLimitedGrads.C index 070987701c..99afce8788 100644 --- a/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/faceLimitedGrad/faceLimitedGrads.C +++ b/src/finiteVolume/finiteVolume/gradSchemes/limitedGradSchemes/faceLimitedGrad/faceLimitedGrads.C @@ -63,7 +63,7 @@ Foam::fv::faceLimitedGrad<Foam::scalar>::calcGrad const surfaceVectorField& Cf = mesh.Cf(); // create limiter - scalarField limiter(vsf.internalField().size(), 1.0); + scalarField limiter(vsf.primitiveField().size(), 1.0); scalar rk = (1.0/k_ - 1.0); @@ -165,7 +165,7 @@ Foam::fv::faceLimitedGrad<Foam::scalar>::calcGrad << " average: " << gAverage(limiter) << endl; } - g.internalFieldRef() *= limiter; + g.primitiveFieldRef() *= limiter; g.correctBoundaryConditions(); gaussGrad<scalar>::correctBoundaryConditions(vsf, g); @@ -199,7 +199,7 @@ Foam::fv::faceLimitedGrad<Foam::vector>::calcGrad const surfaceVectorField& Cf = mesh.Cf(); // create limiter - scalarField limiter(vvf.internalField().size(), 1.0); + scalarField limiter(vvf.primitiveField().size(), 1.0); scalar rk = (1.0/k_ - 1.0); @@ -326,7 +326,7 @@ Foam::fv::faceLimitedGrad<Foam::vector>::calcGrad << " average: " << gAverage(limiter) << endl; } - g.internalFieldRef() *= limiter; + g.primitiveFieldRef() *= limiter; g.correctBoundaryConditions(); gaussGrad<vector>::correctBoundaryConditions(vvf, g); diff --git a/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianScheme.C b/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianScheme.C index 937a359d85..795fbff975 100644 --- a/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianScheme.C +++ b/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianScheme.C @@ -60,7 +60,7 @@ gaussLaplacianScheme<Type, GType>::fvmLaplacianUncorrected ); fvMatrix<Type>& fvm = tfvm.ref(); - fvm.upper() = deltaCoeffs.internalField()*gammaMagSf.internalField(); + fvm.upper() = deltaCoeffs.primitiveField()*gammaMagSf.primitiveField(); fvm.negSumDiag(); forAll(vf.boundaryField(), patchi) @@ -187,7 +187,7 @@ gaussLaplacianScheme<Type, GType>::fvmLaplacian SfGammaSn*this->tsnGradScheme_().correction(vf); } - fvm.source() -= mesh.V()*fvc::div(tfaceFluxCorrection())().internalField(); + fvm.source() -= mesh.V()*fvc::div(tfaceFluxCorrection())().primitiveField(); if (mesh.fluxRequired(vf.name())) { diff --git a/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianSchemes.C b/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianSchemes.C index 8afa4447dc..c102de28cc 100644 --- a/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianSchemes.C +++ b/src/finiteVolume/finiteVolume/laplacianSchemes/gaussLaplacianScheme/gaussLaplacianSchemes.C @@ -70,7 +70,7 @@ Foam::fv::gaussLaplacianScheme<Foam::Type, Foam::scalar>::fvmLaplacian \ fvc::div \ ( \ *fvm.faceFluxCorrectionPtr() \ - )().internalField(); \ + )().primitiveField(); \ } \ else \ { \ @@ -79,7 +79,7 @@ Foam::fv::gaussLaplacianScheme<Foam::Type, Foam::scalar>::fvmLaplacian \ fvc::div \ ( \ gammaMagSf*this->tsnGradScheme_().correction(vf) \ - )().internalField(); \ + )().primitiveField(); \ } \ } \ \ @@ -88,7 +88,7 @@ Foam::fv::gaussLaplacianScheme<Foam::Type, Foam::scalar>::fvmLaplacian \ \ \ template<> \ -Foam::tmp<Foam::GeometricField<Foam::Type, Foam::fvPatchField, Foam::volMesh>>\ +Foam::tmp<Foam::GeometricField<Foam::Type, Foam::fvPatchField, Foam::volMesh>> \ Foam::fv::gaussLaplacianScheme<Foam::Type, Foam::scalar>::fvcLaplacian \ ( \ const GeometricField<scalar, fvsPatchField, surfaceMesh>& gamma, \ diff --git a/src/finiteVolume/finiteVolume/snGradSchemes/faceCorrectedSnGrad/faceCorrectedSnGrad.C b/src/finiteVolume/finiteVolume/snGradSchemes/faceCorrectedSnGrad/faceCorrectedSnGrad.C index a621a62a4a..5ef44cedc1 100644 --- a/src/finiteVolume/finiteVolume/snGradSchemes/faceCorrectedSnGrad/faceCorrectedSnGrad.C +++ b/src/finiteVolume/finiteVolume/snGradSchemes/faceCorrectedSnGrad/faceCorrectedSnGrad.C @@ -68,7 +68,7 @@ Foam::fv::faceCorrectedSnGrad<Type>::fullGradCorrection ) ); - Field<Type>& sfCorr = tsfCorr.ref().internalFieldRef(); + Field<Type>& sfCorr = tsfCorr.ref().primitiveFieldRef(); const pointField& points = mesh.points(); const faceList& faces = mesh.faces(); diff --git a/src/finiteVolume/finiteVolume/snGradSchemes/limitedSnGrad/limitedSnGrad.C b/src/finiteVolume/finiteVolume/snGradSchemes/limitedSnGrad/limitedSnGrad.C index 308ad6cad7..93f12751a4 100644 --- a/src/finiteVolume/finiteVolume/snGradSchemes/limitedSnGrad/limitedSnGrad.C +++ b/src/finiteVolume/finiteVolume/snGradSchemes/limitedSnGrad/limitedSnGrad.C @@ -77,9 +77,9 @@ limitedSnGrad<Type>::correction if (fv::debug) { InfoInFunction - << "limiter min: " << min(limiter.internalField()) - << " max: "<< max(limiter.internalField()) - << " avg: " << average(limiter.internalField()) << endl; + << "limiter min: " << min(limiter.primitiveField()) + << " max: "<< max(limiter.primitiveField()) + << " avg: " << average(limiter.primitiveField()) << endl; } return limiter*corr; diff --git a/src/finiteVolume/fvMatrices/fvMatrix/fvMatrix.C b/src/finiteVolume/fvMatrices/fvMatrix/fvMatrix.C index 2c54f9bac9..91ec6420f8 100644 --- a/src/finiteVolume/fvMatrices/fvMatrix/fvMatrix.C +++ b/src/finiteVolume/fvMatrices/fvMatrix/fvMatrix.C @@ -191,7 +191,7 @@ void Foam::fvMatrix<Type>::setValuesFromList const_cast < GeometricField<Type, fvPatchField, volMesh>& - >(psi_).internalFieldRef(); + >(psi_).primitiveFieldRef(); forAll(cellLabels, i) { @@ -654,7 +654,7 @@ void Foam::fvMatrix<Type>::relax(const scalar alpha) } // Finally add the relaxation contribution to the source. - S += (D - D0)*psi_.internalField(); + S += (D - D0)*psi_.primitiveField(); } @@ -742,7 +742,7 @@ Foam::tmp<Foam::volScalarField> Foam::fvMatrix<Type>::A() const ) ); - tAphi.ref().internalFieldRef() = D()/psi_.mesh().V(); + tAphi.ref().primitiveFieldRef() = D()/psi_.mesh().V(); tAphi.ref().correctBoundaryConditions(); return tAphi; @@ -775,20 +775,20 @@ Foam::fvMatrix<Type>::H() const // Loop over field components for (direction cmpt=0; cmpt<Type::nComponents; cmpt++) { - scalarField psiCmpt(psi_.internalField().component(cmpt)); + scalarField psiCmpt(psi_.primitiveField().component(cmpt)); scalarField boundaryDiagCmpt(psi_.size(), 0.0); addBoundaryDiag(boundaryDiagCmpt, cmpt); boundaryDiagCmpt.negate(); addCmptAvBoundaryDiag(boundaryDiagCmpt); - Hphi.internalFieldRef().replace(cmpt, boundaryDiagCmpt*psiCmpt); + Hphi.primitiveFieldRef().replace(cmpt, boundaryDiagCmpt*psiCmpt); } - Hphi.internalFieldRef() += lduMatrix::H(psi_.internalField()) + source_; - addBoundarySource(Hphi.internalFieldRef()); + Hphi.primitiveFieldRef() += lduMatrix::H(psi_.primitiveField()) + source_; + addBoundarySource(Hphi.primitiveFieldRef()); - Hphi.internalFieldRef() /= psi_.mesh().V(); + Hphi.primitiveFieldRef() /= psi_.mesh().V(); Hphi.correctBoundaryConditions(); typename Type::labelType validComponents @@ -834,7 +834,7 @@ Foam::tmp<Foam::volScalarField> Foam::fvMatrix<Type>::H1() const ); volScalarField& H1_ = tH1.ref(); - H1_.internalFieldRef() = lduMatrix::H1(); + H1_.primitiveFieldRef() = lduMatrix::H1(); forAll(psi_.boundaryField(), patchi) { @@ -851,7 +851,7 @@ Foam::tmp<Foam::volScalarField> Foam::fvMatrix<Type>::H1() const } } - H1_.internalFieldRef() /= psi_.mesh().V(); + H1_.primitiveFieldRef() /= psi_.mesh().V(); H1_.correctBoundaryConditions(); return tH1; @@ -894,10 +894,10 @@ flux() const for (direction cmpt=0; cmpt<pTraits<Type>::nComponents; cmpt++) { - fieldFlux.internalFieldRef().replace + fieldFlux.primitiveFieldRef().replace ( cmpt, - lduMatrix::faceH(psi_.internalField().component(cmpt)) + lduMatrix::faceH(psi_.primitiveField().component(cmpt)) ); } @@ -1491,7 +1491,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator== { checkMethod(A, tsu(), "=="); tmp<fvMatrix<Type>> tC(new fvMatrix<Type>(A)); - tC.ref().source() += tsu().mesh().V()*tsu().internalField(); + tC.ref().source() += tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1532,7 +1532,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator== { checkMethod(tA(), tsu(), "=="); tmp<fvMatrix<Type>> tC(tA.ptr()); - tC.ref().source() += tsu().mesh().V()*tsu().internalField(); + tC.ref().source() += tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1697,7 +1697,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator+ { checkMethod(A, tsu(), "+"); tmp<fvMatrix<Type>> tC(new fvMatrix<Type>(A)); - tC.ref().source() -= tsu().mesh().V()*tsu().internalField(); + tC.ref().source() -= tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1738,7 +1738,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator+ { checkMethod(tA(), tsu(), "+"); tmp<fvMatrix<Type>> tC(tA.ptr()); - tC.ref().source() -= tsu().mesh().V()*tsu().internalField(); + tC.ref().source() -= tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1779,7 +1779,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator+ { checkMethod(A, tsu(), "+"); tmp<fvMatrix<Type>> tC(new fvMatrix<Type>(A)); - tC.ref().source() -= tsu().mesh().V()*tsu().internalField(); + tC.ref().source() -= tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1820,7 +1820,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator+ { checkMethod(tA(), tsu(), "+"); tmp<fvMatrix<Type>> tC(tA.ptr()); - tC.ref().source() -= tsu().mesh().V()*tsu().internalField(); + tC.ref().source() -= tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1916,7 +1916,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator- { checkMethod(A, tsu(), "-"); tmp<fvMatrix<Type>> tC(new fvMatrix<Type>(A)); - tC.ref().source() += tsu().mesh().V()*tsu().internalField(); + tC.ref().source() += tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -1957,7 +1957,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator- { checkMethod(tA(), tsu(), "-"); tmp<fvMatrix<Type>> tC(tA.ptr()); - tC.ref().source() += tsu().mesh().V()*tsu().internalField(); + tC.ref().source() += tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -2001,7 +2001,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator- checkMethod(A, tsu(), "-"); tmp<fvMatrix<Type>> tC(new fvMatrix<Type>(A)); tC.ref().negate(); - tC.ref().source() -= tsu().mesh().V()*tsu().internalField(); + tC.ref().source() -= tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -2045,7 +2045,7 @@ Foam::tmp<Foam::fvMatrix<Type>> Foam::operator- checkMethod(tA(), tsu(), "-"); tmp<fvMatrix<Type>> tC(tA.ptr()); tC.ref().negate(); - tC.ref().source() -= tsu().mesh().V()*tsu().internalField(); + tC.ref().source() -= tsu().mesh().V()*tsu().primitiveField(); tsu.clear(); return tC; } @@ -2289,18 +2289,18 @@ Foam::operator& scalarField psiCmpt(psi.field().component(cmpt)); scalarField boundaryDiagCmpt(M.diag()); M.addBoundaryDiag(boundaryDiagCmpt, cmpt); - Mphi.internalFieldRef().replace(cmpt, -boundaryDiagCmpt*psiCmpt); + Mphi.primitiveFieldRef().replace(cmpt, -boundaryDiagCmpt*psiCmpt); } } else { - Mphi.internalFieldRef() = Zero; + Mphi.primitiveFieldRef() = Zero; } - Mphi.internalFieldRef() += M.lduMatrix::H(psi.field()) + M.source(); - M.addBoundarySource(Mphi.internalFieldRef()); + Mphi.primitiveFieldRef() += M.lduMatrix::H(psi.field()) + M.source(); + M.addBoundarySource(Mphi.primitiveFieldRef()); - Mphi.internalFieldRef() /= -psi.mesh().V(); + Mphi.primitiveFieldRef() /= -psi.mesh().V(); Mphi.correctBoundaryConditions(); return tMphi; diff --git a/src/finiteVolume/fvMatrices/fvMatrix/fvMatrixSolve.C b/src/finiteVolume/fvMatrices/fvMatrix/fvMatrixSolve.C index 60b29fb78d..9b0c3c73cb 100644 --- a/src/finiteVolume/fvMatrices/fvMatrix/fvMatrixSolve.C +++ b/src/finiteVolume/fvMatrices/fvMatrix/fvMatrixSolve.C @@ -143,7 +143,7 @@ Foam::SolverPerformance<Type> Foam::fvMatrix<Type>::solveSegregated // copy field and source - scalarField psiCmpt(psi.internalField().component(cmpt)); + scalarField psiCmpt(psi.primitiveField().component(cmpt)); addBoundaryDiag(diag(), cmpt); scalarField sourceCmpt(source.component(cmpt)); @@ -202,7 +202,7 @@ Foam::SolverPerformance<Type> Foam::fvMatrix<Type>::solveSegregated solverPerfVec.replace(cmpt, solverPerf); - psi.internalFieldRef().replace(cmpt, psiCmpt); + psi.primitiveFieldRef().replace(cmpt, psiCmpt); diag() = saveDiag; } @@ -337,7 +337,7 @@ Foam::tmp<Foam::Field<Type>> Foam::fvMatrix<Type>::residual() const // Loop over field components for (direction cmpt=0; cmpt<Type::nComponents; cmpt++) { - scalarField psiCmpt(psi_.internalField().component(cmpt)); + scalarField psiCmpt(psi_.primitiveField().component(cmpt)); scalarField boundaryDiagCmpt(psi_.size(), 0.0); addBoundaryDiag(boundaryDiagCmpt, cmpt); diff --git a/src/finiteVolume/fvMatrices/fvScalarMatrix/fvScalarMatrix.C b/src/finiteVolume/fvMatrices/fvScalarMatrix/fvScalarMatrix.C index c72f271f84..b6dc0fe45a 100644 --- a/src/finiteVolume/fvMatrices/fvScalarMatrix/fvScalarMatrix.C +++ b/src/finiteVolume/fvMatrices/fvScalarMatrix/fvScalarMatrix.C @@ -114,7 +114,7 @@ Foam::solverPerformance Foam::fvMatrix<Foam::scalar>::fvSolver::solve solverPerformance solverPerf = solver_->solve ( - psi.internalFieldRef(), + psi.primitiveFieldRef(), totalSource ); @@ -166,7 +166,7 @@ Foam::solverPerformance Foam::fvMatrix<Foam::scalar>::solveSegregated internalCoeffs_, psi_.boundaryField().scalarInterfaces(), solverControls - )->solve(psi.internalFieldRef(), totalSource); + )->solve(psi.primitiveFieldRef(), totalSource); if (solverPerformance::debug) { @@ -193,8 +193,8 @@ Foam::tmp<Foam::scalarField> Foam::fvMatrix<Foam::scalar>::residual() const ( lduMatrix::residual ( - psi_.internalField(), - source_ - boundaryDiag*psi_.internalField(), + psi_.primitiveField(), + source_ - boundaryDiag*psi_.primitiveField(), boundaryCoeffs_, psi_.boundaryField().scalarInterfaces(), 0 @@ -229,10 +229,10 @@ Foam::tmp<Foam::volScalarField> Foam::fvMatrix<Foam::scalar>::H() const ); volScalarField& Hphi = tHphi.ref(); - Hphi.internalFieldRef() = (lduMatrix::H(psi_.internalField()) + source_); - addBoundarySource(Hphi.internalFieldRef()); + Hphi.primitiveFieldRef() = (lduMatrix::H(psi_.primitiveField()) + source_); + addBoundarySource(Hphi.primitiveFieldRef()); - Hphi.internalFieldRef() /= psi_.mesh().V(); + Hphi.primitiveFieldRef() /= psi_.mesh().V(); Hphi.correctBoundaryConditions(); return tHphi; @@ -261,10 +261,10 @@ Foam::tmp<Foam::volScalarField> Foam::fvMatrix<Foam::scalar>::H1() const ); volScalarField& H1_ = tH1.ref(); - H1_.internalFieldRef() = lduMatrix::H1(); - //addBoundarySource(Hphi.internalField()); + H1_.primitiveFieldRef() = lduMatrix::H1(); + //addBoundarySource(Hphi.primitiveField()); - H1_.internalFieldRef() /= psi_.mesh().V(); + H1_.primitiveFieldRef() /= psi_.mesh().V(); H1_.correctBoundaryConditions(); return tH1; diff --git a/src/finiteVolume/fvMatrices/solvers/GAMGSymSolver/GAMGAgglomerations/faceAreaPairGAMGAgglomeration/faceAreaPairGAMGAgglomeration.C b/src/finiteVolume/fvMatrices/solvers/GAMGSymSolver/GAMGAgglomerations/faceAreaPairGAMGAgglomeration/faceAreaPairGAMGAgglomeration.C index 42a35f5c1b..03072be0f2 100644 --- a/src/finiteVolume/fvMatrices/solvers/GAMGSymSolver/GAMGAgglomerations/faceAreaPairGAMGAgglomeration/faceAreaPairGAMGAgglomeration.C +++ b/src/finiteVolume/fvMatrices/solvers/GAMGSymSolver/GAMGAgglomerations/faceAreaPairGAMGAgglomeration/faceAreaPairGAMGAgglomeration.C @@ -62,7 +62,7 @@ Foam::faceAreaPairGAMGAgglomeration::faceAreaPairGAMGAgglomeration { const fvMesh& fvmesh = refCast<const fvMesh>(mesh); - //agglomerate(mesh, sqrt(fvmesh.magSf().internalField())); + //agglomerate(mesh, sqrt(fvmesh.magSf().primitiveField())); agglomerate ( mesh, @@ -70,8 +70,8 @@ Foam::faceAreaPairGAMGAgglomeration::faceAreaPairGAMGAgglomeration ( cmptMultiply ( - fvmesh.Sf().internalField() - /sqrt(fvmesh.magSf().internalField()), + fvmesh.Sf().primitiveField() + /sqrt(fvmesh.magSf().primitiveField()), vector(1, 1.01, 1.02) //vector::one ) diff --git a/src/finiteVolume/fvMatrices/solvers/MULES/CMULESTemplates.C b/src/finiteVolume/fvMatrices/solvers/MULES/CMULESTemplates.C index 38d71faf54..41fc3b1194 100644 --- a/src/finiteVolume/fvMatrices/solvers/MULES/CMULESTemplates.C +++ b/src/finiteVolume/fvMatrices/solvers/MULES/CMULESTemplates.C @@ -53,18 +53,18 @@ void Foam::MULES::correct if (mesh.moving()) { - psi.internalFieldRef() = + psi.primitiveFieldRef() = ( - rho.field()*psi.internalField()*rDeltaT + rho.field()*psi.primitiveField()*rDeltaT + Su.field() - psiIf )/(rho.field()*rDeltaT - Sp.field()); } else { - psi.internalFieldRef() = + psi.primitiveFieldRef() = ( - rho.field()*psi.internalField()*rDeltaT + rho.field()*psi.primitiveField()*rDeltaT + Su.field() - psiIf )/(rho.field()*rDeltaT - Sp.field()); @@ -293,7 +293,7 @@ void Foam::MULES::limiterCorr *( (rho.field()*rDeltaT - Sp.field())*psiMaxn - Su.field() - - rho.field()*psi.internalField()*rDeltaT + - rho.field()*psi.primitiveField()*rDeltaT ); psiMinn = @@ -301,7 +301,7 @@ void Foam::MULES::limiterCorr *( Su.field() - (rho.field()*rDeltaT - Sp.field())*psiMinn - + rho.field()*psi.internalField()*rDeltaT + + rho.field()*psi.primitiveField()*rDeltaT ); scalarField sumlPhip(psiIf.size()); diff --git a/src/finiteVolume/fvMatrices/solvers/MULES/IMULESTemplates.C b/src/finiteVolume/fvMatrices/solvers/MULES/IMULESTemplates.C index 4cc8cd128c..ec7d3448a3 100644 --- a/src/finiteVolume/fvMatrices/solvers/MULES/IMULESTemplates.C +++ b/src/finiteVolume/fvMatrices/solvers/MULES/IMULESTemplates.C @@ -188,8 +188,8 @@ void Foam::MULES::implicitSolve MULEScontrols ); - scalar maxPsiM1 = gMax(psi.internalField()) - 1.0; - scalar minPsi = gMin(psi.internalField()); + scalar maxPsiM1 = gMax(psi.primitiveField()) - 1.0; + scalar minPsi = gMin(psi.primitiveField()); scalar unboundedness = max(max(maxPsiM1, 0.0), -min(minPsi, 0.0)); diff --git a/src/finiteVolume/fvMesh/fvMesh.C b/src/finiteVolume/fvMesh/fvMesh.C index 31e5852cda..0ba93d1f10 100644 --- a/src/finiteVolume/fvMesh/fvMesh.C +++ b/src/finiteVolume/fvMesh/fvMesh.C @@ -763,8 +763,9 @@ Foam::tmp<Foam::scalarField> Foam::fvMesh::movePoints(const pointField& p) tmp<scalarField> tsweptVols = polyMesh::movePoints(p); scalarField& sweptVols = tsweptVols.ref(); - phi.internalFieldRef() = scalarField::subField(sweptVols, nInternalFaces()); - phi.internalFieldRef() *= rDeltaT; + phi.primitiveFieldRef() = + scalarField::subField(sweptVols, nInternalFaces()); + phi.primitiveFieldRef() *= rDeltaT; const fvPatchList& patches = boundary(); diff --git a/src/finiteVolume/fvMesh/fvMeshSubset/fvMeshSubsetInterpolate.C b/src/finiteVolume/fvMesh/fvMeshSubset/fvMeshSubsetInterpolate.C index a9c42ed4e1..2dc96d4ad6 100644 --- a/src/finiteVolume/fvMesh/fvMeshSubset/fvMeshSubsetInterpolate.C +++ b/src/finiteVolume/fvMesh/fvMeshSubset/fvMeshSubsetInterpolate.C @@ -96,7 +96,7 @@ tmp<GeometricField<Type, fvPatchField, volMesh>> fvMeshSubset::interpolate ), sMesh, vf.dimensions(), - Field<Type>(vf.internalField(), cellMap), + Field<Type>(vf.primitiveField(), cellMap), patchFields ) ); @@ -233,7 +233,7 @@ tmp<GeometricField<Type, fvsPatchField, surfaceMesh>> fvMeshSubset::interpolate vf.dimensions(), Field<Type> ( - vf.internalField(), + vf.primitiveField(), SubList<label> ( faceMap, @@ -301,10 +301,10 @@ tmp<GeometricField<Type, fvsPatchField, surfaceMesh>> fvMeshSubset::interpolate forAll(pfld, i) { label baseFacei = faceMap[subPatch.start()+i]; - if (baseFacei < vf.internalField().size()) + if (baseFacei < vf.primitiveField().size()) { // Exposed internal face - pfld[i] = vf.internalField()[baseFacei]; + pfld[i] = vf.primitiveField()[baseFacei]; } else { @@ -402,7 +402,7 @@ fvMeshSubset::interpolate ), sMesh, vf.dimensions(), - Field<Type>(vf.internalField(), pointMap), + Field<Type>(vf.primitiveField(), pointMap), patchFields ) ); diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/LimitedScheme/LimitedScheme.C b/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/LimitedScheme/LimitedScheme.C index ede6264d6e..efe01350d4 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/LimitedScheme/LimitedScheme.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/LimitedScheme/LimitedScheme.C @@ -57,7 +57,7 @@ void Foam::LimitedScheme<Type, Limiter, LimitFunc>::calcLimiter const vectorField& C = mesh.C(); - scalarField& pLim = limiterField.internalFieldRef(); + scalarField& pLim = limiterField.primitiveFieldRef(); forAll(pLim, face) { diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/PhiScheme/PhiScheme.C b/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/PhiScheme/PhiScheme.C index 77cdbcc358..010145ec26 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/PhiScheme/PhiScheme.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/PhiScheme/PhiScheme.C @@ -83,7 +83,7 @@ Foam::PhiScheme<Type, PhiLimiter>::limiter const surfaceScalarField& Uflux = tUflux(); - scalarField& pLimiter = Limiter.internalFieldRef(); + scalarField& pLimiter = Limiter.primitiveFieldRef(); forAll(pLimiter, face) { diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/limitedSurfaceInterpolationScheme/limitedSurfaceInterpolationScheme.C b/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/limitedSurfaceInterpolationScheme/limitedSurfaceInterpolationScheme.C index 184c8667a6..62d3b3903e 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/limitedSurfaceInterpolationScheme/limitedSurfaceInterpolationScheme.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/limitedSchemes/limitedSurfaceInterpolationScheme/limitedSurfaceInterpolationScheme.C @@ -149,7 +149,7 @@ Foam::limitedSurfaceInterpolationScheme<Type>::weights // from which the weight is calculated using the limiter value surfaceScalarField& Weights = tLimiter.ref(); - scalarField& pWeights = Weights.internalFieldRef(); + scalarField& pWeights = Weights.primitiveFieldRef(); forAll(pWeights, face) { diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/cellCoBlended/cellCoBlended.H b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/cellCoBlended/cellCoBlended.H index 3ba12ae60b..8492479b77 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/cellCoBlended/cellCoBlended.H +++ b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/cellCoBlended/cellCoBlended.H @@ -235,10 +235,10 @@ public: scalarField sumPhi ( - fvc::surfaceSum(mag(tUflux))().internalField() + fvc::surfaceSum(mag(tUflux))().primitiveField() ); - Co.internalFieldRef() = + Co.primitiveFieldRef() = (sumPhi/mesh.V().field())*(0.5*mesh.time().deltaTValue()); Co.correctBoundaryConditions(); diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/clippedLinear/clippedLinear.H b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/clippedLinear/clippedLinear.H index 21fb2bdd8c..135e3bff73 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/clippedLinear/clippedLinear.H +++ b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/clippedLinear/clippedLinear.H @@ -153,8 +153,8 @@ public: surfaceScalarField& clippedLinearWeights = tclippedLinearWeights.ref(); - clippedLinearWeights.internalFieldRef() = - max(min(cdWeights.internalField(), 1 - wfLimit_), wfLimit_); + clippedLinearWeights.primitiveFieldRef() = + max(min(cdWeights.primitiveField(), 1 - wfLimit_), wfLimit_); surfaceScalarField::Boundary& clwbf = clippedLinearWeights.boundaryFieldRef(); diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/pointLinear/pointLinear.C b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/pointLinear/pointLinear.C index b1c2745710..345663f62e 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/pointLinear/pointLinear.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/pointLinear/pointLinear.C @@ -48,7 +48,7 @@ correction tmp<GeometricField<Type, fvsPatchField, surfaceMesh>> tsfCorr = linearInterpolate(vf); - Field<Type>& sfCorr = tsfCorr.ref().internalFieldRef(); + Field<Type>& sfCorr = tsfCorr.ref().primitiveFieldRef(); const pointField& points = mesh.points(); const pointField& C = mesh.C(); diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/reverseLinear/reverseLinear.H b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/reverseLinear/reverseLinear.H index 720fd82bb2..82b47b6314 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/reverseLinear/reverseLinear.H +++ b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/reverseLinear/reverseLinear.H @@ -125,8 +125,8 @@ public: surfaceScalarField& reverseLinearWeights = treverseLinearWeights.ref(); - reverseLinearWeights.internalFieldRef() = - 1.0 - cdWeights.internalField(); + reverseLinearWeights.primitiveFieldRef() = + 1.0 - cdWeights.primitiveField(); surfaceScalarField::Boundary& rlwbf = reverseLinearWeights.boundaryFieldRef(); diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/skewCorrected/skewCorrectionVectors.C b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/skewCorrected/skewCorrectionVectors.C index bc4fe7bd67..f51f4c748d 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/schemes/skewCorrected/skewCorrectionVectors.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/schemes/skewCorrected/skewCorrectionVectors.C @@ -126,7 +126,7 @@ void Foam::skewCorrectionVectors::calcSkewCorrectionVectors() scalar skewCoeff = 0.0; - if (Sf.internalField().size()) + if (Sf.primitiveField().size()) { skewCoeff = max(mag(skewCorrectionVectors_)*mesh_.deltaCoeffs()).value(); diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolation/surfaceInterpolation.C b/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolation/surfaceInterpolation.C index c1291ace08..c0f548f9af 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolation/surfaceInterpolation.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolation/surfaceInterpolation.C @@ -169,7 +169,7 @@ void Foam::surfaceInterpolation::makeWeights() const const vectorField& Sf = mesh_.faceAreas(); // ... and reference to the internal field of the weighting factors - scalarField& w = weights.internalFieldRef(); + scalarField& w = weights.primitiveFieldRef(); forAll(owner, facei) { diff --git a/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolationScheme/surfaceInterpolationScheme.C b/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolationScheme/surfaceInterpolationScheme.C index 31e6a12273..8d7074174f 100644 --- a/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolationScheme/surfaceInterpolationScheme.C +++ b/src/finiteVolume/interpolation/surfaceInterpolation/surfaceInterpolationScheme/surfaceInterpolationScheme.C @@ -181,7 +181,7 @@ Foam::surfaceInterpolationScheme<Type>::interpolate ); GeometricField<Type, fvsPatchField, surfaceMesh>& sf = tsf.ref(); - Field<Type>& sfi = sf.internalFieldRef(); + Field<Type>& sfi = sf.primitiveFieldRef(); for (label fi=0; fi<P.size(); fi++) { @@ -274,7 +274,7 @@ Foam::surfaceInterpolationScheme<Type>::dotInterpolate ); GeometricField<RetType, fvsPatchField, surfaceMesh>& sf = tsf.ref(); - Field<RetType>& sfi = sf.internalFieldRef(); + Field<RetType>& sfi = sf.primitiveFieldRef(); const typename SFType::Internal& Sfi = Sf(); diff --git a/src/finiteVolume/interpolation/volPointInterpolation/pointConstraints.C b/src/finiteVolume/interpolation/volPointInterpolation/pointConstraints.C index 0c0b20d7c0..26c22dc349 100644 --- a/src/finiteVolume/interpolation/volPointInterpolation/pointConstraints.C +++ b/src/finiteVolume/interpolation/volPointInterpolation/pointConstraints.C @@ -378,7 +378,7 @@ void Foam::pointConstraints::constrainDisplacement syncUntransformedData ( pf.mesh()(), - pf.internalFieldRef(), + pf.primitiveFieldRef(), maxMagSqrEqOp<vector>() ); @@ -390,7 +390,7 @@ void Foam::pointConstraints::constrainDisplacement twoDPointCorrector::New(mesh()()).correctDisplacement ( mesh()().points(), - pf.internalFieldRef() + pf.primitiveFieldRef() ); if (overrideFixedValue) diff --git a/src/finiteVolume/interpolation/volPointInterpolation/pointConstraintsTemplates.C b/src/finiteVolume/interpolation/volPointInterpolation/pointConstraintsTemplates.C index 4c8eb878bd..cc515c1899 100644 --- a/src/finiteVolume/interpolation/volPointInterpolation/pointConstraintsTemplates.C +++ b/src/finiteVolume/interpolation/volPointInterpolation/pointConstraintsTemplates.C @@ -140,7 +140,7 @@ void Foam::pointConstraints::constrain syncUntransformedData ( mesh()(), - pf.internalFieldRef(), + pf.primitiveFieldRef(), maxMagSqrEqOp<Type>() ); diff --git a/src/finiteVolume/interpolation/volPointInterpolation/volPointInterpolate.C b/src/finiteVolume/interpolation/volPointInterpolation/volPointInterpolate.C index 19f28f1cb0..d318331699 100644 --- a/src/finiteVolume/interpolation/volPointInterpolation/volPointInterpolate.C +++ b/src/finiteVolume/interpolation/volPointInterpolation/volPointInterpolate.C @@ -216,7 +216,7 @@ void Foam::volPointInterpolation::interpolateBoundaryField { const primitivePatch& boundary = boundaryPtr_(); - Field<Type>& pfi = pf.internalFieldRef(); + Field<Type>& pfi = pf.primitiveFieldRef(); // Get face data in flat list tmp<Field<Type>> tboundaryVals(flatBoundaryField(vf)); diff --git a/src/fvMotionSolver/fvMotionSolvers/componentDisplacement/componentLaplacian/displacementComponentLaplacianFvMotionSolver.C b/src/fvMotionSolver/fvMotionSolvers/componentDisplacement/componentLaplacian/displacementComponentLaplacianFvMotionSolver.C index b3e8befe3c..4d8db04150 100644 --- a/src/fvMotionSolver/fvMotionSolvers/componentDisplacement/componentLaplacian/displacementComponentLaplacianFvMotionSolver.C +++ b/src/fvMotionSolver/fvMotionSolvers/componentDisplacement/componentLaplacian/displacementComponentLaplacianFvMotionSolver.C @@ -158,12 +158,12 @@ Foam::displacementComponentLaplacianFvMotionSolver::curPoints() const // Apply pointLocation_ b.c. to mesh points. - pointLocation_().internalFieldRef() = fvMesh_.points(); + pointLocation_().primitiveFieldRef() = fvMesh_.points(); - pointLocation_().internalFieldRef().replace + pointLocation_().primitiveFieldRef().replace ( cmpt_, - points0_ + pointDisplacement_.internalField() + points0_ + pointDisplacement_.primitiveField() ); pointLocation_().correctBoundaryConditions(); @@ -181,9 +181,9 @@ Foam::displacementComponentLaplacianFvMotionSolver::curPoints() const } } - twoDCorrectPoints(pointLocation_().internalFieldRef()); + twoDCorrectPoints(pointLocation_().primitiveFieldRef()); - return tmp<pointField>(pointLocation_().internalField()); + return tmp<pointField>(pointLocation_().primitiveField()); } else { @@ -193,7 +193,7 @@ Foam::displacementComponentLaplacianFvMotionSolver::curPoints() const curPoints.replace ( cmpt_, - points0_ + pointDisplacement_.internalField() + points0_ + pointDisplacement_.primitiveField() ); // Implement frozen points diff --git a/src/fvMotionSolver/fvMotionSolvers/componentVelocity/componentLaplacian/velocityComponentLaplacianFvMotionSolver.C b/src/fvMotionSolver/fvMotionSolvers/componentVelocity/componentLaplacian/velocityComponentLaplacianFvMotionSolver.C index e4df765084..16e466457a 100644 --- a/src/fvMotionSolver/fvMotionSolvers/componentVelocity/componentLaplacian/velocityComponentLaplacianFvMotionSolver.C +++ b/src/fvMotionSolver/fvMotionSolvers/componentVelocity/componentLaplacian/velocityComponentLaplacianFvMotionSolver.C @@ -105,7 +105,7 @@ Foam::velocityComponentLaplacianFvMotionSolver::curPoints() const ( cmpt_, tcurPoints().component(cmpt_) - + fvMesh_.time().deltaTValue()*pointMotionU_.internalField() + + fvMesh_.time().deltaTValue()*pointMotionU_.primitiveField() ); twoDCorrectPoints(tcurPoints.ref()); diff --git a/src/fvMotionSolver/fvMotionSolvers/displacement/SBRStress/displacementSBRStressFvMotionSolver.C b/src/fvMotionSolver/fvMotionSolvers/displacement/SBRStress/displacementSBRStressFvMotionSolver.C index 9da8e59836..b2d12efb6c 100644 --- a/src/fvMotionSolver/fvMotionSolvers/displacement/SBRStress/displacementSBRStressFvMotionSolver.C +++ b/src/fvMotionSolver/fvMotionSolvers/displacement/SBRStress/displacementSBRStressFvMotionSolver.C @@ -105,7 +105,7 @@ Foam::displacementSBRStressFvMotionSolver::curPoints() const tmp<pointField> tcurPoints ( - points0() + pointDisplacement().internalField() + points0() + pointDisplacement().primitiveField() ); twoDCorrectPoints(tcurPoints.ref()); diff --git a/src/fvMotionSolver/fvMotionSolvers/displacement/laplacian/displacementLaplacianFvMotionSolver.C b/src/fvMotionSolver/fvMotionSolvers/displacement/laplacian/displacementLaplacianFvMotionSolver.C index 853fcd1362..ccb44f877e 100644 --- a/src/fvMotionSolver/fvMotionSolvers/displacement/laplacian/displacementLaplacianFvMotionSolver.C +++ b/src/fvMotionSolver/fvMotionSolvers/displacement/laplacian/displacementLaplacianFvMotionSolver.C @@ -173,9 +173,9 @@ Foam::displacementLaplacianFvMotionSolver::curPoints() const << endl; } - pointLocation_().internalFieldRef() = + pointLocation_().primitiveFieldRef() = points0() - + pointDisplacement_.internalField(); + + pointDisplacement_.primitiveField(); pointLocation_().correctBoundaryConditions(); @@ -190,15 +190,15 @@ Foam::displacementLaplacianFvMotionSolver::curPoints() const } } - twoDCorrectPoints(pointLocation_().internalFieldRef()); + twoDCorrectPoints(pointLocation_().primitiveFieldRef()); - return tmp<pointField>(pointLocation_().internalField()); + return tmp<pointField>(pointLocation_().primitiveField()); } else { tmp<pointField> tcurPoints ( - points0() + pointDisplacement_.internalField() + points0() + pointDisplacement_.primitiveField() ); pointField& curPoints = tcurPoints.ref(); diff --git a/src/fvMotionSolver/fvMotionSolvers/displacement/layeredSolver/displacementLayeredMotionMotionSolver.C b/src/fvMotionSolver/fvMotionSolvers/displacement/layeredSolver/displacementLayeredMotionMotionSolver.C index cf2c464ae2..0f8c44b35c 100644 --- a/src/fvMotionSolver/fvMotionSolvers/displacement/layeredSolver/displacementLayeredMotionMotionSolver.C +++ b/src/fvMotionSolver/fvMotionSolvers/displacement/layeredSolver/displacementLayeredMotionMotionSolver.C @@ -512,7 +512,7 @@ Foam::displacementLayeredMotionMotionSolver::curPoints() const { tmp<pointField> tcurPoints ( - points0() + pointDisplacement_.internalField() + points0() + pointDisplacement_.primitiveField() ); return tcurPoints; diff --git a/src/fvMotionSolver/fvMotionSolvers/velocity/laplacian/velocityLaplacianFvMotionSolver.C b/src/fvMotionSolver/fvMotionSolvers/velocity/laplacian/velocityLaplacianFvMotionSolver.C index 6d7c00a259..2c14e54106 100644 --- a/src/fvMotionSolver/fvMotionSolvers/velocity/laplacian/velocityLaplacianFvMotionSolver.C +++ b/src/fvMotionSolver/fvMotionSolvers/velocity/laplacian/velocityLaplacianFvMotionSolver.C @@ -100,7 +100,7 @@ Foam::velocityLaplacianFvMotionSolver::curPoints() const tmp<pointField> tcurPoints ( fvMesh_.points() - + fvMesh_.time().deltaTValue()*pointMotionU_.internalField() + + fvMesh_.time().deltaTValue()*pointMotionU_.primitiveField() ); twoDCorrectPoints(tcurPoints.ref()); diff --git a/src/fvMotionSolver/fvPatchFields/derived/cellMotion/cellMotionFvPatchField.C b/src/fvMotionSolver/fvPatchFields/derived/cellMotion/cellMotionFvPatchField.C index 299ee35293..0ad8ad0e45 100644 --- a/src/fvMotionSolver/fvPatchFields/derived/cellMotion/cellMotionFvPatchField.C +++ b/src/fvMotionSolver/fvPatchFields/derived/cellMotion/cellMotionFvPatchField.C @@ -102,10 +102,10 @@ void Foam::cellMotionFvPatchField<Type>::updateCoeffs() const fvPatch& p = this->patch(); const polyPatch& pp = p.patch(); - const fvMesh& mesh = this->dimensionedInternalField().mesh(); + const fvMesh& mesh = this->internalField().mesh(); const pointField& points = mesh.points(); - word pfName = this->dimensionedInternalField().name(); + word pfName = this->internalField().name(); pfName.replace("cell", "point"); const GeometricField<Type, pointPatchField, pointMesh>& pointMotion = diff --git a/src/fvMotionSolver/motionDiffusivity/inverseDistance/inverseDistanceDiffusivity.C b/src/fvMotionSolver/motionDiffusivity/inverseDistance/inverseDistanceDiffusivity.C index 30e3d68e0d..273e91e5de 100644 --- a/src/fvMotionSolver/motionDiffusivity/inverseDistance/inverseDistanceDiffusivity.C +++ b/src/fvMotionSolver/motionDiffusivity/inverseDistance/inverseDistanceDiffusivity.C @@ -100,7 +100,7 @@ void Foam::inverseDistanceDiffusivity::correct() dimless, zeroGradientFvPatchScalarField::typeName ); - y_.internalFieldRef() = y(); + y_.primitiveFieldRef() = y(); y_.correctBoundaryConditions(); faceDiffusivity_ = 1.0/fvc::interpolate(y_); diff --git a/src/fvMotionSolver/motionDiffusivity/inverseVolume/inverseVolumeDiffusivity.C b/src/fvMotionSolver/motionDiffusivity/inverseVolume/inverseVolumeDiffusivity.C index aac4df7009..0683d8bcd8 100644 --- a/src/fvMotionSolver/motionDiffusivity/inverseVolume/inverseVolumeDiffusivity.C +++ b/src/fvMotionSolver/motionDiffusivity/inverseVolume/inverseVolumeDiffusivity.C @@ -85,7 +85,7 @@ void Foam::inverseVolumeDiffusivity::correct() zeroGradientFvPatchScalarField::typeName ); - V.internalFieldRef() = mesh().V(); + V.primitiveFieldRef() = mesh().V(); V.correctBoundaryConditions(); faceDiffusivity_ = 1.0/fvc::interpolate(V); diff --git a/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingDisplacement/angularOscillatingDisplacementPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingDisplacement/angularOscillatingDisplacementPointPatchVectorField.C index c30708bf17..e19f500b16 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingDisplacement/angularOscillatingDisplacementPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingDisplacement/angularOscillatingDisplacementPointPatchVectorField.C @@ -155,7 +155,7 @@ void angularOscillatingDisplacementPointPatchVectorField::updateCoeffs() return; } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); scalar angle = angle0_ + amplitude_*sin(omega_*t.value()); diff --git a/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingVelocity/angularOscillatingVelocityPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingVelocity/angularOscillatingVelocityPointPatchVectorField.C index 607189f57e..5932d8402c 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingVelocity/angularOscillatingVelocityPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/angularOscillatingVelocity/angularOscillatingVelocityPointPatchVectorField.C @@ -155,7 +155,7 @@ void angularOscillatingVelocityPointPatchVectorField::updateCoeffs() return; } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); const pointPatch& p = this->patch(); diff --git a/src/fvMotionSolver/pointPatchFields/derived/oscillatingDisplacement/oscillatingDisplacementPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/oscillatingDisplacement/oscillatingDisplacementPointPatchVectorField.C index 50c25c9977..9e36b8cefb 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/oscillatingDisplacement/oscillatingDisplacementPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/oscillatingDisplacement/oscillatingDisplacementPointPatchVectorField.C @@ -105,7 +105,7 @@ void oscillatingDisplacementPointPatchVectorField::updateCoeffs() return; } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); Field<vector>::operator=(amplitude_*sin(omega_*t.value())); diff --git a/src/fvMotionSolver/pointPatchFields/derived/oscillatingVelocity/oscillatingVelocityPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/oscillatingVelocity/oscillatingVelocityPointPatchVectorField.C index fdc13505bf..f75b568eca 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/oscillatingVelocity/oscillatingVelocityPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/oscillatingVelocity/oscillatingVelocityPointPatchVectorField.C @@ -143,7 +143,7 @@ void oscillatingVelocityPointPatchVectorField::updateCoeffs() return; } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); const pointPatch& p = this->patch(); diff --git a/src/fvMotionSolver/pointPatchFields/derived/surfaceSlipDisplacement/surfaceSlipDisplacementPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/surfaceSlipDisplacement/surfaceSlipDisplacementPointPatchVectorField.C index 68cbdf0458..82b530d305 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/surfaceSlipDisplacement/surfaceSlipDisplacementPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/surfaceSlipDisplacement/surfaceSlipDisplacementPointPatchVectorField.C @@ -419,7 +419,7 @@ void surfaceSlipDisplacementPointPatchVectorField::evaluate calcProjection(displacement); // Get internal field to insert values into - Field<vector>& iF = const_cast<Field<vector>&>(this->internalField()); + Field<vector>& iF = const_cast<Field<vector>&>(this->primitiveField()); //setInInternalField(iF, motionU); setInInternalField(iF, displacement); diff --git a/src/fvMotionSolver/pointPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValuePointPatchField.C b/src/fvMotionSolver/pointPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValuePointPatchField.C index 6223cdb13c..5fdac87571 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValuePointPatchField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/timeVaryingMappedFixedValue/timeVaryingMappedFixedValuePointPatchField.C @@ -600,7 +600,7 @@ void Foam::timeVaryingMappedFixedValuePointPatchField<Type>::write os.writeKeyword("perturb") << perturb_ << token::END_STATEMENT << nl; } - if (fieldTableName_ != this->dimensionedInternalField().name()) + if (fieldTableName_ != this->internalField().name()) { os.writeKeyword("fieldTableName") << fieldTableName_ << token::END_STATEMENT << nl; diff --git a/src/fvMotionSolver/pointPatchFields/derived/uniformInterpolatedDisplacement/uniformInterpolatedDisplacementPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/uniformInterpolatedDisplacement/uniformInterpolatedDisplacementPointPatchVectorField.C index 4a1c4ec654..deb36c716c 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/uniformInterpolatedDisplacement/uniformInterpolatedDisplacementPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/uniformInterpolatedDisplacement/uniformInterpolatedDisplacementPointPatchVectorField.C @@ -62,7 +62,7 @@ uniformInterpolatedDisplacementPointPatchVectorField fieldName_(dict.lookup("fieldName")), interpolationScheme_(dict.lookup("interpolationScheme")) { - const pointMesh& pMesh = this->dimensionedInternalField().mesh(); + const pointMesh& pMesh = this->internalField().mesh(); // Read time values instantList allTimes = Time::findTimes(pMesh().time().path()); @@ -161,7 +161,7 @@ void uniformInterpolatedDisplacementPointPatchVectorField::updateCoeffs() ); } - const pointMesh& pMesh = this->dimensionedInternalField().mesh(); + const pointMesh& pMesh = this->internalField().mesh(); const Time& t = pMesh().time(); // Update indices of times and weights @@ -232,7 +232,7 @@ void uniformInterpolatedDisplacementPointPatchVectorField::updateCoeffs() IOobject ( word("uniformInterpolate(") - + this->dimensionedInternalField().name() + + this->internalField().name() + ')', pMesh.time().timeName(), pMesh.thisDb(), diff --git a/src/fvMotionSolver/pointPatchFields/derived/waveDisplacement/waveDisplacementPointPatchVectorField.C b/src/fvMotionSolver/pointPatchFields/derived/waveDisplacement/waveDisplacementPointPatchVectorField.C index 51d6921ef5..34976e9827 100644 --- a/src/fvMotionSolver/pointPatchFields/derived/waveDisplacement/waveDisplacementPointPatchVectorField.C +++ b/src/fvMotionSolver/pointPatchFields/derived/waveDisplacement/waveDisplacementPointPatchVectorField.C @@ -104,7 +104,7 @@ void Foam::waveDisplacementPointPatchVectorField::updateCoeffs() return; } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); const scalarField points( waveNumber_ & patch().localPoints()); diff --git a/src/fvOptions/corrections/limitTemperature/limitTemperature.C b/src/fvOptions/corrections/limitTemperature/limitTemperature.C index af7cbb409c..89277cd116 100644 --- a/src/fvOptions/corrections/limitTemperature/limitTemperature.C +++ b/src/fvOptions/corrections/limitTemperature/limitTemperature.C @@ -84,7 +84,7 @@ void Foam::fv::limitTemperature::correct(volScalarField& he) scalarField heMin(thermo.he(thermo.p(), Tmin, cells_)); scalarField heMax(thermo.he(thermo.p(), Tmax, cells_)); - scalarField& hec = he.internalFieldRef(); + scalarField& hec = he.primitiveFieldRef(); forAll(cells_, i) { diff --git a/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSource.C b/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSource.C index a57a6c947f..33757db420 100644 --- a/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSource.C +++ b/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSource.C @@ -250,7 +250,7 @@ void Foam::fv::rotorDiskSource::setFaceArea(vector& axis, const bool correct) mesh_, dimensionedScalar("0", dimArea, 0) ); - UIndirectList<scalar>(area.internalField(), cells_) = area_; + UIndirectList<scalar>(area.primitiveField(), cells_) = area_; Info<< type() << ": " << name_ << " writing field " << area.name() << endl; @@ -448,7 +448,7 @@ Foam::tmp<Foam::vectorField> Foam::fv::rotorDiskSource::inflowVelocity } case ifLocal: { - return U.internalField(); + return U.primitiveField(); break; } diff --git a/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSourceTemplates.C b/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSourceTemplates.C index 2dcbbb003a..c60b60b530 100644 --- a/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSourceTemplates.C +++ b/src/fvOptions/sources/derived/rotorDiskSource/rotorDiskSourceTemplates.C @@ -186,7 +186,7 @@ void Foam::fv::rotorDiskSource::writeField ) ); - Field<Type>& field = tfield.ref().internalFieldRef(); + Field<Type>& field = tfield.ref().primitiveFieldRef(); if (cells_.size() != values.size()) { diff --git a/src/fvOptions/sources/interRegion/interRegionExplicitPorositySource/interRegionExplicitPorositySource.C b/src/fvOptions/sources/interRegion/interRegionExplicitPorositySource/interRegionExplicitPorositySource.C index 41f13fcf58..98a6bcb9e0 100644 --- a/src/fvOptions/sources/interRegion/interRegionExplicitPorositySource/interRegionExplicitPorositySource.C +++ b/src/fvOptions/sources/interRegion/interRegionExplicitPorositySource/interRegionExplicitPorositySource.C @@ -160,9 +160,9 @@ void Foam::fv::interRegionExplicitPorositySource::addSup // Map local velocity onto neighbour region meshInterp().mapSrcToTgt ( - U.internalField(), + U.primitiveField(), plusEqOp<vector>(), - UNbr.internalFieldRef() + UNbr.primitiveFieldRef() ); fvMatrix<vector> nbrEqn(UNbr, eqn.dimensions()); @@ -214,9 +214,9 @@ void Foam::fv::interRegionExplicitPorositySource::addSup // Map local velocity onto neighbour region meshInterp().mapSrcToTgt ( - U.internalField(), + U.primitiveField(), plusEqOp<vector>(), - UNbr.internalFieldRef() + UNbr.primitiveFieldRef() ); fvMatrix<vector> nbrEqn(UNbr, eqn.dimensions()); @@ -255,17 +255,17 @@ void Foam::fv::interRegionExplicitPorositySource::addSup // Map local rho onto neighbour region meshInterp().mapSrcToTgt ( - rho.internalField(), + rho.primitiveField(), plusEqOp<scalar>(), - rhoNbr.internalFieldRef() + rhoNbr.primitiveFieldRef() ); // Map local mu onto neighbour region meshInterp().mapSrcToTgt ( - mu.internalField(), + mu.primitiveField(), plusEqOp<scalar>(), - muNbr.internalFieldRef() + muNbr.primitiveFieldRef() ); porosityPtr_->addResistance(nbrEqn, rhoNbr, muNbr); diff --git a/src/fvOptions/sources/interRegion/interRegionHeatTransfer/interRegionHeatTransferModel/interRegionHeatTransferModel.C b/src/fvOptions/sources/interRegion/interRegionHeatTransfer/interRegionHeatTransferModel/interRegionHeatTransferModel.C index fe4c425565..c838f42e20 100644 --- a/src/fvOptions/sources/interRegion/interRegionHeatTransfer/interRegionHeatTransferModel/interRegionHeatTransferModel.C +++ b/src/fvOptions/sources/interRegion/interRegionHeatTransfer/interRegionHeatTransferModel/interRegionHeatTransferModel.C @@ -201,7 +201,7 @@ void Foam::fv::interRegionHeatTransferModel::addSup const volScalarField& Tnbr = nbrMesh.lookupObject<volScalarField>(TNbrName_); - interpolate(Tnbr, Tmapped.internalFieldRef()); + interpolate(Tnbr, Tmapped.primitiveFieldRef()); if (debug) { diff --git a/src/fvOptions/sources/interRegion/interRegionHeatTransfer/tabulatedHeatTransfer/tabulatedHeatTransfer.C b/src/fvOptions/sources/interRegion/interRegionHeatTransfer/tabulatedHeatTransfer/tabulatedHeatTransfer.C index e97e6bcd22..f7a1c4a83c 100644 --- a/src/fvOptions/sources/interRegion/interRegionHeatTransfer/tabulatedHeatTransfer/tabulatedHeatTransfer.C +++ b/src/fvOptions/sources/interRegion/interRegionHeatTransfer/tabulatedHeatTransfer/tabulatedHeatTransfer.C @@ -122,7 +122,7 @@ void Foam::fv::tabulatedHeatTransfer::calculateHtc() const volVectorField& U = mesh_.lookupObject<volVectorField>(UName_); - scalarField& htcc = htc_.internalFieldRef(); + scalarField& htcc = htc_.primitiveFieldRef(); forAll(htcc, i) { diff --git a/src/fvOptions/sources/interRegion/interRegionHeatTransfer/variableHeatTransfer/variableHeatTransfer.C b/src/fvOptions/sources/interRegion/interRegionHeatTransfer/variableHeatTransfer/variableHeatTransfer.C index 4f78964ed4..c137c581ee 100644 --- a/src/fvOptions/sources/interRegion/interRegionHeatTransfer/variableHeatTransfer/variableHeatTransfer.C +++ b/src/fvOptions/sources/interRegion/interRegionHeatTransfer/variableHeatTransfer/variableHeatTransfer.C @@ -122,7 +122,7 @@ void Foam::fv::variableHeatTransfer::calculateHtc() const scalarField htcNbrMapped(interpolate(htcNbr)); - htc_.internalFieldRef() = htcNbrMapped*AoV_; + htc_.primitiveFieldRef() = htcNbrMapped*AoV_; } diff --git a/src/genericPatchFields/genericFvPatchField/genericFvPatchField.C b/src/genericPatchFields/genericFvPatchField/genericFvPatchField.C index 374aa5eac6..75cba4fb68 100644 --- a/src/genericPatchFields/genericFvPatchField/genericFvPatchField.C +++ b/src/genericPatchFields/genericFvPatchField/genericFvPatchField.C @@ -40,7 +40,7 @@ Foam::genericFvPatchField<Type>::genericFvPatchField FatalErrorInFunction << "Trying to construct an genericFvPatchField on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() + << " of field " << this->internalField().name() << abort(FatalError); } @@ -64,8 +64,8 @@ Foam::genericFvPatchField<Type>::genericFvPatchField dict ) << "\n Cannot find 'value' entry" << " on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << nl << " which is required to set the" " values of the generic patch field." << nl @@ -121,9 +121,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField "is not a compound" << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } } @@ -153,9 +153,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -187,9 +187,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -224,9 +224,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -261,9 +261,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -295,9 +295,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -312,9 +312,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField << " not supported" << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } } @@ -398,9 +398,9 @@ Foam::genericFvPatchField<Type>::genericFvPatchField ) << "\n unrecognised native type " << l << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } } @@ -698,8 +698,8 @@ Foam::genericFvPatchField<Type>::valueInternalCoeffs << "cannot be called for a genericFvPatchField" " (actual type " << actualTypeName_ << ")" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "generic boundary condition." << abort(FatalError); @@ -719,8 +719,8 @@ Foam::genericFvPatchField<Type>::valueBoundaryCoeffs << "cannot be called for a genericFvPatchField" " (actual type " << actualTypeName_ << ")" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "generic boundary condition." << abort(FatalError); @@ -737,8 +737,8 @@ Foam::genericFvPatchField<Type>::gradientInternalCoeffs() const << "cannot be called for a genericFvPatchField" " (actual type " << actualTypeName_ << ")" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "generic boundary condition." << abort(FatalError); @@ -754,8 +754,8 @@ Foam::genericFvPatchField<Type>::gradientBoundaryCoeffs() const << "cannot be called for a genericFvPatchField" " (actual type " << actualTypeName_ << ")" << "\n on patch " << this->patch().name() - << " of field " << this->dimensionedInternalField().name() - << " in file " << this->dimensionedInternalField().objectPath() + << " of field " << this->internalField().name() + << " in file " << this->internalField().objectPath() << "\n You are probably trying to solve for a field with a " "generic boundary condition." << abort(FatalError); diff --git a/src/genericPatchFields/genericPointPatchField/genericPointPatchField.C b/src/genericPatchFields/genericPointPatchField/genericPointPatchField.C index 8f4970855f..07472e503d 100644 --- a/src/genericPatchFields/genericPointPatchField/genericPointPatchField.C +++ b/src/genericPatchFields/genericPointPatchField/genericPointPatchField.C @@ -99,9 +99,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField "is not a compound" << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } } @@ -131,9 +131,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -165,9 +165,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -202,9 +202,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -239,9 +239,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -273,9 +273,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField << this->size() << ')' << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } @@ -290,9 +290,9 @@ Foam::genericPointPatchField<Type>::genericPointPatchField << " not supported" << "\n on patch " << this->patch().name() << " of field " - << this->dimensionedInternalField().name() + << this->internalField().name() << " in file " - << this->dimensionedInternalField().objectPath() + << this->internalField().objectPath() << exit(FatalIOError); } } diff --git a/src/lagrangian/DSMC/clouds/Templates/DSMCCloud/DSMCCloud.C b/src/lagrangian/DSMC/clouds/Templates/DSMCCloud/DSMCCloud.C index 991e027256..02a900a722 100644 --- a/src/lagrangian/DSMC/clouds/Templates/DSMCCloud/DSMCCloud.C +++ b/src/lagrangian/DSMC/clouds/Templates/DSMCCloud/DSMCCloud.C @@ -202,7 +202,7 @@ void Foam::DSMCCloud<ParcelType>::initialise mostAbundantType ); - sigmaTcRMax_.internalFieldRef() = cP.sigmaT()*maxwellianMostProbableSpeed + sigmaTcRMax_.primitiveFieldRef() = cP.sigmaT()*maxwellianMostProbableSpeed ( temperature, cP.mass() @@ -414,13 +414,13 @@ void Foam::DSMCCloud<ParcelType>::resetFields() template<class ParcelType> void Foam::DSMCCloud<ParcelType>::calculateFields() { - scalarField& rhoN = rhoN_.internalFieldRef(); - scalarField& rhoM = rhoM_.internalFieldRef(); - scalarField& dsmcRhoN = dsmcRhoN_.internalFieldRef(); - scalarField& linearKE = linearKE_.internalFieldRef(); - scalarField& internalE = internalE_.internalFieldRef(); - scalarField& iDof = iDof_.internalFieldRef(); - vectorField& momentum = momentum_.internalFieldRef(); + scalarField& rhoN = rhoN_.primitiveFieldRef(); + scalarField& rhoM = rhoM_.primitiveFieldRef(); + scalarField& dsmcRhoN = dsmcRhoN_.primitiveFieldRef(); + scalarField& linearKE = linearKE_.primitiveFieldRef(); + scalarField& internalE = internalE_.primitiveFieldRef(); + scalarField& iDof = iDof_.primitiveFieldRef(); + vectorField& momentum = momentum_.primitiveFieldRef(); forAllConstIter(typename DSMCCloud<ParcelType>, *this, iter) { diff --git a/src/lagrangian/intermediate/clouds/Templates/KinematicCloud/KinematicCloudI.H b/src/lagrangian/intermediate/clouds/Templates/KinematicCloud/KinematicCloudI.H index b0a3803727..37a1a43d17 100644 --- a/src/lagrangian/intermediate/clouds/Templates/KinematicCloud/KinematicCloudI.H +++ b/src/lagrangian/intermediate/clouds/Templates/KinematicCloud/KinematicCloudI.H @@ -483,7 +483,7 @@ Foam::KinematicCloud<CloudType>::vDotSweep() const vDotSweep[celli] += p.nParticle()*p.areaP()*mag(p.U() - U_[celli]); } - vDotSweep.internalFieldRef() /= mesh_.V(); + vDotSweep.primitiveFieldRef() /= mesh_.V(); vDotSweep.correctBoundaryConditions(); return tvDotSweep; @@ -522,7 +522,7 @@ Foam::KinematicCloud<CloudType>::theta() const theta[celli] += p.nParticle()*p.volume(); } - theta.internalFieldRef() /= mesh_.V(); + theta.primitiveFieldRef() /= mesh_.V(); theta.correctBoundaryConditions(); return ttheta; @@ -551,7 +551,7 @@ Foam::KinematicCloud<CloudType>::alpha() const ) ); - scalarField& alpha = talpha.ref().internalFieldRef(); + scalarField& alpha = talpha.ref().primitiveFieldRef(); forAllConstIter(typename KinematicCloud<CloudType>, *this, iter) { const parcelType& p = iter(); @@ -588,7 +588,7 @@ Foam::KinematicCloud<CloudType>::rhoEff() const ) ); - scalarField& rhoEff = trhoEff.ref().internalFieldRef(); + scalarField& rhoEff = trhoEff.ref().primitiveFieldRef(); forAllConstIter(typename KinematicCloud<CloudType>, *this, iter) { const parcelType& p = iter(); diff --git a/src/lagrangian/intermediate/clouds/Templates/MPPICCloud/MPPICCloud.C b/src/lagrangian/intermediate/clouds/Templates/MPPICCloud/MPPICCloud.C index ccf53ffe12..702d2454b8 100644 --- a/src/lagrangian/intermediate/clouds/Templates/MPPICCloud/MPPICCloud.C +++ b/src/lagrangian/intermediate/clouds/Templates/MPPICCloud/MPPICCloud.C @@ -263,8 +263,8 @@ void Foam::MPPICCloud<CloudType>::info() tmp<volScalarField> alpha = this->theta(); - const scalar alphaMin = gMin(alpha().internalField()); - const scalar alphaMax = gMax(alpha().internalField()); + const scalar alphaMin = gMin(alpha().primitiveField()); + const scalar alphaMax = gMax(alpha().primitiveField()); Info<< " Min cell volume fraction = " << alphaMin << endl; Info<< " Max cell volume fraction = " << alphaMax << endl; diff --git a/src/lagrangian/intermediate/clouds/Templates/ReactingCloud/ReactingCloudI.H b/src/lagrangian/intermediate/clouds/Templates/ReactingCloud/ReactingCloudI.H index 141a8d4515..73d8565849 100644 --- a/src/lagrangian/intermediate/clouds/Templates/ReactingCloud/ReactingCloudI.H +++ b/src/lagrangian/intermediate/clouds/Templates/ReactingCloud/ReactingCloudI.H @@ -129,7 +129,7 @@ inline Foam::tmp<Foam::fvScalarMatrix> Foam::ReactingCloud<CloudType>::SYi volScalarField& sourceField = trhoTrans.ref(); - sourceField.internalFieldRef() = + sourceField.primitiveFieldRef() = rhoTrans_[i]/(this->db().time().deltaTValue()*this->mesh().V()); const dimensionedScalar YiSMALL("YiSMALL", dimless, SMALL); diff --git a/src/lagrangian/intermediate/clouds/Templates/ThermoCloud/ThermoCloudI.H b/src/lagrangian/intermediate/clouds/Templates/ThermoCloud/ThermoCloudI.H index a3859eeb2a..46187ebad7 100644 --- a/src/lagrangian/intermediate/clouds/Templates/ThermoCloud/ThermoCloudI.H +++ b/src/lagrangian/intermediate/clouds/Templates/ThermoCloud/ThermoCloudI.H @@ -282,7 +282,7 @@ inline Foam::tmp<Foam::volScalarField> Foam::ThermoCloud<CloudType>::Ep() const if (radiation_) { - scalarField& Ep = tEp.ref().internalFieldRef(); + scalarField& Ep = tEp.ref().primitiveFieldRef(); const scalar dt = this->db().time().deltaTValue(); const scalarField& V = this->mesh().V(); const scalar epsilon = constProps_.epsilon0(); @@ -318,7 +318,7 @@ inline Foam::tmp<Foam::volScalarField> Foam::ThermoCloud<CloudType>::ap() const if (radiation_) { - scalarField& ap = tap.ref().internalFieldRef(); + scalarField& ap = tap.ref().primitiveFieldRef(); const scalar dt = this->db().time().deltaTValue(); const scalarField& V = this->mesh().V(); const scalar epsilon = constProps_.epsilon0(); @@ -355,7 +355,7 @@ Foam::ThermoCloud<CloudType>::sigmap() const if (radiation_) { - scalarField& sigmap = tsigmap.ref().internalFieldRef(); + scalarField& sigmap = tsigmap.ref().primitiveFieldRef(); const scalar dt = this->db().time().deltaTValue(); const scalarField& V = this->mesh().V(); const scalar epsilon = constProps_.epsilon0(); diff --git a/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleErosion/ParticleErosion.C b/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleErosion/ParticleErosion.C index 25f526ae82..8255e89428 100644 --- a/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleErosion/ParticleErosion.C +++ b/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleErosion/ParticleErosion.C @@ -131,7 +131,7 @@ void Foam::ParticleErosion<CloudType>::preEvolve() { if (QPtr_.valid()) { - QPtr_->internalFieldRef() = 0.0; + QPtr_->primitiveFieldRef() = 0.0; } else { diff --git a/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleTrap/ParticleTrap.C b/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleTrap/ParticleTrap.C index cb615dacaf..4062fb7aae 100644 --- a/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleTrap/ParticleTrap.C +++ b/src/lagrangian/intermediate/submodels/CloudFunctionObjects/ParticleTrap/ParticleTrap.C @@ -110,7 +110,7 @@ void Foam::ParticleTrap<CloudType>::postMove bool& ) { - if (alphaPtr_->internalField()[celli] < threshold_) + if (alphaPtr_->primitiveField()[celli] < threshold_) { const vector& gradAlpha = gradAlphaPtr_()[celli]; vector nHat = gradAlpha/mag(gradAlpha); diff --git a/src/lagrangian/intermediate/submodels/CloudFunctionObjects/VoidFraction/VoidFraction.C b/src/lagrangian/intermediate/submodels/CloudFunctionObjects/VoidFraction/VoidFraction.C index 9108677236..dcc5129cfd 100644 --- a/src/lagrangian/intermediate/submodels/CloudFunctionObjects/VoidFraction/VoidFraction.C +++ b/src/lagrangian/intermediate/submodels/CloudFunctionObjects/VoidFraction/VoidFraction.C @@ -82,7 +82,7 @@ void Foam::VoidFraction<CloudType>::preEvolve() { if (thetaPtr_.valid()) { - thetaPtr_->internalFieldRef() = 0.0; + thetaPtr_->primitiveFieldRef() = 0.0; } else { @@ -115,7 +115,7 @@ void Foam::VoidFraction<CloudType>::postEvolve() const fvMesh& mesh = this->owner().mesh(); - theta.internalFieldRef() /= mesh.time().deltaTValue()*mesh.V(); + theta.primitiveFieldRef() /= mesh.time().deltaTValue()*mesh.V(); CloudFunctionObject<CloudType>::postEvolve(); } diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.C b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.C index a1b8ae028e..80ba549d97 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.C +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.C @@ -231,10 +231,10 @@ bool Foam::AveragingMethod<Type>::write() const } // average - cellValue.internalFieldRef() /= mesh_.V(); - cellGrad.internalFieldRef() /= mesh_.V(); - pointValue.internalFieldRef() /= pointVolume; - pointGrad.internalFieldRef() /= pointVolume; + cellValue.primitiveFieldRef() /= mesh_.V(); + cellGrad.primitiveFieldRef() /= mesh_.V(); + pointValue.primitiveFieldRef() /= pointVolume; + pointGrad.primitiveFieldRef() /= pointVolume; // write if (!cellValue.write()) return false; diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.H b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.H index dacaa9f644..42e8ce7ccb 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.H +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/AveragingMethod/AveragingMethod.H @@ -164,7 +164,7 @@ public: virtual bool write() const; //- Return an internal field of the average - virtual tmp<Field<Type>> internalField() const = 0; + virtual tmp<Field<Type>> primitiveField() const = 0; //- Assign to another average inline void operator=(const AveragingMethod<Type>& x); diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.C b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.C index 126181accf..51dfe78ac6 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.C +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.C @@ -80,9 +80,9 @@ void Foam::AveragingMethods::Basic<Type>::updateGrad() dimensioned<Type>("zero", dimless, Zero), zeroGradientFvPatchField<Type>::typeName ); - tempData.internalFieldRef() = data_; + tempData.primitiveFieldRef() = data_; tempData.correctBoundaryConditions(); - dataGrad_ = fvc::grad(tempData)->internalField(); + dataGrad_ = fvc::grad(tempData)->primitiveField(); } @@ -125,7 +125,7 @@ Foam::AveragingMethods::Basic<Type>::interpolateGrad template<class Type> Foam::tmp<Foam::Field<Type>> -Foam::AveragingMethods::Basic<Type>::internalField() const +Foam::AveragingMethods::Basic<Type>::primitiveField() const { return tmp<Field<Type>>(data_); } diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.H b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.H index 4696b33641..7c13d475e3 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.H +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Basic/Basic.H @@ -145,7 +145,7 @@ public: ) const; //- Return an internal field of the average - tmp<Field<Type>> internalField() const; + tmp<Field<Type>> primitiveField() const; //- Return an internal field of the gradient tmp<Field<TypeGrad>> internalFieldGrad() const; diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.C b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.C index 6277ce3790..6fefd0410b 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.C +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.C @@ -244,7 +244,7 @@ void Foam::AveragingMethods::Dual<Type>::average template<class Type> Foam::tmp<Foam::Field<Type>> -Foam::AveragingMethods::Dual<Type>::internalField() const +Foam::AveragingMethods::Dual<Type>::primitiveField() const { return tmp<Field<Type>>(dataCell_); } diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.H b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.H index f7d52bd3e1..c9cc862dd4 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.H +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Dual/Dual.H @@ -178,7 +178,7 @@ public: void average(const AveragingMethod<scalar>& weight); //- Return an internal field of the average - tmp<Field<Type>> internalField() const; + tmp<Field<Type>> primitiveField() const; //- Return an internal field of the gradient tmp<Field<TypeGrad>> internalFieldGrad() const; diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.C b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.C index 34b52197d1..ba27159e9e 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.C +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.C @@ -198,7 +198,7 @@ Foam::AveragingMethods::Moment<Type>::interpolateGrad template<class Type> Foam::tmp<Foam::Field<Type>> -Foam::AveragingMethods::Moment<Type>::internalField() const +Foam::AveragingMethods::Moment<Type>::primitiveField() const { return tmp<Field<Type>>(data_); } diff --git a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.H b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.H index cc62a5e5c3..8bda35212b 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.H +++ b/src/lagrangian/intermediate/submodels/MPPIC/AveragingMethods/Moment/Moment.H @@ -158,7 +158,7 @@ public: ) const; //- Return an internal field of the average - tmp<Field<Type>> internalField() const; + tmp<Field<Type>> primitiveField() const; //- Return an internal field of the gradient tmp<Field<TypeGrad>> internalFieldGrad() const; diff --git a/src/lagrangian/intermediate/submodels/MPPIC/PackingModels/Implicit/Implicit.C b/src/lagrangian/intermediate/submodels/MPPIC/PackingModels/Implicit/Implicit.C index f95fc10f0f..868d70d609 100644 --- a/src/lagrangian/intermediate/submodels/MPPIC/PackingModels/Implicit/Implicit.C +++ b/src/lagrangian/intermediate/submodels/MPPIC/PackingModels/Implicit/Implicit.C @@ -150,7 +150,7 @@ void Foam::PackingModels::Implicit<CloudType>::cacheFields(const bool store) dimensionedScalar("zero", dimDensity, 0), zeroGradientFvPatchField<scalar>::typeName ); - rho.internalFieldRef() = max(rhoAverage.internalField(), rhoMin_); + rho.primitiveFieldRef() = max(rhoAverage.primitiveField(), rhoMin_); rho.correctBoundaryConditions(); // Stress field @@ -172,12 +172,12 @@ void Foam::PackingModels::Implicit<CloudType>::cacheFields(const bool store) zeroGradientFvPatchField<scalar>::typeName ); - tauPrime.internalFieldRef() = + tauPrime.primitiveFieldRef() = this->particleStressModel_->dTaudTheta ( - alpha_.internalField(), - rho.internalField(), - uSqrAverage.internalField() + alpha_.primitiveField(), + rho.primitiveField(), + uSqrAverage.primitiveField() )(); tauPrime.correctBoundaryConditions(); @@ -256,7 +256,7 @@ void Foam::PackingModels::Implicit<CloudType>::cacheFields(const bool store) dimensionedVector("zero", dimVelocity, Zero), fixedValueFvPatchField<vector>::typeName ); - U.internalFieldRef() = uAverage.internalField(); + U.primitiveFieldRef() = uAverage.primitiveField(); U.correctBoundaryConditions(); surfaceScalarField phi @@ -313,9 +313,9 @@ void Foam::PackingModels::Implicit<CloudType>::cacheFields(const bool store) uCorrect_->correctBoundaryConditions(); //Info << endl; - //Info << " alpha: " << alpha_.internalField() << endl; - //Info << "phiCorrect: " << phiCorrect_->internalField() << endl; - //Info << " uCorrect: " << uCorrect_->internalField() << endl; + //Info << " alpha: " << alpha_.primitiveField() << endl; + //Info << "phiCorrect: " << phiCorrect_->primitiveField() << endl; + //Info << " uCorrect: " << uCorrect_->primitiveField() << endl; //Info << endl; } else diff --git a/src/lagrangian/molecularDynamics/molecule/mdTools/averageMDFields.H b/src/lagrangian/molecularDynamics/molecule/mdTools/averageMDFields.H index 457a6ed864..61669d69d5 100644 --- a/src/lagrangian/molecularDynamics/molecule/mdTools/averageMDFields.H +++ b/src/lagrangian/molecularDynamics/molecule/mdTools/averageMDFields.H @@ -8,15 +8,15 @@ if (runTime.outputTime()) forAll(allSpeciesRhoN, rN) { - allSpeciesRhoN[rN].internalFieldRef() = + allSpeciesRhoN[rN].primitiveFieldRef() = allSpeciesN_RU[rN] /mesh.cellVolumes() /nAveragingSteps; - totalRhoN_sum += allSpeciesRhoN[rN].internalField(); + totalRhoN_sum += allSpeciesRhoN[rN].primitiveField(); } - totalRhoN.internalFieldRef() = totalRhoN_sum; + totalRhoN.primitiveFieldRef() = totalRhoN_sum; /*-----------------------------------------------------------------------*\ @@ -27,15 +27,15 @@ if (runTime.outputTime()) forAll(allSpeciesRhoM, rM) { - allSpeciesRhoM[rM].internalFieldRef() = + allSpeciesRhoM[rM].primitiveFieldRef() = allSpeciesM_RU[rM] /mesh.cellVolumes() /nAveragingSteps; - totalRhoM_sum += allSpeciesRhoM[rM].internalField(); + totalRhoM_sum += allSpeciesRhoM[rM].primitiveField(); } - totalRhoM.internalFieldRef() = totalRhoM_sum; + totalRhoM.primitiveFieldRef() = totalRhoM_sum; /*-----------------------------------------------------------------------*\ Bulk velocity @@ -51,7 +51,7 @@ if (runTime.outputTime()) vectorField& singleSpeciesVelocity ( - allSpeciesVelocity[v].internalField() + allSpeciesVelocity[v].primitiveField() ); forAll(singleSpeciesVelocity, sSV) @@ -104,7 +104,7 @@ if (runTime.outputTime()) scalarField& singleSpeciesTemp ( - allSpeciesTemperature[t].internalField() + allSpeciesTemperature[t].primitiveField() ); forAll(singleSpeciesTemp, sST) @@ -178,7 +178,7 @@ if (runTime.outputTime()) scalarField& singleSpeciesMeanKE ( - allSpeciesMeanKE[mKE].internalField() + allSpeciesMeanKE[mKE].primitiveField() ); forAll(singleSpeciesMeanKE, sSMKE) diff --git a/src/lagrangian/molecularDynamics/molecule/mdTools/createMDFields.H b/src/lagrangian/molecularDynamics/molecule/mdTools/createMDFields.H index d999d28cda..590d7494fe 100644 --- a/src/lagrangian/molecularDynamics/molecule/mdTools/createMDFields.H +++ b/src/lagrangian/molecularDynamics/molecule/mdTools/createMDFields.H @@ -60,7 +60,7 @@ forAll(allSpeciesRhoN, rN) "zeroGradient" ) ); - allSpeciesRhoN[rN].internalFieldRef() = 0; + allSpeciesRhoN[rN].primitiveFieldRef() = 0; allSpeciesRhoN[rN].correctBoundaryConditions(); } @@ -80,7 +80,7 @@ volScalarField totalRhoN dimless/dimVolume, "zeroGradient" ); -totalRhoN.internalFieldRef() = 0; +totalRhoN.primitiveFieldRef() = 0; totalRhoN.correctBoundaryConditions(); /*---------------------------------------------------------------------------*\ @@ -115,7 +115,7 @@ forAll(allSpeciesRhoM, rM) "zeroGradient" ) ); - allSpeciesRhoM[rM].internalFieldRef() = 0; + allSpeciesRhoM[rM].primitiveFieldRef() = 0; allSpeciesRhoM[rM].correctBoundaryConditions(); } @@ -135,7 +135,7 @@ volScalarField totalRhoM dimMass/dimVolume, "zeroGradient" ); -totalRhoM.internalFieldRef() = 0; +totalRhoM.primitiveFieldRef() = 0; totalRhoM.correctBoundaryConditions(); /*---------------------------------------------------------------------------*\ @@ -170,7 +170,7 @@ forAll(allSpeciesVelocity, v) "zeroGradient" ) ); - allSpeciesVelocity[v].internalFieldRef() = Zero; + allSpeciesVelocity[v].primitiveFieldRef() = Zero; allSpeciesVelocity[v].correctBoundaryConditions(); } @@ -190,7 +190,7 @@ Info << " Creating total velocity field" << endl; // dimVelocity, // "zeroGradient" // ); -// totalVelocity.internalFieldRef() = Zero; +// totalVelocity.primitiveFieldRef() = Zero; // totalVelocity.correctBoundaryConditions(); @@ -243,7 +243,7 @@ forAll(allSpeciesTemperature, t) "zeroGradient" ) ); - allSpeciesTemperature[t].internalFieldRef() = 0; + allSpeciesTemperature[t].primitiveFieldRef() = 0; allSpeciesTemperature[t].correctBoundaryConditions(); } @@ -263,7 +263,7 @@ volScalarField totalTemperature dimTemperature, "zeroGradient" ); -totalTemperature.internalFieldRef() = 0; +totalTemperature.primitiveFieldRef() = 0; totalTemperature.correctBoundaryConditions(); /*---------------------------------------------------------------------------*\ @@ -299,7 +299,7 @@ forAll(allSpeciesMeanKE, mKE) "zeroGradient" ) ); - allSpeciesMeanKE[mKE].internalFieldRef() = 0; + allSpeciesMeanKE[mKE].primitiveFieldRef() = 0; allSpeciesMeanKE[mKE].correctBoundaryConditions(); } @@ -319,5 +319,5 @@ volScalarField totalMeanKE dimensionSet(1, 2, -2, 0, 0, 0, 0), "zeroGradient" ); -totalMeanKE.internalFieldRef() = 0; +totalMeanKE.primitiveFieldRef() = 0; totalMeanKE.correctBoundaryConditions(); diff --git a/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/GradientDispersionRAS/GradientDispersionRAS.C b/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/GradientDispersionRAS/GradientDispersionRAS.C index b1730e4d48..1dc9ab7a1f 100644 --- a/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/GradientDispersionRAS/GradientDispersionRAS.C +++ b/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/GradientDispersionRAS/GradientDispersionRAS.C @@ -104,10 +104,10 @@ Foam::vector Foam::GradientDispersionRAS<CloudType>::update const scalar cps = 0.16432; - const scalar k = this->kPtr_->internalField()[celli]; + const scalar k = this->kPtr_->primitiveField()[celli]; const scalar epsilon = - this->epsilonPtr_->internalField()[celli] + ROOTVSMALL; - const vector& gradk = this->gradkPtr_->internalField()[celli]; + this->epsilonPtr_->primitiveField()[celli] + ROOTVSMALL; + const vector& gradk = this->gradkPtr_->primitiveField()[celli]; const scalar UrelMag = mag(U - Uc - UTurb); diff --git a/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/StochasticDispersionRAS/StochasticDispersionRAS.C b/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/StochasticDispersionRAS/StochasticDispersionRAS.C index 5fe3584f79..e78fcf9ed9 100644 --- a/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/StochasticDispersionRAS/StochasticDispersionRAS.C +++ b/src/lagrangian/turbulence/submodels/Kinematic/DispersionModel/StochasticDispersionRAS/StochasticDispersionRAS.C @@ -75,9 +75,9 @@ Foam::vector Foam::StochasticDispersionRAS<CloudType>::update const scalar cps = 0.16432; - const scalar k = this->kPtr_->internalField()[celli]; + const scalar k = this->kPtr_->primitiveField()[celli]; const scalar epsilon = - this->epsilonPtr_->internalField()[celli] + ROOTVSMALL; + this->epsilonPtr_->primitiveField()[celli] + ROOTVSMALL; const scalar UrelMag = mag(U - Uc - UTurb); diff --git a/src/mesh/snappyHexMesh/externalDisplacementMeshMover/medialAxisMeshMover.C b/src/mesh/snappyHexMesh/externalDisplacementMeshMover/medialAxisMeshMover.C index 55a0bdd375..f32bcca5b7 100644 --- a/src/mesh/snappyHexMesh/externalDisplacementMeshMover/medialAxisMeshMover.C +++ b/src/mesh/snappyHexMesh/externalDisplacementMeshMover/medialAxisMeshMover.C @@ -2142,7 +2142,7 @@ bool Foam::medialAxisMeshMover::move pointField patchDisp ( - pointDisplacement_.internalField(), + pointDisplacement_.primitiveField(), pp.meshPoints() ); diff --git a/src/meshTools/AMIInterpolation/patches/cyclicACMI/cyclicACMIPointPatchField/cyclicACMIPointPatchField.C b/src/meshTools/AMIInterpolation/patches/cyclicACMI/cyclicACMIPointPatchField/cyclicACMIPointPatchField.C index e3af8a1345..897839717d 100644 --- a/src/meshTools/AMIInterpolation/patches/cyclicACMI/cyclicACMIPointPatchField/cyclicACMIPointPatchField.C +++ b/src/meshTools/AMIInterpolation/patches/cyclicACMI/cyclicACMIPointPatchField/cyclicACMIPointPatchField.C @@ -131,7 +131,7 @@ void Foam::cyclicACMIPointPatchField<Type>::swapAddSeparated const GeometricField<Type, pointPatchField, pointMesh>& fld = refCast<const GeometricField<Type, pointPatchField, pointMesh>> ( - this->dimensionedInternalField() + this->internalField() ); const cyclicACMIPointPatchField<Type>& nbr = diff --git a/src/meshTools/AMIInterpolation/patches/cyclicAMI/cyclicAMIPointPatchField/cyclicAMIPointPatchField.C b/src/meshTools/AMIInterpolation/patches/cyclicAMI/cyclicAMIPointPatchField/cyclicAMIPointPatchField.C index 58be0afc3c..8678b33d86 100644 --- a/src/meshTools/AMIInterpolation/patches/cyclicAMI/cyclicAMIPointPatchField/cyclicAMIPointPatchField.C +++ b/src/meshTools/AMIInterpolation/patches/cyclicAMI/cyclicAMIPointPatchField/cyclicAMIPointPatchField.C @@ -131,7 +131,7 @@ void Foam::cyclicAMIPointPatchField<Type>::swapAddSeparated const GeometricField<Type, pointPatchField, pointMesh>& fld = refCast<const GeometricField<Type, pointPatchField, pointMesh>> ( - this->dimensionedInternalField() + this->internalField() ); const cyclicAMIPointPatchField<Type>& nbr = diff --git a/src/parallel/decompose/decompose/fvFieldDecomposerDecomposeFields.C b/src/parallel/decompose/decompose/fvFieldDecomposerDecomposeFields.C index af2475cea3..e00abe07b2 100644 --- a/src/parallel/decompose/decompose/fvFieldDecomposerDecomposeFields.C +++ b/src/parallel/decompose/decompose/fvFieldDecomposerDecomposeFields.C @@ -72,7 +72,7 @@ Foam::fvFieldDecomposer::decomposeField ), procMesh_, field.dimensions(), - Field<Type>(field.internalField(), cellAddressing_), + Field<Type>(field.primitiveField(), cellAddressing_), patchFields ) ); @@ -112,7 +112,7 @@ Foam::fvFieldDecomposer::decomposeField resF(), Field<Type> ( - field.internalField(), + field.primitiveField(), *processorVolPatchFieldDecomposerPtrs_[patchi] ) ) @@ -129,7 +129,7 @@ Foam::fvFieldDecomposer::decomposeField resF(), Field<Type> ( - field.internalField(), + field.primitiveField(), *processorVolPatchFieldDecomposerPtrs_[patchi] ) ) @@ -182,7 +182,7 @@ Foam::fvFieldDecomposer::decomposeField // Create and map the internal field values Field<Type> internalField ( - field.internalField(), + field.primitiveField(), mapAddr ); @@ -193,9 +193,9 @@ Foam::fvFieldDecomposer::decomposeField // (i.e. using slices) Field<Type> allFaceField(field.mesh().nFaces()); - forAll(field.internalField(), i) + forAll(field.primitiveField(), i) { - allFaceField[i] = field.internalField()[i]; + allFaceField[i] = field.primitiveField()[i]; } forAll(field.boundaryField(), patchi) @@ -242,7 +242,7 @@ Foam::fvFieldDecomposer::decomposeField ), procMesh_, field.dimensions(), - Field<Type>(field.internalField(), mapAddr), + Field<Type>(field.primitiveField(), mapAddr), patchFields ) ); diff --git a/src/parallel/reconstruct/reconstruct/fvFieldReconstructorReconstructFields.C b/src/parallel/reconstruct/reconstruct/fvFieldReconstructorReconstructFields.C index e6f48fc807..88a8d1b532 100644 --- a/src/parallel/reconstruct/reconstruct/fvFieldReconstructorReconstructFields.C +++ b/src/parallel/reconstruct/reconstruct/fvFieldReconstructorReconstructFields.C @@ -140,7 +140,7 @@ Foam::fvFieldReconstructor::reconstructFvVolumeField // Set the cell values in the reconstructed field internalField.rmap ( - procField.internalField(), + procField.primitiveField(), cellProcAddressing_[proci] ); @@ -373,7 +373,7 @@ Foam::fvFieldReconstructor::reconstructFvSurfaceField const labelList& faceMap = faceProcAddressing_[proci]; // Correctly oriented copy of internal field - Field<Type> procInternalField(procField.internalField()); + Field<Type> procInternalField(procField.primitiveField()); // Addressing into original field labelList curAddr(procInternalField.size()); diff --git a/src/parallel/reconstruct/reconstruct/pointFieldReconstructorReconstructFields.C b/src/parallel/reconstruct/reconstruct/pointFieldReconstructorReconstructFields.C index 68b617a157..41b1c3fc9b 100644 --- a/src/parallel/reconstruct/reconstruct/pointFieldReconstructorReconstructFields.C +++ b/src/parallel/reconstruct/reconstruct/pointFieldReconstructorReconstructFields.C @@ -76,7 +76,7 @@ Foam::pointFieldReconstructor::reconstructField(const IOobject& fieldIoObject) // Set the cell values in the reconstructed field internalField.rmap ( - procField.internalField(), + procField.primitiveField(), procToGlobalAddr ); diff --git a/src/postProcessing/functionObjects/field/regionSizeDistribution/regionSizeDistribution.C b/src/postProcessing/functionObjects/field/regionSizeDistribution/regionSizeDistribution.C index a2b5cea4bd..523135ee69 100644 --- a/src/postProcessing/functionObjects/field/regionSizeDistribution/regionSizeDistribution.C +++ b/src/postProcessing/functionObjects/field/regionSizeDistribution/regionSizeDistribution.C @@ -544,7 +544,7 @@ void Foam::regionSizeDistribution::write() // Sum all regions - const scalarField alphaVol(alpha.internalField()*mesh.V()); + const scalarField alphaVol(alpha.primitiveField()*mesh.V()); Map<scalar> allRegionVolume(regionSum(regions, mesh.V())); Map<scalar> allRegionAlphaVolume(regionSum(regions, alphaVol)); Map<label> allRegionNumCells @@ -780,7 +780,7 @@ void Foam::regionSizeDistribution::write() const scalarField& fld = obr_.lookupObject < volScalarField - >(fldName).internalField(); + >(fldName).primitiveField(); writeGraphs ( @@ -809,7 +809,7 @@ void Foam::regionSizeDistribution::write() vectorField fld = obr_.lookupObject < volVectorField - >(fldName).internalField(); + >(fldName).primitiveField(); if (coordSysPtr_.valid()) { diff --git a/src/randomProcesses/Kmesh/Kmesh.C b/src/randomProcesses/Kmesh/Kmesh.C index 5bc6ad1de3..6e62c9a1d5 100644 --- a/src/randomProcesses/Kmesh/Kmesh.C +++ b/src/randomProcesses/Kmesh/Kmesh.C @@ -52,7 +52,7 @@ Foam::Kmesh::Kmesh(const fvMesh& mesh) boundBox box = mesh.bounds(); l_ = box.span(); - vector cornerCellCentre = ::Foam::max(mesh.C().internalField()); + vector cornerCellCentre = ::Foam::max(mesh.C().primitiveField()); vector cellL = 2*(box.max() - cornerCellCentre); vector rdeltaByL; diff --git a/src/randomProcesses/fft/calcEk.C b/src/randomProcesses/fft/calcEk.C index 858859033c..666afa8316 100644 --- a/src/randomProcesses/fft/calcEk.C +++ b/src/randomProcesses/fft/calcEk.C @@ -33,7 +33,7 @@ graph calcEk ( fft::forwardTransform ( - ReComplexField(U.internalField()), + ReComplexField(U.primitiveField()), K.nn() ), K diff --git a/src/regionCoupled/derivedFvPatchFields/energyRegionCoupled/energyRegionCoupledFvPatchScalarField.C b/src/regionCoupled/derivedFvPatchFields/energyRegionCoupled/energyRegionCoupledFvPatchScalarField.C index 7169fb5427..c0912107aa 100644 --- a/src/regionCoupled/derivedFvPatchFields/energyRegionCoupled/energyRegionCoupledFvPatchScalarField.C +++ b/src/regionCoupled/derivedFvPatchFields/energyRegionCoupled/energyRegionCoupledFvPatchScalarField.C @@ -258,8 +258,8 @@ energyRegionCoupledFvPatchScalarField FatalErrorInFunction << "' not type '" << regionCoupledBase::typeName << "'" << "\n for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } } @@ -354,7 +354,7 @@ patchNeighbourField() const const scalarField nbrIntT ( - nbrThermoPtr_->T().internalField(), nbrFaceCells + nbrThermoPtr_->T().primitiveField(), nbrFaceCells ); scalarField intNbrT @@ -379,7 +379,7 @@ patchNeighbourTemperatureField() const const scalarField nbrIntT ( - nbrThermoPtr_->T().internalField(), nbrFaceCells + nbrThermoPtr_->T().primitiveField(), nbrFaceCells ); tmp<scalarField> tintNbrT = @@ -396,7 +396,7 @@ patchInternalTemperatureField() const tmp<scalarField> tintT ( - new scalarField(thermoPtr_->T().internalField(), faceCells) + new scalarField(thermoPtr_->T().primitiveField(), faceCells) ); return tintT; @@ -416,7 +416,7 @@ void Foam::energyRegionCoupledFvPatchScalarField::updateInterfaceMatrix scalarField myHE(this->size()); - if (&psiInternal == &internalField()) + if (&psiInternal == &primitiveField()) { label patchi = this->patch().index(); const scalarField& pp = thermoPtr_->p().boundaryField()[patchi]; diff --git a/src/regionModels/pyrolysisModels/reactingOneDim/reactingOneDim.C b/src/regionModels/pyrolysisModels/reactingOneDim/reactingOneDim.C index 8304be3363..7d509a0ca0 100644 --- a/src/regionModels/pyrolysisModels/reactingOneDim/reactingOneDim.C +++ b/src/regionModels/pyrolysisModels/reactingOneDim/reactingOneDim.C @@ -629,7 +629,7 @@ scalar reactingOneDim::solidRegionDiffNo() const / fvc::interpolate(Cp()*rho_) ); - DiNum = max(KrhoCpbyDelta.internalField())*time().deltaTValue(); + DiNum = max(KrhoCpbyDelta.primitiveField())*time().deltaTValue(); } return DiNum; @@ -721,9 +721,9 @@ void reactingOneDim::evolveRegion() solidThermo_.correct(); Info<< "pyrolysis min/max(T) = " - << min(solidThermo_.T().internalField()) + << min(solidThermo_.T().primitiveField()) << ", " - << max(solidThermo_.T().internalField()) + << max(solidThermo_.T().primitiveField()) << endl; } diff --git a/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisRadiativeCoupledMixed/filmPyrolysisRadiativeCoupledMixedFvPatchScalarField.C b/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisRadiativeCoupledMixed/filmPyrolysisRadiativeCoupledMixedFvPatchScalarField.C index 81c5ba9f04..66871bd8dc 100644 --- a/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisRadiativeCoupledMixed/filmPyrolysisRadiativeCoupledMixedFvPatchScalarField.C +++ b/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisRadiativeCoupledMixed/filmPyrolysisRadiativeCoupledMixedFvPatchScalarField.C @@ -171,8 +171,8 @@ filmPyrolysisRadiativeCoupledMixedFvPatchScalarField FatalErrorInFunction << "' not type '" << mappedPatchBase::typeName << "'" << "\n for patch " << p.name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } @@ -362,10 +362,10 @@ void filmPyrolysisRadiativeCoupledMixedFvPatchScalarField::updateCoeffs() Info<< mesh.name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " <- " + << this->internalField().name() << " <- " << nbrMesh.name() << ':' << nbrPatch.name() << ':' - << this->dimensionedInternalField().name() << " :" << nl + << this->internalField().name() << " :" << nl << " convective heat[W] : " << Qc << nl << " radiative heat [W] : " << Qr << nl << " total heat [W] : " << Qt << nl diff --git a/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisVelocityCoupled/filmPyrolysisVelocityCoupledFvPatchVectorField.C b/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisVelocityCoupled/filmPyrolysisVelocityCoupledFvPatchVectorField.C index 6db83b0b0a..985f3fbdcb 100644 --- a/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisVelocityCoupled/filmPyrolysisVelocityCoupledFvPatchVectorField.C +++ b/src/regionModels/regionCoupling/derivedFvPatchFields/filmPyrolysisVelocityCoupled/filmPyrolysisVelocityCoupledFvPatchVectorField.C @@ -189,8 +189,8 @@ void Foam::filmPyrolysisVelocityCoupledFvPatchVectorField::updateCoeffs() << "Unable to process flux field phi with dimensions " << phi.dimensions() << nl << " on patch " << patch().name() - << " of field " << dimensionedInternalField().name() - << " in file " << dimensionedInternalField().objectPath() + << " of field " << internalField().name() + << " in file " << internalField().objectPath() << exit(FatalError); } diff --git a/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/alphatFilmWallFunction/alphatFilmWallFunctionFvPatchScalarField.C b/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/alphatFilmWallFunction/alphatFilmWallFunctionFvPatchScalarField.C index 2f90ad626c..d0a2222ef1 100644 --- a/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/alphatFilmWallFunction/alphatFilmWallFunctionFvPatchScalarField.C +++ b/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/alphatFilmWallFunction/alphatFilmWallFunctionFvPatchScalarField.C @@ -168,7 +168,7 @@ void alphatFilmWallFunctionFvPatchScalarField::updateCoeffs() IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/nutkFilmWallFunction/nutkFilmWallFunctionFvPatchScalarField.C b/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/nutkFilmWallFunction/nutkFilmWallFunctionFvPatchScalarField.C index d14bf49738..d9b5a0cd2a 100644 --- a/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/nutkFilmWallFunction/nutkFilmWallFunctionFvPatchScalarField.C +++ b/src/regionModels/surfaceFilmModels/derivedFvPatchFields/wallFunctions/nutkFilmWallFunction/nutkFilmWallFunctionFvPatchScalarField.C @@ -81,7 +81,7 @@ tmp<scalarField> nutkFilmWallFunctionFvPatchScalarField::calcUTau IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -132,7 +132,7 @@ tmp<scalarField> nutkFilmWallFunctionFvPatchScalarField::calcNut() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); @@ -224,7 +224,7 @@ tmp<scalarField> nutkFilmWallFunctionFvPatchScalarField::yPlus() const IOobject::groupName ( turbulenceModel::propertiesName, - dimensionedInternalField().group() + internalField().group() ) ); diff --git a/src/regionModels/surfaceFilmModels/kinematicSingleLayer/kinematicSingleLayer.C b/src/regionModels/surfaceFilmModels/kinematicSingleLayer/kinematicSingleLayer.C index fa478e3f30..2634e50aa0 100644 --- a/src/regionModels/surfaceFilmModels/kinematicSingleLayer/kinematicSingleLayer.C +++ b/src/regionModels/surfaceFilmModels/kinematicSingleLayer/kinematicSingleLayer.C @@ -939,8 +939,8 @@ scalar kinematicSingleLayer::CourantNumber() const { const scalarField sumPhi ( - fvc::surfaceSum(mag(phi_))().internalField() - / (deltaRho_.internalField() + ROOTVSMALL) + fvc::surfaceSum(mag(phi_))().primitiveField() + / (deltaRho_.primitiveField() + ROOTVSMALL) ); forAll(delta_, i) @@ -1095,7 +1095,7 @@ void kinematicSingleLayer::info() << indent << "min/max(delta) = " << gMin(deltaInternal) << ", " << gMax(deltaInternal) << nl << indent << "coverage = " - << gSum(alpha_.internalField()*magSf())/gSum(magSf()) << nl; + << gSum(alpha_.primitiveField()*magSf())/gSum(magSf()) << nl; injection_.info(Info); } diff --git a/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/constantFilmThermo/constantFilmThermo.C b/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/constantFilmThermo/constantFilmThermo.C index d8e4e78f7d..0f9167b247 100644 --- a/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/constantFilmThermo/constantFilmThermo.C +++ b/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/constantFilmThermo/constantFilmThermo.C @@ -275,7 +275,7 @@ tmp<volScalarField> constantFilmThermo::rho() const ) ); - trho.ref().internalFieldRef() = this->rho(0, 0); + trho.ref().primitiveFieldRef() = this->rho(0, 0); trho.ref().correctBoundaryConditions(); return trho; @@ -302,7 +302,7 @@ tmp<volScalarField> constantFilmThermo::mu() const ) ); - tmu.ref().internalFieldRef() = this->mu(0, 0); + tmu.ref().primitiveFieldRef() = this->mu(0, 0); tmu.ref().correctBoundaryConditions(); return tmu; @@ -329,7 +329,7 @@ tmp<volScalarField> constantFilmThermo::sigma() const ) ); - tsigma.ref().internalFieldRef() = this->sigma(0, 0); + tsigma.ref().primitiveFieldRef() = this->sigma(0, 0); tsigma.ref().correctBoundaryConditions(); return tsigma; @@ -356,7 +356,7 @@ tmp<volScalarField> constantFilmThermo::Cp() const ) ); - tCp.ref().internalFieldRef() = this->Cp(0, 0); + tCp.ref().primitiveFieldRef() = this->Cp(0, 0); tCp.ref().correctBoundaryConditions(); return tCp; @@ -383,7 +383,7 @@ tmp<volScalarField> constantFilmThermo::kappa() const ) ); - tkappa.ref().internalFieldRef() = this->kappa(0, 0); + tkappa.ref().primitiveFieldRef() = this->kappa(0, 0); tkappa.ref().correctBoundaryConditions(); return tkappa; diff --git a/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/liquidFilmThermo/liquidFilmThermo.C b/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/liquidFilmThermo/liquidFilmThermo.C index 55b21144b1..5511b2e200 100644 --- a/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/liquidFilmThermo/liquidFilmThermo.C +++ b/src/regionModels/surfaceFilmModels/submodels/kinematic/filmThermoModel/liquidFilmThermo/liquidFilmThermo.C @@ -255,7 +255,7 @@ tmp<volScalarField> liquidFilmThermo::rho() const ) ); - scalarField& rho = trho.ref().internalFieldRef(); + scalarField& rho = trho.ref().primitiveFieldRef(); if (useReferenceValues_) { @@ -303,7 +303,7 @@ tmp<volScalarField> liquidFilmThermo::mu() const ) ); - scalarField& mu = tmu.ref().internalFieldRef(); + scalarField& mu = tmu.ref().primitiveFieldRef(); if (useReferenceValues_) { @@ -351,7 +351,7 @@ tmp<volScalarField> liquidFilmThermo::sigma() const ) ); - scalarField& sigma = tsigma.ref().internalFieldRef(); + scalarField& sigma = tsigma.ref().primitiveFieldRef(); if (useReferenceValues_) { @@ -399,7 +399,7 @@ tmp<volScalarField> liquidFilmThermo::Cp() const ) ); - scalarField& Cp = tCp.ref().internalFieldRef(); + scalarField& Cp = tCp.ref().primitiveFieldRef(); if (useReferenceValues_) { @@ -447,7 +447,7 @@ tmp<volScalarField> liquidFilmThermo::kappa() const ) ); - scalarField& kappa = tkappa.ref().internalFieldRef(); + scalarField& kappa = tkappa.ref().primitiveFieldRef(); if (useReferenceValues_) { diff --git a/src/regionModels/surfaceFilmModels/submodels/kinematic/force/contactAngleForce/contactAngleForce.C b/src/regionModels/surfaceFilmModels/submodels/kinematic/force/contactAngleForce/contactAngleForce.C index 57352ab7fb..8e2fa0e4f5 100644 --- a/src/regionModels/surfaceFilmModels/submodels/kinematic/force/contactAngleForce/contactAngleForce.C +++ b/src/regionModels/surfaceFilmModels/submodels/kinematic/force/contactAngleForce/contactAngleForce.C @@ -153,7 +153,7 @@ tmp<fvVectorMatrix> contactAngleForce::correct(volVectorField& U) ) ); - vectorField& force = tForce.ref().internalFieldRef(); + vectorField& force = tForce.ref().primitiveFieldRef(); const labelUList& own = owner_.regionMesh().owner(); const labelUList& nbr = owner_.regionMesh().neighbour(); diff --git a/src/regionModels/surfaceFilmModels/submodels/kinematic/injectionModel/curvatureSeparation/curvatureSeparation.C b/src/regionModels/surfaceFilmModels/submodels/kinematic/injectionModel/curvatureSeparation/curvatureSeparation.C index 81ed5ec258..cb46796ffe 100644 --- a/src/regionModels/surfaceFilmModels/submodels/kinematic/injectionModel/curvatureSeparation/curvatureSeparation.C +++ b/src/regionModels/surfaceFilmModels/submodels/kinematic/injectionModel/curvatureSeparation/curvatureSeparation.C @@ -78,7 +78,7 @@ tmp<volScalarField> curvatureSeparation::calcInvR1 ); - scalarField& invR1 = tinvR1.ref().internalFieldRef(); + scalarField& invR1 = tinvR1.ref().primitiveFieldRef(); // apply defined patch radii const scalar rMin = 1e-6; @@ -207,7 +207,7 @@ tmp<scalarField> curvatureSeparation::calcCosAngle dimensionedScalar("zero", dimless, 0.0), zeroGradientFvPatchScalarField::typeName ); - volCosAngle.internalFieldRef() = cosAngle; + volCosAngle.primitiveFieldRef() = cosAngle; volCosAngle.correctBoundaryConditions(); volCosAngle.write(); } @@ -349,7 +349,7 @@ void curvatureSeparation::correct dimensionedScalar("zero", dimForce, 0.0), zeroGradientFvPatchScalarField::typeName ); - volFnet.internalFieldRef() = Fnet; + volFnet.primitiveFieldRef() = Fnet; volFnet.correctBoundaryConditions(); volFnet.write(); } diff --git a/src/regionModels/surfaceFilmModels/submodels/thermo/filmRadiationModel/standardRadiation/standardRadiation.C b/src/regionModels/surfaceFilmModels/submodels/thermo/filmRadiationModel/standardRadiation/standardRadiation.C index f96aa0ce93..d8525ce4a0 100644 --- a/src/regionModels/surfaceFilmModels/submodels/thermo/filmRadiationModel/standardRadiation/standardRadiation.C +++ b/src/regionModels/surfaceFilmModels/submodels/thermo/filmRadiationModel/standardRadiation/standardRadiation.C @@ -132,7 +132,7 @@ tmp<volScalarField> standardRadiation::Shs() Shs = beta_*QinP*alpha*(1.0 - exp(-kappaBar_*delta)); // Update net Qr on local region - QrNet_.internalFieldRef() = QinP - Shs; + QrNet_.primitiveFieldRef() = QinP - Shs; QrNet_.correctBoundaryConditions(); return tShs; diff --git a/src/regionModels/surfaceFilmModels/submodels/thermo/phaseChangeModel/phaseChangeModel/phaseChangeModel.C b/src/regionModels/surfaceFilmModels/submodels/thermo/phaseChangeModel/phaseChangeModel/phaseChangeModel.C index aae14e76ec..8ce85e2409 100644 --- a/src/regionModels/surfaceFilmModels/submodels/thermo/phaseChangeModel/phaseChangeModel/phaseChangeModel.C +++ b/src/regionModels/surfaceFilmModels/submodels/thermo/phaseChangeModel/phaseChangeModel/phaseChangeModel.C @@ -94,7 +94,7 @@ void phaseChangeModel::correct dEnergy ); - latestMassPC_ = sum(dMass.internalField()); + latestMassPC_ = sum(dMass.primitiveField()); totalMassPC_ += latestMassPC_; availableMass -= dMass; diff --git a/src/rigidBodyMeshMotion/rigidBodyMeshMotion.C b/src/rigidBodyMeshMotion/rigidBodyMeshMotion.C index 27f3333291..5419720297 100644 --- a/src/rigidBodyMeshMotion/rigidBodyMeshMotion.C +++ b/src/rigidBodyMeshMotion/rigidBodyMeshMotion.C @@ -153,12 +153,12 @@ Foam::rigidBodyMeshMotion::rigidBodyMeshMotion pointScalarField& scale = bodyMeshes_[bi].weight_; // Scaling: 1 up to di then linear down to 0 at do away from patches - scale.internalFieldRef() = + scale.primitiveFieldRef() = min ( max ( - (bodyMeshes_[bi].do_ - pDist.internalField()) + (bodyMeshes_[bi].do_ - pDist.primitiveField()) /(bodyMeshes_[bi].do_ - bodyMeshes_[bi].di_), scalar(0) ), @@ -166,14 +166,14 @@ Foam::rigidBodyMeshMotion::rigidBodyMeshMotion ); // Convert the scale function to a cosine - scale.internalFieldRef() = + scale.primitiveFieldRef() = min ( max ( 0.5 - 0.5 - *cos(scale.internalField() + *cos(scale.primitiveField() *Foam::constant::mathematical::pi), scalar(0) ), @@ -197,7 +197,7 @@ Foam::rigidBodyMeshMotion::~rigidBodyMeshMotion() Foam::tmp<Foam::pointField> Foam::rigidBodyMeshMotion::curPoints() const { - return points0() + pointDisplacement_.internalField(); + return points0() + pointDisplacement_.primitiveField(); } @@ -281,7 +281,7 @@ void Foam::rigidBodyMeshMotion::solve() // Update the displacements if (bodyMeshes_.size() == 1) { - pointDisplacement_.internalFieldRef() = model_.transformPoints + pointDisplacement_.primitiveFieldRef() = model_.transformPoints ( bodyMeshes_[0].bodyID_, bodyMeshes_[0].weight_, @@ -298,7 +298,7 @@ void Foam::rigidBodyMeshMotion::solve() weights[bi] = &bodyMeshes_[bi].weight_; } - pointDisplacement_.internalFieldRef() = + pointDisplacement_.primitiveFieldRef() = model_.transformPoints(bodyIDs, weights, points0()) - points0(); } diff --git a/src/sampling/graphField/makeGraph.C b/src/sampling/graphField/makeGraph.C index d975a7814a..66d20a8ecf 100644 --- a/src/sampling/graphField/makeGraph.C +++ b/src/sampling/graphField/makeGraph.C @@ -68,7 +68,7 @@ void makeGraph makeGraph ( x, - vsf.internalField(), + vsf.primitiveField(), name, path, graphFormat diff --git a/src/sampling/graphField/writeCellGraph.C b/src/sampling/graphField/writeCellGraph.C index 740e3172cd..535e2c3434 100644 --- a/src/sampling/graphField/writeCellGraph.C +++ b/src/sampling/graphField/writeCellGraph.C @@ -24,8 +24,8 @@ void writeCellGraph vsf.name(), "x", vsf.name(), - vsf.mesh().C().internalField().component(vector::X), - vsf.internalField() + vsf.mesh().C().primitiveField().component(vector::X), + vsf.primitiveField() ).write(path/vsf.name(), graphFormat); } diff --git a/src/sampling/meshToMesh/meshToMeshTemplates.C b/src/sampling/meshToMesh/meshToMeshTemplates.C index cff62b8b83..446b46ecf3 100644 --- a/src/sampling/meshToMesh/meshToMeshTemplates.C +++ b/src/sampling/meshToMesh/meshToMeshTemplates.C @@ -325,7 +325,7 @@ void Foam::meshToMesh::mapSrcToTgt GeometricField<Type, fvPatchField, volMesh>& result ) const { - mapSrcToTgt(field, cop, result.internalFieldRef()); + mapSrcToTgt(field, cop, result.primitiveFieldRef()); const PtrList<AMIPatchToPatchInterpolation>& AMIList = patchAMIs(); @@ -517,7 +517,7 @@ void Foam::meshToMesh::mapTgtToSrc GeometricField<Type, fvPatchField, volMesh>& result ) const { - mapTgtToSrc(field, cop, result.internalField()); + mapTgtToSrc(field, cop, result.primitiveField()); const PtrList<AMIPatchToPatchInterpolation>& AMIList = patchAMIs(); diff --git a/src/sampling/sampledSurface/distanceSurface/distanceSurface.C b/src/sampling/sampledSurface/distanceSurface/distanceSurface.C index 91ccabd825..9d703f4dc8 100644 --- a/src/sampling/sampledSurface/distanceSurface/distanceSurface.C +++ b/src/sampling/sampledSurface/distanceSurface/distanceSurface.C @@ -83,7 +83,7 @@ void Foam::distanceSurface::createGeometry() // Internal field { const pointField& cc = fvm.C(); - scalarField& fld = cellDistance.internalFieldRef(); + scalarField& fld = cellDistance.primitiveFieldRef(); List<pointIndexHit> nearest; surfPtr_().findNearest @@ -257,7 +257,7 @@ void Foam::distanceSurface::createGeometry() pointMesh::New(fvm), dimensionedScalar("zero", dimLength, 0) ); - pDist.internalFieldRef() = pointDistance_; + pDist.primitiveFieldRef() = pointDistance_; Pout<< "Writing point distance:" << pDist.objectPath() << endl; pDist.write(); diff --git a/src/sampling/sampledSurface/isoSurface/isoSurface.C b/src/sampling/sampledSurface/isoSurface/isoSurface.C index 08cf119df2..e93bc9f94f 100644 --- a/src/sampling/sampledSurface/isoSurface/isoSurface.C +++ b/src/sampling/sampledSurface/isoSurface/isoSurface.C @@ -1183,8 +1183,8 @@ Foam::isoSurface::isoSurface Pout<< "isoSurface:" << nl << " isoField : " << cVals.name() << nl << " cell min/max : " - << min(cVals.internalField()) << " / " - << max(cVals.internalField()) << nl + << min(cVals.primitiveField()) << " / " + << max(cVals.primitiveField()) << nl << " point min/max : " << min(pVals_) << " / " << max(pVals_) << nl diff --git a/src/sampling/sampledSurface/isoSurface/sampledIsoSurface.C b/src/sampling/sampledSurface/isoSurface/sampledIsoSurface.C index bfeb2cd1b5..91806f7913 100644 --- a/src/sampling/sampledSurface/isoSurface/sampledIsoSurface.C +++ b/src/sampling/sampledSurface/isoSurface/sampledIsoSurface.C @@ -220,8 +220,8 @@ void Foam::sampledIsoSurface::getIsoFields() const << " max:" << max(*volFieldPtr_).value() << endl; InfoInFunction << "pointField " << pointFieldPtr_->name() - << " min:" << gMin(pointFieldPtr_->internalField()) - << " max:" << gMax(pointFieldPtr_->internalField()) << endl; + << " min:" << gMin(pointFieldPtr_->primitiveField()) + << " max:" << gMax(pointFieldPtr_->primitiveField()) << endl; } } else @@ -324,8 +324,8 @@ void Foam::sampledIsoSurface::getIsoFields() const InfoInFunction << "pointSubField " << pointSubFieldPtr_->name() - << " min:" << gMin(pointSubFieldPtr_->internalField()) - << " max:" << gMax(pointSubFieldPtr_->internalField()) << endl; + << " min:" << gMin(pointSubFieldPtr_->primitiveField()) + << " max:" << gMax(pointSubFieldPtr_->primitiveField()) << endl; } } } diff --git a/src/sampling/sampledSurface/isoSurface/sampledIsoSurfaceCell.C b/src/sampling/sampledSurface/isoSurface/sampledIsoSurfaceCell.C index b70a3750b0..46663e2306 100644 --- a/src/sampling/sampledSurface/isoSurface/sampledIsoSurfaceCell.C +++ b/src/sampling/sampledSurface/isoSurface/sampledIsoSurfaceCell.C @@ -132,7 +132,7 @@ bool Foam::sampledIsoSurfaceCell::updateGeometry() const { label celli = pCells[i]; - cellAvg[celli] += pointFld().internalField()[pointI]; + cellAvg[celli] += pointFld().primitiveField()[pointI]; nPointCells[celli]++; } } @@ -146,7 +146,7 @@ bool Foam::sampledIsoSurfaceCell::updateGeometry() const ( fvm, cellAvg, - pointFld().internalField(), + pointFld().primitiveField(), isoVal_, regularise_ ); @@ -163,8 +163,8 @@ bool Foam::sampledIsoSurfaceCell::updateGeometry() const const isoSurfaceCell iso ( fvm, - cellFld.internalField(), - pointFld().internalField(), + cellFld.primitiveField(), + pointFld().primitiveField(), isoVal_, regularise_ ); diff --git a/src/sampling/sampledSurface/sampledCuttingPlane/sampledCuttingPlane.C b/src/sampling/sampledSurface/sampledCuttingPlane/sampledCuttingPlane.C index ec8f04ce13..aa06bc1b0e 100644 --- a/src/sampling/sampledSurface/sampledCuttingPlane/sampledCuttingPlane.C +++ b/src/sampling/sampledSurface/sampledCuttingPlane/sampledCuttingPlane.C @@ -125,7 +125,7 @@ void Foam::sampledCuttingPlane::createGeometry() // Internal field { const pointField& cc = fvm.cellCentres(); - scalarField& fld = cellDistance.internalFieldRef(); + scalarField& fld = cellDistance.primitiveFieldRef(); forAll(cc, i) { @@ -217,7 +217,7 @@ void Foam::sampledCuttingPlane::createGeometry() pointMesh::New(fvm), dimensionedScalar("zero", dimLength, 0) ); - pDist.internalFieldRef() = pointDistance_; + pDist.primitiveFieldRef() = pointDistance_; Pout<< "Writing point distance:" << pDist.objectPath() << endl; pDist.write(); diff --git a/src/sampling/sampledSurface/sampledPatchInternalField/sampledPatchInternalFieldTemplates.C b/src/sampling/sampledSurface/sampledPatchInternalField/sampledPatchInternalFieldTemplates.C index af9ed27167..211f55ca91 100644 --- a/src/sampling/sampledSurface/sampledPatchInternalField/sampledPatchInternalFieldTemplates.C +++ b/src/sampling/sampledSurface/sampledPatchInternalField/sampledPatchInternalFieldTemplates.C @@ -43,7 +43,7 @@ Foam::sampledPatchInternalField::sampleField forAll(patchStart(), i) { // Get patchface wise data by sampling internal field - Field<Type> interpVals = vField.internalField(); + Field<Type> interpVals = vField.primitiveField(); mappers_[i].map().distribute(interpVals); // Store at correct position in values diff --git a/src/sampling/sampledSurface/thresholdCellFaces/sampledThresholdCellFaces.C b/src/sampling/sampledSurface/thresholdCellFaces/sampledThresholdCellFaces.C index 2f1007cb57..d39297292e 100644 --- a/src/sampling/sampledSurface/thresholdCellFaces/sampledThresholdCellFaces.C +++ b/src/sampling/sampledSurface/thresholdCellFaces/sampledThresholdCellFaces.C @@ -111,7 +111,7 @@ bool Foam::sampledThresholdCellFaces::updateGeometry() const thresholdCellFaces surf ( fvm, - cellFld.internalField(), + cellFld.primitiveField(), lowerThreshold_, upperThreshold_, triangulate_ diff --git a/src/sixDoFRigidBodyMotion/pointPatchFields/derived/sixDoFRigidBodyDisplacement/sixDoFRigidBodyDisplacementPointPatchVectorField.C b/src/sixDoFRigidBodyMotion/pointPatchFields/derived/sixDoFRigidBodyDisplacement/sixDoFRigidBodyDisplacementPointPatchVectorField.C index 0595948e73..353397bc2a 100644 --- a/src/sixDoFRigidBodyMotion/pointPatchFields/derived/sixDoFRigidBodyDisplacement/sixDoFRigidBodyDisplacementPointPatchVectorField.C +++ b/src/sixDoFRigidBodyMotion/pointPatchFields/derived/sixDoFRigidBodyDisplacement/sixDoFRigidBodyDisplacementPointPatchVectorField.C @@ -195,7 +195,7 @@ void sixDoFRigidBodyDisplacementPointPatchVectorField::updateCoeffs() } } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); const pointPatch& ptPatch = this->patch(); diff --git a/src/sixDoFRigidBodyMotion/pointPatchFields/derived/uncoupledSixDoFRigidBodyDisplacement/uncoupledSixDoFRigidBodyDisplacementPointPatchVectorField.C b/src/sixDoFRigidBodyMotion/pointPatchFields/derived/uncoupledSixDoFRigidBodyDisplacement/uncoupledSixDoFRigidBodyDisplacementPointPatchVectorField.C index 98d1fc871b..123b128b92 100644 --- a/src/sixDoFRigidBodyMotion/pointPatchFields/derived/uncoupledSixDoFRigidBodyDisplacement/uncoupledSixDoFRigidBodyDisplacementPointPatchVectorField.C +++ b/src/sixDoFRigidBodyMotion/pointPatchFields/derived/uncoupledSixDoFRigidBodyDisplacement/uncoupledSixDoFRigidBodyDisplacementPointPatchVectorField.C @@ -148,7 +148,7 @@ void uncoupledSixDoFRigidBodyDisplacementPointPatchVectorField::updateCoeffs() return; } - const polyMesh& mesh = this->dimensionedInternalField().mesh()(); + const polyMesh& mesh = this->internalField().mesh()(); const Time& t = mesh.time(); // Store the motion state at the beginning of the time-step diff --git a/src/sixDoFRigidBodyMotion/sixDoFRigidBodyMotionSolver/sixDoFRigidBodyMotionSolver.C b/src/sixDoFRigidBodyMotion/sixDoFRigidBodyMotionSolver/sixDoFRigidBodyMotionSolver.C index 3946c76e4e..f25d1bba49 100644 --- a/src/sixDoFRigidBodyMotion/sixDoFRigidBodyMotionSolver/sixDoFRigidBodyMotionSolver.C +++ b/src/sixDoFRigidBodyMotion/sixDoFRigidBodyMotionSolver/sixDoFRigidBodyMotionSolver.C @@ -118,26 +118,26 @@ Foam::sixDoFRigidBodyMotionSolver::sixDoFRigidBodyMotionSolver pointPatchDist pDist(pMesh, patchSet_, points0()); // Scaling: 1 up to di then linear down to 0 at do away from patches - scale_.internalFieldRef() = + scale_.primitiveFieldRef() = min ( max ( - (do_ - pDist.internalField())/(do_ - di_), + (do_ - pDist.primitiveField())/(do_ - di_), scalar(0) ), scalar(1) ); // Convert the scale function to a cosine - scale_.internalFieldRef() = + scale_.primitiveFieldRef() = min ( max ( 0.5 - 0.5 - *cos(scale_.internalField() + *cos(scale_.primitiveField() *Foam::constant::mathematical::pi), scalar(0) ), @@ -161,7 +161,7 @@ Foam::sixDoFRigidBodyMotionSolver::~sixDoFRigidBodyMotionSolver() Foam::tmp<Foam::pointField> Foam::sixDoFRigidBodyMotionSolver::curPoints() const { - return points0() + pointDisplacement_.internalField(); + return points0() + pointDisplacement_.primitiveField(); } @@ -241,7 +241,7 @@ void Foam::sixDoFRigidBodyMotionSolver::solve() } // Update the displacements - pointDisplacement_.internalFieldRef() = + pointDisplacement_.primitiveFieldRef() = motion_.transform(points0(), scale_) - points0(); // Displacement has changed. Update boundary conditions diff --git a/src/thermophysicalModels/basic/basicThermo/basicThermo.C b/src/thermophysicalModels/basic/basicThermo/basicThermo.C index 93f01ff684..9d12c6de9c 100644 --- a/src/thermophysicalModels/basic/basicThermo/basicThermo.C +++ b/src/thermophysicalModels/basic/basicThermo/basicThermo.C @@ -308,8 +308,8 @@ const Foam::basicThermo& Foam::basicThermo::lookupThermo { if ( - &(iter()->he().dimensionedInternalField()) - == &(pf.dimensionedInternalField()) + &(iter()->he().internalField()) + == &(pf.internalField()) ) { return *iter(); diff --git a/src/thermophysicalModels/basic/heThermo/heThermo.C b/src/thermophysicalModels/basic/heThermo/heThermo.C index f613fb77a6..280b33999c 100644 --- a/src/thermophysicalModels/basic/heThermo/heThermo.C +++ b/src/thermophysicalModels/basic/heThermo/heThermo.C @@ -54,7 +54,7 @@ heBoundaryCorrection(volScalarField& h) template<class BasicThermo, class MixtureType> void Foam::heThermo<BasicThermo, MixtureType>::init() { - scalarField& heCells = he_.internalFieldRef(); + scalarField& heCells = he_.primitiveFieldRef(); const scalarField& pCells = this->p_; const scalarField& TCells = this->T_; @@ -187,7 +187,7 @@ Foam::tmp<Foam::volScalarField> Foam::heThermo<BasicThermo, MixtureType>::he ); volScalarField& he = the.ref(); - scalarField& heCells = he.internalFieldRef(); + scalarField& heCells = he.primitiveFieldRef(); const scalarField& pCells = p; const scalarField& TCells = T; @@ -282,7 +282,7 @@ Foam::heThermo<BasicThermo, MixtureType>::hc() const ); volScalarField& hcf = thc.ref(); - scalarField& hcCells = hcf.internalFieldRef(); + scalarField& hcCells = hcf.primitiveFieldRef(); forAll(hcCells, celli) { diff --git a/src/thermophysicalModels/basic/psiThermo/hePsiThermo.C b/src/thermophysicalModels/basic/psiThermo/hePsiThermo.C index 481fe17ec7..71cc38498e 100644 --- a/src/thermophysicalModels/basic/psiThermo/hePsiThermo.C +++ b/src/thermophysicalModels/basic/psiThermo/hePsiThermo.C @@ -33,10 +33,10 @@ void Foam::hePsiThermo<BasicPsiThermo, MixtureType>::calculate() const scalarField& hCells = this->he_; const scalarField& pCells = this->p_; - scalarField& TCells = this->T_.internalFieldRef(); - scalarField& psiCells = this->psi_.internalFieldRef(); - scalarField& muCells = this->mu_.internalFieldRef(); - scalarField& alphaCells = this->alpha_.internalFieldRef(); + scalarField& TCells = this->T_.primitiveFieldRef(); + scalarField& psiCells = this->psi_.primitiveFieldRef(); + scalarField& muCells = this->mu_.primitiveFieldRef(); + scalarField& alphaCells = this->alpha_.primitiveFieldRef(); forAll(TCells, celli) { diff --git a/src/thermophysicalModels/basic/rhoThermo/heRhoThermo.C b/src/thermophysicalModels/basic/rhoThermo/heRhoThermo.C index a6d2627114..9c889ac7f3 100644 --- a/src/thermophysicalModels/basic/rhoThermo/heRhoThermo.C +++ b/src/thermophysicalModels/basic/rhoThermo/heRhoThermo.C @@ -33,11 +33,11 @@ void Foam::heRhoThermo<BasicPsiThermo, MixtureType>::calculate() const scalarField& hCells = this->he(); const scalarField& pCells = this->p_; - scalarField& TCells = this->T_.internalFieldRef(); - scalarField& psiCells = this->psi_.internalFieldRef(); - scalarField& rhoCells = this->rho_.internalFieldRef(); - scalarField& muCells = this->mu_.internalFieldRef(); - scalarField& alphaCells = this->alpha_.internalFieldRef(); + scalarField& TCells = this->T_.primitiveFieldRef(); + scalarField& psiCells = this->psi_.primitiveFieldRef(); + scalarField& rhoCells = this->rho_.primitiveFieldRef(); + scalarField& muCells = this->mu_.primitiveFieldRef(); + scalarField& alphaCells = this->alpha_.primitiveFieldRef(); forAll(TCells, celli) { diff --git a/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveRadiation/greyDiffusiveRadiationMixedFvPatchScalarField.C b/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveRadiation/greyDiffusiveRadiationMixedFvPatchScalarField.C index a1f3476295..cd4d4827d2 100644 --- a/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveRadiation/greyDiffusiveRadiationMixedFvPatchScalarField.C +++ b/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveRadiation/greyDiffusiveRadiationMixedFvPatchScalarField.C @@ -166,7 +166,7 @@ updateCoeffs() label rayId = -1; label lambdaId = -1; - dom.setRayIdLambdaId(dimensionedInternalField().name(), rayId, lambdaId); + dom.setRayIdLambdaId(internalField().name(), rayId, lambdaId); const label patchi = patch().index(); diff --git a/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveViewFactor/greyDiffusiveViewFactorFixedValueFvPatchScalarField.C b/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveViewFactor/greyDiffusiveViewFactorFixedValueFvPatchScalarField.C index 233d80b450..7c69076113 100644 --- a/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveViewFactor/greyDiffusiveViewFactorFixedValueFvPatchScalarField.C +++ b/src/thermophysicalModels/radiation/derivedFvPatchFields/greyDiffusiveViewFactor/greyDiffusiveViewFactorFixedValueFvPatchScalarField.C @@ -144,7 +144,7 @@ updateCoeffs() Info<< patch().boundaryMesh().mesh().name() << ':' << patch().name() << ':' - << this->dimensionedInternalField().name() << " <- " + << this->internalField().name() << " <- " << " heat transfer rate:" << Q << " wall radiative heat flux " << " min:" << gMin(*this) diff --git a/src/thermophysicalModels/radiation/derivedFvPatchFields/wideBandDiffusiveRadiation/wideBandDiffusiveRadiationMixedFvPatchScalarField.C b/src/thermophysicalModels/radiation/derivedFvPatchFields/wideBandDiffusiveRadiation/wideBandDiffusiveRadiationMixedFvPatchScalarField.C index 01f9c43074..d77a56a845 100644 --- a/src/thermophysicalModels/radiation/derivedFvPatchFields/wideBandDiffusiveRadiation/wideBandDiffusiveRadiationMixedFvPatchScalarField.C +++ b/src/thermophysicalModels/radiation/derivedFvPatchFields/wideBandDiffusiveRadiation/wideBandDiffusiveRadiationMixedFvPatchScalarField.C @@ -167,7 +167,7 @@ updateCoeffs() label rayId = -1; label lambdaId = -1; - dom.setRayIdLambdaId(dimensionedInternalField().name(), rayId, lambdaId); + dom.setRayIdLambdaId(internalField().name(), rayId, lambdaId); const label patchi = patch().index(); diff --git a/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanAbsorptionEmission/greyMeanAbsorptionEmission.C b/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanAbsorptionEmission/greyMeanAbsorptionEmission.C index 045dde224f..69c68ad184 100644 --- a/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanAbsorptionEmission/greyMeanAbsorptionEmission.C +++ b/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanAbsorptionEmission/greyMeanAbsorptionEmission.C @@ -213,7 +213,7 @@ Foam::radiation::greyMeanAbsorptionEmission::aCont(const label bandI) const ) ); - scalarField& a = ta.ref().internalFieldRef(); + scalarField& a = ta.ref().primitiveFieldRef(); forAll(a, celli) { @@ -300,11 +300,11 @@ Foam::radiation::greyMeanAbsorptionEmission::ECont(const label bandI) const if (dQ.dimensions() == dimEnergy/dimTime) { - E.ref().internalFieldRef() = EhrrCoeff_*dQ/mesh_.V(); + E.ref().primitiveFieldRef() = EhrrCoeff_*dQ/mesh_.V(); } else if (dQ.dimensions() == dimEnergy/dimTime/dimVolume) { - E.ref().internalFieldRef() = EhrrCoeff_*dQ; + E.ref().primitiveFieldRef() = EhrrCoeff_*dQ; } else { diff --git a/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanSolidAbsorptionEmission/greyMeanSolidAbsorptionEmission.C b/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanSolidAbsorptionEmission/greyMeanSolidAbsorptionEmission.C index bca25380bc..0162f20421 100644 --- a/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanSolidAbsorptionEmission/greyMeanSolidAbsorptionEmission.C +++ b/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/greyMeanSolidAbsorptionEmission/greyMeanSolidAbsorptionEmission.C @@ -54,10 +54,10 @@ greyMeanSolidAbsorptionEmission::X(const word specie) const const volScalarField& T = thermo_.T(); const volScalarField& p = thermo_.p(); - tmp<scalarField> tXj(new scalarField(T.internalField().size(), 0.0)); + tmp<scalarField> tXj(new scalarField(T.primitiveField().size(), 0.0)); scalarField& Xj = tXj.ref(); - tmp<scalarField> tRhoInv(new scalarField(T.internalField().size(), 0.0)); + tmp<scalarField> tRhoInv(new scalarField(T.primitiveField().size(), 0.0)); scalarField& rhoInv = tRhoInv.ref(); forAll(mixture_.Y(), specieI) @@ -162,7 +162,7 @@ calc(const label propertyId) const ) ); - scalarField& a = ta.ref().internalFieldRef(); + scalarField& a = ta.ref().primitiveFieldRef(); forAllConstIter(HashTable<label>, speciesNames_, iter) { diff --git a/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/wideBandAbsorptionEmission/wideBandAbsorptionEmission.C b/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/wideBandAbsorptionEmission/wideBandAbsorptionEmission.C index cd1a916f45..d7899338d0 100644 --- a/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/wideBandAbsorptionEmission/wideBandAbsorptionEmission.C +++ b/src/thermophysicalModels/radiation/submodels/absorptionEmissionModel/wideBandAbsorptionEmission/wideBandAbsorptionEmission.C @@ -177,7 +177,7 @@ Foam::radiation::wideBandAbsorptionEmission::aCont(const label bandI) const ) ); - scalarField& a = ta.ref().internalFieldRef(); + scalarField& a = ta.ref().primitiveFieldRef(); forAll(a, i) { @@ -255,18 +255,18 @@ Foam::radiation::wideBandAbsorptionEmission::ECont(const label bandI) const if (dQ.dimensions() == dimEnergy/dimTime) { - E.ref().internalFieldRef() = + E.ref().primitiveFieldRef() = iEhrrCoeffs_[bandI] - *dQ.internalField() + *dQ.primitiveField() *(iBands_[bandI][1] - iBands_[bandI][0]) /totalWaveLength_ /mesh_.V(); } else if (dQ.dimensions() == dimEnergy/dimTime/dimVolume) { - E.ref().internalFieldRef() = + E.ref().primitiveFieldRef() = iEhrrCoeffs_[bandI] - *dQ.internalField() + *dQ.primitiveField() *(iBands_[bandI][1] - iBands_[bandI][0]) /totalWaveLength_; } @@ -291,10 +291,10 @@ void Foam::radiation::wideBandAbsorptionEmission::correct for (label j=0; j<nBands_; j++) { - aLambda[j].internalFieldRef() = this->a(j); + aLambda[j].primitiveFieldRef() = this->a(j); - a.internalFieldRef() += - aLambda[j].internalField() + a.primitiveFieldRef() += + aLambda[j].primitiveField() *(iBands_[j][1] - iBands_[j][0]) /totalWaveLength_; } diff --git a/src/thermophysicalModels/reactionThermo/psiuReactionThermo/heheuPsiThermo.C b/src/thermophysicalModels/reactionThermo/psiuReactionThermo/heheuPsiThermo.C index b36603cedb..00689a7b18 100644 --- a/src/thermophysicalModels/reactionThermo/psiuReactionThermo/heheuPsiThermo.C +++ b/src/thermophysicalModels/reactionThermo/psiuReactionThermo/heheuPsiThermo.C @@ -36,11 +36,11 @@ void Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::calculate() const scalarField& heuCells = this->heu_; const scalarField& pCells = this->p_; - scalarField& TCells = this->T_.internalFieldRef(); - scalarField& TuCells = this->Tu_.internalFieldRef(); - scalarField& psiCells = this->psi_.internalFieldRef(); - scalarField& muCells = this->mu_.internalFieldRef(); - scalarField& alphaCells = this->alpha_.internalFieldRef(); + scalarField& TCells = this->T_.primitiveFieldRef(); + scalarField& TuCells = this->Tu_.primitiveFieldRef(); + scalarField& psiCells = this->psi_.primitiveFieldRef(); + scalarField& muCells = this->mu_.primitiveFieldRef(); + scalarField& alphaCells = this->alpha_.primitiveFieldRef(); forAll(TCells, celli) { @@ -176,7 +176,7 @@ Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::heheuPsiThermo this->heuBoundaryTypes() ) { - scalarField& heuCells = this->heu_.internalFieldRef(); + scalarField& heuCells = this->heu_.primitiveFieldRef(); const scalarField& pCells = this->p_; const scalarField& TuCells = this->Tu_; @@ -308,7 +308,7 @@ Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::Tb() const ); volScalarField& Tb_ = tTb.ref(); - scalarField& TbCells = Tb_.internalFieldRef(); + scalarField& TbCells = Tb_.primitiveFieldRef(); const scalarField& pCells = this->p_; const scalarField& TCells = this->T_; const scalarField& hCells = this->he_; @@ -368,7 +368,7 @@ Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::psiu() const ); volScalarField& psiu = tpsiu.ref(); - scalarField& psiuCells = psiu.internalFieldRef(); + scalarField& psiuCells = psiu.primitiveFieldRef(); const scalarField& TuCells = this->Tu_; const scalarField& pCells = this->p_; @@ -422,7 +422,7 @@ Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::psib() const ); volScalarField& psib = tpsib.ref(); - scalarField& psibCells = psib.internalFieldRef(); + scalarField& psibCells = psib.primitiveFieldRef(); const volScalarField Tb_(Tb()); const scalarField& TbCells = Tb_; const scalarField& pCells = this->p_; @@ -477,7 +477,7 @@ Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::muu() const ); volScalarField& muu_ = tmuu.ref(); - scalarField& muuCells = muu_.internalFieldRef(); + scalarField& muuCells = muu_.primitiveFieldRef(); const scalarField& pCells = this->p_; const scalarField& TuCells = this->Tu_; @@ -535,7 +535,7 @@ Foam::heheuPsiThermo<BasicPsiThermo, MixtureType>::mub() const ); volScalarField& mub_ = tmub.ref(); - scalarField& mubCells = mub_.internalFieldRef(); + scalarField& mubCells = mub_.primitiveFieldRef(); const volScalarField Tb_(Tb()); const scalarField& pCells = this->p_; const scalarField& TbCells = Tb_; diff --git a/src/thermophysicalModels/solidChemistryModel/pyrolysisChemistryModel/pyrolysisChemistryModel.C b/src/thermophysicalModels/solidChemistryModel/pyrolysisChemistryModel/pyrolysisChemistryModel.C index 0f70a25a16..982eecb5e6 100644 --- a/src/thermophysicalModels/solidChemistryModel/pyrolysisChemistryModel/pyrolysisChemistryModel.C +++ b/src/thermophysicalModels/solidChemistryModel/pyrolysisChemistryModel/pyrolysisChemistryModel.C @@ -110,7 +110,7 @@ pyrolysisChemistryModel ); // Calculate inital values of Ysi0 = rho*delta*Yi - Ys0_[fieldI].internalFieldRef() = + Ys0_[fieldI].primitiveFieldRef() = this->solidThermo().rho() *max(this->Ys_[fieldI], scalar(0.001))*mesh.V(); } diff --git a/src/thermophysicalModels/solidThermo/solidThermo/heSolidThermo.C b/src/thermophysicalModels/solidThermo/solidThermo/heSolidThermo.C index e0812d4a78..b2cce5611d 100644 --- a/src/thermophysicalModels/solidThermo/solidThermo/heSolidThermo.C +++ b/src/thermophysicalModels/solidThermo/solidThermo/heSolidThermo.C @@ -31,12 +31,12 @@ License template<class BasicSolidThermo, class MixtureType> void Foam::heSolidThermo<BasicSolidThermo, MixtureType>::calculate() { - scalarField& TCells = this->T_.internalFieldRef(); + scalarField& TCells = this->T_.primitiveFieldRef(); const scalarField& hCells = this->he_; const scalarField& pCells = this->p_; - scalarField& rhoCells = this->rho_.internalFieldRef(); - scalarField& alphaCells = this->alpha_.internalFieldRef(); + scalarField& rhoCells = this->rho_.primitiveFieldRef(); + scalarField& alphaCells = this->alpha_.primitiveFieldRef(); forAll(TCells, celli) { @@ -218,7 +218,7 @@ Foam::heSolidThermo<BasicSolidThermo, MixtureType>::Kappa() const ); volVectorField& Kappa = tKappa.ref(); - vectorField& KappaCells = Kappa.internalFieldRef(); + vectorField& KappaCells = Kappa.primitiveFieldRef(); const scalarField& TCells = this->T_; const scalarField& pCells = this->p_; -- GitLab