SUMO - Simulation of Urban MObility
GUIE2Collector Class Reference

The gui-version of the MSE2Collector. More...

#include <GUIE2Collector.h>

Inheritance diagram for GUIE2Collector:
Inheritance graph
Collaboration diagram for GUIE2Collector:
Collaboration graph

Data Structures

class  MyWrapper
 

Public Types

enum  Notification {
  NOTIFICATION_DEPARTED, NOTIFICATION_JUNCTION, NOTIFICATION_SEGMENT, NOTIFICATION_LANE_CHANGE,
  NOTIFICATION_TELEPORT, NOTIFICATION_PARKING, NOTIFICATION_ARRIVED, NOTIFICATION_VAPORIZED,
  NOTIFICATION_TELEPORT_ARRIVED, NOTIFICATION_PARKING_REROUTE
}
 Definition of a vehicle state. More...
 
typedef std::map< std::string, VehicleInfo * > VehicleInfoMap
 

Public Member Functions

void addTo (const StoringVisitor &cont) const
 Adds this object to the given container. More...
 
virtual GUIDetectorWrapperbuildDetectorGUIRepresentation ()
 Returns the wrapper for this detector. More...
 
const std::string & getDescription () const
 
double getEndPos () const
 Returns the end position of the detector. More...
 
const std::string & getID () const
 Returns the id. More...
 
const MSLanegetLane () const
 Returns the lane the reminder works on. More...
 
std::vector< MSLane * > getLanes ()
 Returns a vector containing pointers to the lanes covered by the detector ordered from its first to its last lane. More...
 
MSLanegetLastLane () const
 Returns the id of the detector's last lane. More...
 
double getLength () const
 Returns the length of the detector. More...
 
double getStartPos () const
 Returns the begin position of the detector. More...
 
virtual DetectorUsage getUsageType () const
 Returns the detector's usage type. More...
 
 GUIE2Collector (const std::string &id, DetectorUsage usage, MSLane *lane, double startPos, double endPos, double detLength, SUMOTime haltingTimeThreshold, double haltingSpeedThreshold, double jamDistThreshold, const std::string &vTypes, bool showDetector)
 Constructor with given end position and detector length. More...
 
 GUIE2Collector (const std::string &id, DetectorUsage usage, std::vector< MSLane *> lanes, double startPos, double endPos, SUMOTime haltingTimeThreshold, double haltingSpeedThreshold, double jamDistThreshold, const std::string &vTypes, bool showDetector)
 Constructor with a sequence of lanes and given start and end position on the first and last lanes. More...
 
virtual void notifyMoveInternal (const SUMOVehicle &veh, const double frontOnLane, const double timeOnLane, const double meanSpeedFrontOnLane, const double meanSpeedVehicleOnLane, const double travelledDistanceFrontOnLane, const double travelledDistanceVehicleOnLane)
 Internal notification about the vehicle moves. More...
 
virtual void reset ()
 Resets all values. More...
 
void setDescription (const std::string &description)
 
void setID (const std::string &newID)
 resets the id More...
 
 ~GUIE2Collector ()
 Destructor. More...
 
Methods inherited from MSMoveReminder
virtual bool notifyMove (SUMOVehicle &veh, double oldPos, double newPos, double newSpeed)
 Adds/removes vehicles from the list of vehicles to regard. More...
 
virtual bool notifyLeave (SUMOVehicle &veh, double lastPos, MSMoveReminder::Notification reason, const MSLane *enteredLane=0)
 Removes a known vehicle due to its lane-change. More...
 
virtual bool notifyEnter (SUMOVehicle &veh, MSMoveReminder::Notification reason, const MSLane *enteredLane)
 Adds the vehicle to known vehicles if not beyond the dector. More...
 
Methods inherited from MSDetectorFileOutput.
virtual void detectorUpdate (const SUMOTime step)
 Computes the detector values in each time step. More...
 
virtual void writeXMLOutput (OutputDevice &dev, SUMOTime startTime, SUMOTime stopTime)
 Write the generated output to the given device. More...
 
virtual void writeXMLDetectorProlog (OutputDevice &dev) const
 Open the XML-output. More...
 
Methods returning current values
int getCurrentVehicleNumber () const
 Returns the number of vehicles currently on the detector. More...
 
double getCurrentOccupancy () const
 Returns the current detector occupancy. More...
 
double getCurrentMeanSpeed () const
 Returns the mean vehicle speed of vehicles currently on the detector. More...
 
double getCurrentMeanLength () const
 Returns the mean vehicle length of vehicles currently on the detector. More...
 
int getCurrentJamNumber () const
 Returns the current number of jams. More...
 
int getCurrentMaxJamLengthInVehicles () const
 Returns the length in vehicles of the currently largest jam. More...
 
double getCurrentMaxJamLengthInMeters () const
 Returns the length in meters of the currently largest jam. More...
 
int getCurrentJamLengthInVehicles () const
 Returns the length of all jams in vehicles. More...
 
double getCurrentJamLengthInMeters () const
 Returns the length of all jams in meters. More...
 
int getCurrentStartedHalts () const
 Returns the length of all jams in meters. More...
 
int getCurrentHaltingNumber () const
 Returns the number of current haltings within the area. More...
 
std::vector< std::string > getCurrentVehicleIDs () const
 Returns the IDs of the vehicles within the area. More...
 
std::vector< VehicleInfo * > getCurrentVehicles () const
 Returns the VehicleInfos for the vehicles currently on the detector. More...
 
int getPassedVeh ()
 Returns the number of vehicles passed over the sensor (i.e. entered the sensor) More...
 
void subtractPassedVeh (int passed)
 Subtract the number of vehicles indicated from passed from the sensor count. More...
 
Estimation methods

TODO: Need documentation, used for tls control in MSSOTLE2Sensors (->Daniel?)

int getEstimatedCurrentVehicleNumber (double speedThreshold) const
 Returns an estimate of the number of vehicles currently on the detector. More...
 
double getEstimateQueueLength () const
 Returns an estimate of the lenght of the queue of vehicles currently stopped on the detector. More...
 
Interface methods, to be derived by subclasses
void updateDetector (SUMOVehicle &veh, double entryPos, double leavePos, SUMOTime entryTime, SUMOTime currentTime, SUMOTime leaveTime, bool cleanUp)
 

