#include <Vertex.h>
Classes | |
class | TrackEqual |
Public Types | |
enum | { dimension = 3, dimension4D = 4 } |
error matrix dimension More... | |
enum | { size = dimension * ( dimension + 1 ) / 2, size4D = ( dimension4D ) * ( dimension4D + 1 ) / 2 } |
matix size More... | |
typedef math::Error< dimension >::type | CovarianceMatrix |
covariance error matrix (3x3) More... | |
typedef math::Error< dimension4D >::type | CovarianceMatrix4D |
covariance error matrix (4x4) More... | |
typedef math::Error< dimension >::type | Error |
covariance error matrix (3x3) More... | |
typedef math::Error< dimension4D >::type | Error4D |
covariance error matrix (4x4) More... | |
typedef unsigned int | index |
index type More... | |
typedef math::XYZPoint | Point |
point in the space More... | |
typedef std::vector< TrackBaseRef >::const_iterator | trackRef_iterator |
The iteratator for the vector<TrackRef> More... | |
Public Member Functions | |
void | add (const TrackBaseRef &r, float w=1.0) |
add a reference to a Track More... | |
void | add (const TrackBaseRef &r, const Track &refTrack, float w=1.0) |
add the original a Track(reference) and the smoothed Track More... | |
double | chi2 () const |
chi-squares More... | |
double | covariance (int i, int j) const |
(i, j)-th element of error matrix, i, j = 0, ... 2 More... | |
CovarianceMatrix | covariance () const |
return SMatrix More... | |
CovarianceMatrix4D | covariance4D () const |
return SMatrix 4D More... | |
Error | error () const |
return SMatrix More... | |
Error4D | error4D () const |
return SMatrix More... | |
void | fill (CovarianceMatrix &v) const |
fill SMatrix More... | |
void | fill (CovarianceMatrix4D &v) const |
4D version More... | |
bool | hasRefittedTracks () const |
Checks whether refitted tracks are stored. More... | |
bool | isFake () const |
bool | isValid () const |
Tells whether the vertex is valid. More... | |
double | ndof () const |
double | normalizedChi2 () const |
chi-squared divided by n.d.o.f. More... | |
unsigned int | nTracks (float minWeight=0.5) const |
Returns the number of tracks in the vertex with weight above minWeight. More... | |
TrackBaseRef | originalTrack (const Track &refTrack) const |
math::XYZTLorentzVectorD | p4 (float mass=0.13957018, float minWeight=0.5) const |
Returns the four momentum of the sum of the tracks, assuming the given mass for the decay products. More... | |
const Point & | position () const |
position More... | |
Track | refittedTrack (const TrackBaseRef &track) const |
Track | refittedTrack (const TrackRef &track) const |
const std::vector< Track > & | refittedTracks () const |
Returns the container of refitted tracks. More... | |
void | removeTracks () |
double | t () const |
t coordinate More... | |
double | tError () const |
error on t More... | |
const TrackBaseRef & | trackRefAt (size_t idx) const |
python friendly track getting More... | |
trackRef_iterator | tracks_begin () const |
first iterator over tracks More... | |
trackRef_iterator | tracks_end () const |
last iterator over tracks More... | |
size_t | tracksSize () const |
number of tracks More... | |
template<typename TREF > | |
float | trackWeight (const TREF &r) const |
returns the weight with which a Track has contributed to the vertex-fit. More... | |
Vertex () | |
Vertex (const Point &, const Error &) | |
Constructor for a fake vertex. More... | |
Vertex (const Point &, const Error4D &, double) | |
Constructor for a fake vertex. 4D. More... | |
Vertex (const Point &, const Error &, double chi2, double ndof, size_t size) | |
constructor for a valid vertex, with all data More... | |
Vertex (const Point &, const Error4D &, double time, double chi2, double ndof, size_t size) | |
constructor for a valid vertex, with all data 4D More... | |
double | x () const |
x coordinate More... | |
double | xError () const |
error on x More... | |
double | y () const |
y coordinate More... | |
double | yError () const |
error on y More... | |
double | z () const |
z coordinate More... | |
double | zError () const |
error on z More... | |
Private Member Functions | |
index | idx (index i, index j) const |
position index More... | |
Private Attributes | |
float | chi2_ |
chi-sqared More... | |
float | covariance_ [size4D] |
covariance matrix (4x4) as vector More... | |
float | ndof_ |
number of degrees of freedom More... | |
Point | position_ |
position More... | |
std::vector< Track > | refittedTracks_ |
The vector of refitted tracks. More... | |
double | time_ |
std::vector< TrackBaseRef > | tracks_ |
reference to tracks More... | |
bool | validity_ |
tells wether the vertex is really valid. More... | |
std::vector< uint8_t > | weights_ |
A reconstructed Vertex providing position, error, chi2, ndof and reconstrudted tracks. The vertex can be valid, fake, or invalid. A valid vertex is one which has been obtained from a vertex fit of tracks, and all data is meaningful A fake vertex is a vertex which was not made out of a proper fit with tracks, but still has a position and error (chi2 and ndof are null). For a primary vertex, it could simply be the beam line. A fake vertex is considered valid. An invalid vertex has no meaningful data.
typedef math::Error<dimension>::type reco::Vertex::Error |
typedef math::Error<dimension4D>::type reco::Vertex::Error4D |
typedef unsigned int reco::Vertex::index |
typedef math::XYZPoint reco::Vertex::Point |
typedef std::vector<TrackBaseRef >::const_iterator reco::Vertex::trackRef_iterator |
anonymous enum |
error matrix dimension
Enumerator | |
---|---|
dimension | |
dimension4D |
Definition at line 41 of file Vertex.h.
anonymous enum |
matix size
Enumerator | |
---|---|
size | |
size4D |
Definition at line 51 of file Vertex.h.
|
inline |
default constructor - The vertex will not be valid. Position, error, chi2, ndof will have random entries, and the vectors of tracks will be empty Use the isValid method to check that your vertex is valid.
Definition at line 57 of file Vertex.h.
References chi2(), covariance_, mps_fire::i, ndof(), size, size4D, ntuplemaker::time, and validity_.
Constructor for a fake vertex.
Definition at line 34 of file Vertex.cc.
References covariance_, dimension, dimension4D, mps_fire::i, idx(), and validity_.
Constructor for a fake vertex. 4D.
Definition at line 49 of file Vertex.cc.
References covariance_, dimension, mps_fire::i, idx(), and validity_.
constructor for a valid vertex, with all data
Definition at line 8 of file Vertex.cc.
References covariance_, dimension, dimension4D, mps_fire::i, idx(), tracks_, and validity_.
Vertex::Vertex | ( | const Point & | p, |
const Error4D & | err, | ||
double | time, | ||
double | chi2, | ||
double | ndof, | ||
size_t | size | ||
) |
constructor for a valid vertex, with all data 4D
Definition at line 24 of file Vertex.cc.
References covariance_, dimension4D, mps_fire::i, idx(), size4D, tracks_, and validity_.
void reco::Vertex::add | ( | const TrackBaseRef & | r, |
float | w = 1.0 |
||
) |
add a reference to a Track
Referenced by reco::PFDisplacedVertex::addElement(), NuclearVertexBuilder::FillVertexWithCrossingPoint(), NuclearVertexBuilder::FillVertexWithLastPrimHit(), isFake(), TransientVertex::operator reco::Vertex(), pat::PATTrackAndVertexUnpacker::produce(), PixelVertexProducer::produce(), counter.Counter::register(), SequenceTypes.Task::remove(), SequenceTypes.Task::replace(), and tracks_end().
void reco::Vertex::add | ( | const TrackBaseRef & | r, |
const Track & | refTrack, | ||
float | w = 1.0 |
||
) |
add the original a Track(reference) and the smoothed Track
Referenced by counter.Counter::register(), SequenceTypes.Task::remove(), and SequenceTypes.Task::replace().
|
inline |
chi-squares
Definition at line 98 of file Vertex.h.
References chi2_.
Referenced by BPHCompositeVertexSelect::accept(), BPHFittedVertexSelect::accept(), PatBJetVertexAnalyzer::analyze(), VertexMonitor::analyze(), TkConvValidator::analyze(), PrimaryVertexValidation::analyze(), BPHMonitor::analyze(), ConversionProducer::buildCollection(), BPHMonitor::case11_selection(), ConversionLessByChi2(), reco::PFDisplacedVertex::Dump(), GsfVertexTrackCompatibilityEstimator::estimate(), KalmanVertexTrackCompatibilityEstimator< N >::estimate(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), V0Fitter::fitAll(), PFDisplacedVertexFinder::fitVertexFromSeed(), OniaPhotonConversionProducer::HighpuritySubset(), HLTmumutkFilter::hltFilter(), HLTmumutktkFilter::hltFilter(), HLTVertexFilter::hltFilter(), ConversionTools::isGoodConversion(), EventVtxInfoNtupleDumper::produce(), pat::PATVertexSlimmer::produce(), pat::PATSecondaryVertexSlimmer::produce(), ConeIsolation::produce(), ElectronMVAVariableHelper< ParticleType >::produce(), pat::PATConversionProducer::produce(), CandCommonVertexFitterBase::set(), PFCandCommonVertexFitterBase::set(), Vertex(), PrimaryVertexMonitor::vertexPlots(), PrimaryVertexValidation::vtxSort(), and BPHChi2Select::~BPHChi2Select().
|
inline |
(i, j)-th element of error matrix, i, j = 0, ... 2
Definition at line 130 of file Vertex.h.
References covariance_, and idx().
Referenced by SignedImpactParameter3D::apply(), SignedTransverseImpactParameter::apply(), SignedDecayLength3D::apply(), OniaPhotonConversionProducer::checkTkVtxCompatibility(), VertexDistance::compatibility(), reco::TemplatedSecondaryVertex< SV >::computeDist1d(), reco::TemplatedSecondaryVertex< SV >::computeDist2d(), reco::TemplatedSecondaryVertex< SV >::computeDist3d(), GsfConstraintAtVertex::constrainAtVertex(), svhelper::cov33(), tauImpactParameter::ParticleBuilder::createLorentzVectorParticle(), VertexDistance::distance(), VertexCompatibleWithBeam::distanceToBeam(), GsfVertexTrackCompatibilityEstimator::estimate(), KalmanVertexTrackCompatibilityEstimator< N >::estimate(), V0Fitter::fitAll(), IPTools::linearizedSignedImpactParameter3D(), TracksClusteringFromDisplacedSeed::nearTracks(), ConversionHitChecker::nHitsBeforeVtx(), VertexCompatibleWithBeam::operator()(), TemplatedInclusiveVertexFinder< InputContainer, VTX >::produce(), TemplatedSecondaryVertexProducer< IPTI, VTX >::produce(), PVFitter::pvQuality(), PFCandCommonVertexFitterBase::set(), IPTools::signedDecayLength3D(), TrackVertexArbitration< VTX >::trackVertexArbitrator(), reco::JetSignalVertexCompatibilityAlgo::trackVertexCompat(), PrimaryVertexMonitor::vertexPlots(), reco::V0Candidate::vtxCovariance(), and SignedTransverseImpactParameter::zImpactParameter().
|
inline |
|
inline |
return SMatrix 4D
Definition at line 136 of file Vertex.h.
References fill(), and funct::m.
Referenced by pat::PATVertexSlimmer::produce().
|
inline |
return SMatrix
Definition at line 139 of file Vertex.h.
References fill(), and funct::m.
Referenced by IPTools::absoluteImpactParameter(), BPHCompositeVertexSelect::accept(), BPHFittedVertexSelect::accept(), FWSecVertexProxyBuilder::build(), FWVertexProxyBuilder::build(), Page1Parser.Page1Parser::check_for_whole_start_tag(), dummyPrediction(), HLTmumutkFilter::hltFilter(), HLTmumutktkFilter::hltFilter(), pat::VertexAssociationSelector::operator()(), pat::PATSecondaryVertexSlimmer::produce(), ConeIsolation::produce(), Onia2MuMuPAT::produce(), TemplatedSecondaryVertexProducer< IPTI, VTX >::produce(), IPProducer< Container, Base, Helper >::produce(), and reco::GhostTrackVertexFinder::vertices().
|
inline |
return SMatrix
Definition at line 141 of file Vertex.h.
References fill(), funct::m, and findQualityFiles::v.
void reco::Vertex::fill | ( | CovarianceMatrix & | v | ) | const |
fill SMatrix
Referenced by covariance(), covariance4D(), error(), error4D(), fill(), and CandCommonVertexFitterBase::set().
void Vertex::fill | ( | CovarianceMatrix4D & | v | ) | const |
4D version
Definition at line 58 of file Vertex.cc.
References covariance_, dimension4D, fill(), mps_fire::i, idx(), and groupFilesInBlocks::temp.
|
inline |
Checks whether refitted tracks are stored.
Definition at line 149 of file Vertex.h.
References originalTrack(), refittedTrack(), refittedTracks_, and HiIsolationCommonParameters_cff::track.
Referenced by nTracks(), GhostTrackComputer::operator()(), CombinedSVComputer::operator()(), p4(), Onia2MuMuPAT::produce(), and reco::TrackKinematics::TrackKinematics().
position index
Definition at line 199 of file Vertex.h.
Referenced by covariance(), fill(), ntupleDataFormat.TrackMatchInfo::track(), ntupleDataFormat.TrackingParticleMatchInfo::trackingParticle(), trackRefAt(), and Vertex().
|
inline |
Tells whether a Vertex is fake, i.e. not a vertex made out of a proper fit with tracks. For a primary vertex, it could simply be the beam line.
Definition at line 72 of file Vertex.h.
References add(), chi2_, ndof_, alignCSCRings::r, removeTracks(), tracks_, and w.
Referenced by TrackingRecoMaterialAnalyser::analyze(), TopDiLeptonDQM::analyze(), V0Monitor::analyze(), TrackingMonitor::analyze(), FSQDQM::analyze(), VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), MVAJetPuId::computeIdVariables(), PileupJetIdAlgo::computeIdVariables(), TrackingNtuple::fillVertices(), BVertexFilterT< VTX >::filter(), TauTagTools::filteredPFChargedHadrCands(), TauTagTools::filteredTracks(), HLTVertexFilter::hltFilter(), HcalHBHEMuonAnalyzer::isGoodVertex(), PVObjectSelector::operator()(), EventVtxInfoNtupleDumper::produce(), VertexCompositeCandidateCollectionSelector::produce(), PFchsMETcorrInputProducer::produce(), PrimaryVertexMonitor::pvTracksPlots(), PrimaryVertexMonitor::vertexPlots(), and BPHChi2Select::~BPHChi2Select().
|
inline |
Tells whether the vertex is valid.
Definition at line 68 of file Vertex.h.
References validity_.
Referenced by ntupleDataFormat._Object::_checkIsValid(), EwkMuDQM::analyze(), EwkElecDQM::analyze(), TkConvValidator::analyze(), PrimaryVertexValidation::analyze(), VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), ConversionProducer::buildCollection(), ConvertedPhotonProducer::buildCollections(), NuclearLikelihood::calculate(), ConversionProducer::checkPhi(), reco::Conversion::dxy(), reco::Conversion::dz(), PrimaryVertexValidation::fillTrackHistos(), NuclearVertexBuilder::FillVertexWithAdaptVtxFitter(), TrackingNtuple::fillVertices(), HLTVertexFilter::hltFilter(), ConversionTools::isGoodConversion(), reco::Conversion::lxy(), reco::Conversion::lz(), ElectronMVAVariableHelper< ParticleType >::produce(), PrimaryVertexMonitor::pvTracksPlots(), core.AutoHandle.AutoHandle::ReallyLoad(), BPHDecayVertex::validVertex(), PrimaryVertexMonitor::vertexPlots(), and BPHChi2Select::~BPHChi2Select().
|
inline |
Number of degrees of freedom Meant to be Double32_t for soft-assignment fitters: tracks may contribute to the vertex with fractional weights. The ndof is then = to the sum of the track weights. see e.g. CMS NOTE-2006/032, CMS NOTE-2004/002
Definition at line 105 of file Vertex.h.
References ndof_.
Referenced by BPHCompositeVertexSelect::accept(), BPHFittedVertexSelect::accept(), CMSDAS11DijetAnalyzer::analyze(), CMSDAS11DijetTestAnalyzer::analyze(), TrackingRecoMaterialAnalyser::analyze(), VertexMonitor::analyze(), V0Monitor::analyze(), SiPixelTrackResidualSource::analyze(), TkConvValidator::analyze(), TrackingMonitor::analyze(), PrimaryVertexValidation::analyze(), BPHMonitor::analyze(), VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), ConversionProducer::buildCollection(), BPHMonitor::case11_selection(), MVAJetPuId::computeIdVariables(), PileupJetIdAlgo::computeIdVariables(), ConversionLessByChi2(), reco::PFDisplacedVertex::Dump(), PrimaryVertexAnalyzer4PUSlimmed::fillGenAssociatedRecoVertexHistograms(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), V0Fitter::fitAll(), PFDisplacedVertexFinder::fitVertexFromSeed(), OniaPhotonConversionProducer::HighpuritySubset(), HLTmumutkFilter::hltFilter(), HLTmumutktkFilter::hltFilter(), HLTVertexFilter::hltFilter(), ConversionTools::isGoodConversion(), HcalHBHEMuonAnalyzer::isGoodVertex(), PVObjectSelector::operator()(), EventVtxInfoNtupleDumper::produce(), pat::PATVertexSlimmer::produce(), pat::PATSecondaryVertexSlimmer::produce(), ConeIsolation::produce(), VertexCompositeCandidateCollectionSelector::produce(), ElectronMVAVariableHelper< ParticleType >::produce(), PFchsMETcorrInputProducer::produce(), pat::PATConversionProducer::produce(), CandCommonVertexFitterBase::set(), PFCandCommonVertexFitterBase::set(), Vertex(), PrimaryVertexMonitor::vertexPlots(), and BPHChi2Select::~BPHChi2Select().
|
inline |
chi-squared divided by n.d.o.f.
Definition at line 107 of file Vertex.h.
Referenced by VertexMonitor::analyze(), PrimaryVertexValidation::analyze(), FSQDQM::analyze(), reco::PFDisplacedVertex::Dump(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), V0Fitter::fitAll(), HLTmumutkFilter::hltFilter(), and HLTmumutktkFilter::hltFilter().
unsigned int Vertex::nTracks | ( | float | minWeight = 0.5 | ) | const |
Returns the number of tracks in the vertex with weight above minWeight.
Definition at line 169 of file Vertex.cc.
References hasRefittedTracks(), fftjetcommon_cfi::minWeight, gen::n, originalTrack(), refittedTracks_, tracks_begin(), tracks_end(), and trackWeight().
Referenced by nTracks(), and refittedTracks().
TrackBaseRef Vertex::originalTrack | ( | const Track & | refTrack | ) | const |
Returns the original track which corresponds to a particular refitted Track Throws an exception if now refitted tracks are stored ot the track is not found in the list
Definition at line 108 of file Vertex.cc.
References Exception, spr::find(), refittedTrack(), refittedTracks_, HiIsolationCommonParameters_cff::track, tracks_, tracks_begin(), and tracks_end().
Referenced by PFDisplacedVertexFinder::commonTracks(), PF_PU_AssoMapAlgos::FindNIVertex(), hasRefittedTracks(), PFDisplacedVertexHelper::identifyVertex(), reco::PFDisplacedVertex::isBSM(), PFDisplacedVertexHelper::lambdaCP(), reco::PFDisplacedVertex::momentum(), nTracks(), p4(), and Onia2MuMuPAT::produce().
math::XYZTLorentzVectorD Vertex::p4 | ( | float | mass = 0.13957018 , |
float | minWeight = 0.5 |
||
) | const |
Returns the four momentum of the sum of the tracks, assuming the given mass for the decay products.
Definition at line 135 of file Vertex.cc.
References hasRefittedTracks(), fftjetcommon_cfi::minWeight, originalTrack(), refittedTracks_, tracks_begin(), tracks_end(), and trackWeight().
Referenced by FWVertexProxyBuilder::build(), BtoCharmDecayVertexMergerT< VTX >::buildVertexProxy(), Tau.Tau::dxy_approx(), Tau.Tau::dz(), Lepton.Lepton::p4WithFSR(), pat::PATSecondaryVertexSlimmer::produce(), reco::Conversion::refittedPair4Momentum(), and refittedTracks().
|
inline |
position
Definition at line 109 of file Vertex.h.
References position_.
Referenced by IPTools::absoluteImpactParameter(), IPTools::absoluteImpactParameter3D(), IPTools::absoluteTransverseImpactParameter(), BPHSoftMuonSelect::accept(), CMSDAS11DijetAnalyzer::analyze(), CMSDAS11DijetTestAnalyzer::analyze(), TrackTypeMonitor::analyze(), TrackingRecoMaterialAnalyser::analyze(), dqm::TrackAnalyzer::analyze(), ElectronConversionRejectionValidator::analyze(), BDHadronTrackMonitoringAnalyzer::analyze(), TkConvValidator::analyze(), HcalRaddamMuon::analyze(), TopMonitor::analyze(), TrackingMonitor::analyze(), PrimaryVertexValidation::analyze(), METMonitor::analyze(), HTMonitor::analyze(), FSQDQM::analyze(), PackedCandidateTrackValidator::analyze(), SignedImpactParameter3D::apply(), CaloRecoTauAlgorithm::buildCaloTau(), PFRecoTauAlgorithm::buildPFTau(), pat::LeptonVertexSignificance::calculate(), LeptonJetVarProducer< T >::calculatePtRatioRel(), reco::PFMETProducerMVA::chargedFracInCone(), ConversionProducer::checkPhi(), OniaPhotonConversionProducer::checkTkVtxCompatibility(), VertexDistance::compatibility(), reco::TemplatedSecondaryVertex< SV >::computeDist1d(), reco::TemplatedSecondaryVertex< SV >::computeDist2d(), reco::TemplatedSecondaryVertex< SV >::computeDist3d(), MVAJetPuId::computeIdVariables(), PileupJetIdAlgo::computeIdVariables(), pat::MuonMvaEstimator::computeMva(), reco::PFMETProducerMVA::computePFCandidateInfo(), vertexTools::computeSharedTracks(), GsfConstraintAtVertex::constrainAtVertex(), EcalBarrelClusterFastTimer::correctTimeToVertex(), DeepTauId::createEgammaBlockInputs(), DeepTauId::createHadronsBlockInputs(), tauImpactParameter::ParticleBuilder::createLorentzVectorParticle(), DeepTauId::createMuonBlockInputs(), VertexDistance::distance(), VertexCompatibleWithBeam::distanceToBeam(), dummyPrediction(), reco::PFDisplacedVertex::Dump(), pat::PATMuonProducer::embedHighLevel(), pat::PATElectronProducer::embedHighLevel(), GsfVertexTrackCompatibilityEstimator::estimate(), KalmanVertexTrackCompatibilityEstimator< N >::estimate(), BPHWriteSpecificDecay::fill(), SingleTopTChannelLepton_miniAOD::MonitorEnsemble::fill(), TopSingleLepton_miniAOD::MonitorEnsemble::fill(), SingleTopTChannelLepton::MonitorEnsemble::fill(), TopSingleLepton::MonitorEnsemble::fill(), DeepBoostedJetTagInfoProducer::fillParticleFeatures(), PFEGammaAlgo::fillPFCandidates(), PrimaryVertexValidation::fillTrackHistos(), TrackingFailureFilter::filter(), TauTagTools::filteredPFChargedHadrCands(), TauTagTools::filteredTracks(), NuclearInteractionEDProducer::findAdditionalSecondaryTracks(), PF_PU_AssoMapAlgos::FindConversionVertex(), PF_PU_AssoMapAlgos::FindNIVertex(), PFDisplacedVertexFinder::fitVertexFromSeed(), L1TTauOffline::getPrimaryVertex(), OniaPhotonConversionProducer::HighpuritySubset(), HLTmumutkFilter::hltFilter(), HLTmumutktkFilter::hltFilter(), PFDisplacedVertexHelper::identifyVertex(), EGammaMvaEleEstimator::IDIsoCombinedMvaValue(), NuclearVertexBuilder::isCompatible(), HcalHBHEMuonAnalyzer::isGoodVertex(), muon::isHighPtMuon(), EGammaMvaEleEstimator::isoMvaValue(), muon::isSoftMuon(), MuonIDTableProducer::isSoftMuonHIP(), muon::isTightMuon(), isTightMuonCustom(), MuonIDTableProducer::isTrackerHighPt(), muon::isTrackerHighPtMuon(), PhotonConversionTrajectorySeedProducerFromQuadrupletsAlgo::loop(), OniaPhotonConversionProducer::makePhotonCandidate(), L3MuonTrajectoryBuilder::makeTkCandCollection(), ConversionTools::matchesConversion(), EGammaMvaEleEstimatorCSA14::mvaValue(), EGammaMvaEleEstimator::mvaValue(), TracksClusteringFromDisplacedSeed::nearTracks(), NuclearTrackCorrector::newTrajNeeded(), VertexCompatibleWithBeam::operator()(), reco::VertexFilter::operator()(), PVObjectSelector::operator()(), pat::VertexAssociationSelector::operator()(), PrimaryVertexValidation::passesTrackCuts(), PFTauElementsOperators::PFGammaCandsInOutEllipse(), position(), PFAlgo::processBlock(), EventVtxInfoNtupleDumper::produce(), pat::PATVertexSlimmer::produce(), pat::PATSecondaryVertexSlimmer::produce(), JetCoreClusterSplitter::produce(), pat::LeptonUpdater< T >::produce(), Onia2MuMuPAT::produce(), pat::PATIsolatedTrackProducer::produce(), VertexFromTrackProducer::produce(), pat::PATMuonProducer::produce(), TemplatedInclusiveVertexFinder< InputContainer, VTX >::produce(), TemplatedSecondaryVertexProducer< IPTI, VTX >::produce(), IPProducer< Container, Base, Helper >::produce(), PrimaryVertexMonitor::pvTracksPlots(), TkConvValidator::recalculateMomentumAtFittedVertex(), TauElementsOperators::replaceSubStr(), pf2pat::IPCutPFCandidateSelectorDefinition::select(), PFTauElementsOperators::setAreaMetricrecoElementsmaxabsEta(), muon::setCutBasedSelectorFlags(), pat::LeptonUpdater< T >::setDZ(), reco::PFDisplacedVertex::setPrimaryDirection(), reco::V0Candidate::setRecoVertex(), FWConvTrackHitsDetailView::setTextInfo(), VertexDistanceXY::signedDistance(), VertexDistance3D::signedDistance(), IPTools::signedImpactParameter3D(), IPTools::signedTransverseImpactParameter(), ConeIsolationAlgorithm::tag(), ConversionProducer::trackD0Cut(), QcdUeDQM::trackSelection(), TrackVertexArbitration< VTX >::trackVertexArbitrator(), reco::JetSignalVertexCompatibilityAlgo::trackVertexCompat(), PrimaryVertexMonitor::vertexPlots(), and reco::GhostTrackVertexFinder::vertices().
Track reco::Vertex::refittedTrack | ( | const TrackBaseRef & | track | ) | const |
Returns the refitted track which corresponds to a particular original Track Throws an exception if now refitted tracks are stored ot the track is not found in the list
Referenced by hasRefittedTracks(), GhostTrackComputer::operator()(), CombinedSVComputer::operator()(), originalTrack(), refittedTrack(), reco::TrackKinematics::TrackKinematics(), and reco::PFDisplacedVertex::trackPosition().
Returns the refitted track which corresponds to a particular original Track Throws an exception if now refitted tracks are stored ot the track is not found in the list
Definition at line 130 of file Vertex.cc.
References refittedTrack().
|
inline |
Returns the container of refitted tracks.
Definition at line 164 of file Vertex.h.
References ResonanceBuilder::mass, fftjetcommon_cfi::minWeight, nTracks(), p4(), and refittedTracks_.
Referenced by TkConvValidator::analyze(), PFDisplacedVertexFinder::commonTracks(), PF_PU_AssoMapAlgos::FindNIVertex(), PFDisplacedVertexHelper::identifyVertex(), PFDisplacedVertexHelper::isKaonMass(), PFDisplacedVertexHelper::lambdaCP(), reco::PFDisplacedVertex::momentum(), Onia2MuMuPAT::produce(), reco::PFDisplacedVertex::totalCharge(), and reco::PFDisplacedVertex::trackPosition().
void Vertex::removeTracks | ( | ) |
Definition at line 101 of file Vertex.cc.
References refittedTracks_, tracks_, and weights_.
Referenced by reco::PFDisplacedVertex::cleanTracks(), PFDisplacedVertexFinder::fitVertexFromSeed(), and isFake().
|
inline |
t coordinate
Definition at line 117 of file Vertex.h.
References time_.
Referenced by VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), pat::PATVertexSlimmer::produce(), TemplatedInclusiveVertexFinder< InputContainer, VTX >::produce(), and trackWeight().
|
inline |
error on t
Definition at line 125 of file Vertex.h.
References covariance(), and mathSSE::sqrt().
Referenced by VertexAssociatorByPositionAndTracks::associateRecoToSim(), and VertexAssociatorByPositionAndTracks::associateSimToReco().
|
inline |
python friendly track getting
Definition at line 96 of file Vertex.h.
References idx(), and tracks_.
Vertex::trackRef_iterator Vertex::tracks_begin | ( | ) | const |
first iterator over tracks
Definition at line 76 of file Vertex.cc.
References tracks_.
Referenced by NuclearVertexBuilder::addSecondaryTrack(), PatBJetVertexAnalyzer::analyze(), VertexMonitor::analyze(), PrimaryVertexValidation::analyze(), FSQDQM::analyze(), VertexAssociatorByTracks::associateRecoToSim(), VertexAssociatorByTracks::associateSimToReco(), FWSecVertexProxyBuilder::build(), FWVertexProxyBuilder::build(), NuclearLikelihood::calculate(), PrimaryVertexAnalyzer4PUSlimmed::calculatePurityAndFillHistograms(), calculateVertexSharedTracks(), PFIsolationEstimator::chargedHadronVertex(), MVAJetPuId::computeIdVariables(), vertexTools::computeSharedTracks(), computeSharedTracks(), PFRecoTauDiscriminationByFlight::discriminate(), GsfVertexTrackCompatibilityEstimator::estimate(), KalmanVertexTrackCompatibilityEstimator< N >::estimate(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), FFTJetPFPileupCleaner::findSomeVertexWFakes(), PATPrimaryVertexSelector::getVertexVariables(), HLTmumutkFilter::hltFilter(), HLTmumutktkFilter::hltFilter(), NuclearVertexBuilder::isCompatible(), PFEGammaFilters::isElectronSafeForJetMET(), main(), nTracks(), CombinedSVComputer::operator()(), originalTrack(), p4(), reco::NuclearInteraction::primaryTrack(), pat::PATSecondaryVertexSlimmer::produce(), L2TauPixelIsoTagProducer::produce(), PFchsMETcorrInputProducer::produce(), Onia2MuMuPAT::produce(), PFTauPrimaryVertexProducer::produce(), TemplatedSecondaryVertexProducer< IPTI, VTX >::produce(), PVClusterComparer::pTSquaredSum(), PrimaryVertexMonitor::pvTracksPlots(), PFEGammaAlgo::removeOrLinkECALClustersToKFTracks(), NuclearLikelihood::secondaryTrackMaxHits(), reco::NuclearInteraction::secondaryTracks_begin(), PFElectronAlgo::SetIDOutputs(), PFElectronAlgo::SetLinks(), BoostedDoubleSVProducer::setTracksPVBase(), PrimaryVertexResolution::sortTracksByPt(), VertexHigherPtSquared::sumPtSquared(), TrackerDpgAnalysis::sumPtSquared(), reco::TrackKinematics::TrackKinematics(), trackWeight(), and PrimaryVertexMonitor::vertexPlots().
Vertex::trackRef_iterator Vertex::tracks_end | ( | ) | const |
last iterator over tracks
Definition at line 81 of file Vertex.cc.
References add(), alignCSCRings::r, refittedTracks_, tracks_, w, and weights_.
Referenced by NuclearVertexBuilder::addSecondaryTrack(), PatBJetVertexAnalyzer::analyze(), VertexMonitor::analyze(), PrimaryVertexValidation::analyze(), FSQDQM::analyze(), VertexAssociatorByTracks::associateRecoToSim(), VertexAssociatorByTracks::associateSimToReco(), FWSecVertexProxyBuilder::build(), FWVertexProxyBuilder::build(), PrimaryVertexAnalyzer4PUSlimmed::calculatePurityAndFillHistograms(), calculateVertexSharedTracks(), PFIsolationEstimator::chargedHadronVertex(), MVAJetPuId::computeIdVariables(), vertexTools::computeSharedTracks(), computeSharedTracks(), PFRecoTauDiscriminationByFlight::discriminate(), GsfVertexTrackCompatibilityEstimator::estimate(), KalmanVertexTrackCompatibilityEstimator< N >::estimate(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), FFTJetPFPileupCleaner::findSomeVertexWFakes(), PATPrimaryVertexSelector::getVertexVariables(), HLTmumutktkFilter::hltFilter(), PFEGammaFilters::isElectronSafeForJetMET(), main(), nTracks(), CombinedSVComputer::operator()(), originalTrack(), p4(), pat::PATSecondaryVertexSlimmer::produce(), L2TauPixelIsoTagProducer::produce(), PFchsMETcorrInputProducer::produce(), Onia2MuMuPAT::produce(), PFTauPrimaryVertexProducer::produce(), TemplatedSecondaryVertexProducer< IPTI, VTX >::produce(), PVClusterComparer::pTSquaredSum(), PrimaryVertexMonitor::pvTracksPlots(), PFEGammaAlgo::removeOrLinkECALClustersToKFTracks(), NuclearLikelihood::secondaryTrackMaxHits(), reco::NuclearInteraction::secondaryTracks_end(), PFElectronAlgo::SetIDOutputs(), PFElectronAlgo::SetLinks(), BoostedDoubleSVProducer::setTracksPVBase(), PrimaryVertexResolution::sortTracksByPt(), VertexHigherPtSquared::sumPtSquared(), TrackerDpgAnalysis::sumPtSquared(), reco::TrackKinematics::TrackKinematics(), trackWeight(), and PrimaryVertexMonitor::vertexPlots().
size_t Vertex::tracksSize | ( | ) | const |
number of tracks
Definition at line 71 of file Vertex.cc.
References weights_.
Referenced by PatVertexAnalyzer::analyze(), PatBJetVertexAnalyzer::analyze(), VertexMonitor::analyze(), TopDiLeptonDQM::analyze(), V0Monitor::analyze(), PrimaryVertexResolution::analyze(), TrackingMonitor::analyze(), PrimaryVertexValidation::analyze(), FSQDQM::analyze(), VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), BtoCharmDecayVertexMergerT< VTX >::buildVertexProxy(), NuclearLikelihood::calculate(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), SVTagInfoValidationAnalyzer::fillSimToReco(), NuclearVertexBuilder::FillVertexWithAdaptVtxFitter(), HLTmumutkFilter::hltFilter(), HLTmumutktkFilter::hltFilter(), reco::PFDisplacedVertex::momentum(), EventVtxInfoNtupleDumper::produce(), ConeIsolation::produce(), VertexCompositeCandidateCollectionSelector::produce(), Onia2MuMuPAT::produce(), PrimaryVertexMonitor::pvTracksPlots(), NuclearLikelihood::secondaryTrackMaxHits(), reco::NuclearInteraction::secondaryTracksSize(), PrimaryVertexResolution::sortTracksByPt(), reco::PFDisplacedVertex::totalCharge(), trackWeight(), PrimaryVertexMonitor::vertexPlots(), and PrimaryVertexValidation::vtxSort().
|
inline |
returns the weight with which a Track has contributed to the vertex-fit.
Definition at line 81 of file Vertex.h.
References mps_fire::i, t(), tracks_, tracks_begin(), tracks_end(), tracksSize(), and weights_.
Referenced by pat::PATLostTracks::addPackedCandidate(), VertexAssociatorByTracks::associateRecoToSim(), VertexAssociatorByTracks::associateSimToReco(), FWVertexProxyBuilder::build(), PFIsolationEstimator::chargedHadronVertex(), PileupJetIdAlgo::computeIdVariables(), vertexTools::computeSharedTracks(), computeSharedTracks(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), FFTJetPFPileupCleaner::findSomeVertexWFakes(), nTracks(), CombinedSVComputer::operator()(), p4(), pat::PATSecondaryVertexSlimmer::produce(), Onia2MuMuPAT::produce(), PrimaryVertexMonitor::pvTracksPlots(), BoostedDoubleSVProducer::setTracksPVBase(), reco::TrackKinematics::TrackKinematics(), trackWeight(), PrimaryVertexMonitor::vertexPlots(), and reco::btag::weight().
|
inline |
x coordinate
Definition at line 111 of file Vertex.h.
References position_.
Referenced by svgfig.Curve.Sample::__repr__(), svgfig.Ellipse::__repr__(), BPHCompositeVertexSelect::accept(), BPHFittedVertexSelect::accept(), PatVertexAnalyzer::analyze(), TopDiLeptonDQM::analyze(), V0Monitor::analyze(), TkConvValidator::analyze(), FSQDQM::analyze(), SignedImpactParameter3D::apply(), SignedTransverseImpactParameter::apply(), SignedDecayLength3D::apply(), Vispa.Gui.WidgetContainer.WidgetContainer::autosize(), Vispa.Gui.VispaWidget.VispaWidget::boundingRect(), FWSecVertexProxyBuilder::build(), FWVertexProxyBuilder::build(), PFRecoTauAlgorithm::buildPFTau(), SignedDecayLength3D::closestApproachToJet(), SignedImpactParameter3D::closestApproachToJet(), IPTools::closestApproachToJet(), SignedImpactParameter3D::distance(), SignedImpactParameter3D::distanceWithJetAxis(), reco::Conversion::dxy(), reco::Conversion::dz(), PFPhotonAlgo::EvaluateSingleLegMVA(), PFEGammaAlgo::EvaluateSingleLegMVA(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), V0Fitter::fitAll(), BtoCharmDecayVertexMergerT< VTX >::flightDirection(), flightDirection(), getVertexD0(), HLTVertexFilter::hltFilter(), ConversionTools::isGoodConversion(), TCMETAlgo::isGoodTrack(), IPTools::jetTrackDistance(), IPTools::linearizedSignedImpactParameter3D(), reco::Conversion::lxy(), reco::PFDisplacedVertex::momentum(), ConversionHitChecker::nHitsBeforeVtx(), pat::VertexAssociationSelector::operator()(), geometryXMLparser.Alignable::pos(), Vispa.Gui.ConnectableWidget.ConnectableWidget::positionizeMenuWidget(), PFAlgo::processBlock(), EcalDetailedTimeRecHitProducer::produce(), VertexCompositeCandidateCollectionSelector::produce(), pat::PATConversionProducer::produce(), PhotonIDValueMapProducer::produce(), ntupleDataFormat._HitObject::r(), ntupleDataFormat._HitObject::r3D(), PFAlgo::reconstructCluster(), PrimaryVertexResolution::Resolution::Resolution(), PFPhotonAlgo::RunPFPhoton(), reco::PFDisplacedVertex::setPrimaryDirection(), FWConvTrackHitsDetailView::setTextInfo(), IPTools::signedDecayLength3D(), IPTools::signedImpactParameter3D(), IPTools::signedTransverseImpactParameter(), btagbtvdeep::vertexDdotP(), and SignedTransverseImpactParameter::zImpactParameter().
|
inline |
error on x
Definition at line 119 of file Vertex.h.
References covariance(), and mathSSE::sqrt().
Referenced by PatVertexAnalyzer::analyze(), dqm::TrackAnalyzer::analyze(), FSQDQM::analyze(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), PrimaryVertexAnalyzer4PUSlimmed::fillResolutionAndPullHistograms(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), NuclearVertexBuilder::isCompatible(), PhotonConversionTrajectorySeedProducerFromQuadrupletsAlgo::loop(), PrimaryVertexValidation::passesTrackCuts(), VertexFromTrackProducer::produce(), PrimaryVertexResolution::Resolution::Resolution(), pf2pat::IPCutPFCandidateSelectorDefinition::select(), and PrimaryVertexMonitor::vertexPlots().
|
inline |
y coordinate
Definition at line 113 of file Vertex.h.
References position_.
Referenced by svgfig.Ellipse::__repr__(), BPHCompositeVertexSelect::accept(), BPHFittedVertexSelect::accept(), PatVertexAnalyzer::analyze(), TopDiLeptonDQM::analyze(), V0Monitor::analyze(), TkConvValidator::analyze(), FSQDQM::analyze(), SignedImpactParameter3D::apply(), SignedTransverseImpactParameter::apply(), SignedDecayLength3D::apply(), Vispa.Gui.WidgetContainer.WidgetContainer::autosize(), Vispa.Gui.VispaWidget.VispaWidget::boundingRect(), FWSecVertexProxyBuilder::build(), FWVertexProxyBuilder::build(), PFRecoTauAlgorithm::buildPFTau(), SignedDecayLength3D::closestApproachToJet(), SignedImpactParameter3D::closestApproachToJet(), IPTools::closestApproachToJet(), SignedImpactParameter3D::distance(), SignedImpactParameter3D::distanceWithJetAxis(), reco::Conversion::dxy(), reco::Conversion::dz(), PFPhotonAlgo::EvaluateSingleLegMVA(), PFEGammaAlgo::EvaluateSingleLegMVA(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), V0Fitter::fitAll(), BtoCharmDecayVertexMergerT< VTX >::flightDirection(), flightDirection(), getVertexD0(), HLTVertexFilter::hltFilter(), ConversionTools::isGoodConversion(), TCMETAlgo::isGoodTrack(), IPTools::jetTrackDistance(), IPTools::linearizedSignedImpactParameter3D(), reco::Conversion::lxy(), reco::PFDisplacedVertex::momentum(), ConversionHitChecker::nHitsBeforeVtx(), pat::VertexAssociationSelector::operator()(), geometryXMLparser.Alignable::pos(), Vispa.Gui.ConnectableWidget.ConnectableWidget::positionizeMenuWidget(), PFAlgo::processBlock(), EcalDetailedTimeRecHitProducer::produce(), VertexCompositeCandidateCollectionSelector::produce(), pat::PATConversionProducer::produce(), PhotonIDValueMapProducer::produce(), ntupleDataFormat._HitObject::r(), ntupleDataFormat._HitObject::r3D(), PFAlgo::reconstructCluster(), PrimaryVertexResolution::Resolution::Resolution(), PFPhotonAlgo::RunPFPhoton(), reco::PFDisplacedVertex::setPrimaryDirection(), FWConvTrackHitsDetailView::setTextInfo(), IPTools::signedDecayLength3D(), IPTools::signedImpactParameter3D(), IPTools::signedTransverseImpactParameter(), btagbtvdeep::vertexDdotP(), and SignedTransverseImpactParameter::zImpactParameter().
|
inline |
error on y
Definition at line 121 of file Vertex.h.
References covariance(), and mathSSE::sqrt().
Referenced by PatVertexAnalyzer::analyze(), dqm::TrackAnalyzer::analyze(), FSQDQM::analyze(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), PrimaryVertexAnalyzer4PUSlimmed::fillResolutionAndPullHistograms(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), NuclearVertexBuilder::isCompatible(), PrimaryVertexValidation::passesTrackCuts(), VertexFromTrackProducer::produce(), PrimaryVertexResolution::Resolution::Resolution(), pf2pat::IPCutPFCandidateSelectorDefinition::select(), and PrimaryVertexMonitor::vertexPlots().
|
inline |
z coordinate
Definition at line 115 of file Vertex.h.
References position_.
Referenced by CMSDAS11DijetAnalyzer::analyze(), CMSDAS11DijetTestAnalyzer::analyze(), PatVertexAnalyzer::analyze(), TrackingRecoMaterialAnalyser::analyze(), TopDiLeptonDQM::analyze(), V0Monitor::analyze(), TrackingMonitor::analyze(), FSQDQM::analyze(), SignedImpactParameter3D::apply(), SignedTransverseImpactParameter::apply(), SignedDecayLength3D::apply(), VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), FWSecVertexProxyBuilder::build(), FWVertexProxyBuilder::build(), CaloRecoTauTagInfoAlgorithm::buildCaloTauTagInfo(), PFRecoTauAlgorithm::buildPFTau(), PFRecoTauTagInfoAlgorithm::buildPFTauTagInfo(), SignedDecayLength3D::closestApproachToJet(), SignedImpactParameter3D::closestApproachToJet(), IPTools::closestApproachToJet(), vertexTools::computeSharedTracks(), SignedImpactParameter3D::distance(), SignedImpactParameter3D::distanceWithJetAxis(), reco::Conversion::dz(), PFPhotonAlgo::EvaluateLCorrMVA(), PFPhotonAlgo::EvaluateSingleLegMVA(), PFEGammaAlgo::EvaluateSingleLegMVA(), EwkElecTauHistManager::fillHistograms(), EwkMuTauHistManager::fillHistograms(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), SVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), V0Fitter::fitAll(), BtoCharmDecayVertexMergerT< VTX >::flightDirection(), flightDirection(), HLTVertexFilter::hltFilter(), TCMETAlgo::isGoodTrack(), IPTools::jetTrackDistance(), IPTools::linearizedSignedImpactParameter3D(), QualityCutsAnalyzer::LoopOverJetTracksAssociation(), reco::Conversion::lz(), reco::PFDisplacedVertex::momentum(), ConversionHitChecker::nHitsBeforeVtx(), PVObjectSelector::operator()(), pat::VertexAssociationSelector::operator()(), geometryXMLparser.Alignable::pos(), PFAlgo::processBlock(), EventVtxInfoNtupleDumper::produce(), ConeIsolation::produce(), EcalDetailedTimeRecHitProducer::produce(), L2TauPixelIsoTagProducer::produce(), VertexCompositeCandidateCollectionSelector::produce(), PFchsMETcorrInputProducer::produce(), PhotonIDValueMapProducer::produce(), ntupleDataFormat._HitObject::r3D(), PFAlgo::reconstructCluster(), PrimaryVertexResolution::Resolution::Resolution(), PFPhotonAlgo::RunPFPhoton(), reco::PFDisplacedVertex::setPrimaryDirection(), FWConvTrackHitsDetailView::setTextInfo(), IPTools::signedDecayLength3D(), IPTools::signedImpactParameter3D(), ConeIsolationAlgorithm::tag(), ImpactParameterAlgorithm::tag(), btagbtvdeep::vertexDdotP(), and SignedTransverseImpactParameter::zImpactParameter().
|
inline |
error on z
Definition at line 123 of file Vertex.h.
References covariance(), and mathSSE::sqrt().
Referenced by PatVertexAnalyzer::analyze(), dqm::TrackAnalyzer::analyze(), FSQDQM::analyze(), VertexAssociatorByPositionAndTracks::associateRecoToSim(), VertexAssociatorByPositionAndTracks::associateSimToReco(), pat::LeptonVertexSignificance::calculate(), pat::PATMuonProducer::embedHighLevel(), pat::PATElectronProducer::embedHighLevel(), SVTagInfoValidationAnalyzer::fillRecoToSim(), recoBSVTagInfoValidationAnalyzer::fillRecoToSim(), PrimaryVertexAnalyzer4PUSlimmed::fillResolutionAndPullHistograms(), SVTagInfoValidationAnalyzer::fillSimToReco(), recoBSVTagInfoValidationAnalyzer::fillSimToReco(), TrackingNtuple::fillVertices(), NuclearVertexBuilder::isCompatible(), PhotonConversionTrajectorySeedProducerFromQuadrupletsAlgo::loop(), pat::VertexAssociationSelector::operator()(), PrimaryVertexValidation::passesTrackCuts(), VertexFromTrackProducer::produce(), PrimaryVertexResolution::Resolution::Resolution(), pf2pat::IPCutPFCandidateSelectorDefinition::select(), pat::LeptonUpdater< T >::setDZ(), and PrimaryVertexMonitor::vertexPlots().
|
private |
chi-sqared
Definition at line 182 of file Vertex.h.
Referenced by chi2(), isFake(), and normalizedChi2().
|
private |
covariance matrix (4x4) as vector
Definition at line 188 of file Vertex.h.
Referenced by covariance(), fill(), and Vertex().
|
private |
number of degrees of freedom
Definition at line 184 of file Vertex.h.
Referenced by isFake(), ndof(), and normalizedChi2().
|
private |
|
private |
The vector of refitted tracks.
Definition at line 192 of file Vertex.h.
Referenced by hasRefittedTracks(), nTracks(), originalTrack(), p4(), refittedTracks(), removeTracks(), and tracks_end().
|
private |
reference to tracks
Definition at line 190 of file Vertex.h.
Referenced by isFake(), originalTrack(), removeTracks(), trackRefAt(), tracks_begin(), tracks_end(), trackWeight(), and Vertex().
|
private |
|
private |
Definition at line 193 of file Vertex.h.
Referenced by removeTracks(), tracks_end(), tracksSize(), and trackWeight().