IMP Reference Guide
2.8.0
The Integrative Modeling Platform
|
Common base class for heavy weight IMP
objects.
More...
#include <IMP/Object.h>
Inherits IMP::NonCopyable.
Inherited by IMP::algebra::DynamicNearestNeighbor3D, IMP::algebra::NearestNeighborD< D >, IMP::algebra::VectorKDMetric, IMP::atom::CHARMMResidueTopologyBase, IMP::atom::CHARMMSegmentTopology, IMP::atom::CHARMMTopology, IMP::atom::ForceFieldParameters, IMP::atom::Mol2Selector, IMP::atom::PDBSelector, IMP::atom::SmoothingFunction, IMP::Configuration, IMP::ConfigurationSet, IMP::core::ClosePairsFinder, IMP::core::DataObject< Data >, IMP::display::Geometry, IMP::display::Writer, IMP::domino::AssignmentContainer, IMP::domino::AssignmentsTable, IMP::domino::ParticleStates, IMP::domino::ParticleStatesTable, IMP::domino::RestraintCache, IMP::domino::SubsetFilter, IMP::domino::SubsetFilterTable, IMP::em2d::CollisionCrossSection, IMP::em2d::Image, IMP::em2d::ImageReaderWriter, IMP::em2d::ProjectionFinder, IMP::em2d::ScoreFunction, IMP::em::CoarseCC, IMP::em::DensityMap, IMP::em::EnvelopeScore, IMP::em::MapReaderWriter, IMP::em::PCAAligner, IMP::example::ExampleObject, IMP::isd::BivariateFunction, IMP::isd::CrossLinkData, IMP::isd::CysteineCrossLinkData, IMP::isd::Distribution, IMP::isd::FretData, IMP::isd::GaussianProcessInterpolation, IMP::isd::MultivariateFNormalSufficient, IMP::isd::UnivariateFunction, IMP::isd::vonMises, IMP::isd::vonMisesSufficient, IMP::kinematics::DirectionalDOF, IMP::kinematics::DOF, IMP::kinematics::DOFsSampler, IMP::kinematics::Joint, IMP::kinematics::KinematicForest, IMP::kinematics::LocalPlanner, IMP::kinematics::ProteinKinematics, IMP::kmeans::KMeans, IMP::Model, IMP::ModelObject, IMP::mpi::ReplicaExchange, IMP::multifit::AssemblyHeader, IMP::multifit::ComponentHeader, IMP::multifit::Ensemble, IMP::multifit::FFTFitting, IMP::multifit::FFTFittingOutput, IMP::multifit::ProbabilisticAnchorGraph, IMP::multifit::ProteomicsData, IMP::multifit::ProteomicsEMAlignmentAtomic, IMP::multifit::SettingsData, IMP::PairModifier, IMP::PairPredicate, IMP::PairScore, IMP::QuadModifier, IMP::QuadPredicate, IMP::QuadScore, IMP::Refiner, IMP::rmf::LoadLink, IMP::rmf::SaveLink, IMP::rotamer::RotamerCalculator, IMP::rotamer::RotamerLibrary, IMP::Sampler, IMP::saxs::ChiFreeScore, IMP::saxs::ChiScore, IMP::saxs::ChiScoreLog, IMP::saxs::DerivativeCalculator, IMP::saxs::Profile, IMP::saxs::ProfileFitter< ScoringFunctionT >, IMP::saxs::RatioVolatilityScore, IMP::saxs::RigidBodiesProfileHandler, IMP::SingletonModifier, IMP::SingletonPredicate, IMP::SingletonScore, IMP::statistics::Embedding, IMP::statistics::Metric, IMP::statistics::PartitionalClustering, IMP::TripletModifier, IMP::TripletPredicate, IMP::TripletScore, IMP::UnaryFunction, IMP::Undecorator, and log.DummyObject.
Common base class for heavy weight IMP
objects.
The base class for non value-type classes in IMP
. Anything inheriting from Object has the following properties:
Types inheriting from Object should always be created using new
in C++ and passed using pointers and stored using Pointer objects. Note that you have to be careful of cycles and so must use WeakPointer objects to break cycles. IMP_NEW() can help shorten creating a ref counted pointer. See Pointer for more information.
See example::ExampleObject for a simple example.
Reference counting is a technique for managing memory and automatically freeing memory (destroying objects) when it is no longer needed. In reference counting, each object has a reference count, which tracks how many different places are using the object. When this count goes to 0, the object is freed.
Python internally reference counts everything. C++, on the other hand, requires extra steps be taken to ensure that objects are reference counted properly.
In IMP
, reference counting is done through the Pointer, PointerMember and Object classes. The former should be used instead of a raw C++ pointer when storing a pointer to any object inheriting from Object.
Any time one is using reference counting, one needs to be aware of cycles, since if, for example, object A contains an IMP::Pointer to object B and object B contains an Pointer to object A, their reference counts will never go to 0 even if both A and B are no longer used. To avoid this, use an WeakPointer in one of A or B.
Functions that create new objects should follow the following pattern
ObjectType *create_object(arguments) { IMP_NEW(ObjectType, ret, (args)); do_stuff; return ret.release(); }
using Pointer::release() to safely return the new object without freeing it.
Public Member Functions | |
virtual void | clear_caches () |
CheckLevel | get_check_level () const |
LogLevel | get_log_level () const |
virtual VersionInfo | get_version_info () const |
Get information about the module and version of the object. More... | |
void | set_check_level (CheckLevel l) |
void | set_log_level (LogLevel l) |
Set the logging level used in this object. More... | |
void | set_was_used (bool tf) const |
void | show (std::ostream &out=std::cout) const |
Protected Member Functions | |
Object (std::string name) | |
Construct an object with the given name. More... | |
virtual void | do_destroy () |
|
protected |
Construct an object with the given name.
An instance of "%1%" in the string will be replaced by a unique index.
|
virtual |
Objects can have internal caches. This method resets them returning the object to its just-initialized state.
Reimplemented in IMP::core::ExcludedVolumeRestraint, and IMP::core::MinimumRestraint.
|
protectedvirtual |
Override this method to take action on destruction.
Reimplemented in IMP::container::ExclusiveConsecutivePairContainer, and IMP::display::PymolWriter.
|
virtual |
Get information about the module and version of the object.
Reimplemented in IMP::isd::GeneralizedGuinierPorodFunction, IMP::atom::WritePDBOptimizerState, IMP::atom::CHARMMResidueTopology, IMP::atom::NotPDBSelector, IMP::isd::Covariance1DFunction, IMP::em::DensityMap, IMP::atom::CHARMMPatch, IMP::atom::XorPDBSelector, IMP::atom::OrPDBSelector, IMP::domino::CappedAssignmentContainer, IMP::atom::SelectionGeometry, IMP::atom::CHARMMIdealResidueTopology, IMP::atom::AndPDBSelector, IMP::domino::HeapAssignmentContainer, IMP::domino::ProbabilisticSubsetFilterTable, IMP::atom::PPDBSelector, IMP::Model, IMP::atom::CHARMMResidueTopologyBase, IMP::atom::BackbonePDBSelector, IMP::domino::RangeViewAssignmentContainer, IMP::atom::CHARMMParameters, IMP::domino::PairListSubsetFilterTable, IMP::domino::ReadAssignmentContainer, IMP::atom::BondGeometry, IMP::atom::BondsGeometry, IMP::atom::NonWaterPDBSelector, IMP::domino::ListSubsetFilterTable, IMP::core::LateralSurfaceConstraint, IMP::atom::NonHydrogenPDBSelector, IMP::domino::PermutationStates, IMP::isd::Linear1DFunction, IMP::domino::WriteAssignmentContainer, IMP::atom::NonWaterNonHydrogenPDBSelector, IMP::domino::RecursiveStates, IMP::domino::EquivalenceAndExclusionSubsetFilterTable, IMP::atom::CHARMMTopology, IMP::saxs::Profile, IMP::core::MonteCarloWithBasinHopping, IMP::atom::HydrogenPDBSelector, IMP::domino::EquivalenceSubsetFilterTable, IMP::core::SurfaceGeometryConstraint, IMP::domino::ReadHDF5AssignmentContainer, IMP::domino::EqualitySubsetFilterTable, IMP::isd::MultivariateFNormalSufficient, IMP::domino::RestraintCache, IMP::domino::CompoundStates, IMP::atom::HierarchiesGeometry, IMP::atom::WaterPDBSelector, IMP::core::MonteCarloWithLocalOptimization, IMP::domino::ExclusionSubsetFilterTable, IMP::domino::NestedRigidBodyStates, IMP::domino::WriteHDF5AssignmentContainer, IMP::atom::HierarchyGeometry, IMP::algebra::DynamicNearestNeighbor3D, IMP::atom::ChainPDBSelector, IMP::multifit::ProteomicsData, IMP::core::SurfaceGeometry, IMP::container::ExclusiveConsecutivePairFilter, IMP::atom::AllPDBSelector, IMP::misc::MetricClosePairsFinder< LowerBound, UpperBound >, IMP::domino::RigidBodyStates, IMP::core::SoftSpherePairScore, IMP::rmf::HierarchySaveLink, IMP::atom::NPDBSelector, IMP::core::EdgePairGeometry, IMP::core::EdgePairsGeometry, IMP::core::WeightedSphereDistancePairScore, IMP::em2d::ProjectionFinder, IMP::atom::MolecularDynamics, IMP::multifit::SettingsData, IMP::algebra::NearestNeighborD< D >, IMP::container::ExclusiveConsecutivePairContainer, IMP::domino::SampleAssignmentContainer, IMP::atom::CPDBSelector, IMP::domino::XYZStates, IMP::core::XYZDerivativeGeometry, IMP::core::XYZDerivativesGeometry, IMP::core::TransformationSymmetryMover, IMP::em2d::Image, IMP::core::SoftSubSurfacePairScore, IMP::em2d::SpiderImageReaderWriter, IMP::core::XYZRGeometry, IMP::core::XYZRsGeometry, IMP::domino::MinimumRestraintScoreSubsetFilterTable, IMP::isd::FStudentT, IMP::isd::GaussianAnchorEMRestraint, IMP::atom::ResidueTypePDBSelector, IMP::isd::GaussianProcessInterpolation, IMP::core::NormalizedSphereDistancePairScore, IMP::isd::vonMisesSufficient, IMP::em2d::Em2DRestraint, IMP::core::SoftSuperSurfacePairScore, IMP::domino::ListAssignmentsTable, IMP::core::PredicateSingletonScore< Predicate, Score >, IMP::domino::IndexStates, IMP::core::CoinFlipPairPredicate, IMP::core::CoinFlipQuadPredicate, IMP::core::CoinFlipSingletonPredicate, IMP::core::CoinFlipTripletPredicate, IMP::core::IncrementalScoringFunction, IMP::domino::ListAssignmentContainer, IMP::pmi::TransformMover, IMP::container::ClosePairContainer, IMP::atom::AtomTypePDBSelector, IMP::core::MCCGSampler, IMP::domino::RestraintScoreSubsetFilterTable, IMP::em::CoarseCC, IMP::atom::ForceSwitch, IMP::core::HarmonicSurfaceDepthPairScore, IMP::em2d::ProjectionParametersScoreState, IMP::rotamer::RotamerLibrary, IMP::core::SphereDistanceToSingletonScore, IMP::domino::BranchAndBoundAssignmentsTable, IMP::rmf::HierarchyLoadLink, IMP::display::PlaneGeometry, IMP::multifit::AssemblyHeader, IMP::core::TransformationSymmetry, IMP::domino::ParticleStatesTable, IMP::rotamer::RotamerCalculator, IMP::atom::BrownianDynamics, IMP::core::ClosePairsPairScore, IMP::core::AllSamePairPredicate, IMP::core::AllSameQuadPredicate, IMP::core::AllSameSingletonPredicate, IMP::core::AllSameTripletPredicate, IMP::isd::OneDimensionalSufficientDistribution, IMP::core::RigidBodyTunneler, IMP::em2d::ProjectionStates, IMP::em2d::TIFFImageReaderWriter, IMP::core::HarmonicSurfaceHeightPairScore, IMP::em2d::JPGImageReaderWriter, IMP::atom::CBetaPDBSelector, IMP::kmeans::KMeans, IMP::statistics::VectorDEmbedding, IMP::core::WeightedSumOfExponential, IMP::display::SurfaceMeshGeometry, IMP::kinematics::ProteinKinematics, IMP::core::MSConnectivityRestraint, IMP::core::IsCollisionPairPredicate, IMP::core::HarmonicSphereDistancePairScore, IMP::isd::CysteineCrossLinkRestraint, IMP::isd::GaussianEMRestraint, IMP::isd::FNormal, IMP::isd::FretRestraint, IMP::container::ConsecutivePairFilter, IMP::pmi::CompositeRestraint, IMP::core::RigidBodyUmbrella, IMP::core::RigidClosePairsFinder, IMP::isd::TALOSRestraint, IMP::core::OrderedTypePairPredicate, IMP::core::OrderedTypeQuadPredicate, IMP::core::OrderedTypeSingletonPredicate, IMP::core::OrderedTypeTripletPredicate, IMP::core::ExcludedVolumeRestraint, IMP::em2d::ParticlesDummyRestraint, IMP::atom::CAlphaPDBSelector, IMP::core::HarmonicSurfaceDistancePairScore, IMP::em::MRCReaderWriter, IMP::em::SpiderMapReaderWriter, IMP::atom::LennardJonesPairScore, IMP::core::BallMover, IMP::multifit::ComplementarityRestraint, IMP::em2d::PCAFitRestraint, IMP::container::CloseBipartitePairContainer, IMP::domino::RecursiveAssignmentsTable, IMP::container::ListPairContainer, IMP::container::ListQuadContainer, IMP::container::ListSingletonContainer, IMP::container::ListTripletContainer, IMP::display::LabelGeometry, IMP::isd::StudentTRestraint, IMP::isd::GaussianProcessInterpolationRestraint, IMP::isd::LognormalAmbiguousRestraint, IMP::core::HarmonicUpperBoundSphereDiameterPairScore, IMP::spb::EM2DRestraint, IMP::atom::SoapPairFilter, IMP::core::SurfaceMover, IMP::core::SurfaceTetheredChain, IMP::misc::FreelyJointedChain, IMP::core::FixedRefiner, IMP::domino::PackedAssignmentContainer, IMP::atom::CHARMMStereochemistryRestraint, IMP::container::DynamicListPairContainer, IMP::container::DynamicListQuadContainer, IMP::container::DynamicListSingletonContainer, IMP::container::DynamicListTripletContainer, IMP::core::WeightedDerivativesToRefined, IMP::core::WeightedSum, IMP::statistics::ParticleEmbedding, IMP::core::TruncatedHarmonic< DIRECTION >, IMP::core::TypedPairScore, IMP::atom::ATOMPDBSelector, IMP::core::ConnectivityRestraint, IMP::em::FitRestraint, IMP::isd::AtomicCrossLinkMSRestraint, IMP::container::PredicatePairsRestraint, IMP::container::PredicateQuadsRestraint, IMP::container::PredicateSingletonsRestraint, IMP::container::PredicateTripletsRestraint, IMP::core::CentroidOfRefined, IMP::kinematics::DirectionalDOF, IMP::multifit::ProteomicsEMAlignmentAtomic, IMP::mpi::ReplicaExchange, IMP::spb::MonteCarloWithWte, IMP::container::ConsecutivePairContainer, IMP::container::PairsConstraint, IMP::container::QuadsConstraint, IMP::container::SingletonsConstraint, IMP::container::TripletsConstraint, IMP::core::TransformationAndReflectionSymmetry, IMP::container::ConnectingPairContainer, IMP::core::RigidBodyMover, IMP::em2d::ScoreFunction, IMP::gsl::Simplex, IMP::score_functor::SurfaceDistancePairScore< DistanceScoreT >, IMP::core::PairConstraint, IMP::core::QuadConstraint, IMP::core::SingletonConstraint, IMP::core::SurfaceDepthPairScore, IMP::core::TripletConstraint, IMP::display::ReferenceFrameGeometry, IMP::em::EMReaderWriter, IMP::core::DirectionMover, IMP::em2d::GridStates, IMP::isd::CrossLinkMSRestraint, IMP::algebra::MaxVectorKDMetric, IMP::core::UnorderedTypePairPredicate, IMP::core::UnorderedTypeQuadPredicate, IMP::core::UnorderedTypeSingletonPredicate, IMP::core::UnorderedTypeTripletPredicate, IMP::em2d::Fine2DRegistrationRestraint, IMP::isd::MarginalNOERestraint, IMP::isd::vonMises, IMP::core::KClosePairsPairScore, IMP::em::EnvelopeScore, IMP::em2d::RelativePositionMover, IMP::container::DistributePairsScoreState, IMP::container::DistributeQuadsScoreState, IMP::container::DistributeSingletonsScoreState, IMP::container::DistributeTripletsScoreState, IMP::domino::SimpleAssignmentsTable, IMP::core::CoverRefined, IMP::core::SurfaceSymmetryConstraint, IMP::saxs::Restraint, IMP::statistics::ChiSquareMetric, IMP::atom::NonAlternativePDBSelector, IMP::core::LogNormalMover, IMP::display::BoundingBoxGeometry, IMP::em::CoarseCCatIntervals, IMP::em::EnvelopeFitRestraint, IMP::em2d::DistanceFilter, IMP::em2d::DummyRestraint, IMP::isd::OneDimensionalDistribution, IMP::core::AttributeSingletonPredicate, IMP::display::PymolWriter, IMP::isd::GaussianRestraint, IMP::isd::LognormalRestraint, IMP::isd::MarginalHBondRestraint, IMP::atom::BondPairContainer, IMP::SaveToConfigurationSetOptimizerState, IMP::container::PairsRestraint, IMP::container::QuadsRestraint, IMP::container::SingletonsRestraint, IMP::container::TripletsRestraint, IMP::core::HarmonicWell, IMP::multifit::ProbabilisticAnchorGraph, IMP::atom::CADihedralRestraint, IMP::statistics::ConfigurationSetRMSDMetric, IMP::atom::StereochemistryPairFilter, IMP::container::AllBipartitePairContainer, IMP::core::GenericDistanceToSingletonScore< UF >, IMP::display::TriangleGeometry, IMP::domino::DependencyScoreState, IMP::multifit::ComponentHeader, IMP::rmf::SaveOptimizerState, IMP::atom::BerendsenThermostatOptimizerState, IMP::core::NormalMover, IMP::isd::HybridMonteCarlo, IMP::score_functor::DistancePairScore< DistanceScoreT >, IMP::score_functor::DistancePairScore< score_functor::OrientedSoap >, IMP::score_functor::DistancePairScore< score_functor::Statistical< Key, BIPARTITE, INTERPOLATE, SPARSE > >, IMP::score_functor::DistancePairScore< score_functor::Statistical< ProteinLigandType, BIPARTITE, INTERPOLATE, false > >, IMP::score_functor::DistancePairScore< score_functor::Dope >, IMP::atom::CoulombPairScore, IMP::core::HarmonicUpperBoundSphereDistancePairScore, IMP::em2d::CollisionCrossSection, IMP::container::InContainerPairFilter, IMP::container::InContainerQuadFilter, IMP::container::InContainerSingletonFilter, IMP::container::InContainerTripletFilter, IMP::container::PairContainerSet, IMP::container::QuadContainerSet, IMP::container::SingletonContainerSet, IMP::container::TripletContainerSet, IMP::em::PCAFitRestraint, IMP::isd::CrossLinkData, IMP::RestraintSet, IMP::statistics::PartitionalClusteringWithCenter, IMP::core::NeighborsTable, IMP::core::SurfaceHeightPairScore, IMP::display::PolygonGeometry, IMP::example::ExampleComplexRestraint, IMP::multifit::DummyRestraint, IMP::container::AllPairContainer, IMP::core::MonteCarlo, IMP::core::MultipleBinormalRestraint, IMP::core::ConjugateGradients, IMP::core::DiameterRestraint, IMP::core::PairRestraint, IMP::core::QuadRestraint, IMP::core::SingletonRestraint, IMP::core::TripletRestraint, IMP::spb::TransformationSymmetry, IMP::atom::CAAngleRestraint, IMP::em::EnvelopePenetrationRestraint, IMP::em::PCAAligner, IMP::em2d::DistanceFilterTable, IMP::gsl::QuasiNewton, IMP::pmi::SigmoidRestraintSphere, IMP::spb::Gaussian, IMP::display::RestraintSetGeometry, IMP::isd::FretData, IMP::isd::NOERestraint, IMP::multifit::WeightedExcludedVolumeRestraint, IMP::Particle, IMP::pmi::MembraneRestraint, IMP::spb::DistanceRMSDMetric, IMP::core::TransformedDistancePairScore, IMP::display::SegmentGeometry, IMP::em::DensityFillingRestraint, IMP::em2d::RigidBodiesImageFitRestraint, IMP::example::ExampleSingletonModifier, IMP::isd::CysteineCrossLinkData, IMP::spb::UniformBoundedRestraint, IMP::algebra::EuclideanVectorKDMetric, IMP::atom::ImproperSingletonScore, IMP::Configuration, IMP::container::PairContainerStatistics, IMP::container::PairsOptimizerState, IMP::container::QuadContainerStatistics, IMP::container::QuadsOptimizerState, IMP::container::SingletonContainerStatistics, IMP::container::SingletonsOptimizerState, IMP::container::TripletContainerStatistics, IMP::container::TripletsOptimizerState, IMP::domino::DominoSampler, IMP::isd::AmbiguousRestraint, IMP::spb::ChiSquareMetric, IMP::core::DerivativesFromRefined, IMP::core::SubsetMover, IMP::core::TableRefiner, IMP::display::FilterGeometry, IMP::example::ExampleObject, IMP::example::ExampleUnaryFunction, IMP::isd::AmbiguousNOERestraint, IMP::spb::TiltSingletonScore, IMP::atom::LangevinThermostatOptimizerState, IMP::container::MinimumPairRestraint, IMP::container::MinimumQuadRestraint, IMP::container::MinimumSingletonRestraint, IMP::container::MinimumTripletRestraint, IMP::core::GenericBoundingBox3DSingletonScore< UF >, IMP::core::DerivativesToRefined, IMP::multifit::FFTFitting, IMP::pmi::InternalCoordinatesConstraint, IMP::saxs::RigidBodiesProfileHandler, IMP::spb::RigidBodyNewMover, IMP::ConfigurationSet, IMP::core::ChildrenRefiner, IMP::display::PointGeometry, IMP::em::MapReaderWriter, IMP::kinematics::KinematicForest, IMP::kinematics::KinematicForestScoreState, IMP::kinematics::RevoluteJointMover, IMP::saxs::ChiScoreLog, IMP::spb::DistanceTerminiRestraint, IMP::misc::DecayPairContainerOptimizerState, IMP::misc::WormLikeChain, IMP::saxs::RadiusOfGyrationRestraint, IMP::spb::ContactMapMetric, IMP::spb::PbcBoxedRigidBodyMover, IMP::spb::TwoStateGoModelRestraint, IMP::statistics::ConfigurationSetXYZEmbedding, IMP::atom::AngleSingletonScore, IMP::core::DihedralRestraint, IMP::core::MoveStatisticsScoreState, IMP::example::ExampleSubsetFilterTable, IMP::isd::RepulsiveDistancePairScore, IMP::multifit::RadiusOfGyrationRestraint, IMP::spb::AttributeDistancePairScore, IMP::symmetry::RigidBodyMover, IMP::atom::EzRestraint, IMP::atom::HelixRestraint, IMP::atom::VelocityScalingOptimizerState, IMP::container::EventPairsOptimizerState, IMP::container::EventQuadsOptimizerState, IMP::container::EventSingletonsOptimizerState, IMP::container::EventTripletsOptimizerState, IMP::core::BoxSweepClosePairsFinder, IMP::core::GenericAttributeSingletonScore< UF >, IMP::core::LeavesRefiner, IMP::core::ConstantPairPredicate, IMP::core::ConstantQuadPredicate, IMP::core::QuadraticClosePairsFinder, IMP::core::RigidBodyFrameGeometry, IMP::core::RigidBodyFramesGeometry, IMP::core::SerialMover, IMP::core::ConstantSingletonPredicate, IMP::core::ConstantTripletPredicate, IMP::display::EllipsoidGeometry, IMP::em2d::ImageReaderWriter, IMP::isd::MolecularDynamicsMover, IMP::saxs::RatioVolatilityScore, IMP::atom::BondSingletonScore, IMP::core::MinimumRestraint, IMP::isd::vonMisesKappaJeffreysRestraint, IMP::spb::BoxedMover, IMP::spb::PbcBoxedMover, IMP::atom::DihedralSingletonScore, IMP::core::Cosine, IMP::core::Harmonic, IMP::core::RefinedPairsPairScore, IMP::core::SphereDistancePairScore, IMP::core::SurfaceDistancePairScore, IMP::example::ExampleRestraint, IMP::isd::vonMisesKappaConjugateRestraint, IMP::multifit::Ensemble, IMP::score_functor::ScoreUnaryFunction< Score, D >, IMP::spb::DiameterRgyrRestraint, IMP::score_functor::ScoreUnaryFunction< score_functor::OpenCubicSpline >, IMP::container::MinimumPairScore, IMP::container::MinimumQuadScore, IMP::container::MinimumSingletonScore, IMP::container::MinimumTripletScore, IMP::core::GridClosePairsFinder, IMP::core::Linear, IMP::core::NearestNeighborsClosePairsFinder, IMP::core::InBoundingBox3DSingletonPredicate, IMP::core::Transform, IMP::display::RestraintGeometry, IMP::isd::LogWrapper, IMP::misc::LowestRefinedPairScore, IMP::core::AngleRestraint, IMP::core::RigidBodyDerivativeGeometry, IMP::core::RigidBodyDerivativesGeometry, IMP::display::CylinderGeometry, IMP::example::ExampleConstraint, IMP::example::ExamplePairScore, IMP::isd::UniformPrior, IMP::spb::KinkPairScore, IMP::statistics::RecursivePartitionalClusteringEmbedding, IMP::statistics::RecursivePartitionalClusteringMetric, IMP::symmetry::BallMover, IMP::atom::CoverBond, IMP::core::HarmonicDistancePairScore, IMP::core::WriteRestraintScoresOptimizerState, IMP::display::WriteOptimizerState, IMP::domino::BranchAndBoundSampler, IMP::em::XplorReaderWriter, IMP::misc::LogPairScore, IMP::spb::CellMover, IMP::atom::BondedPairFilter, IMP::atom::BondEndpointsRefiner, IMP::atom::CHARMMSegmentTopology, IMP::atom::RemoveTranslationOptimizerState, IMP::core::AngleTripletScore, IMP::core::ClosedCubicSpline, IMP::core::ConstantRestraint, IMP::isd::ISDRestraint, IMP::isd::WeightMover, IMP::kinematics::Joint, IMP::misc::SoftCylinderPairScore, IMP::multifit::FittingStates, IMP::spb::RMSDMetric, IMP::core::HarmonicLowerBound, IMP::core::HarmonicUpperBound, IMP::core::RigidBodyAnglePairScore, IMP::saxs::ChiScore, IMP::core::ChecksScoreState, IMP::core::VolumeRestraint, IMP::display::SphereGeometry, IMP::isd::JeffreysRestraint, IMP::isd::WeightRestraint, IMP::kinematics::DOF, IMP::multifit::FFTFittingOutput, IMP::spb::NuisanceRangeModifier, IMP::atom::RemoveRigidMotionOptimizerState, IMP::atom::SameResiduePairFilter, IMP::kinematics::RRT, IMP::misc::StateAdaptor, IMP::spb::SameParticlePairFilter, IMP::spb::SameRigidBodyPairFilter, IMP::core::RigidBodyHierarchyGeometry, IMP::gsl::ConjugateGradients, IMP::statistics::EuclideanMetric, IMP::display::GeometrySet, IMP::multifit::RigidLeavesRefiner, IMP::core::SteepestDescent, IMP::em::HighDensityEmbedding, IMP::isd::Distribution, IMP::misc::CommonEndpointPairFilter, IMP::kinematics::LocalPlanner, IMP::core::DistancePairScore, and IMP::kinematics::DOFsSampler.
void IMP::Object::set_check_level | ( | CheckLevel | l | ) |
Each object can be assigned a different check level too.
void IMP::Object::set_log_level | ( | LogLevel | l | ) |
Set the logging level used in this object.
Each object can be assigned a different log level in order to, for example, suppress messages for verbose and uninteresting objects. If set to DEFAULT, the global level as returned by IMP::get_log_level() is used, otherwise the local one is used. Methods in classes inheriting from Object should start with IMP_OBJECT_LOG to change the log level to the local one for this object and increase the current indent.
void IMP::Object::set_was_used | ( | bool | tf | ) | const |
IMP
provides warnings when objects are never used before they are destroyed. Examples of use include adding an IMP::Restraint to an IMP::Model. If an object is not properly marked as used, or your code is the one using it, call set_was_used(true) on the object.