Static Public Member Functions

template<class T >
static std::string getIDSecure (const T *obj, const std::string &fallBack="NULL")
 get an identifier for Named-like object which may be Null More...
 

Protected Member Functions

void removeFromVehicleUpdateValues (SUMOVehicle &veh)
 

Protected Attributes

std::string myDescription
 a description of this moveReminder More...
 
std::string myID
 The name of the object. More...
 
MSLane *const myLane
 Lane on which the reminder works. More...
 

Private Attributes

bool myShowDetectorInGUI
 Whether the detector shall be drawn in the gui. More...
 

Virtual methods to implement by derived classes

bool vehicleApplies (const SUMOVehicle &veh) const
 Checks whether the detector measures vehicles of the given type. More...
 
bool isTyped () const
 Checks whether the detector is type specific. More...
 
std::set< std::string > myVehicleTypes
 The vehicle types to look for (empty means all) More...
 

Detailed Description

The gui-version of the MSE2Collector.

Allows the building of a wrapper (also declared herein) which draws the detector on the gl-canvas. Beside this, the method "amVisible" is overridden to signalise that this detector is not used for simulation- -internal reasons, but is placed over the simulation by the user.

Definition at line 51 of file GUIE2Collector.h.

Member Typedef Documentation

◆ VehicleInfoMap

typedef std::map<std::string, VehicleInfo*> MSE2Collector::VehicleInfoMap
inherited

Definition at line 158 of file MSE2Collector.h.

Member Enumeration Documentation

◆ Notification

Definition of a vehicle state.

Enumerator
NOTIFICATION_DEPARTED 

The vehicle has departed (was inserted into the network)

NOTIFICATION_JUNCTION 

The vehicle arrived at a junction.

NOTIFICATION_SEGMENT 

The vehicle changes the segment (meso only)

NOTIFICATION_LANE_CHANGE 

The vehicle changes lanes (micro only)

NOTIFICATION_TELEPORT 

The vehicle is being teleported.

NOTIFICATION_PARKING 

The vehicle starts or ends parking.

NOTIFICATION_ARRIVED 

The vehicle arrived at its destination (is deleted)

NOTIFICATION_VAPORIZED 

The vehicle got vaporized.

NOTIFICATION_TELEPORT_ARRIVED 

The vehicle was teleported out of the net.

NOTIFICATION_PARKING_REROUTE 

The vehicle needs another parking area.

Definition at line 96 of file MSMoveReminder.h.

Constructor & Destructor Documentation

◆ GUIE2Collector() [1/2]

GUIE2Collector::GUIE2Collector ( const std::string &  id,
DetectorUsage  usage,
MSLane lane,
double  startPos,
double  endPos,
double  detLength,
SUMOTime  haltingTimeThreshold,
double  haltingSpeedThreshold,
double  jamDistThreshold,
const std::string &  vTypes,
bool  showDetector 
)

Constructor with given end position and detector length.

Parameters
[in]idThe detector's unique id.
[in]usageInformation how the detector is used
[in]laneThe lane the detector ends
[in]startPosThe start position on the lane the detector is placed at
[in]endPosThe end position on the lane the detector is placed at
[in]lengthThe length the detector has (heuristic lane selection is done if the continuation is not unique)
[in]haltingTimeThresholdThe time a vehicle's speed must be below haltingSpeedThreshold to be assigned as jammed
[in]haltingSpeedThresholdThe speed a vehicle's speed must be below to be assigned as jammed
[in]jamDistThresholdThe distance between two vehicles in order to not count them to one jam
[in]vTypesVehicle types, that the detector takes into account
[in]friendlyPositioningWhether positions should be corrected to "snap" on lane beginnings or ends if closer than POS_EPSILON
[in]showDetectorWhether the detector should be visible in the GUI
Note
Exactly one of the arguments startPos, endPos and length should be invalid (i.e. equal to std::numeric_limits<double>::max()). If length is invalid, it is required that 0 <= startPos < endPos <= lane->length If endPos is invalid, the detector may span over several lanes downstream of the lane If pos is invalid, the detector may span over several lanes upstream of the lane

Definition at line 51 of file GUIE2Collector.cpp.

◆ GUIE2Collector() [2/2]

GUIE2Collector::GUIE2Collector ( const std::string &  id,
DetectorUsage  usage,
std::vector< MSLane *>  lanes,
double  startPos,
double  endPos,
SUMOTime  haltingTimeThreshold,
double  haltingSpeedThreshold,
double  jamDistThreshold,
const std::string &  vTypes,
bool  showDetector 
)

Constructor with a sequence of lanes and given start and end position on the first and last lanes.

Parameters
[in]idThe detector's unique id.
[in]usageInformation how the detector is used
[in]lanesA sequence of lanes the detector covers (must form a continuous piece)
[in]startPosThe position of the detector start on the first lane the detector is placed at
[in]endPosThe position of the detector end on the last lane the detector is placed at
[in]haltingTimeThresholdThe time a vehicle's speed must be below haltingSpeedThreshold to be assigned as jammed
[in]haltingSpeedThresholdThe speed a vehicle's speed must be below to be assigned as jammed
[in]jamDistThresholdThe distance between two vehicles in order to not count them to one jam
[in]vTypesVehicle types, that the detector takes into account
[in]friendlyPositioningWhether positions should be corrected to "snap" on lane beginnings or ends if closer than POS_EPSILON
[in]showDetectorWhether the detector should be visible in the GUI

Definition at line 59 of file GUIE2Collector.cpp.

◆ ~GUIE2Collector()

GUIE2Collector::~GUIE2Collector ( )

Destructor.

Definition at line 67 of file GUIE2Collector.cpp.

Member Function Documentation

◆ addTo()

void Named::addTo ( const StoringVisitor cont) const
inlineinherited

Adds this object to the given container.

Parameters

Definition at line 129 of file Named.h.

References Named::StoringVisitor::add().

◆ buildDetectorGUIRepresentation()

GUIDetectorWrapper * GUIE2Collector::buildDetectorGUIRepresentation ( )
virtual

Returns the wrapper for this detector.

Returns
The wrapper representing the detector
See also
MyWrapper

Reimplemented from MSDetectorFileOutput.

