MBDyn-1.7.3
|
Go to the source code of this file.
Macros | |
#define | NDEBUG |
#define | PUBLIC |
#define | PRIVATE static |
#define | MAX(a, b) (((a) > (b)) ? (a) : (b)) |
#define | MIN(a, b) (((a) < (b)) ? (a) : (b)) |
#define | ONES_COMPLEMENT(r) (-(r)-1) |
#define | TRUE (1) |
#define | FALSE (0) |
#define | EMPTY (-1) |
#define | ALIVE (0) |
#define | DEAD (-1) |
#define | DEAD_PRINCIPAL (-1) |
#define | DEAD_NON_PRINCIPAL (-2) |
#define | ROW_IS_DEAD(r) ROW_IS_MARKED_DEAD (Row[r].shared2.mark) |
#define | ROW_IS_MARKED_DEAD(row_mark) (row_mark < ALIVE) |
#define | ROW_IS_ALIVE(r) (Row [r].shared2.mark >= ALIVE) |
#define | COL_IS_DEAD(c) (Col [c].start < ALIVE) |
#define | COL_IS_ALIVE(c) (Col [c].start >= ALIVE) |
#define | COL_IS_DEAD_PRINCIPAL(c) (Col [c].start == DEAD_PRINCIPAL) |
#define | KILL_ROW(r) { Row [r].shared2.mark = DEAD ; } |
#define | KILL_PRINCIPAL_COL(c) { Col [c].start = DEAD_PRINCIPAL ; } |
#define | KILL_NON_PRINCIPAL_COL(c) { Col [c].start = DEAD_NON_PRINCIPAL ; } |
#define | PRINTF printf |
#define | INDEX(i) (i) |
#define | DEBUG0(params) ; |
#define | DEBUG1(params) ; |
#define | DEBUG2(params) ; |
#define | DEBUG3(params) ; |
#define | DEBUG4(params) ; |
#define | ASSERT(expression) ((void) 0) |
Typedefs | |
typedef long int | integer |
typedef double | doublereal |
#define ASSERT | ( | expression | ) | ((void) 0) |
Definition at line 977 of file colamd.c.
Referenced by FileName::_sPutExt(), OutputHandler::Abstract(), Accumulator::Accumulator(), Actuator::Actuator(), STLVectorHandler::Add(), VectorHandler::Add(), VecN::Add(), MyVectorHandler::Add(), Mat3xN::Add(), FullMatrixHandler::Add(), MatNx3::Add(), MatNxN::Add(), Mat6x6::AddMat(), Mat3xN::AddMat3x3(), InducedVelocity::AddSectionalForce(), FullMatrixHandler::AddT(), NonlinearSolver::AddTimeCPU(), Vec3::AddTo(), FullSubMatrixHandler::AddTo(), Mat3x3::AddTo(), SparseSubMatrixHandler::AddTo(), FullSubMatrixHandler::AddToT(), SparseSubMatrixHandler::AddToT(), CompactSparseMatrixHandler::AddUnchecked(), Mat3xN::AddVec(), MatNx3::AddVec(), Mat3x3::AddVec(), ThirdOrderIntegrator::Advance(), DerivativeSolver::Advance(), Step1Integrator::Advance(), Step2Integrator::Advance(), InverseDynamicsStepSolver::Advance(), OutputHandler::Aerodynamic(), Aerodynamic2DElem< iNN >::Aerodynamic2DElem(), AerodynamicBeam::AerodynamicBeam(), AerodynamicBeam2::AerodynamicBeam2(), AerodynamicBody::AerodynamicBody(), AerodynamicModal::AerodynamicModal(), OutputHandler::AeroModals(), NestedElem::AfterConvergence(), DrivenElem::AfterConvergence(), InducedVelocity::AfterConvergence(), LoadableElem::AfterConvergence(), ConstitutiveLawOwner< T, Tder >::AfterConvergence(), DiscreteControlElem::AfterConvergence(), DataManager::AfterConvergence(), DynamicStructDispNode::AfterConvergence(), DynamicStructNode::AfterConvergence(), DrivenElem::AfterPredict(), NestedElem::AfterPredict(), LoadableElem::AfterPredict(), OutputHandler::AirProps(), MatrixScale< T >::Allocate(), NamedValue::AllocName(), amul(), angle(), anglerel(), AngularAccelerationJoint::AngularAccelerationJoint(), angvel(), angvrel(), ArrayTplDriveCaller< T >::ArrayTplDriveCaller(), ArrayTplDriveCaller< doublereal >::ArrayTplDriveCaller(), DataManager::AssConstrJac(), DataManager::AssConstrRes(), DistanceJoint::AssJac(), DrivenElem::AssJac(), NestedElem::AssJac(), ThreeWayMinorLoss::AssJac(), RodBezier::AssJac(), Rod::AssJac(), ModuleNonsmoothNode::AssJac(), DistanceJointWithOffset::AssJac(), ElasticAxialJoint::AssJac(), ElasticDispJoint::AssJac(), ElasticHingeJoint::AssJac(), LoadableElem::AssJac(), ElasticJoint::AssJac(), Beam2::AssJac(), DataManager::AssJac(), LoadIncForce::AssJac(), DrivenElem::AssMats(), NestedElem::AssMats(), LoadableElem::AssMats(), DataManager::AssMats(), InLineJoint::AssRes(), DistanceJoint::AssRes(), UniversalHingeJoint::AssRes(), PrismaticJoint::AssRes(), SphericalHingeJoint::AssRes(), InPlaneJoint::AssRes(), DrivenElem::AssRes(), StructMappingExtForce::AssRes(), GenelDistance::AssRes(), NestedElem::AssRes(), RodBezier::AssRes(), PlaneHingeJoint::AssRes(), ViscousBody::AssRes(), DynamicMass::AssRes(), DynamicVariableBody::AssRes(), Rod::AssRes(), InLineWithOffsetJoint::AssRes(), TotalEquation::AssRes(), TotalJoint::AssRes(), DistanceJointWithOffset::AssRes(), UniversalRotationJoint::AssRes(), PinJoint::AssRes(), AeroDynModule::AssRes(), DeformableJoint::AssRes(), ElasticAxialJoint::AssRes(), ElasticDispJoint::AssRes(), StaticMass::AssRes(), ElasticHingeJoint::AssRes(), StaticVariableBody::AssRes(), LoadableElem::AssRes(), Beam2::AssRes(), UniversalPinJoint::AssRes(), PlaneRotationJoint::AssRes(), Modal::AssRes(), ClampJoint::AssRes(), ElasticDispJointInv::AssRes(), ViscousAxialJoint::AssRes(), DynamicBody::AssRes(), TotalPinJoint::AssRes(), ViscousHingeJoint::AssRes(), ViscousDispJoint::AssRes(), ViscoElasticAxialJoint::AssRes(), ModalBody::AssRes(), AxialRotationJoint::AssRes(), StaticBody::AssRes(), ViscoElasticDispJoint::AssRes(), TotalForce::AssRes(), LoadIncForce::AssRes(), PlanePinJoint::AssRes(), ViscoElasticHingeJoint::AssRes(), DriveDisplacementJoint::AssVec(), DriveHingeJoint::AssVec(), GenericAerodynamicForce::AssVec(), DriveDisplacementPinJoint::AssVec(), SparseSubMatrixHandler::Attach(), AutomaticStructElem::AutomaticStructElem(), NaiveSparsePermSolutionManager< T >::BackPerm(), Beam::Beam(), Beam2::Beam2(), OutputHandler::Beams(), BeamSliderJoint::BeamSliderJoint(), DrivenElem::BeforePredict(), NestedElem::BeforePredict(), LoadableElem::BeforePredict(), VecIter< Elem * >::bGetCurr(), VecIter< Elem * >::bGetFirst(), VecIter< Elem * >::bGetNext(), StrainGageParam::Bind(), NestedElem::bInverseDynamics(), DriveArrayCaller::bIsDifferentiable(), BiStopCLWrapper< T, Tder >::BiStopCLWrapper(), NonlinearSolverTestRange::bIsValid(), bmul(), Body::Body(), BufferStreamDrive_base::BufferStreamDrive_base(), c81_data_merge(), C81AeroData::C81AeroData(), C81InterpolatedAeroData::C81InterpolatedAeroData(), C81MultipleAeroData::C81MultipleAeroData(), MinMaxDriveDCR::c_str(), DataManager::Cast(), Solver::CheckTimeStepLimit(), IncludeParser::Close(), CenterOfMass::Collect_int(), SchurMatrixHandler::CompNewf(), SchurMatrixHandlerUm::CompNewf(), SchurMatrixHandler::CompNewg(), AutomaticStructElem::ComputeAccelerations(), IterativeMatrixScale< T >::ComputeScaleFactors(), MatrixHandler::ConditionNumber(), ConstitutiveLawOwner< T, Tder >::ConstitutiveLawOwner(), ContactJoint::ContactJoint(), Control_valve::Control_valve(), Control_valve2::Control_valve2(), DataManager::ConvergedSet(), VecN::Copy(), MatNxN::Copy(), FullMatrixHandler::CopyMatrixBlock(), FullMatrixHandler::CopyMatrixRow(), VecN::Create_(), Mat3xN::Create_(), MatNx3::Create_(), MatNxN::Create_(), FullMatrixHandler::CreateColRow(), IdentProcess::CreateIdent(), d_get_priv_data(), DAC_Process_Debug::DAC_Process_Debug(), STLVectorHandler::DecCoef(), MyVectorHandler::DecCoef(), FullMatrixHandler::DecCoef(), SparseSubMatrixHandler::DecCoef(), DeformableAxialJoint::DeformableAxialJoint(), DeformableDispJoint::DeformableDispJoint(), DeformableHingeJoint::DeformableHingeJoint(), DeformableJoint::DeformableJoint(), NestedElem::DescribeDof(), Node::DescribeDof(), TotalJoint::DescribeDof(), ConstitutiveLaw< doublereal, doublereal >::DescribeDof(), Elem::DescribeDof(), ModLugreFriction::DescribeDof(), Aerodynamic2DElem< iNN >::DescribeDof(), DiscreteCoulombFriction::DescribeDof(), ConstitutiveLawOwner< T, Tder >::DescribeDof(), TotalPinJoint::DescribeDof(), NestedElem::DescribeEq(), Node::DescribeEq(), TotalJoint::DescribeEq(), Elem::DescribeEq(), ConstitutiveLaw< doublereal, doublereal >::DescribeEq(), ModLugreFriction::DescribeEq(), Aerodynamic2DElem< iNN >::DescribeEq(), DiscreteCoulombFriction::DescribeEq(), ConstitutiveLawOwner< T, Tder >::DescribeEq(), TotalPinJoint::DescribeEq(), detect_super_cols(), FileDrive::dGet(), MultiStepDrive::dGet(), VecN::dGet(), Vec6::dGet(), Mat3xN::dGet(), Vec3::dGet(), MatNx3::dGet(), Mat6x6::dGet(), MatNxN::dGet(), Mat3x3::dGet(), DriveArrayCaller::dGet(), STLVectorHandler::dGetCoef(), MyVectorHandler::dGetCoef(), FullMatrixHandler::dGetCoef(), SparseSubMatrixHandler::dGetCoef(), AeroDynModule::dGetCurrBladeNodeBuiltinTwist(), AeroDynModule::dGetCurrBladeNodePITNOW(), GaussDataIterator::dGetCurrPnt(), NumIntIterator::dGetCurrPnt(), GaussDataIterator::dGetCurrWght(), NumIntIterator::dGetCurrWght(), Elem2Param::dGetDofValue(), StrainGageParam::dGetDofValue(), StructDispNode::dGetDofValue(), ScalarDifferentialNode::dGetDofValue(), ScalarAlgebraicNode::dGetDofValue(), DynamicStructDispNode::dGetDofValue(), StructNode::dGetDofValue(), DynamicStructNode::dGetDofValue(), StructDispNode::dGetDofValuePrev(), ScalarDifferentialNode::dGetDofValuePrev(), ScalarAlgebraicNode::dGetDofValuePrev(), DynamicStructDispNode::dGetDofValuePrev(), StructNode::dGetDofValuePrev(), DynamicStructNode::dGetDofValuePrev(), GaussDataIterator::dGetFirst(), NumIntIterator::dGetFirst(), IdentProcess::dGetForgettingFactor(), NestedElem::dGetM(), Factor::dGetNewStepTime(), DriveArrayCaller::dGetP(), Motor::dGetPhiElectric(), GaussData::dGetPnt(), TrapezoidData::dGetPnt(), HydraulicFluid::dGetPres0(), ModuleIMU::dGetPrivData(), LinearVelocityJoint::dGetPrivData(), ViscousBody::dGetPrivData(), DistanceJoint::dGetPrivData(), InducedVelocity::dGetPrivData(), DeformableAxialJoint::dGetPrivData(), DeformableDispJoint::dGetPrivData(), DeformableJoint::dGetPrivData(), DeformableHingeJoint::dGetPrivData(), Brake::dGetPrivData(), DriveDisplacementJoint::dGetPrivData(), DriveHingeJoint::dGetPrivData(), RodBezier::dGetPrivData(), PlaneHingeJoint::dGetPrivData(), Rod::dGetPrivData(), AngularVelocityJoint::dGetPrivData(), DistanceJointWithOffset::dGetPrivData(), TotalEquation::dGetPrivData(), TotalJoint::dGetPrivData(), HBeam::dGetPrivData(), StructDispNode::dGetPrivData(), LoadableElem::dGetPrivData(), DriveDisplacementPinJoint::dGetPrivData(), PlaneRotationJoint::dGetPrivData(), Beam2::dGetPrivData(), Wheel4::dGetPrivData(), Modal::dGetPrivData(), TotalReaction::dGetPrivData(), TimeStep::dGetPrivData(), Beam::dGetPrivData(), ViscoElasticBeam2::dGetPrivData(), TotalPinJoint::dGetPrivData(), AxialRotationJoint::dGetPrivData(), ViscoElasticBeam::dGetPrivData(), ShockAbsorberConstitutiveLaw< doublereal, doublereal >::dGetPrivData(), PlanePinJoint::dGetPrivData(), StructNode::dGetPrivData(), DeformableHingeJoint::dGetPrivDataInv(), HydraulicFluid::dGetTemp0(), DriveHandler::dGetTime(), NonlinearSolver::dGetTimeCPU(), DriveHandler::dGetTimeStep(), GaussData::dGetWght(), TrapezoidData::dGetWght(), DiscreteControlARXProcess_Debug::DiscreteControlARXProcess_Debug(), DiscreteControlElem::DiscreteControlElem(), DiscreteIdentProcess_Debug::DiscreteIdentProcess_Debug(), DispMeasure::DispMeasure(), distance(), DistanceJointWithOffset::DistanceJointWithOffset(), DataManager::DofOwnerInit(), DofOwnerOwner::DofOwnerOwner(), DofPlugIn::DofPlugIn(), OutputHandler::DofStats(), drive(), DriveArrayCaller::DriveArrayCaller(), OutputHandler::DriveCallers(), DriveDisplacementJoint::DriveDisplacementJoint(), DriveDisplacementPinJoint::DriveDisplacementPinJoint(), DriveHingeJoint::DriveHingeJoint(), DrivenElem::DrivenElem(), Beam::DsDxi(), DummyPlugIn::DummyPlugIn(), DummyStructNode::DummyStructNode(), Dynamic_control_valve::Dynamic_control_valve(), Dynamic_pipe::Dynamic_pipe(), DynamicForgettingFactor::DynamicForgettingFactor(), DynamicForgettingFactor2::DynamicForgettingFactor2(), DynamicPipe::DynamicPipe(), EE_Eval(), OutputHandler::Eigenanalysis(), OutputHandler::Electric(), DataManager::ElemAssInit(), DataManager::ElemOutputPrepare(), EE_Modulus::Eval(), EE_Divide::Eval(), EE_StmtList::Eval(), ImplicitStepIntegrator::EvalProd(), InverseDynamicsStepSolver::EvalProd(), OutputHandler::Externals(), IncludeParser::fCheckStack(), GaussDataIterator::fGetNext(), NumIntIterator::fGetNext(), FileDrive::FileDrive(), FileDriveCaller::FileDriveCaller(), find_ordering(), FixedStepFileDrive::FixedStepFileDrive(), Flow_valve::Flow_valve(), OutputHandler::Forces(), ForgettingFactor::ForgettingFactor(), FourierSeriesDriveCaller::FourierSeriesDriveCaller(), FreqSweepDriveCaller::FreqSweepDriveCaller(), FullMatrixHandler::FullMatrixHandler(), FullSubMatrixHandler::FullSubMatrixHandler(), garbage_collection(), GaussData::GaussData(), GenelCrossSpringDamperSupport::GenelCrossSpringDamperSupport(), GenelCrossSpringSupport::GenelCrossSpringSupport(), OutputHandler::Genels(), GenelSpringDamperSupport::GenelSpringDamperSupport(), GenelSpringSupport::GenelSpringSupport(), GenelStateSpaceMIMO::GenelStateSpaceMIMO(), GenelStateSpaceSISO::GenelStateSpaceSISO(), Eu2PhiWrap::Get(), GaussData::Get(), TrapezoidData::Get(), OutputHandler::Get(), NestedElem::GetAerodynamicElemType(), NestedElem::GetB_int(), BufferStreamElem::GetBuf(), BufferStreamDrive::GetBuf(), BufferStreamElem::GetBufRaw(), BufferStreamDrive::GetBufRaw(), BufferStreamDriveRaw::GetBufRaw(), Mat3x3::GetCol(), SolverDiagnostics::GetCondMatNorm(), MatrixScaleBase::GetCondNumNorm(), NestedElem::GetConnectedNodes(), LoadableElem::GetConnectedNodes(), DiscreteControlElem::GetConnectedNodes(), AeroDynModule::GetCurrBladeNodeRa(), AeroDynModule::GetCurrBladeR(), DataManager::GetDofDescription(), GenelClamp::GetDofType(), Accelerometer::GetDofType(), InlineFriction::GetDofType(), InLineJoint::GetDofType(), LinearAccelerationJoint::GetDofType(), DistanceJoint::GetDofType(), LinearVelocityJoint::GetDofType(), GenelStateSpaceSISO::GetDofType(), PrismaticJoint::GetDofType(), UniversalHingeJoint::GetDofType(), Pipe::GetDofType(), InPlaneContactJoint::GetDofType(), SphericalHingeJoint::GetDofType(), InPlaneJoint::GetDofType(), GimbalRotationJoint::GetDofType(), ContactJoint::GetDofType(), LoadIncNorm::GetDofType(), Accumulator::GetDofType(), NestedElem::GetDofType(), Brake::GetDofType(), DriveDisplacementJoint::GetDofType(), GenelDistance::GetDofType(), DriveHingeJoint::GetDofType(), TranslAccel::GetDofType(), PlaneHingeJoint::GetDofType(), TotalEquation::GetDofType(), AngularAccelerationJoint::GetDofType(), AerodynamicModal::GetDofType(), TotalJoint::GetDofType(), BeamSliderJoint::GetDofType(), GenelStateSpaceMIMO::GetDofType(), InLineWithOffsetJoint::GetDofType(), Dynamic_pipe::GetDofType(), AngularVelocityJoint::GetDofType(), DistanceJointWithOffset::GetDofType(), Tank::GetDofType(), UniversalRotationJoint::GetDofType(), PinJoint::GetDofType(), RotAccel::GetDofType(), Control_valve2::GetDofType(), InPlaneWithOffsetJoint::GetDofType(), StructDispNode::GetDofType(), Aerodynamic2DElem< iNN >::GetDofType(), Membrane4EAS::GetDofType(), LoadableElem::GetDofType(), DynamicPipe::GetDofType(), DriveDisplacementPinJoint::GetDofType(), PlaneRotationJoint::GetDofType(), UniversalPinJoint::GetDofType(), ClampJoint::GetDofType(), Dynamic_control_valve::GetDofType(), InducedVelocityElem::GetDofType(), Modal::GetDofType(), Shell4EAS::GetDofType(), ScalarDifferentialNode::GetDofType(), TotalReaction::GetDofType(), Shell4EASANS::GetDofType(), ConstitutiveLawOwner< T, Tder >::GetDofType(), ModuleIMUConstraint::GetDofType(), TotalPinJoint::GetDofType(), Pressure_flow_control_valve::GetDofType(), ScalarAlgebraicNode::GetDofType(), AxialRotationJoint::GetDofType(), GenelMass::GetDofType(), Pressure_valve::GetDofType(), Flow_valve::GetDofType(), PlanePinJoint::GetDofType(), Node2Scalar::GetDofType(), DataManager::GetDofType(), NestedElem::GetElemType(), DataManager::GetEqDescription(), GenelClamp::GetEqType(), InlineFriction::GetEqType(), GimbalRotationJoint::GetEqType(), LoadIncNorm::GetEqType(), NestedElem::GetEqType(), Membrane4EAS::GetEqType(), DynamicPipe::GetEqType(), ClampJoint::GetEqType(), Modal::GetEqType(), Shell4EAS::GetEqType(), Shell4EASANS::GetEqType(), DataManager::GetEqType(), BeamConn::Getf(), ConstitutiveLawOwner< T, Tder >::GetF(), ConstitutiveLawOwner< T, Tder >::GetFDE(), ConstitutiveLawOwner< T, Tder >::GetFDEPrime(), C81MultipleAeroData::GetForces(), Vec3::GetFrom(), Mat3x3::GetFrom(), NestedElem::GetG_int(), NaivePermMatrixHandler::GetInvPerm(), NestedElem::GetJ(), NestedElem::GetJ_int(), MathParser::GetLineNumber(), Mat6x6::GetMat(), Mat3xN::GetMat3x3(), Mat3xN::GetMat3x3ScalarMult(), MBDynParser::GetMat6xN(), NamedValue::GetName(), InitialAssemblyIterator::GetNext(), NestedElem::GetNumConnectedNodes(), LoadableElem::GetNumConnectedNodes(), NaivePermMatrixHandler::GetPerm(), Rotor::GetPos(), BeamConn::GetR(), Mat3x3::GetRow(), NestedElem::GetS(), NestedElem::GetS_int(), LinSol::GetSolutionManager(), MathParser::GetToken(), Vec6::GetVec(), Mat3xN::GetVec(), MatNx3::GetVec(), Mat3x3::GetVec(), GimbalRotationJoint::GimbalRotationJoint(), gpc_addmul(), GPC_LAPACK_pinv::GPC_LAPACK_pinv(), gpc_mul(), GPCDesigner::GPCDesigner(), OutputHandler::Gravity(), Gust1D::Gust1D(), HBeam::HBeam(), HopeSolver::HopeSolver(), OutputHandler::Hydraulic(), HydraulicElem::HydraulicElem(), HydrodynamicPlainBearing::HydrodynamicPlainBearing(), DataManager::IDDofInit(), Ident::Ident(), IdentProcess::IdentProcess(), FullSubMatrixHandler::iGetColIndex(), SparseSubMatrixHandler::iGetColIndex(), AeroDynModule::iGetCurrBlade(), AeroDynModule::iGetCurrBladeElem(), NestedElem::iGetFirstIndex(), NestedElem::iGetInitialNumDof(), LoadableElem::iGetInitialNumDof(), NestedElem::iGetNumDof(), ModuleNonsmoothNode::iGetNumDof(), LoadableElem::iGetNumDof(), ConstitutiveLawOwner< T, Tder >::iGetNumDof(), LoadableElem::iGetNumPrivData(), LinearAccelerationJoint::iGetPrivDataIdx(), LinearVelocityJoint::iGetPrivDataIdx(), AircraftInstruments::iGetPrivDataIdx(), ViscousBody::iGetPrivDataIdx(), DistanceJoint::iGetPrivDataIdx(), InducedVelocity::iGetPrivDataIdx(), DeformableAxialJoint::iGetPrivDataIdx(), DeformableDispJoint::iGetPrivDataIdx(), DeformableJoint::iGetPrivDataIdx(), Brake::iGetPrivDataIdx(), DeformableHingeJoint::iGetPrivDataIdx(), DriveDisplacementJoint::iGetPrivDataIdx(), DriveHingeJoint::iGetPrivDataIdx(), RodBezier::iGetPrivDataIdx(), AngularAccelerationJoint::iGetPrivDataIdx(), PlaneHingeJoint::iGetPrivDataIdx(), AirProperties::iGetPrivDataIdx(), Rod::iGetPrivDataIdx(), AngularVelocityJoint::iGetPrivDataIdx(), DistanceJointWithOffset::iGetPrivDataIdx(), TotalEquation::iGetPrivDataIdx(), TotalJoint::iGetPrivDataIdx(), HBeam::iGetPrivDataIdx(), LoadableElem::iGetPrivDataIdx(), DriveDisplacementPinJoint::iGetPrivDataIdx(), PlaneRotationJoint::iGetPrivDataIdx(), Wheel4::iGetPrivDataIdx(), Modal::iGetPrivDataIdx(), ClampJoint::iGetPrivDataIdx(), ScalarDifferentialNode::iGetPrivDataIdx(), TotalReaction::iGetPrivDataIdx(), TimeStep::iGetPrivDataIdx(), Beam::iGetPrivDataIdx(), TotalPinJoint::iGetPrivDataIdx(), ScalarAlgebraicNode::iGetPrivDataIdx(), AxialRotationJoint::iGetPrivDataIdx(), ShockAbsorberConstitutiveLaw< doublereal, doublereal >::iGetPrivDataIdx(), PlanePinJoint::iGetPrivDataIdx(), Beam::iGetPrivDataIdx_int(), FullSubMatrixHandler::iGetRowIndex(), SparseSubMatrixHandler::iGetRowIndex(), MySubVectorHandler::iGetRowIndex(), DriveHandler::iGetStep(), DataManager::iIDGetTotNumDofs(), FileName::iInit(), STLVectorHandler::IncCoef(), MyVectorHandler::IncCoef(), FullMatrixHandler::IncCoef(), SparseSubMatrixHandler::IncCoef(), IncludeParser::IncludeParser(), OutputHandler::Inertia(), RTAISolver::Init(), VecIter< Elem * >::Init(), UniformRotor::Init(), GlauertRotor::Init(), ManglerRotor::Init(), DynamicInflowRotor::Init(), PetersHeRotor::Init(), init_rows_cols(), init_scoring(), InitialAssemblyIterator::InitialAssemblyIterator(), ModuleTemplate::InitialAssJac(), ModuleMDS::InitialAssJac(), ModuleIMU::InitialAssJac(), DistanceJoint::InitialAssJac(), LoadIncNorm::InitialAssJac(), ModuleFMU::InitialAssJac(), CyclocopterInflow::InitialAssJac(), ModuleNonsmoothNode::InitialAssJac(), DistanceJointWithOffset::InitialAssJac(), AeroDynModule::InitialAssJac(), NestedElem::InitialAssJac(), LoadableElem::InitialAssJac(), Wheel4::InitialAssJac(), ModuleIMUConstraint::InitialAssJac(), TimeStep::InitialAssJac(), LoadIncForce::InitialAssJac(), ModuleTemplate::InitialAssRes(), ModuleMDS::InitialAssRes(), ModuleIMU::InitialAssRes(), DistanceJoint::InitialAssRes(), LoadIncNorm::InitialAssRes(), ModuleFMU::InitialAssRes(), CyclocopterInflow::InitialAssRes(), ModuleNonsmoothNode::InitialAssRes(), AeroDynModule::InitialAssRes(), DistanceJointWithOffset::InitialAssRes(), NestedElem::InitialAssRes(), LoadableElem::InitialAssRes(), Wheel4::InitialAssRes(), ModuleIMUConstraint::InitialAssRes(), TimeStep::InitialAssRes(), LoadIncForce::InitialAssRes(), DataManager::InitialJointAssembly(), NestedElem::InitialWorkSpaceDim(), LoadableElem::InitialWorkSpaceDim(), Rotor::InitParam(), InitSF(), InitUDE(), STLVectorHandler::InnerProd(), VectorHandler::InnerProd(), GPC_LAPACK_pinv::Inv(), Mat3x3::Inv(), is_abs_path(), Mat3x3::IsDiag(), OutputHandler::IsOpen(), IsotropicHardeningConstitutiveLaw< T, Tder >::IsotropicHardeningConstitutiveLaw(), Mat3x3::IsSymmetric(), ThirdOrderIntegrator::Jacobian(), DerivativeSolver::Jacobian(), StepNIntegrator::Jacobian(), InverseDynamicsStepSolver::Jacobian(), OutputHandler::Joints(), LabelSearch(), Mat3x3::LDLSolve(), LinearAccelerationJoint::LinearAccelerationJoint(), LineSearchSolver::LineSearch(), OutputHandler::Loadable(), LoadableElem::LoadableElem(), LoadIncForce::LoadIncForce(), LoadIncNorm::LoadIncNorm(), OutputHandler::Log(), LogarithmicWindProfile::LogarithmicWindProfile(), LogConstitutiveLaw< doublereal, doublereal >::LogConstitutiveLaw(), OutputHandler::LogOpen(), NonlinearSolverTest::MakeTest(), Mass::Mass(), Mat3x3::Mat3x3(), Mat3xN::Mat3xN(), Mat6x6::Mat6x6(), NaiveMatrixHandler::MatMatMul_base(), CompactSparseMatrixHandler_tpl< off >::MatMatMul_base(), NaivePermMatrixHandler::MatMatMul_base(), MatR2vec(), NaiveMatrixHandler::MatTMatMul_base(), CompactSparseMatrixHandler_tpl< off >::MatTMatMul_base(), NaivePermMatrixHandler::MatTMatMul_base(), NaiveMatrixHandler::MatTVecMul_base(), CompactSparseMatrixHandler_tpl< off >::MatTVecMul_base(), FullMatrixHandler::MatTVecMul_base(), NaivePermMatrixHandler::MatTVecMul_base(), NaiveMatrixHandler::MatVecMul_base(), CompactSparseMatrixHandler_tpl< off >::MatVecMul_base(), FullMatrixHandler::MatVecMul_base(), NaivePermMatrixHandler::MatVecMul_base(), mbdyn_make_salt(), mbdyn_parse_arguments(), mbdyn_program(), mbdyn_symamd(), mbedge_eat_field(), mbedge_eat_sep(), MinorLoss::MinorLoss(), Modal::Modal(), OutputHandler::Modal(), ModalExt::ModalExt(), ModalForce::ModalForce(), ModalMappingExt::ModalMappingExt(), model_curr(), model_elem(), model_node(), model_sf(), StreamContentCopyCast::Modify(), mp_acos_t(), mp_acosh_t(), mp_actg(), mp_actg2(), mp_asin_t(), mp_atanh_t(), mp_cast(), mp_ctg(), mp_ctg_t(), mp_ctgh(), mp_ctgh_t(), mp_func_1(), mp_func_2(), mp_greater_than_0_t(), mp_greater_than_or_equal_to_0_t(), mp_in(), mp_max(), mp_min(), mp_par(), mp_print(), mp_ramp(), mp_rand(), mp_rndm(), mp_sign(), mp_sprintf(), mp_sramp(), mp_srnd(), mp_step(), mp_stop(), mp_tan_t(), VecN::Mult(), Mat3xN::Mult(), MatNxN::Mult(), MultistepSolver::MultistepSolver(), MySubVectorHandler::MySubVectorHandler(), MyVectorHandler::MyVectorHandler(), NaiveMatrixHandler::NaiveMatrixHandler(), NaivePermMatrixHandler::NaivePermMatrixHandler(), NestedElem::NeedsAirProperties(), NestedElem::NestedElem(), DataManager::NodeOutputPrepare(), Beam::Omega0(), STLVectorHandler::operator()(), NaiveMatrixHandler::operator()(), VecN::operator()(), Vec6::operator()(), MyVectorHandler::operator()(), FullMatrixHandler::operator()(), NaivePermMatrixHandler::operator()(), Vec3::operator()(), Mat3xN::operator()(), MatNx3::operator()(), Mat6x6::operator()(), MatNxN::operator()(), Mat3x3::operator()(), SparseSubMatrixHandler::operator()(), Mat3xN::operator*(), STLVectorHandler::operator+=(), VectorHandler::operator+=(), MyVectorHandler::operator+=(), STLVectorHandler::operator-=(), VectorHandler::operator-=(), MyVectorHandler::operator-=(), Vec6::operator/(), VecExp::operator/(), MatExp::operator/(), Vec3::operator/(), Mat6x6::operator/(), Mat3x3::operator/(), Vec3::operator/=(), Mat6x6::operator/=(), Mat3x3::operator/=(), operator<<(), STLVectorHandler::operator=(), MyVectorHandler::operator=(), Vec3::operator[](), order_children(), Orifice::Orifice(), NestedElem::Output(), DrivenElem::Output(), RodBezier::Output(), Rod::Output(), Joint::Output(), OutputHandler::Output(), LoadableElem::Output(), AerodynamicBody::Output(), AerodynamicBeam::Output(), DriveCaller::Output(), AerodynamicBeam2::Output(), DataManager::OutputEigenvectors(), DataManager::OutputEigGeometry(), DataManager::OutputEigOpen(), NestedElem::OutputPrepare(), AbsoluteDispForce::OutputPrepare(), AbsoluteInternalDispForce::OutputPrepare(), AutomaticStructDispElem::OutputPrepare(), Aerodynamic2DElem< iNN >::OutputPrepare(), StructDispNode::OutputPrepare(), Beam2::OutputPrepare(), AbsoluteForce::OutputPrepare(), AutomaticStructElem::OutputPrepare(), Wheel4::OutputPrepare(), FollowerForce::OutputPrepare(), Beam::OutputPrepare(), AbsoluteCouple::OutputPrepare(), DataManager::OutputPrepare(), FollowerCouple::OutputPrepare(), AbsoluteInternalForce::OutputPrepare(), FollowerInternalForce::OutputPrepare(), AbsoluteInternalCouple::OutputPrepare(), FollowerInternalCouple::OutputPrepare(), StructNode::OutputPrepare(), Joint::OutputPrepare_int(), Inertia::OutputPrepare_int(), OutputHandler::Parameters(), OutputHandler::Partition(), OutputHandler::PartitionOpen(), DataManager::pChooseElem(), DriveArrayCaller::pCopy(), FullMatrixHandler::pdGetMat(), FullMatrixHandler::pdGetVec(), SolutionManager::pdSetResVec(), SolutionManager::pdSetSolVec(), DataManager::pFindDrive(), DataManager::pFindElem(), ConstitutiveLawOwner< T, Tder >::pGetConstLaw(), AeroDynModule::pGetCurrBladeNode(), DofOwnerOwner::pGetDofOwner(), NestedElem::pGetDofOwner(), SwitchDriveCaller::pGetDrive(), NestedElem::pGetInducedVelocity(), Mat6x6::pGetMat(), HBeam::pGetNode(), Membrane4EAS::pGetNode(), Beam2::pGetNode(), Shell4EAS::pGetNode(), Beam::pGetNode(), Shell4EASANS::pGetNode(), Solver::pGetStepIntegrator(), Vec6::pGetVec(), PiecewiseConstShape1D::PiecewiseConstShape1D(), PiecewiseLinearDriveCaller::PiecewiseLinearDriveCaller(), PiecewiseLinearShape1D::PiecewiseLinearShape1D(), PiezoActuatorBeam::PiezoActuatorBeam(), PiezoActuatorBeam2::PiezoActuatorBeam2(), PiezoActuatorVEBeam::PiezoActuatorVEBeam(), PiezoActuatorVEBeam2::PiezoActuatorVEBeam2(), Pipe::Pipe(), PivotRelFrameDummyStructNode::PivotRelFrameDummyStructNode(), pLabelSearch(), OutputHandler::Plates(), PointSurfaceContact::PointSurfaceContact(), NodeResForces::Pole(), position(), PowerLawWindProfile::PowerLawWindProfile(), DataManager::ppFindElem(), AeroMemory::Predict(), ThirdOrderIntegrator::Predict(), Step1Integrator::Predict(), Step2Integrator::Predict(), StreamContentMotion::Prepare(), InverseSolver::Prepare(), Solver::Prepare(), OutputHandler::PresNodes(), Pressure_flow_control_valve::Pressure_flow_control_valve(), Pressure_valve::Pressure_valve(), PrismaticJoint::PrismaticJoint(), PrivPlugIn::PrivPlugIn(), STLVectorHandler::Put(), VectorHandler::Put(), VecN::Put(), Vec6::Put(), MyVectorHandler::Put(), Mat3xN::Put(), Vec3::Put(), FullMatrixHandler::Put(), MatNx3::Put(), MatNxN::Put(), Mat6x6::Put(), Mat3x3::Put(), AirPropOwner::PutAirProperties(), NestedElem::PutAirProperties(), STLVectorHandler::PutCoef(), FullMatrixHandler::PutCoef(), MyVectorHandler::PutCoef(), SparseSubMatrixHandler::PutCoef(), FullSubMatrixHandler::PutColIndex(), SparseSubMatrixHandler::PutColIndex(), FullSubMatrixHandler::PutCross(), SparseSubMatrixHandler::PutCross(), FullSubMatrixHandler::PutDiag(), SparseSubMatrixHandler::PutDiag(), GravityOwner::PutGravity(), SparseSubMatrixHandler::PutItem(), MySubVectorHandler::PutItem(), Mat6x6::PutMat(), Mat3xN::PutMat3x3(), SparseSubMatrixHandler::PutMat3x3(), DAC_Process_Debug::PutOutput(), FullSubMatrixHandler::PutRowIndex(), SparseSubMatrixHandler::PutRowIndex(), MySubVectorHandler::PutRowIndex(), FullMatrixHandler::PutT(), Vec6::PutTo(), Vec3::PutTo(), Mat3x3::PutTo(), Mat3xN::PutVec(), MatNx3::PutVec(), Mat3x3::PutVec(), DofPlugIn::Read(), IncludeDR::Read(), RefFrameDR::Read(), ChDirDR::Read(), HFluidDR::Read(), C81DataDR::Read(), ConstLawDR::Read(), MinMaxDriveDCR::Read(), DriveCallerDR::Read(), TplDriveCallerDR::Read(), SFuncDR::Read(), ModuleLoadDR::Read(), SymbolicCLR< T, Tder >::Read(), ReadAerodynamicBeam(), ReadAirstreamData(), ReadBufferStreamDrive(), ReadBufferStreamElem(), DataManager::ReadControl(), InverseSolver::ReadData(), Solver::ReadData(), ReadElectric(), DataManager::ReadElem(), DataManager::ReadElems(), ReadFF(), ReadGenel(), ReadHydraulicElem(), ReadInducedVelocity(), ReadLoadable(), ReadMembraneConstLaw(), ReadModal(), ReadModalExtForce(), ReadModalMappingExtForce(), DataManager::ReadNode(), DataManager::ReadNodes(), ReadOneBufCast(), ReadPX(), ReadRotor(), ReadShape(), ReadShellConstLaw(), ReadStructMappingExtForce(), ReadStructNode(), ReadTimeStepData(), ExtRigidForceEDGE::Recv(), ExtModalForceEDGE::Recv(), StructExtForce::RecvFromFileDes(), StructExtEDGEForce::RecvFromStream(), StructExtForce::RecvFromStream(), ReferenceFrame::ReferenceFrame(), OutputHandler::ReferenceFrames(), Converged::Register(), MathParser::RegisterNameSpace(), RelFrameDummyStructNode::RelFrameDummyStructNode(), MyVectorHandler::Reset(), SparseSubMatrixHandler::Reset(), AerodynamicOutput::ResetIterator(), ResForceSet::ResForceSet(), ThirdOrderIntegrator::Residual(), DerivativeSolver::Residual(), StepNIntegrator::Residual(), InverseDynamicsStepSolver::Residual(), STLVectorHandler::Resize(), VecN::Resize(), Mat3xN::Resize(), FullSubMatrixHandler::Resize(), MatNx3::Resize(), SparseSubMatrixHandler::Resize(), MySubVectorHandler::Resize(), DrivenElem::Restart(), InverseSolver::Restart(), OutputHandler::Restart(), LoadableElem::Restart(), Solver::Restart(), DriveArrayCaller::Restart(), OutputHandler::RestartOpen(), OutputHandler::RestartXSol(), Rod::Rod(), RodBezier::RodBezier(), RodWithOffset::RodWithOffset(), RotAccel::RotAccel(), OutputHandler::Rotors(), RotorTrim::RotorTrim(), RotorTrimBase::RotorTrimBase(), RTAISolver::RTAISolver(), RTMBDynInDrive::RTMBDynInDrive(), RTMBDynOutElem::RTMBDynOutElem(), RTSolverBase::RTSolverBase(), RunMBDyn(), SampleAndHold::SampleAndHold(), STLVectorHandler::ScalarAddMul(), VectorHandler::ScalarAddMul(), MyVectorHandler::ScalarAddMul(), ScalarFunctionOrthotropicCL< T, Tder >::ScalarFunctionOrthotropicCL(), ScalarFuncWindProfile::ScalarFuncWindProfile(), STLVectorHandler::ScalarMul(), VectorHandler::ScalarMul(), MyVectorHandler::ScalarMul(), ScalarPX::ScalarPX(), NaiveSparseSolutionManager::ScaleSolution(), MatrixScaleBase::ScaleVector(), ExtRigidForceEDGE::Send(), ExtModalForceEDGE::Send(), VariableStepFileDrive::ServePending(), TplDriveOwner< Vec6 >::Set(), DriveOwner::Set(), StreamContentCopyCast::Set(), Gust::SetAirProperties(), HopeSolver::SetCoef(), AeroDynModule::SetCurrBladeNodePITNOW(), AerodynamicOutput::SetData(), MBDynParser::SetDataManager(), StructDispNode::SetDofValue(), ScalarDifferentialNode::SetDofValue(), ScalarAlgebraicNode::SetDofValue(), DynamicStructDispNode::SetDofValue(), Node2Scalar::SetDofValue(), StructNode::SetDofValue(), DynamicStructNode::SetDofValue(), NestedElem::SetInitialValue(), LoadableElem::SetInitialValue(), NestedElem::SetOutputFlag(), ToBeOutput::SetOutputFlag(), OutputHandler::SetPrecision(), C81MultipleAeroData::SetSectionData(), C81InterpolatedAeroData::SetSectionData(), DriveHandler::SetTime(), Traceable::SetTraceFlag(), RTAISolver::Setup(), NestedElem::SetValue(), DrivenElem::SetValue(), LoadableElem::SetValue(), ViscoElasticBeam2::SetValue(), ViscoElasticBeam::SetValue(), DriveHandler::SetVar(), OutputHandler::SetWidth(), ShapeFunc2N(), ShapeFunc3N(), ShapeOwner::ShapeOwner(), BiCGStab::Solve(), Gmres::Solve(), NewtonRaphsonSolver::Solve(), LineSearchSolver::Solve(), NaiveSparsePermSolutionManager< T >::Solve(), Mat3x3::Solve(), Solver::Solver(), SparseSubMatrixHandler::SparseSubMatrixHandler(), STAHRAeroData::STAHRAeroData(), Solver::Start(), StdAirProperties::StdAirProperties(), STLVectorHandler::STLVectorHandler(), StreamContentCopyCast::StreamContentCopyCast(), StreamContentMotion::StreamContentMotion(), StreamContentValue::StreamContentValue(), StreamDrive::StreamDrive(), StreamDriveCopyCast::StreamDriveCopyCast(), StreamOutElem::StreamOutElem(), StringDriveCaller::StringDriveCaller(), OutputHandler::StrNodes(), StructExtEDGEForce::StructExtEDGEForce(), StructExtForce::StructExtForce(), StructMappingExtForce::StructMappingExtForce(), StructuralForce::StructuralForce(), StructuralInternalForce::StructuralInternalForce(), STLVectorHandler::Sub(), VectorHandler::Sub(), VecN::Sub(), MyVectorHandler::Sub(), Mat3xN::Sub(), FullMatrixHandler::Sub(), MatNx3::Sub(), MatNxN::Sub(), Vec3::SubFrom(), FullSubMatrixHandler::SubFrom(), SparseSubMatrixHandler::SubFrom(), FullSubMatrixHandler::SubFromT(), SparseSubMatrixHandler::SubFromT(), Mat6x6::SubMat(), Mat3xN::SubMat3x3(), FullMatrixHandler::SubT(), Mat3xN::SubVec(), MatNx3::SubVec(), Mat3x3::SubVec(), SwashPlate::SwashPlate(), Tank::Tank(), NonlinearSolverTestMinMax::TestMerge(), ImplicitStepIntegrator::TestScale(), InverseDynamicsStepSolver::TestScale(), TheodorsenAeroData::TheodorsenAeroData(), OutputHandler::ThermalElements(), OutputHandler::ThermalNodes(), ThreeWayMinorLoss::ThreeWayMinorLoss(), TotalEquation::TotalEquation(), TotalJoint::TotalJoint(), TotalPinJoint::TotalPinJoint(), DriveCaller::Trace(), OutputHandler::Traces(), TranslAccel::TranslAccel(), TypedValue::TypedValue(), unit_convert(), unitvec(), AeroMemory::Update(), ThirdOrderIntegrator::Update(), DrivenElem::Update(), NestedElem::Update(), DerivativeSolver::Update(), StepNIntegrator::Update(), StructDispNode::Update(), LoadableElem::Update(), ConstitutiveLawOwner< T, Tder >::Update(), ClampJoint::Update(), TotalPinJoint::Update(), DataManager::Update(), DynamicStructDispNode::Update(), InverseDynamicsStepSolver::Update(), LogConstitutiveLaw< doublereal, doublereal >::Update(), StructNode::Update(), DynamicStructNode::Update(), OutputHandler::UseDefaultPrecision(), OutputHandler::UseNetCDF(), OutputHandler::UseScientific(), OutputHandler::UseText(), VariableBody::VariableBody(), VariableStepFileDrive::VariableStepFileDrive(), Vec3::Vec3(), VecIter< Elem * >::VecIter(), VecN::VecN(), VectorPX::VectorPX(), velocity(), ViscousBody::ViscousBody(), vrel(), NestedElem::WorkSpaceDim(), ModuleNonsmoothNode::WorkSpaceDim(), LoadableElem::WorkSpaceDim(), Beam::~Beam(), Beam2::~Beam2(), ConstitutiveLawOwner< T, Tder >::~ConstitutiveLawOwner(), DriveArrayCaller::~DriveArrayCaller(), DrivenElem::~DrivenElem(), HBeam::~HBeam(), HighParser::~HighParser(), LoadableElem::~LoadableElem(), Membrane4EAS::~Membrane4EAS(), NamedValue::~NamedValue(), NestedElem::~NestedElem(), PiezoActuatorBeam2::~PiezoActuatorBeam2(), PiezoActuatorVEBeam2::~PiezoActuatorVEBeam2(), ShapeOwner::~ShapeOwner(), Shell4EAS::~Shell4EAS(), and Shell4EASANS::~Shell4EASANS().
Definition at line 783 of file colamd.c.
Referenced by detect_super_cols(), find_ordering(), garbage_collection(), and init_scoring().
Definition at line 782 of file colamd.c.
Referenced by detect_super_cols(), find_ordering(), init_scoring(), and order_children().
#define COL_IS_DEAD_PRINCIPAL | ( | c | ) | (Col [c].start == DEAD_PRINCIPAL) |
Definition at line 784 of file colamd.c.
Referenced by order_children().
#define DEBUG0 | ( | params | ) | ; |
Definition at line 971 of file colamd.c.
Referenced by init_rows_cols(), mbdyn_colamd(), and mbdyn_symamd().
#define DEBUG1 | ( | params | ) | ; |
Definition at line 972 of file colamd.c.
Referenced by find_ordering(), init_rows_cols(), init_scoring(), and mbdyn_symamd().
#define DEBUG2 | ( | params | ) | ; |
Definition at line 973 of file colamd.c.
Referenced by find_ordering(), garbage_collection(), and init_scoring().
#define DEBUG3 | ( | params | ) | ; |
Definition at line 974 of file colamd.c.
Referenced by find_ordering(), and garbage_collection().
#define DEBUG4 | ( | params | ) | ; |
Definition at line 975 of file colamd.c.
Referenced by find_ordering(), and init_scoring().
#define EMPTY (-1) |
Definition at line 768 of file colamd.c.
Referenced by detect_super_cols(), find_ordering(), init_rows_cols(), init_scoring(), order_children(), InverseSolver::Prepare(), Solver::Prepare(), and ReadLinSol().
#define FALSE (0) |
Definition at line 763 of file colamd.c.
Referenced by init_rows_cols(), mbdyn_colamd(), and mbdyn_symamd().
#define INDEX | ( | i | ) | (i) |
Definition at line 809 of file colamd.c.
Referenced by print_report().
#define KILL_NON_PRINCIPAL_COL | ( | c | ) | { Col [c].start = DEAD_NON_PRINCIPAL ; } |
Definition at line 787 of file colamd.c.
Referenced by detect_super_cols().
#define KILL_PRINCIPAL_COL | ( | c | ) | { Col [c].start = DEAD_PRINCIPAL ; } |
Definition at line 786 of file colamd.c.
Referenced by find_ordering(), and init_scoring().
#define KILL_ROW | ( | r | ) | { Row [r].shared2.mark = DEAD ; } |
Definition at line 785 of file colamd.c.
Referenced by find_ordering(), garbage_collection(), and init_scoring().
Definition at line 749 of file colamd.c.
Referenced by find_ordering(), and init_scoring().
Definition at line 750 of file colamd.c.
Referenced by find_ordering(), and init_scoring().
#define NDEBUG |
Definition at line 692 of file colamd.c.
Referenced by find_ordering().
#define ONES_COMPLEMENT | ( | r | ) | (-(r)-1) |
Definition at line 752 of file colamd.c.
Referenced by garbage_collection().
#define PRINTF printf |
Definition at line 806 of file colamd.c.
Referenced by print_report().
#define ROW_IS_ALIVE | ( | r | ) | (Row [r].shared2.mark >= ALIVE) |
Definition at line 781 of file colamd.c.
Referenced by clear_mark(), detect_super_cols(), find_ordering(), and garbage_collection().
#define ROW_IS_DEAD | ( | r | ) | ROW_IS_MARKED_DEAD (Row[r].shared2.mark) |
Definition at line 779 of file colamd.c.
Referenced by find_ordering(), and init_scoring().
#define ROW_IS_MARKED_DEAD | ( | row_mark | ) | (row_mark < ALIVE) |
Definition at line 780 of file colamd.c.
Referenced by find_ordering().
#define TRUE (1) |
Definition at line 759 of file colamd.c.
Referenced by init_rows_cols(), mbdyn_colamd(), and mbdyn_symamd().
typedef double doublereal |
|
static |
Definition at line 3064 of file colamd.c.
References ROW_IS_ALIVE.
Referenced by find_ordering().
|
static |
Definition at line 2771 of file colamd.c.
References ASSERT, c, COL_IS_ALIVE, COL_IS_DEAD, EMPTY, KILL_NON_PRINCIPAL_COL, and ROW_IS_ALIVE.
Referenced by find_ordering().
|
static |
Definition at line 2106 of file colamd.c.
References ASSERT, clear_mark(), COL_IS_ALIVE, COL_IS_DEAD, DEBUG1, DEBUG2, DEBUG3, DEBUG4, detect_super_cols(), EMPTY, garbage_collection(), KILL_PRINCIPAL_COL, KILL_ROW, MAX, MIN, NDEBUG, ROW_IS_ALIVE, ROW_IS_DEAD, and ROW_IS_MARKED_DEAD.
Referenced by mbdyn_colamd().
|
static |
Definition at line 2928 of file colamd.c.
References ASSERT, c, COL_IS_ALIVE, DEBUG2, DEBUG3, KILL_ROW, ONES_COMPLEMENT, and ROW_IS_ALIVE.
Referenced by find_ordering().
|
static |
Definition at line 1613 of file colamd.c.
References ASSERT, COLAMD_ERROR_col_length_negative, COLAMD_ERROR_row_index_out_of_bounds, COLAMD_INFO1, COLAMD_INFO2, COLAMD_INFO3, COLAMD_OK_BUT_JUMBLED, COLAMD_STATUS, DEBUG0, DEBUG1, EMPTY, FALSE, and TRUE.
Referenced by mbdyn_colamd().
|
static |
Definition at line 1850 of file colamd.c.
References ASSERT, c, COL_IS_ALIVE, COL_IS_DEAD, COLAMD_DENSE_COL, COLAMD_DENSE_ROW, DEBUG1, DEBUG2, DEBUG4, mbdyn_Colamd_Row::degree, mbdyn_Colamd_Col::degree_next, EMPTY, KILL_PRINCIPAL_COL, KILL_ROW, mbdyn_Colamd_Col::length, MAX, MIN, mbdyn_Colamd_Col::order, mbdyn_Colamd_Col::prev, ROW_IS_DEAD, mbdyn_Colamd_Col::score, mbdyn_Colamd_Row::shared1, mbdyn_Colamd_Col::shared2, mbdyn_Colamd_Col::shared3, mbdyn_Colamd_Col::shared4, and mbdyn_Colamd_Col::start.
Referenced by mbdyn_colamd().
integer mbdyn_colamd | ( | integer | n_row, |
integer | n_col, | ||
integer | Alen, | ||
integer | A[], | ||
integer | p[], | ||
double | knobs[20], | ||
integer | stats[20] | ||
) |
Definition at line 1411 of file colamd.c.
References COLAMD_C, COLAMD_DEFRAG_COUNT, COLAMD_DENSE_COL, COLAMD_DENSE_ROW, COLAMD_ERROR_A_not_present, COLAMD_ERROR_A_too_small, COLAMD_ERROR_ncol_negative, COLAMD_ERROR_nnz_negative, COLAMD_ERROR_nrow_negative, COLAMD_ERROR_p0_nonzero, COLAMD_ERROR_p_not_present, COLAMD_INFO1, COLAMD_INFO2, COLAMD_KNOBS, COLAMD_OK, COLAMD_R, COLAMD_STATS, COLAMD_STATUS, DEBUG0, FALSE, find_ordering(), init_rows_cols(), init_scoring(), mbdyn_colamd_set_defaults(), order_children(), and TRUE.
Referenced by NaiveSparsePermSolutionManager< T >::ComputePermutation(), and mbdyn_symamd().
Definition at line 1004 of file colamd.c.
References COLAMD_RECOMMENDED.
Referenced by NaiveSparsePermSolutionManager< T >::ComputePermutation(), and mbdyn_symamd().
void mbdyn_colamd_report | ( | integer | stats[20] | ) |
Definition at line 1570 of file colamd.c.
References print_report().
void mbdyn_colamd_set_defaults | ( | double | knobs[20] | ) |
Definition at line 1038 of file colamd.c.
References COLAMD_DENSE_COL, COLAMD_DENSE_ROW, and COLAMD_KNOBS.
Referenced by NaiveSparsePermSolutionManager< T >::ComputePermutation(), mbdyn_colamd(), and mbdyn_symamd().
integer mbdyn_symamd | ( | integer | n, |
integer | A[], | ||
integer | p[], | ||
integer | perm[], | ||
double | knobs[20], | ||
integer | stats[20], | ||
void *(*)(size_t, size_t) | allocate, | ||
void(*)(void *) | release | ||
) |
Definition at line 1066 of file colamd.c.
References ASSERT, COLAMD_DEFRAG_COUNT, COLAMD_DENSE_COL, COLAMD_DENSE_ROW, COLAMD_ERROR_A_not_present, COLAMD_ERROR_col_length_negative, COLAMD_ERROR_internal_error, COLAMD_ERROR_ncol_negative, COLAMD_ERROR_nnz_negative, COLAMD_ERROR_out_of_memory, COLAMD_ERROR_p0_nonzero, COLAMD_ERROR_p_not_present, COLAMD_ERROR_row_index_out_of_bounds, COLAMD_INFO1, COLAMD_INFO2, COLAMD_INFO3, COLAMD_KNOBS, COLAMD_OK, COLAMD_OK_BUT_JUMBLED, COLAMD_STATS, COLAMD_STATUS, count, DEBUG0, DEBUG1, FALSE, mbdyn_colamd(), mbdyn_colamd_recommended(), mbdyn_colamd_set_defaults(), and TRUE.
void mbdyn_symamd_report | ( | integer | stats[20] | ) |
Definition at line 1583 of file colamd.c.
References print_report().
|
static |
Definition at line 2670 of file colamd.c.
References ASSERT, c, COL_IS_DEAD, COL_IS_DEAD_PRINCIPAL, EMPTY, order, mbdyn_Colamd_Col::order, mbdyn_Colamd_Col::parent, mbdyn_Colamd_Col::shared1, and mbdyn_Colamd_Col::shared2.
Referenced by mbdyn_colamd().
|
static |
Definition at line 3091 of file colamd.c.
References COLAMD_DEFRAG_COUNT, COLAMD_DENSE_COL, COLAMD_DENSE_ROW, COLAMD_ERROR_A_not_present, COLAMD_ERROR_A_too_small, COLAMD_ERROR_col_length_negative, COLAMD_ERROR_internal_error, COLAMD_ERROR_ncol_negative, COLAMD_ERROR_nnz_negative, COLAMD_ERROR_nrow_negative, COLAMD_ERROR_out_of_memory, COLAMD_ERROR_p0_nonzero, COLAMD_ERROR_p_not_present, COLAMD_ERROR_row_index_out_of_bounds, COLAMD_INFO1, COLAMD_INFO2, COLAMD_INFO3, COLAMD_OK, COLAMD_OK_BUT_JUMBLED, COLAMD_STATUS, INDEX, and PRINTF.
Referenced by mbdyn_colamd_report(), and mbdyn_symamd_report().