![]() |
Eclipse SUMO - Simulation of Urban MObility
|
The gui-version of the MSE3Collector. More...
#include <GUIE3Collector.h>
Data Structures | |
class | MyWrapper |
Public Member Functions | |
void | addTo (const StoringVisitor &cont) const |
Adds this object to the given container. More... | |
GUIDetectorWrapper * | buildDetectorGUIRepresentation () |
Returns the wrapper for this detector. More... | |
void | detectorUpdate (const SUMOTime step) |
Computes the detector values in each time step. More... | |
void | enter (const SUMOTrafficObject &veh, const double entryTimestep, const double fractionTimeOnDet, MSE3EntryReminder *entryReminder) |
Called if a vehicle touches an entry-cross-section. More... | |
const CrossSectionVector & | getEntries () const |
Returns the list of entry points. More... | |
const CrossSectionVector & | getExits () const |
Returns the list of exit points. More... | |
const std::string & | getID () const |
Returns the id. More... | |
GUIE3Collector (const std::string &id, const CrossSectionVector &entries, const CrossSectionVector &exits, double haltingSpeedThreshold, SUMOTime haltingTimeThreshold, const std::string &vTypes, bool openEntry) | |
Constructor. More... | |
void | leave (const SUMOTrafficObject &veh, const double leaveTimestep, const double fractionTimeOnDet) |
Called if a vehicle back passes a leave-cross-section. More... | |
void | leaveFront (const SUMOTrafficObject &veh, const double leaveTimestep) |
Called if a vehicle front passes a leave-cross-section. More... | |
void | reset () |
Resets all generated values to allow computation of next interval. More... | |
void | setID (const std::string &newID) |
resets the id More... | |
~GUIE3Collector () | |
Destructor. More... | |
Methods returning current values | |
double | getCurrentMeanSpeed () const |
Returns the mean speed within the area. More... | |
int | getCurrentHaltingNumber () const |
Returns the number of current haltings within the area. More... | |
int | getVehiclesWithin () const |
Returns the number of vehicles within the area. More... | |
std::vector< std::string > | getCurrentVehicleIDs () const |
Returns the number of vehicles within the area. More... | |
Methods inherited from MSDetectorFileOutput. | |
void | writeXMLOutput (OutputDevice &dev, SUMOTime startTime, SUMOTime stopTime) |
Writes collected values into the given stream. More... | |
void | writeXMLDetectorProlog (OutputDevice &dev) const |
Opens the XML-output using "e3Detector" as root element. More... | |
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 Attributes | |
std::map< const SUMOTrafficObject *, E3Values > | myEnteredContainer |
Container for vehicles that have entered the area. More... | |
CrossSectionVector | myEntries |
The detector's entries. More... | |
std::vector< MSE3EntryReminder * > | myEntryReminders |
The detector's built entry reminder. More... | |
CrossSectionVector | myExits |
The detector's exits. More... | |
double | myHaltingSpeedThreshold |
Speed-threshold to determine if a vehicle is halting. More... | |
SUMOTime | myHaltingTimeThreshold |
std::string | myID |
The name of the object. More... | |
SUMOTime | myLastResetTime |
Information when the last reset has been done. More... | |
std::vector< MSE3LeaveReminder * > | myLeaveReminders |
The detector's built exit reminder. More... | |
std::vector< E3Values > | myLeftContainer |
Container for vehicles that have left the area. More... | |
const bool | myOpenEntry |
whether this dector is declared as having incomplete entry detectors More... | |
Storages for current values | |
double | myCurrentMeanSpeed |
The current mean speed of known vehicles (inside) More... | |
int | myCurrentHaltingsNumber |
The current number of haltings (inside) More... | |
Virtual methods to implement by derived classes | |
bool | vehicleApplies (const SUMOTrafficObject &veh) const |
Checks whether the detector measures vehicles of the given type. More... | |
bool | isTyped () const |
Checks whether the detector is type specific. More... | |
bool | detectPersons () const |
std::set< std::string > | myVehicleTypes |
The vehicle types to look for (empty means all) More... | |
const int | myDetectPersons |
Whether pedestrians shall be detected instead of vehicles. More... | |
The gui-version of the MSE3Collector.
Allows the building of a wrapper (also declared herein) which draws the detector on the gl-canvas.
Definition at line 46 of file GUIE3Collector.h.
GUIE3Collector::GUIE3Collector | ( | const std::string & | id, |
const CrossSectionVector & | entries, | ||
const CrossSectionVector & | exits, | ||
double | haltingSpeedThreshold, | ||
SUMOTime | haltingTimeThreshold, | ||
const std::string & | vTypes, | ||
bool | openEntry | ||
) |
Constructor.
Definition at line 161 of file GUIE3Collector.cpp.
GUIE3Collector::~GUIE3Collector | ( | ) |
Destructor.
Definition at line 168 of file GUIE3Collector.cpp.
|
inlineinherited |
Adds this object to the given container.
[in,filled] | cont The container to add this item to |
Definition at line 127 of file Named.h.
References Named::StoringVisitor::add().
|
virtual |
Returns the wrapper for this detector.
Reimplemented from MSDetectorFileOutput.
Definition at line 185 of file GUIE3Collector.cpp.
|
virtualinherited |
Computes the detector values in each time step.
This method should be called at the end of a simulation step, when all vehicles have moved. The current values are computed and summed up with the previous.
[in] | currentTime | The current simulation time (unused) |
Reimplemented from MSDetectorFileOutput.
Definition at line 489 of file MSE3Collector.cpp.
References DEBUG_COND, DELTA_T, SUMOTrafficObject::getID(), SUMOTrafficObject::getSpeed(), MSE3Collector::E3Values::hadUpdate, MSE3Collector::E3Values::haltingBegin, MSE3Collector::E3Values::haltings, MSE3Collector::E3Values::intervalHaltings, MSE3Collector::E3Values::intervalSpeedSum, MSE3Collector::myCurrentHaltingsNumber, MSE3Collector::myCurrentMeanSpeed, MSE3Collector::myEnteredContainer, MSE3Collector::myHaltingSpeedThreshold, MSE3Collector::myHaltingTimeThreshold, SIMTIME, MSE3Collector::E3Values::speedSum, and TS.
|
inlineinherited |
Definition at line 167 of file MSDetectorFileOutput.h.
References MSDetectorFileOutput::myDetectPersons.
Referenced by MSMeanData::init(), and MSDetectorFileOutput::vehicleApplies().
|
inherited |
Called if a vehicle touches an entry-cross-section.
Inserts vehicle into internal containers.
[in] | veh | The vehicle that entered the area |
[in] | entryTimestep | The time in seconds the vehicle entered the area |
[in] | fractionTimeOnDet | The interpolated time in seconds the vehicle already spent on the detector |
Definition at line 317 of file MSE3Collector.cpp.
References MSE3Collector::E3Values::backLeaveTime, MSE3Collector::E3Values::entryReminder, MSE3Collector::E3Values::entryTime, MSE3Collector::E3Values::frontLeaveTime, SUMOTrafficObject::getID(), Named::getID(), SUMOTrafficObject::getSpeed(), MSGlobals::gUseMesoSim, MSE3Collector::E3Values::hadUpdate, MSE3Collector::E3Values::haltingBegin, MSE3Collector::E3Values::haltings, MSE3Collector::E3Values::intervalHaltings, MSE3Collector::E3Values::intervalSpeedSum, MSE3Collector::E3Values::intervalTimeLoss, MSE3Collector::myEnteredContainer, MSE3Collector::myHaltingSpeedThreshold, MSE3Collector::myHaltingTimeThreshold, MSE3Collector::myLastResetTime, MSE3Collector::E3Values::speedSum, STEPS2TIME, SUMO_TAG_E3DETECTOR, TIME2STEPS, MSE3Collector::E3Values::timeLoss, toString(), MSDetectorFileOutput::vehicleApplies(), and WRITE_WARNING.
|
inherited |
Returns the number of current haltings within the area.
If no vehicle is within the area, 0 is returned.
Definition at line 536 of file MSE3Collector.cpp.
References MSE3Collector::myCurrentHaltingsNumber.
Referenced by libsumo::MultiEntryExit::getLastStepHaltingNumber(), and GUIE3Collector::MyWrapper::getParameterWindow().
|
inherited |
Returns the mean speed within the area.
If no vehicle is within the area, -1 is returned.
Definition at line 530 of file MSE3Collector.cpp.
References MSE3Collector::myCurrentMeanSpeed.
Referenced by libsumo::MultiEntryExit::getLastStepMeanSpeed(), and GUIE3Collector::MyWrapper::getParameterWindow().
|
inherited |
Returns the number of vehicles within the area.
Definition at line 548 of file MSE3Collector.cpp.
References MSE3Collector::myEnteredContainer.
Referenced by libsumo::MultiEntryExit::getLastStepVehicleIDs().
const CrossSectionVector & GUIE3Collector::getEntries | ( | ) | const |
Returns the list of entry points.
Definition at line 172 of file GUIE3Collector.cpp.
References MSE3Collector::myEntries.
Referenced by GUIE3Collector::MyWrapper::MyWrapper().
const CrossSectionVector & GUIE3Collector::getExits | ( | ) | const |
Returns the list of exit points.
Definition at line 178 of file GUIE3Collector.cpp.
References MSE3Collector::myExits.
Referenced by GUIE3Collector::MyWrapper::MyWrapper().
|
inlineinherited |
Returns the id.
Definition at line 77 of file Named.h.
References Named::myID.
Referenced by MSLCM_LC2013::adaptSpeedToPedestrians(), MSVehicle::adaptToLeader(), MSVehicle::adaptToLeaders(), MSPModel_Remote::add(), MSPModel_Striping::add(), LaneStoringVisitor::add(), MSVehicleTransfer::add(), PCPolyContainer::add(), MSDetectorControl::add(), Named::StoringVisitor::add(), ShapeContainer::add(), NLTriggerBuilder::addAccess(), RORouteDef::addAlternative(), MSLane::addApproachingLane(), NBLoadedSUMOTLDef::addConnection(), NLHandler::addConnection(), MSPModel_Striping::addCrossingVehs(), RODFDetectorCon::addDetector(), RONet::addEdge(), NBParkingCont::addEdges2Keep(), ROJTREdge::addFollowerProbability(), MSTLLogicControl::TLSLogicVariants::addLogic(), MSLane::addNeigh(), RONet::addNode(), NIImporter_SUMO::addPhase(), GUIEdge::addRerouter(), RONet::addRouteDef(), NIXMLEdgesHandler::addSplit(), NBTrafficLightLogic::addStep(), ROVehicle::addStop(), MSRouteHandler::addStop(), MSVehicle::addStop(), MSNet::addStoppingPlace(), MSVehicle::addTraciStop(), MSVehicle::addTraciStopAtStoppingPlace(), AGActivityTripWriter::addTrip(), NIXMLConnectionsHandler::addWalkingArea(), libsumo::Helper::applySubscriptionFilters(), GUITrafficLightLogicWrapper::begin2TrackPhases(), MSTransportable::Stage_Waiting::beginEventOutput(), MSTransportable::Stage_Driving::beginEventOutput(), MSPModel_Striping::blockedAtDist(), MSLink::blockedAtTime(), MSLink::blockedByFoe(), NLEdgeControlBuilder::build(), NIVisumTL::build(), RODFNet::buildApproachList(), MSSOTLE2Sensors::buildContinueSensior(), MSSOTLE2Sensors::buildCountSensorForLane(), MSSOTLE2Sensors::buildCountSensorForOutLane(), NBNode::buildCrossings(), NBNode::buildCrossingsAndWalkingAreas(), NIImporter_VISUM::buildDistrictNode(), MSRailSignal::LinkInfo::buildDriveWay(), NLDetectorBuilder::buildE2Detector(), RODFNet::buildEdgeFlowMap(), GNETLSEditorFrame::buildIinternalLanes(), NBEdge::buildInnerEdges(), NGEdge::buildNBEdge(), NIVissimEdge::buildNBEdge(), NBRampsComputer::buildOffRamp(), NBRampsComputer::buildOnRamp(), MSRailSignal::DriveWay::buildRoute(), MELoop::buildSegmentsFor(), MSSOTLE2Sensors::buildSensorForLane(), MSSOTLE2Sensors::buildSensorForOutLane(), NBNode::buildWalkingAreas(), MSBaseVehicle::calculateArrivalParams(), MSSwarmTrafficLightLogic::calculateEtaDiff(), MSSwarmTrafficLightLogic::calculateEtaRatio(), MSSOTLPolicyBasedTrafficLightLogic::canRelease(), MSVehicle::canReverse(), MSLaneChanger::changeOpposite(), MELoop::changeSegment(), MSSimpleTrafficLightLogic::changeStepAndDuration(), MSEdge::checkAndRegisterBiDirEdge(), MSRailSignal::DriveWay::checkCrossingFlanks(), MSLane::checkForPedestrians(), MSVehicleTransfer::checkInsertions(), MSVehicle::checkLinkLeader(), MSDevice_Battery::checkParam(), MSE2Collector::checkPositioning(), MSVehicle::checkRewindLinkLanes(), MSLCM_SL2015::checkStrategicChange(), MSSwarmTrafficLightLogic::choosePolicy(), MSDevice_SSM::classifyEncounter(), ShapeContainer::clearHighlights(), NBTrafficLightLogic::closeBuilding(), ODDistrictHandler::closeDistrict(), NLHandler::closeEdge(), RORouteHandler::closeRouteDistribution(), RORouteHandler::closeVehicle(), NBTrafficLightDefinition::collectAllLinks(), NBTrafficLightDefinition::collectEdges(), NBLoadedSUMOTLDef::collectEdgeVectors(), NBLoadedTLDef::collectLinks(), ROJTRRouter::compute(), IntermodalRouter< E, L, N, V >::compute(), NBTrafficLightDefinition::compute(), NBNode::computeInternalLaneShape(), NBNode::computeLanes2Lanes(), NBNode::computeLogic(), NBOwnTLDef::computeLogicAndConts(), NBNode::computeNodeShape(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), RODFNet::computeRoutesFor(), NBTrafficLightLogicCont::computeSingleLogic(), NBNode::computeSmoothShape(), NBTurningDirectionsComputer::computeTurnDirectionsForNode(), NGNet::connect(), NBOwnTLDef::corridorLike(), MSSOTLWaveTrafficLightLogic::countVehicles(), MSSOTLE2Sensors::countVehicles(), MSDevice_SSM::createEncounters(), GUINet::createTLWrapper(), MSDeterministicHiLevelTrafficLightLogic::decideNextPhase(), MSSOTLPolicyBasedTrafficLightLogic::decideNextPhase(), MSSwarmTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decidePolicy(), MSSwarmTrafficLightLogic::decidePolicy(), MSLane::detectCollisionBetween(), MSLane::detectCollisions(), MSLane::detectPedestrianJunctionCollision(), NIVissimDistrictConnection::dict_BuildDistrictNodes(), NIVissimDistrictConnection::dict_BuildDistricts(), MSTransportable::Stage_Waiting::endEventOutput(), MSTransportable::Stage_Driving::endEventOutput(), MSE3Collector::enter(), MSVehicle::enterLaneAtMove(), METriggeredCalibrator::execute(), Command_SaveTLSState::execute(), Command_SaveTLSSwitchStates::execute(), Command_SaveTLSSwitches::execute(), MSVTypeProbe::execute(), MSCalibrator::execute(), MSPModel_Striping::MovePedestrians::execute(), MSVehicle::executeMove(), MSLane::executeMovements(), NBNodeCont::extract(), NBTrafficLightLogicCont::extract(), libsumo::Helper::findCloserLane(), MSRailSignal::DriveWay::findFlankProtection(), MSDevice_SSM::findFoeConflictLane(), libsumo::Simulation::findIntermodalRoute(), MSDevice_SSM::findSurroundingVehicles(), MSDevice_SSM::flushConflicts(), NBTrafficLightDefinition::forbids(), NBNodeCont::generateNodeClusters(), RODFDetectorCon::getAggFlowFor(), RODFDetectorCon::getAnyDetectorForEdge(), MSPModel_Striping::getArbitraryPath(), MSVehicle::getBackPosition(), MSVehicle::getBackPositionOnLane(), libsumo::Vehicle::getBestLanes(), NBOwnTLDef::getBestPair(), NBRailwayTopologyAnalyzer::getBrokenRailNodes(), MSVehicle::getCenterOnEdge(), MSDevice_Battery::getChargingStationID(), MSRailSignal::getClickableTLLinkID(), GUILane::getColorValue(), libsumo::TrafficLight::getControlledLinks(), MSLane::getCriticalLeader(), NBNodeShapeComputer::getDefaultRadius(), NBTrafficLightDefinition::getDescription(), MSLink::getDescription(), GUIPerson::getDestinationEdgeID(), RODFNet::getDetectorEdge(), libsumo::Lane::getEdgeID(), GUIMEVehicle::getEdgeID(), GUIPerson::getEdgeID(), MSMeanData::getEdgeID(), MSPModel_Remote::getFirstPedestrianLane(), MSLane::getFollower(), MSLane::getFollowersOnConsecutive(), GUIPerson::getFromEdgeID(), MSCalibrator::getID(), NBEdge::getID(), libsumo::LaneArea::getLaneID(), libsumo::InductionLoop::getLaneID(), libsumo::Vehicle::getLaneID(), MSParkingArea::getLastFreePosWithReservation(), MSLane::getLastVehicleInformation(), MSVehicle::getLatOffset(), MSLane::getLeader(), MSLink::getLeaderInfo(), MSLane::getLeaderOnConsecutive(), MSLane::getLeadersOnConsecutive(), MSLink::getLengthBeforeCrossing(), MSLane::getLinkTo(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForInputLanes(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForOutputLanes(), NIImporter_VISUM::getNamedEdgeContinuating(), MSPerson::getNextEdge(), MSPModel_Striping::getNextLane(), MSLane::getOppositeFollower(), MSLane::getOppositeLeader(), MSLane::getOppositePos(), libsumo::Simulation::getParameter(), GUITrafficLightLogicWrapper::getParameterWindow(), GUILane::getParameterWindow(), GUILane::getParentName(), MSLane::getPartialBehind(), MSSOTLTrafficLightLogic::getPhaseIndexWithMaxCTS(), MSSwarmTrafficLightLogic::getPheromoneForInputLanes(), MSSwarmTrafficLightLogic::getPheromoneForOutputLanes(), PolygonDynamics::getPolygonID(), GUITrafficLightLogicWrapper::getPopUpMenu(), NLTriggerBuilder::getPosition(), NLDetectorBuilder::getPositionChecking(), libsumo::Person::getRoadID(), libsumo::Vehicle::getRoadID(), MSLCM_LC2013::getRoundaboutDistBonus(), libsumo::Vehicle::getRouteID(), MSVehicle::getSafeFollowSpeed(), libsumo::Person::getStage(), MSContainer::MSContainerStage_Driving::getStageSummary(), MSPerson::MSPersonStage_Walking::getStageSummary(), MSContainer::MSContainerStage_Tranship::getStageSummary(), MSPerson::MSPersonStage_Driving::getStageSummary(), MSTransportable::Stage_Trip::getStageSummary(), MSTransportable::Stage_Waiting::getStageSummary(), MSNet::getStoppingPlaceID(), MSLane::getSurroundingVehicles(), MSRailSignal::getTLLinkID(), MSLane::getUpcomingLinks(), MSDevice_SSM::getUpstreamVehicles(), MSPModel_Striping::getVehicleObstacles(), MSDevice_SSM::getVehiclesOnJunction(), MSLink::getZipperSpeed(), NBNode::guessCrossings(), RODFDetectorCon::guessEmptyFlows(), NBNodeCont::guessTLs(), GUITLLogicPhasesTrackerWindow::GUITLLogicPhasesTrackerWindow(), MSLane::handleCollisionBetween(), MSVehicle::haveValidStopEdges(), libsumo::POI::highlight(), MSVehicle::ignoreRed(), MSDeterministicHiLevelTrafficLightLogic::init(), MSRailSignal::init(), MSDelayBasedTrafficLightLogic::init(), MSActuatedTrafficLightLogic::init(), MSTrafficLightLogic::init(), MSSOTLTrafficLightLogic::init(), MSSwarmTrafficLightLogic::init(), MSE2Collector::initAuxiliaries(), NIImporter_SUMO::initTrafficLightLogic(), NIXMLTrafficLightsHandler::initTrafficLightLogic(), NBDistrictCont::insert(), NBTrafficLightLogicCont::insert(), NBNodeCont::insert(), MSEdge::insertVehicle(), MSLane::integrateNewVehicles(), GNEJunction::invalidateTLS(), NBNode::invalidateTLS(), MSTLLogicControl::isActive(), MSPedestrianPushButton::isActiveForEdge(), MSPedestrianPushButton::isActiveOnAnySideOfTheRoad(), RODFNet::isDestination(), RODFNet::isFalseSource(), MSLane::isInsertionSuccess(), MSVehicle::isLeader(), MESegment::isOpen(), RODFNet::isSource(), NIImporter_VISUM::isSplitEdge(), MSSOTLTrafficLightLogic::isThresholdPassed(), MESegment::jamThresholdForSpeed(), NBNodeShapeComputer::joinSameDirectionEdges(), NBEdgeCont::joinSameNodeConnectingEdges(), MSAbstractLaneChangeModel::laneChangeOutput(), MSE3Collector::leave(), MSE3Collector::leaveFront(), MSDevice_BTreceiver::BTreceiverUpdate::leaveRange(), MSPedestrianPushButton::loadCrossingEdgeMap(), NIImporter_OpenDrive::loadNetwork(), MSPedestrianPushButton::loadPushButtons(), ODDistrictCont::makeDistricts(), MSE2Collector::makeVehicleInfo(), MSSOTLE2Sensors::meanVehiclesSpeed(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::moveInDirectionOnLane(), MSPModel_Striping::PState::moveToNextLane(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), libsumo::Helper::moveToXYMap(), MSCalibrator::MSCalibrator(), MSChargingStation::MSChargingStation(), MSDevice_Battery::MSDevice_Battery(), MSE2Collector::MSE2Collector(), NBLoadedTLDef::myCompute(), NIImporter_SUMO::myEndElement(), MSLaneSpeedTrigger::myStartElement(), MSTriggeredRerouter::myStartElement(), MSPModel_Striping::nextBlocking(), MSE3Collector::MSE3EntryReminder::notifyEnter(), MSMeanData::MeanDataValues::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_Bluelight::notifyEnter(), MSDevice_Example::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSMeanData_Net::MSLaneMeanDataValues::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSE3Collector::MSE3LeaveReminder::notifyEnter(), MSMeanData::MeanDataValueTracker::notifyEnter(), MSE2Collector::notifyEnter(), MSDevice_SSM::notifyEnter(), MSDevice_Transportable::notifyLeave(), MSDevice_Example::notifyLeave(), MSDevice_Bluelight::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSE2Collector::notifyLeave(), MSDevice_SSM::notifyLeave(), MSDevice_Example::notifyMove(), MSDevice_Bluelight::notifyMove(), MSDevice_BTsender::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSE2Collector::notifyMove(), MSDevice_SSM::notifyMove(), GUIViewTraffic::onGamingClick(), MSLink::opened(), RORouteHandler::openRoute(), RODFNet::idComp::operator()(), NBNetBuilder::by_id_sorter::operator()(), NBNode::nodes_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_Turns(), NLTriggerBuilder::parseAndBuildCalibrator(), MSRouteHandler::parseWalkPositions(), NBLoadedSUMOTLDef::patchIfCrossingsAdded(), MSLCM_LC2013::patchSpeed(), MSLCM_SL2015::patchSpeed(), NBLoadedTLDef::SignalGroup::patchTYellow(), MSVehicle::planMove(), MSVehicle::planMoveInternal(), MSLane::planMovements(), MSInternalJunction::postloadInit(), MSRightOfWayJunction::postloadInit(), AGStreet::print(), MSDevice_SSM::processEncounters(), MSVehicle::processLaneAdvances(), MSVehicle::processLinkApproaches(), MSVehicle::processNextStop(), NIXMLNodesHandler::processNodeType(), TraCIServerAPI_Vehicle::processSet(), MEVehicle::processStop(), NIXMLNodesHandler::processTrafficLightDefinitions(), MSDelayBasedTrafficLightLogic::proposeProlongation(), NBNodeCont::pruneClusterFringe(), MSPModel_Striping::PState::PState(), MSOffTrafficLightLogic::rebuildPhase(), NBEdge::recheckLanes(), NBEdgeCont::recheckPostProcessConnections(), NIImporter_OpenStreetMap::reconstructLayerElevation(), NBLoadedSUMOTLDef::reconstructLogic(), MSLink::removeApproaching(), MSVehicle::removePassedDriveItems(), GNEJunction::removeTLSConnections(), NBNodeCont::rename(), GNENet::renameJunction(), RORouteDef::repairCurrentRoute(), GNEJunction::replaceIncomingConnections(), MSVehicle::replaceParkingArea(), MSVehicle::replaceRoute(), MSBaseVehicle::replaceRouteEdges(), NIImporter_DlrNavteq::TrafficlightsHandler::report(), NLEdgeControlBuilder::reportCurrentEdgeOrLane(), MSBaseVehicle::reroute(), MSRailSignal::LinkInfo::reroute(), GUIVehicle::rerouteDRTStop(), MSTriggeredRerouter::rerouteParkingArea(), MSVehicle::rerouteParkingArea(), MSLane::resetManeuverReservation(), MSLane::resetPartialOccupation(), RODFNet::revalidateFlows(), NBRailwayTopologyAnalyzer::reverseEdges(), RONet::saveAndRemoveRoutesUntil(), ROVehicle::saveAsXML(), ROPerson::Ride::saveAsXML(), MSTransportableDevice_Routing::saveState(), MSDevice_Routing::saveState(), MSDevice::saveState(), MSDevice_Vehroutes::saveState(), MSDevice_Tripinfo::saveState(), MSBaseVehicle::saveState(), MSLane::saveState(), GUIVehicle::selectBlockingFoes(), MSE2Collector::selectLanes(), MSLink::setApproaching(), NBNodeCont::setAsTLControlled(), GNEEdge::setAttribute(), MSChargingStation::setChargeDelay(), MSChargingStation::setChargingPower(), NLEdgeControlBuilder::setDefaultStopOffsets(), MSChargingStation::setEfficency(), MSLane::setManeuverReservation(), MSDevice_Battery::setMaximumBatteryCapacity(), NBEdge::setNodeBorder(), NIXMLEdgesHandler::setNodes(), NIImporter_OpenDrive::setNodeSecure(), MSLane::setPartialOccupation(), MSDevice_Battery::setPowerMax(), MSLink::setRequestInformation(), MSDevice_Battery::setStoppingTreshold(), NBLoadedSUMOTLDef::setTLControllingInformation(), NBOwnTLDef::setTLControllingInformation(), NBTrafficLightLogicCont::setTLControllingInformation(), NBLoadedTLDef::setTLControllingInformation(), NBEdge::shiftPositionAtNode(), MSLane::sortManeuverReservations(), IntermodalNetwork< E, L, N, V >::splitEdge(), MSLaneChangerSublane::startChangeSublane(), MSStopOut::stopEnded(), MSStopOut::stopStarted(), MSLane::succLinkSec(), GUITrafficLightLogicWrapper::switchTLSLogic(), MELoop::teleportVehicle(), MSSOTLTrafficLightLogic::trySwitch(), PolygonDynamics::update(), MSDevice_SSM::update(), MSDevice_SSM::updateAndWriteOutput(), MSVehicle::updateBestLanes(), MSLCM_SL2015::updateCFRelated(), MSSOTLTrafficLightLogic::updateCTS(), NLEdgeControlBuilder::updateCurrentLaneStopOffsets(), MSVehicle::updateDriveItems(), GNETLSEditorFrame::TLSJunction::updateJunctionDescription(), MSSwarmTrafficLightLogic::updatePheromoneLevels(), MSSwarmTrafficLightLogic::updateSensitivities(), MSAbstractLaneChangeModel::updateTargetLane(), MSDevice_BTreceiver::BTreceiverUpdate::updateVisibility(), NBNodeTypeComputer::validateRailCrossings(), MSLCM_LC2013::wantsChange(), MSLCM_SL2015::wantsChange(), MSLCM_SL2015::wantsChangeSublane(), NBParking::write(), MSBatteryExport::write(), MSEmissionExport::write(), MSFCDExport::write(), MSInstantInductLoop::write(), MSLink::writeApproaching(), MSRailSignal::writeBlocks(), NWWriter_DlrNavteq::writeConnectedLanes(), NWWriter_SUMO::writeDistrict(), MSFullExport::writeEdge(), MSXMLRawOut::writeEdge(), NWWriter_SUMO::writeEdge(), MSMeanData::writeEdge(), NWWriter_XML::writeEdgesAndConnections(), RODFDetector::writeEmitterDefinition(), RODFDetectorCon::writeEmitterPOIs(), RODFDetectorCon::writeEmitters(), RODFDetectorCon::writeEndRerouterDetectors(), NWWriter_OpenDrive::writeInternalEdge(), writeInterval(), NWWriter_SUMO::writeJunction(), MSQueueExport::writeLane(), MSFullExport::writeLane(), MSXMLRawOut::writeLane(), NWWriter_DlrNavteq::writeLinksUnsplitted(), NWWriter_OpenDrive::writeNetwork(), NWWriter_XML::writeNodes(), NWWriter_DlrNavteq::writeNodesUnsplitted(), NWWriter_SUMO::writeRoundabout(), RODFDetectorCon::writeSpeedTrigger(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), RODFDetectorCon::writeValidationDetectors(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), SUMOPolygon::writeXML(), MSRouteProbe::writeXMLOutput(), MSInductLoop::writeXMLOutput(), MSE2Collector::writeXMLOutput(), and RONet::~RONet().
|
inlinestaticinherited |
get an identifier for Named-like object which may be Null
Definition at line 70 of file Named.h.
Referenced by MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), MSLaneChanger::changeOpposite(), MSVehicle::checkRewindLinkLanes(), DijkstraRouter< E, V, BASE >::compute(), AStarRouter< MSEdge, SUMOVehicle, SUMOAbstractRouterPermissions< MSEdge, SUMOVehicle > >::compute(), NBEdge::computeEdge2Edges(), NBEdge::computeLanes2Edges(), NBOwnTLDef::computeLogicAndConts(), MSLaneChanger::continueChange(), MSLane::detectCollisions(), MSRailSignal::DriveWay::findProtection(), MSCFModel_W99::followSpeed(), MSCFModel_CACC::followSpeed(), MSVehicle::getBackPositionOnLane(), NBOwnTLDef::getBestCombination(), NBOwnTLDef::getBestPair(), MSVehicle::getCenterOnEdge(), MSLaneChanger::getColumnleader(), NBEdge::Connection::getDescription(), MSLane::getFollowersOnConsecutive(), GUIVehicle::getLaneID(), MSVehicle::getLatOffset(), MSLane::getLeaderOnConsecutive(), MSLaneChanger::getRealLeader(), GUIVehicle::getShadowLaneID(), GUIVehicle::getTargetLaneID(), NBEdge::init(), MSLane::isInsertionSuccess(), MESegment::isOpen(), joinNamedToString(), joinNamedToStringSorting(), MSPModel_Striping::PState::moveToNextLane(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), libsumo::Helper::moveToXYMap(), operator<<(), NBEdge::recheckLanes(), MSTriggeredRerouter::rerouteParkingArea(), MSLCM_LC2013::saveBlockerLength(), MSLCM_SL2015::saveBlockerLength(), MSLCM_LC2013::slowDownForBlocked(), MSLCM_SL2015::slowDownForBlocked(), MSLaneChangerSublane::startChangeSublane(), toString(), MSLeaderInfo::toString(), MSLeaderDistanceInfo::toString(), MSCriticalFollowerDistanceInfo::toString(), MSVehicle::updateBestLanes(), and MSAbstractLaneChangeModel::updateShadowLane().
|
inherited |
Returns the number of vehicles within the area.
Definition at line 542 of file MSE3Collector.cpp.
References MSE3Collector::myEnteredContainer.
Referenced by libsumo::MultiEntryExit::getLastStepVehicleNumber(), and GUIE3Collector::MyWrapper::getParameterWindow().
|
inlineinherited |
Checks whether the detector is type specific.
Definition at line 163 of file MSDetectorFileOutput.h.
References MSDetectorFileOutput::myVehicleTypes.
|
inherited |
Called if a vehicle back passes a leave-cross-section.
Removes vehicle from internal containers.
[in] | veh | The vehicle that left the area |
[in] | leaveTimestep | The time in seconds the vehicle left the area |
[in] | fractionTimeOnDet | The interpolated time in seconds the vehicle still spent on the detector |
Definition at line 367 of file MSE3Collector.cpp.
References MSE3Collector::E3Values::backLeaveTime, SUMOTrafficObject::getID(), Named::getID(), SUMOTrafficObject::getSpeed(), MSGlobals::gUseMesoSim, MSE3Collector::E3Values::intervalSpeedSum, MSE3Collector::myEnteredContainer, MSE3Collector::myLeftContainer, MSE3Collector::myOpenEntry, MSE3Collector::E3Values::speedSum, SUMO_TAG_E3DETECTOR, MSE3Collector::E3Values::timeLoss, toString(), TS, MSDetectorFileOutput::vehicleApplies(), and WRITE_WARNING.
|
inherited |
Called if a vehicle front passes a leave-cross-section.
[in] | veh | The vehicle that left the area |
[in] | leaveTimestep | The time in seconds the vehicle started crossing the line |
Definition at line 352 of file MSE3Collector.cpp.
References SUMOTrafficObject::getID(), Named::getID(), MSE3Collector::myEnteredContainer, MSE3Collector::myOpenEntry, SUMO_TAG_E3DETECTOR, toString(), MSDetectorFileOutput::vehicleApplies(), and WRITE_WARNING.
|
virtualinherited |
Resets all generated values to allow computation of next interval.
Reimplemented from MSDetectorFileOutput.
Definition at line 310 of file MSE3Collector.cpp.
References MSE3Collector::myLeftContainer.
Referenced by MSE3Collector::MSE3Collector().
|
inlineinherited |
resets the id
[in] | newID | The new id of this object |
Definition at line 85 of file Named.h.
References Named::myID.
Referenced by Distribution_Parameterized::parse(), NBLoadedSUMOTLDef::reconstructLogic(), NBEdgeCont::remapIDs(), NBNodeCont::rename(), NBEdgeCont::rename(), GNEJunction::setAttribute(), and IntermodalNetwork< E, L, N, V >::splitEdge().
|
inlineinherited |
Checks whether the detector measures vehicles of the given type.
[in] | veh | the vehicle of which the type is checked. |
Definition at line 142 of file MSDetectorFileOutput.h.
References MSDetectorFileOutput::detectPersons(), MSNet::getInstance(), MSVehicleType::getOriginalID(), MSNet::getVehicleControl(), SUMOTrafficObject::getVehicleType(), MSVehicleControl::getVTypeDistributionMembership(), SUMOTrafficObject::isVehicle(), and MSDetectorFileOutput::myVehicleTypes.
Referenced by MSE3Collector::enter(), MSE3Collector::leave(), MSE3Collector::leaveFront(), MSRouteProbe::notifyEnter(), MSInductLoop::notifyEnter(), MSCalibrator::VehicleRemover::notifyEnter(), MSE2Collector::notifyEnter(), and MSInstantInductLoop::notifyMove().
|
virtualinherited |
Opens the XML-output using "e3Detector" as root element.
The lists of entries/exists are written, too.
[in] | dev | The output device to write the root into |
IOError | If an error on writing occurs (!!! not yet implemented) |
Implements MSDetectorFileOutput.
Definition at line 483 of file MSE3Collector.cpp.
References OutputDevice::writeXMLHeader().
|
virtualinherited |
Writes collected values into the given stream.
[in] | dev | The output device to write the data into |
[in] | startTime | First time step the data were gathered |
[in] | stopTime | Last time step the data were gathered |
IOError | If an error on writing occurs (!!! not yet implemented) |
Implements MSDetectorFileOutput.
Definition at line 395 of file MSE3Collector.cpp.
References MSGlobals::gUseMesoSim, MIN2(), MSE3Collector::myEnteredContainer, Named::myID, MSE3Collector::myLastResetTime, MSE3Collector::myLeftContainer, STEPS2TIME, and time2string().
|
protectedinherited |
The current number of haltings (inside)
Definition at line 411 of file MSE3Collector.h.
Referenced by MSE3Collector::detectorUpdate(), and MSE3Collector::getCurrentHaltingNumber().
|
protectedinherited |
The current mean speed of known vehicles (inside)
Definition at line 408 of file MSE3Collector.h.
Referenced by MSE3Collector::detectorUpdate(), and MSE3Collector::getCurrentMeanSpeed().
|
protectedinherited |
Whether pedestrians shall be detected instead of vehicles.
Definition at line 176 of file MSDetectorFileOutput.h.
Referenced by MSDetectorFileOutput::detectPersons().
|
protectedinherited |
Container for vehicles that have entered the area.
Definition at line 398 of file MSE3Collector.h.
Referenced by MSE3Collector::detectorUpdate(), MSE3Collector::enter(), MSE3Collector::getCurrentVehicleIDs(), MSE3Collector::getVehiclesWithin(), MSE3Collector::leave(), MSE3Collector::leaveFront(), and MSE3Collector::writeXMLOutput().
|
protectedinherited |
|
protectedinherited |
The detector's built entry reminder.
Definition at line 350 of file MSE3Collector.h.
Referenced by MSE3Collector::MSE3Collector(), and MSE3Collector::~MSE3Collector().
|
protectedinherited |
|
protectedinherited |
Speed-threshold to determine if a vehicle is halting.
Definition at line 360 of file MSE3Collector.h.
Referenced by MSE3Collector::detectorUpdate(), and MSE3Collector::enter().
|
protectedinherited |
Definition at line 357 of file MSE3Collector.h.
Referenced by MSE3Collector::detectorUpdate(), and MSE3Collector::enter().
|
protectedinherited |
The name of the object.
Definition at line 134 of file Named.h.
Referenced by MSE2Collector::addDetectorToLanes(), RODFDetector::buildDestinationDistribution(), NGEdge::buildNBEdge(), NGNode::buildNBNode(), MSSOTLTrafficLightLogic::checkPhases(), NBNode::computeNodeShape(), MSE2Collector::detectorUpdate(), GNEPoly::getAttribute(), GNEPOI::getAttribute(), MSLane::getCanonicalPredecessorLane(), MSLane::getCanonicalSuccessorLane(), Named::getID(), NBEdge::getLaneID(), ROEdge::getStoredEffort(), MSLane::getSurroundingVehicles(), ROEdge::getTravelTime(), MSDelayBasedTrafficLightLogic::init(), MSActuatedTrafficLightLogic::init(), MSSOTLTrafficLightLogic::init(), NBEdge::init(), MSLane::isInsertionSuccess(), NBNode::NBNode(), MSE2Collector::notifyEnter(), MSE2Collector::notifyLeave(), MSE2Collector::notifyMove(), MSMeanData::openInterval(), RORouteDef::preComputeCurrentRoute(), NBEdge::reinitNodes(), MSRoute::release(), GNEPOI::setAttribute(), GNEPoly::setAttribute(), Named::setID(), MSSOTLTrafficLightLogic::setToATargetPhase(), NBEdge::splitGeometry(), Distribution_Parameterized::toStr(), MSChargingStation::writeChargingStationOutput(), RODFDetector::writeEmitterDefinition(), RODFDetector::writeSingleSpeedTrigger(), MEInductLoop::writeXMLOutput(), and MSE3Collector::writeXMLOutput().
|
protectedinherited |
Information when the last reset has been done.
Definition at line 416 of file MSE3Collector.h.
Referenced by MSE3Collector::enter(), and MSE3Collector::writeXMLOutput().
|
protectedinherited |
The detector's built exit reminder.
Definition at line 353 of file MSE3Collector.h.
Referenced by MSE3Collector::MSE3Collector(), and MSE3Collector::~MSE3Collector().
|
protectedinherited |
Container for vehicles that have left the area.
Definition at line 401 of file MSE3Collector.h.
Referenced by MSE3Collector::leave(), MSE3Collector::reset(), and MSE3Collector::writeXMLOutput().
|
protectedinherited |
whether this dector is declared as having incomplete entry detectors
Definition at line 419 of file MSE3Collector.h.
Referenced by MSE3Collector::leave(), and MSE3Collector::leaveFront().
|
protectedinherited |
The vehicle types to look for (empty means all)
Definition at line 173 of file MSDetectorFileOutput.h.
Referenced by MSDetectorFileOutput::isTyped(), MSDetectorFileOutput::MSDetectorFileOutput(), and MSDetectorFileOutput::vehicleApplies().