Definition at line 71 of file GUIE2Collector.cpp.

◆ detectorUpdate()

◆ getCurrentHaltingNumber()

int MSE2Collector::getCurrentHaltingNumber ( ) const
inlineinherited

Returns the number of current haltings within the area.

If no vehicle is within the area, 0 is returned.

Returns
The mean number of haltings within the area

Definition at line 475 of file MSE2Collector.h.

References MSE2Collector::getCurrentVehicleIDs(), MSE2Collector::getCurrentVehicles(), and MSE2Collector::myCurrentHaltingsNumber.

Referenced by TraCI_LaneArea::getLastStepHaltingNumber().

◆ getCurrentJamLengthInMeters()

double MSE2Collector::getCurrentJamLengthInMeters ( ) const
inlineinherited

Returns the length of all jams in meters.

Definition at line 460 of file MSE2Collector.h.

References MSE2Collector::myCurrentJamLengthInMeters.

Referenced by TraCI_LaneArea::getJamLengthMeters(), and GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentJamLengthInVehicles()

int MSE2Collector::getCurrentJamLengthInVehicles ( ) const
inlineinherited

Returns the length of all jams in vehicles.

Definition at line 455 of file MSE2Collector.h.

References MSE2Collector::myCurrentJamLengthInVehicles.

Referenced by TraCI_LaneArea::getJamLengthVehicle(), and GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentJamNumber()

int MSE2Collector::getCurrentJamNumber ( ) const
inlineinherited

Returns the current number of jams.

Definition at line 440 of file MSE2Collector.h.

References MSE2Collector::myCurrentJamNo.

Referenced by GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentMaxJamLengthInMeters()

double MSE2Collector::getCurrentMaxJamLengthInMeters ( ) const
inlineinherited

Returns the length in meters of the currently largest jam.

Definition at line 450 of file MSE2Collector.h.

References MSE2Collector::myCurrentMaxJamLengthInMeters.

Referenced by GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentMaxJamLengthInVehicles()

int MSE2Collector::getCurrentMaxJamLengthInVehicles ( ) const
inlineinherited

Returns the length in vehicles of the currently largest jam.

Definition at line 445 of file MSE2Collector.h.

References MSE2Collector::myCurrentMaxJamLengthInVehicles.

Referenced by GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentMeanLength()

double MSE2Collector::getCurrentMeanLength ( ) const
inlineinherited

Returns the mean vehicle length of vehicles currently on the detector.

Definition at line 435 of file MSE2Collector.h.

References MSE2Collector::myCurrentMeanLength.

Referenced by GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentMeanSpeed()

double MSE2Collector::getCurrentMeanSpeed ( ) const
inlineinherited

Returns the mean vehicle speed of vehicles currently on the detector.

Definition at line 430 of file MSE2Collector.h.

References MSE2Collector::myCurrentMeanSpeed.

Referenced by TraCI_LaneArea::getLastStepMeanSpeed(), GUIE2Collector::MyWrapper::getParameterWindow(), and MSSOTLE2Sensors::meanVehiclesSpeed().

◆ getCurrentOccupancy()

double MSE2Collector::getCurrentOccupancy ( ) const
inlineinherited

Returns the current detector occupancy.

Definition at line 425 of file MSE2Collector.h.

References MSE2Collector::myCurrentOccupancy.

Referenced by TraCI_LaneArea::getLastStepOccupancy(), and GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentStartedHalts()

int MSE2Collector::getCurrentStartedHalts ( ) const
inlineinherited

Returns the length of all jams in meters.

Definition at line 465 of file MSE2Collector.h.

References MSE2Collector::myCurrentStartedHalts.

Referenced by GUIE2Collector::MyWrapper::getParameterWindow().

◆ getCurrentVehicleIDs()

std::vector< std::string > MSE2Collector::getCurrentVehicleIDs ( ) const
inherited

Returns the IDs of the vehicles within the area.

Returns
The IDs of the vehicles that have passed the entry, but not yet an exit point

Definition at line 1248 of file MSE2Collector.cpp.

References MSE2Collector::myVehicleInfos.

Referenced by MSE2Collector::getCurrentHaltingNumber(), and TraCI_LaneArea::getLastStepVehicleIDs().

◆ getCurrentVehicleNumber()

int MSE2Collector::getCurrentVehicleNumber ( ) const
inherited

◆ getCurrentVehicles()

std::vector< MSE2Collector::VehicleInfo * > MSE2Collector::getCurrentVehicles ( ) const
inherited

Returns the VehicleInfos for the vehicles currently on the detector.

Definition at line 1261 of file MSE2Collector.cpp.

References MSE2Collector::myVehicleInfos.

Referenced by MSSOTLE2Sensors::count(), MSE2Collector::getCurrentHaltingNumber(), and MSDelayBasedTrafficLightLogic::proposeProlongation().

◆ getDescription()

const std::string& MSMoveReminder::getDescription ( ) const
inlineinherited

◆ getEndPos()

double MSE2Collector::getEndPos ( ) const
inlineinherited

Returns the end position of the detector.

Returns
The detector's end position

Definition at line 383 of file MSE2Collector.h.

References MSE2Collector::myEndPos.

Referenced by TraCI_LaneArea::getLength().

◆ getEstimatedCurrentVehicleNumber()

int MSE2Collector::getEstimatedCurrentVehicleNumber ( double  speedThreshold) const
inherited

Returns an estimate of the number of vehicles currently on the detector.

Definition at line 1275 of file MSE2Collector.cpp.

References MSLane::getSpeedLimit(), MSMoveReminder::myLane, and MSE2Collector::myVehicleInfos.

Referenced by MSE2Collector::subtractPassedVeh().

◆ getEstimateQueueLength()

double MSE2Collector::getEstimateQueueLength ( ) const
inherited

Returns an estimate of the lenght of the queue of vehicles currently stopped on the detector.

Definition at line 1299 of file MSE2Collector.cpp.

References MSLane::getLength(), max, MIN2(), MSMoveReminder::myLane, and MSE2Collector::myVehicleInfos.

Referenced by MSE2Collector::subtractPassedVeh().

◆ getID()

const std::string& Named::getID ( ) const
inlineinherited

Returns the id.

Returns
The stored id

Definition at line 66 of file Named.h.

References Named::myID.

Referenced by NIImporter_SUMO::_loadNetwork(), MSVehicle::adaptToLeader(), MSVehicle::adaptToLeaders(), PCPolyContainer::add(), MSVehicleTransfer::add(), TraCIServerAPI_Lane::StoringVisitor::add(), MSDetectorControl::add(), Named::StoringVisitor::add(), ShapeContainer::add(), IntermodalRouter< E, L, N, V >::addAccess(), NLTriggerBuilder::addAccess(), RORouteDef::addAlternative(), MSLane::addApproachingLane(), MSNet::addBusStop(), MSNet::addChargingStation(), NBLoadedSUMOTLDef::addConnection(), NLHandler::addConnection(), MSNet::addContainerStop(), NIXMLConnectionsHandler::addCrossing(), RODFDetectorCon::addDetector(), RONet::addEdge(), ROJTREdge::addFollowerProbability(), MSTLLogicControl::TLSLogicVariants::addLogic(), RONet::addNode(), MSNet::addParkingArea(), NIImporter_SUMO::addPhase(), GUIEdge::addRerouter(), NBEdge::addRestrictedLane(), RONet::addRouteDef(), NBDistrict::addSink(), NBDistrict::addSource(), NIXMLEdgesHandler::addSplit(), NBTrafficLightLogic::addStep(), MSRouteHandler::addStop(), ROVehicle::addStop(), MSVehicle::addStop(), NBEdge::addStraightConnections(), NIXMLTrafficLightsHandler::addTlConnection(), NIVissimDisturbance::addToNode(), MSVehicle::addTraciStop(), MSVehicle::addTraciStopAtStoppingPlace(), AGActivityTripWriter::addTrip(), GUITrafficLightLogicWrapper::begin2TrackPhases(), MSTransportable::Stage_Waiting::beginEventOutput(), MSTransportable::Stage_Driving::beginEventOutput(), NLEdgeControlBuilder::build(), NIVisumTL::build(), RODFNet::buildApproachList(), MSSOTLE2Sensors::buildContinueSensior(), MSSOTLE2Sensors::buildCountSensorForLane(), MSSOTLE2Sensors::buildCountSensorForOutLane(), NBNode::buildCrossings(), NBNode::buildCrossingsAndWalkingAreas(), NIImporter_VISUM::buildDistrictNode(), NLDetectorBuilder::buildE2Detector(), NIVissimConnection::buildEdgeConnections(), RODFNet::buildEdgeFlowMap(), GNETLSEditorFrame::buildIinternalLanes(), NBEdge::buildInnerEdges(), NGEdge::buildNBEdge(), NIVissimEdge::buildNBEdge(), NBRampsComputer::buildOffRamp(), NBRampsComputer::buildOnRamp(), MELoop::buildSegmentsFor(), MSSOTLE2Sensors::buildSensorForLane(), MSSOTLE2Sensors::buildSensorForOutLane(), NBNode::buildWalkingAreas(), MSBaseVehicle::calculateArrivalParams(), MSSwarmTrafficLightLogic::calculateEtaDiff(), MSSwarmTrafficLightLogic::calculateEtaRatio(), MSSOTLPolicyBasedTrafficLightLogic::canRelease(), MSLaneChanger::changeOpposite(), MELoop::changeSegment(), MSSimpleTrafficLightLogic::changeStepAndDuration(), NBEdge::checkGeometry(), NBEdgeCont::checkGrade(), MSVehicleTransfer::checkInsertions(), NBEdgeCont::checkOverlap(), MSDevice_Battery::checkParam(), MSE2Collector::checkPositioning(), MSVehicle::checkRewindLinkLanes(), MSSwarmTrafficLightLogic::choosePolicy(), ODDistrictHandler::closeDistrict(), NLHandler::closeEdge(), RORouteHandler::closeRouteDistribution(), RORouteHandler::closeVehicle(), NBTrafficLightDefinition::collectAllLinks(), NBLoadedSUMOTLDef::collectEdges(), NBTrafficLightDefinition::collectEdges(), NBLoadedSUMOTLDef::collectEdgeVectors(), NBLoadedTLDef::collectLinks(), ROJTRRouter::compute(), NBTrafficLightDefinition::compute(), NBEdge::computeAngle(), NBEdge::computeLaneShapes(), NBNode::computeLogic(), NBOwnTLDef::computeLogicAndConts(), NBNode::computeNodeShape(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), RODFNet::computeRoutesFor(), NBTrafficLightLogicCont::computeSingleLogic(), NBNode::computeSmoothShape(), NBTurningDirectionsComputer::computeTurnDirectionsForNode(), NGNet::connect(), MSSOTLWaveTrafficLightLogic::countVehicles(), MSSOTLE2Sensors::countVehicles(), MSDevice_SSM::createEncounters(), GUINet::createTLWrapper(), MSDeterministicHiLevelTrafficLightLogic::decideNextPhase(), MSSOTLPolicyBasedTrafficLightLogic::decideNextPhase(), MSSwarmTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decidePolicy(), MSSwarmTrafficLightLogic::decidePolicy(), MSLane::detectCollisionBetween(), MSLane::detectCollisions(), NIVissimDistrictConnection::dict_BuildDistricts(), NBEdge::divideOnEdges(), NBEdge::divideSelectedLanesOnEdges(), MSTransportable::Stage_Waiting::endEventOutput(), MSTransportable::Stage_Driving::endEventOutput(), MSE3Collector::enter(), METriggeredCalibrator::execute(), MSCalibrator::execute(), Command_SaveTLSState::execute(), Command_SaveTLSSwitchStates::execute(), Command_SaveTLSSwitches::execute(), MSVTypeProbe::execute(), MSPModel_Striping::MovePedestrians::execute(), MSTrafficLightLogic::SwitchCommand::execute(), MSVehicle::executeMove(), MSLane::executeMovements(), NBNodeCont::extract(), NBTrafficLightLogicCont::extract(), NBEdgeCont::extract(), TraCIServerAPI_Vehicle::findCloserLane(), MSDevice_SSM::findFoeConflictLane(), MSDevice_SSM::findSurroundingVehicles(), MSDevice_SSM::flushConflicts(), NBRampsComputer::fulfillsRampConstraints(), RODFDetectorCon::getAggFlowFor(), RODFDetectorCon::getAnyDetectorForEdge(), GNEConnection::getAttribute(), MSVehicle::getBackPosition(), TraCI_Vehicle::getBestLanes(), MSNet::getBusStopID(), MSVehicle::getCenterOnEdge(), MSDevice_Battery::getChargingStationID(), MSNet::getChargingStationID(), NBEdge::getConnection(), NBEdge::getConnectionRef(), MSNet::getContainerStopID(), NBEdge::getCrossingAngle(), RODFNet::getDetectorEdge(), TraCI_Lane::getEdgeID(), MSMeanData::getEdgeID(), NBEdge::getFirstNonPedestrianLane(), MSLane::getFollower(), MSLane::getFollowersOnConsecutive(), TraCI_InductionLoop::getLaneID(), TraCI_LaneArea::getLaneID(), TraCI_Vehicle::getLaneID(), MSLane::getLastVehicleInformation(), MSVehicle::getLatOffset(), MSLane::getLeader(), MSLink::getLeaderInfo(), MSLane::getLeaderOnConsecutive(), MSLane::getLeadersOnConsecutive(), MSLink::getLengthBeforeCrossing(), TraCI_Lane::getLinks(), MSLane::getLinkTo(), MSTLLogicControl::TLSLogicVariants::getLogicInstantiatingOff(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForInputLanes(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForOutputLanes(), NIImporter_VISUM::getNamedEdgeContinuating(), MSPerson::getNextEdge(), MSPModel_Striping::getNextLane(), MSLane::getOppositeFollower(), MSLane::getOppositeLeader(), MSLane::getOppositePos(), GUIInstantInductLoop::MyWrapper::getParameterWindow(), GUIMEInductLoop::MyWrapper::getParameterWindow(), GUIVehicle::getParameterWindow(), GUIE2Collector::MyWrapper::getParameterWindow(), GUIInductLoop::MyWrapper::getParameterWindow(), MSNet::getParkingAreaID(), MSLane::getPartialBehind(), MSSOTLTrafficLightLogic::getPhaseIndexWithMaxCTS(), MSSwarmTrafficLightLogic::getPheromoneForInputLanes(), MSSwarmTrafficLightLogic::getPheromoneForOutputLanes(), GUITrafficLightLogicWrapper::getPopUpMenu(), NLTriggerBuilder::getPosition(), NLDetectorBuilder::getPositionChecking(), NBNode::getPossiblySplittedIncoming(), NBNode::getPossiblySplittedOutgoing(), NIImporter_VISUM::getReversedContinuating(), TraCI_Vehicle::getRoadID(), TraCI_Vehicle::getRouteID(), MSDevice_SSM::getUpstreamVehicles(), MSDevice_SSM::getVehiclesOnJunction(), MSVehicleControl::getWaitingVehicle(), MSLink::getZipperSpeed(), NBNode::guessCrossings(), RODFDetectorCon::guessEmptyFlows(), NBEdgeCont::guessSidewalks(), NBNodeCont::guessTLs(), GUITLLogicPhasesTrackerWindow::GUITLLogicPhasesTrackerWindow(), MSLane::handleCollisionBetween(), NBEdgeCont::ignoreFilterMatch(), MSDeterministicHiLevelTrafficLightLogic::init(), MSRailSignal::init(), MSDelayBasedTrafficLightLogic::init(), MSActuatedTrafficLightLogic::init(), MSTrafficLightLogic::init(), MSSOTLTrafficLightLogic::init(), MSSwarmTrafficLightLogic::init(), MSE2Collector::initAuxiliaries(), NIImporter_SUMO::initTrafficLightLogic(), NIXMLTrafficLightsHandler::initTrafficLightLogic(), NBDistrictCont::insert(), NBNodeCont::insert(), NBTrafficLightLogicCont::insert(), NBEdgeCont::insert(), MSEdge::insertVehicle(), MSLane::integrateNewVehicle(), IntermodalNetwork< E, L, N, V >::IntermodalNetwork(), GNEJunction::invalidateTLS(), NBNode::invalidateTLS(), MSTLLogicControl::isActive(), MSPedestrianPushButton::isActiveForEdge(), MSPedestrianPushButton::isActiveOnAnySideOfTheRoad(), RODFNet::isDestination(), RODFNet::isFalseSource(), MSLane::isInsertionSuccess(), RODFNet::isSource(), MSSOTLTrafficLightLogic::isThresholdPassed(), NBNodeCont::joinJunctions(), NBEdgeCont::joinSameNodeConnectingEdges(), MSE3Collector::leave(), MSE3Collector::leaveFront(), MSDevice_BTreceiver::BTreceiverUpdate::leaveRange(), MSPedestrianPushButton::loadCrossingEdgeMap(), NIImporter_OpenDrive::loadNetwork(), MSPedestrianPushButton::loadPushButtons(), NBEdge::MainDirections::MainDirections(), ODDistrictCont::makeDistricts(), MSE2Collector::makeVehicleInfo(), GNEJunction::markAsModified(), MSSOTLE2Sensors::meanVehiclesSpeed(), METriggeredCalibrator::METriggeredCalibrator(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::moveInDirectionOnLane(), NBRampsComputer::moveRampRight(), MSPModel_Striping::PState::moveToNextLane(), MSCalibrator::MSCalibrator(), MSChargingStation::MSChargingStation(), MSDevice_Battery::MSDevice_Battery(), MSE2Collector::MSE2Collector(), NBLoadedTLDef::myCompute(), NIXMLEdgesHandler::myEndElement(), NIImporter_SUMO::myEndElement(), NIXMLConnectionsHandler::myStartElement(), MSLaneSpeedTrigger::myStartElement(), MSTriggeredRerouter::myStartElement(), NBConnection::NBConnection(), NBRequest::NBRequest(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_Example::notifyEnter(), MSDevice_Tripinfo::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSDevice_SSM::notifyEnter(), MSE2Collector::notifyEnter(), MSDevice_Transportable::notifyLeave(), MSE3Collector::MSE3EntryReminder::notifyLeave(), MSDevice_Example::notifyLeave(), MSDevice_Tripinfo::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSE3Collector::MSE3LeaveReminder::notifyLeave(), MSDevice_SSM::notifyLeave(), MSE2Collector::notifyLeave(), MSDevice_Example::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSDevice_BTsender::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSDevice_SSM::notifyMove(), GUIViewTraffic::onGamingClick(), GNEViewNet::onLeftBtnPress(), RORouteHandler::openRoute(), Named::ComparatorIdLess::operator()(), NBTurningDirectionsComputer::combination_by_angle_sorter::operator()(), RODFNet::idComp::operator()(), NBNetBuilder::by_id_sorter::operator()(), NBOwnTLDef::edge_by_incoming_priority_sorter::operator()(), NBContHelper::same_connection_edge_sorter::operator()(), NBContHelper::edge_by_angle_to_nodeShapeCentroid_sorter::operator()(), NBNode::nodes_by_id_sorter::operator()(), MSEdge::by_id_sorter::operator()(), MSLane::incoming_lane_priority_sorter::operator()(), MSLane::outgoing_lane_priority_sorter::operator()(), NIImporter_VISUM::parse_EdgePolys(), NIImporter_VISUM::parse_Lanes(), NIImporter_VISUM::parse_LanesConnections(), NIImporter_VISUM::parse_Turns(), NIImporter_VISUM::parse_TurnsToSignalGroups(), NIXMLConnectionsHandler::parseDeprecatedLaneDefinition(), NIXMLConnectionsHandler::parseLaneBound(), MSRouteHandler::parseWalkPositions(), NBLoadedSUMOTLDef::patchIfCrossingsAdded(), MSLCM_LC2013::patchSpeed(), MSLCM_SL2015::patchSpeed(), NBLoadedTLDef::SignalGroup::patchTYellow(), MSVehicle::planMove(), MSLane::planMovements(), MSInternalJunction::postloadInit(), MSRightOfWayJunction::postloadInit(), NBEdge::prepareEdgePriorities(), MSAbstractLaneChangeModel::primaryLaneChanged(), AGStreet::print(), MSDevice_SSM::processEncounters(), TraCIServerAPI_TLS::processGet(), TraCIServerAPI_Person::processGet(), MSVehicle::processNextStop(), TraCIServerAPI_Vehicle::processSet(), NIXMLNodesHandler::processTrafficLightDefinitions(), NWWriter_SUMO::prohibitionConnection(), MSDelayBasedTrafficLightLogic::proposeProlongation(), MSPModel_Striping::PState::PState(), NBEdgeCont::recheckLanes(), NBEdge::recheckLanes(), NBEdgeCont::recheckPostProcessConnections(), NIImporter_OpenStreetMap::reconstructLayerElevation(), NBNodeCont::remapIDs(), NBEdgeCont::remapIDs(), NBLoadedTLDef::SignalGroup::remapIncoming(), NBLoadedTLDef::SignalGroup::remapOutgoing(), NBLoadedSUMOTLDef::removeConnection(), NBNodeCont::removeIsolatedRoads(), MSCalibrator::removePending(), NBNode::removeSelfLoops(), NBEdgeCont::removeUnwishedEdges(), NBNodeCont::rename(), NBEdgeCont::rename(), GNENet::renameEdge(), GNENet::renameJunction(), RORouteDef::repairCurrentRoute(), NBConnection::replaceFrom(), MSVehicle::replaceParkingArea(), MSBaseVehicle::replaceRouteEdges(), NBConnection::replaceTo(), NIImporter_DlrNavteq::TrafficlightsHandler::report(), NIImporter_DlrNavteq::ConnectedLanesHandler::report(), MSBaseVehicle::reroute(), MSTriggeredRerouter::rerouteParkingZone(), MSLane::resetPartialOccupation(), NBEdge::restoreRestrictedLane(), GNEEdge::retrieveConnection(), NIXMLTrafficLightsHandler::retrieveLaneIndex(), RODFNet::revalidateFlows(), RONet::saveAndRemoveRoutesUntil(), MSDevice_Vehroutes::saveState(), MSDevice::saveState(), MSDevice_Tripinfo::saveState(), MSBaseVehicle::saveState(), MSLane::saveState(), GUIVehicle::selectBlockingFoes(), MSE2Collector::selectLanes(), NBNodeCont::setAsTLControlled(), GNEEdge::setAttribute(), MSChargingStation::setChargeDelay(), MSChargingStation::setChargingPower(), NBEdge::setControllingTLInformation(), MSChargingStation::setEfficency(), GNEJunction::setLogicValid(), MSDevice_Battery::setMaximumBatteryCapacity(), NBEdge::setNodeBorder(), NIXMLEdgesHandler::setNodes(), MSLane::setPartialOccupation(), MSDevice_Battery::setPowerMax(), MSLink::setRequestInformation(), MSTLLogicControl::TLSLogicVariants::setStateInstantiatingOnline(), MSDevice_Battery::setStoppingTreshold(), NBLoadedSUMOTLDef::setTLControllingInformation(), NBOwnTLDef::setTLControllingInformation(), NBTrafficLightLogicCont::setTLControllingInformation(), NBLoadedTLDef::setTLControllingInformation(), NBEdge::shiftPositionAtNode(), NBEdgeCont::splitAt(), MSStopOut::stopEnded(), MSLane::succLinkSec(), GUITrafficLightLogicWrapper::switchTLSLogic(), MELoop::teleportVehicle(), toString(), METriggeredCalibrator::tryEmit(), MSSOTLTrafficLightLogic::trySwitch(), MSDevice_SSM::update(), MSVehicle::updateBestLanes(), MSSOTLTrafficLightLogic::updateCTS(), GNETLSEditorFrame::updateDescription(), MSDevice_SSM::updateEncounter(), MSSwarmTrafficLightLogic::updatePheromoneLevels(), MSSwarmTrafficLightLogic::updateSensitivities(), MSDevice_BTreceiver::BTreceiverUpdate::updateVisibility(), TraCIServerAPI_Vehicle::vtdMap(), MSPModel_Striping::PState::walk(), MSLCM_LC2013::wantsChange(), MSLCM_SL2015::wantsChange(), MSLCM_SL2015::wantsChangeSublane(), MSBatteryExport::write(), MSEmissionExport::write(), MSFCDExport::write(), MSInstantInductLoop::write(), MSLink::writeApproaching(), NBSign::writeAsPOI(), NWWriter_DlrNavteq::writeConnectedLanes(), NWWriter_SUMO::writeConnection(), NWWriter_SUMO::writeDistrict(), MSFullExport::writeEdge(), MSXMLRawOut::writeEdge(), NWWriter_SUMO::writeEdge(), MSMeanData::writeEdge(), NWWriter_XML::writeEdgesAndConnections(), RODFDetector::writeEmitterDefinition(), RODFDetectorCon::writeEmitterPOIs(), RODFDetectorCon::writeEmitters(), RODFDetectorCon::writeEndRerouterDetectors(), NWWriter_SUMO::writeInternalConnections(), writeInterval(), NWWriter_SUMO::writeJunction(), MSQueueExport::writeLane(), MSFullExport::writeLane(), NWWriter_DlrNavteq::writeLinksUnsplitted(), NWWriter_OpenDrive::writeNetwork(), NWWriter_XML::writeNodes(), NWWriter_DlrNavteq::writeNodesUnsplitted(), NWWriter_DlrNavteq::writeProhibitedManoeuvres(), NWWriter_SUMO::writeRoundabout(), RODFDetectorCon::writeSpeedTrigger(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), RODFDetectorCon::writeValidationDetectors(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), SUMO::Polygon::writeXML(), MSRouteProbe::writeXMLOutput(), MSInductLoop::writeXMLOutput(), MSE2Collector::writeXMLOutput(), and RONet::~RONet().

◆ getIDSecure()

◆ getLane()

◆ getLanes()

std::vector< MSLane * > MSE2Collector::getLanes ( )
inherited

Returns a vector containing pointers to the lanes covered by the detector ordered from its first to its last lane.

Definition at line 557 of file MSE2Collector.cpp.

References MSLane::dictionary(), and MSE2Collector::myLanes.

Referenced by MSE2Collector::getLastLane(), MSE2Collector::initAuxiliaries(), and GUIE2Collector::MyWrapper::MyWrapper().

◆ getLastLane()

MSLane* MSE2Collector::getLastLane ( ) const
inlineinherited

Returns the id of the detector's last lane.

Returns
The detector's end position

Definition at line 400 of file MSE2Collector.h.

References MSE2Collector::getCurrentVehicleNumber(), MSE2Collector::getLanes(), MSE2Collector::myLastLane, and MSE2Collector::reset().

◆ getLength()

double MSE2Collector::getLength ( ) const
inlineinherited

Returns the length of the detector.

Returns
The detector's length

Definition at line 391 of file MSE2Collector.h.

References MSE2Collector::myDetectorLength.

Referenced by MSE2Collector::checkPositioning(), GUIE2Collector::MyWrapper::getParameterWindow(), GUIE2Collector::MyWrapper::MyWrapper(), and MSE2Collector::selectLanes().

◆ getPassedVeh()

int MSE2Collector::getPassedVeh ( )
inlineinherited

Returns the number of vehicles passed over the sensor (i.e. entered the sensor)

Returns
number of cars passed over the sensor

Definition at line 493 of file MSE2Collector.h.

References MSE2Collector::myNumberOfEnteredVehicles.

Referenced by MSSOTLE2Sensors::getPassedVeh().

◆ getStartPos()

double MSE2Collector::getStartPos ( ) const
inlineinherited

Returns the begin position of the detector.

Returns
The detector's begin position

Definition at line 374 of file MSE2Collector.h.

References MSE2Collector::myStartPos.

Referenced by TraCI_LaneArea::getLength(), GUIE2Collector::MyWrapper::getParameterWindow(), TraCI_LaneArea::getPosition(), and GUIE2Collector::MyWrapper::MyWrapper().

◆ getUsageType()

virtual DetectorUsage MSE2Collector::getUsageType ( ) const
inlinevirtualinherited

◆ isTyped()

bool MSDetectorFileOutput::isTyped ( ) const
inlineinherited

Checks whether the detector is type specific.

Returns
whether vehicle types are considered

Definition at line 155 of file MSDetectorFileOutput.h.

References MSDetectorFileOutput::myVehicleTypes.

Referenced by MSMeanData_Amitran::MSLaneMeanDataValues::write().

◆ notifyEnter()

bool MSE2Collector::notifyEnter ( SUMOVehicle veh,
MSMoveReminder::Notification  reason,
const MSLane enteredLane 
)
virtualinherited

Adds the vehicle to known vehicles if not beyond the dector.

If the vehicles is within the detector are, it is added to the list of known vehicles. The method returns true as long as the vehicle is not beyond the detector.

Parameters
[in]vehThe entering vehicle.
[in]reasonhow the vehicle enters the lane
Returns
False, if vehicle passed the detector entirely, else true.
See also
MSMoveReminder::notifyEnter
MSMoveReminder::Notification

Reimplemented from MSMoveReminder.

Definition at line 659 of file MSE2Collector.cpp.

References Named::getID(), SUMOVehicle::getID(), SUMOVehicle::getLane(), SUMOVehicle::isOnRoad(), MSE2Collector::makeVehicleInfo(), MSE2Collector::myLanes, MSE2Collector::myVehicleInfos, SIMTIME, and MSDetectorFileOutput::vehicleApplies().

Referenced by MSE2Collector::getUsageType().

◆ notifyLeave()

bool MSE2Collector::notifyLeave ( SUMOVehicle veh,
double  lastPos,
MSMoveReminder::Notification  reason,
const MSLane enteredLane = 0 
)
virtualinherited

Removes a known vehicle due to its lane-change.

If the reported vehicle is known, it is removed from the list of vehicles to regard (myKnownVehicles).

Parameters
[in]vehThe leaving vehicle.
[in]lastPosPosition on the lane when leaving.
[in]isArrivalwhether the vehicle arrived at its destination
[in]isLaneChangewhether the vehicle changed from the lane
See also
MSMoveReminder::notifyLeave

Reimplemented from MSMoveReminder.

Definition at line 620 of file MSE2Collector.cpp.

References Named::getID(), SUMOVehicle::getID(), MIN2(), MSE2Collector::myLanes, MSE2Collector::myNumberOfLeftVehicles, MSE2Collector::myOffsets, MSE2Collector::myVehicleInfos, MSMoveReminder::NOTIFICATION_JUNCTION, and SIMTIME.

Referenced by MSE2Collector::getUsageType().

◆ notifyMove()

bool MSE2Collector::notifyMove ( SUMOVehicle veh,
double  oldPos,
double  newPos,
double  newSpeed 
)
virtualinherited

Adds/removes vehicles from the list of vehicles to regard.

As soon as the reported vehicle enters the detector area (position>myStartPos) it is added to the list of vehicles to regard (myKnownVehicles). It is removed from this list if it leaves the detector (position<length>myEndPos). The method returns true as long as the vehicle is not beyond the detector.

Parameters
[in]vehThe vehicle in question.
[in]oldPosPosition before the move-micro-timestep.
[in]newPosPosition after the move-micro-timestep. Note that this position is given in reference to the begin of the entry lane of the vehicle.
[in]newSpeedUnused here.
Returns
False, if vehicle passed the detector entirely, else true.
See also
MSMoveReminder
MSMoveReminder::notifyMove

Reimplemented from MSMoveReminder.

Definition at line 567 of file MSE2Collector.cpp.

References MSE2Collector::VehicleInfo::distToDetectorEnd, MSE2Collector::VehicleInfo::entryOffset, MSE2Collector::VehicleInfo::exitOffset, SUMOVehicle::getID(), MSVehicleType::getLength(), SUMOVehicle::getVehicleType(), MSE2Collector::VehicleInfo::hasEntered, MSE2Collector::makeMoveNotification(), MSE2Collector::myDetectorLength, MSE2Collector::myLeftVehicles, MSE2Collector::myMoveNotifications, MSE2Collector::myNumberOfEnteredVehicles, MSE2Collector::myVehicleInfos, and SIMTIME.

Referenced by MSE2Collector::getUsageType().

◆ notifyMoveInternal()

virtual void MSMoveReminder::notifyMoveInternal ( const SUMOVehicle veh,
const double  frontOnLane,
const double  timeOnLane,
const double  meanSpeedFrontOnLane,
const double  meanSpeedVehicleOnLane,
const double  travelledDistanceFrontOnLane,
const double  travelledDistanceVehicleOnLane 
)
inlinevirtualinherited

Internal notification about the vehicle moves.

Indicator if the reminders is still active for the passed vehicle/parameters. If false, the vehicle will erase this reminder from it's reminder-container.

Parameters
[in]vehVehicle that asks this reminder.
[in]frontOnLanetime the front of the vehicle spent on the lane.
[in]timeOnLanetime some part of the vehicle spent on the lane.
[in]meanSpeedFrontOnLaneAverage speed for the time that the front is on the lane.
[in]meanSpeedVehicleOnLaneAverage speed for the time that the vehicle is on the lane (with front or back).
[in]travelledDistanceFrontOnLanedistance travelled while overlapping with the lane.
[in]travelledDistanceVehicleOnLanedistance travelled while front was on the lane.

Reimplemented in MSMeanData::MeanDataValueTracker, MSDevice_Tripinfo, MSMeanData_Net::MSLaneMeanDataValues, MSMeanData_Amitran::MSLaneMeanDataValues, MSMeanData_Harmonoise::MSLaneMeanDataValues, and MSMeanData_Emissions::MSLaneMeanDataValues.

Definition at line 211 of file MSMoveReminder.h.

References UNUSED_PARAMETER.

Referenced by MSMeanData::MeanDataValues::notifyMove(), and MSMoveReminder::updateDetector().

◆ removeFromVehicleUpdateValues()

void MSMoveReminder::removeFromVehicleUpdateValues ( SUMOVehicle veh)
protectedinherited

◆ reset()

◆ setDescription()

void MSMoveReminder::setDescription ( const std::string &  description)
inlineinherited

◆ setID()

void Named::setID ( const std::string &  newID)
inlineinherited

resets the id

Parameters
[in]newIDThe new id of this object

Definition at line 74 of file Named.h.

References Named::myID.

Referenced by Distribution_Parameterized::Distribution_Parameterized(), NBNodeCont::remapIDs(), NBEdgeCont::remapIDs(), NBNodeCont::rename(), and NBEdgeCont::rename().

◆ subtractPassedVeh()

◆ updateDetector()

void MSMoveReminder::updateDetector ( SUMOVehicle veh,
double  entryPos,
double  leavePos,
SUMOTime  entryTime,
SUMOTime  currentTime,
SUMOTime  leaveTime,
bool  cleanUp 
)
inherited

◆ vehicleApplies()

bool MSDetectorFileOutput::vehicleApplies ( const SUMOVehicle veh) const
inlineinherited

◆ writeXMLDetectorProlog()

void MSE2Collector::writeXMLDetectorProlog ( OutputDevice dev) const
virtualinherited

Open the XML-output.

The implementing function should open an xml element using OutputDevice::writeXMLHeader.

Parameters
[in]devThe output device to write the root into
Exceptions
IOErrorIf an error on writing occurs

Implements MSDetectorFileOutput.

Definition at line 1122 of file MSE2Collector.cpp.

References OutputDevice::writeXMLHeader().

Referenced by MSE2Collector::getUsageType().

◆ writeXMLOutput()

Field Documentation

◆ myDescription

std::string MSMoveReminder::myDescription
protectedinherited

a description of this moveReminder

Definition at line 243 of file MSMoveReminder.h.

Referenced by MSMoveReminder::getDescription(), and MSMoveReminder::setDescription().

◆ myID

◆ myLane

◆ myShowDetectorInGUI

bool GUIE2Collector::myShowDetectorInGUI
private

Whether the detector shall be drawn in the gui.

Definition at line 111 of file GUIE2Collector.h.

Referenced by GUIE2Collector::MyWrapper::drawGL().

◆ myVehicleTypes

std::set<std::string> MSDetectorFileOutput::myVehicleTypes
protectedinherited

The vehicle types to look for (empty means all)

Definition at line 162 of file MSDetectorFileOutput.h.

Referenced by MSDetectorFileOutput::isTyped(), MSDetectorFileOutput::MSDetectorFileOutput(), and MSDetectorFileOutput::vehicleApplies().


The documentation for this class was generated from the following files: