Eclipse SUMO - Simulation of Urban MObility
PedestrianEdge< E, L, N, V > Class Template Reference

the pedestrian edge type that is given to the internal router (SUMOAbstractRouter) More...

#include <PedestrianEdge.h>

Inheritance diagram for PedestrianEdge< E, L, N, V >:
Collaboration diagram for PedestrianEdge< E, L, N, V >:

Public Member Functions

void addSuccessor (IntermodalEdge *const s, IntermodalEdge *const via=nullptr)
 
void addTo (const StoringVisitor &cont) const
 Adds this object to the given container. More...
 
double getDistanceTo (const IntermodalEdge *other) const
 
const E * getEdge () const
 
virtual double getEffort (const IntermodalTrip< E, N, V > *const, double) const
 
double getEndPos () const
 
const std::string & getID () const
 Returns the id. More...
 
virtual double getIntended (const double, std::string &) const
 get intended vehicle id and departure time of next public transport ride More...
 
double getLength () const
 
double getLengthGeometryFactor () const
 
const std::string & getLine () const
 
double getMinimumTravelTime (const IntermodalTrip< E, N, V > *const trip) const
 
int getNumericalID () const
 
double getSpeedLimit () const
 
double getStartPos () const
 
virtual const std::vector< IntermodalEdge * > & getSuccessors (SUMOVehicleClass vClass=SVC_IGNORING) const
 
virtual double getTravelTime (const IntermodalTrip< E, N, V > *const trip, double time) const
 
virtual const std::vector< std::pair< const IntermodalEdge *, const IntermodalEdge * > > & getViaSuccessors (SUMOVehicleClass vClass=SVC_IGNORING) const
 
virtual bool hasEffort () const
 
bool includeInRoute (bool allEdges) const
 
bool isInternal () const
 
 PedestrianEdge (int numericalID, const E *edge, const L *lane, bool forward, const double pos=-1.)
 
bool prohibits (const IntermodalTrip< E, N, V > *const trip) const
 
void removeSuccessor (const IntermodalEdge *const edge)
 
virtual bool restricts (const IntermodalTrip< E, N, V > *const) const
 
void setID (const std::string &newID)
 resets the id More...
 
void setLength (const double length)
 
void transferSuccessors (IntermodalEdge *to)
 

Static Public Member Functions

static double getEffortStatic (const IntermodalEdge *const edge, const IntermodalTrip< E, N, V > *const trip, double time)
 
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...
 
static double getTravelTimeStatic (const IntermodalEdge *const edge, const IntermodalTrip< E, N, V > *const trip, double time)
 
static double getTravelTimeStaticRandomized (const IntermodalEdge *const edge, const IntermodalTrip< E, N, V > *const trip, double time)
 

Protected Attributes

std::vector< IntermodalEdge * > myFollowingEdges
 List of edges that may be approached from this edge. More...
 
std::vector< std::pair< const IntermodalEdge *, const IntermodalEdge * > > myFollowingViaEdges
 List of edges that may be approached from this edge with optional internal vias. More...
 
std::string myID
 The name of the object. More...
 

Private Attributes

const E *const myEdge
 the original edge More...
 
ValueTimeLine< double > * myEfforts
 Container for passing effort varying over time for the edge. More...
 
const bool myForward
 the direction of this edge More...
 
const L * myLane
 the original edge More...
 
double myLength
 adaptable length (for splitted edges) More...
 
const std::string myLine
 public transport line or ped vs car More...
 
const int myNumericalID
 the index in myEdges More...
 
const double myStartPos
 the starting position for split edges More...
 

Detailed Description

template<class E, class L, class N, class V>
class PedestrianEdge< E, L, N, V >

the pedestrian edge type that is given to the internal router (SUMOAbstractRouter)

Definition at line 37 of file PedestrianEdge.h.

Constructor & Destructor Documentation

◆ PedestrianEdge()

template<class E , class L , class N , class V >
PedestrianEdge< E, L, N, V >::PedestrianEdge ( int  numericalID,
const E *  edge,
const L *  lane,
bool  forward,
const double  pos = -1. 
)
inline

Definition at line 39 of file PedestrianEdge.h.

Member Function Documentation

◆ addSuccessor()

◆ addTo()

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

Adds this object to the given container.

Parameters
[in,filled]cont The container to add this item to

Definition at line 126 of file Named.h.

References Named::StoringVisitor::add().

◆ getDistanceTo()

template<class E , class L , class N , class V >
double IntermodalEdge< E, L, N, V >::getDistanceTo ( const IntermodalEdge< E, L, N, V > *  other) const
inlineinherited

Definition at line 170 of file IntermodalEdge.h.

References IntermodalEdge< E, L, N, V >::myEdge.

◆ getEdge()

◆ getEffort()

template<class E , class L , class N , class V >
virtual double IntermodalEdge< E, L, N, V >::getEffort ( const IntermodalTrip< E, N, V > * const  ,
double   
) const
inlinevirtualinherited

◆ getEffortStatic()

template<class E , class L , class N , class V >
static double IntermodalEdge< E, L, N, V >::getEffortStatic ( const IntermodalEdge< E, L, N, V > *const  edge,
const IntermodalTrip< E, N, V > *const  trip,
double  time 
)
inlinestaticinherited

◆ getEndPos()

template<class E , class L , class N , class V >
double PedestrianEdge< E, L, N, V >::getEndPos ( ) const
inlinevirtual

◆ getID()

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

Returns the id.

Returns
The stored id

Definition at line 76 of file Named.h.

References Named::myID.

Referenced by MSLCM_LC2013::adaptSpeedToPedestrians(), MSVehicle::adaptToLeader(), MSVehicle::adaptToLeaders(), LaneStoringVisitor::add(), Named::StoringVisitor::add(), MSVehicleTransfer::add(), MSPModel_Striping::add(), MSPModel_Remote::add(), PCPolyContainer::add(), ShapeContainer::add(), MSDetectorControl::add(), NLTriggerBuilder::addAccess(), RORouteDef::addAlternative(), MSLane::addApproachingLane(), NLHandler::addConnection(), NBLoadedSUMOTLDef::addConnection(), MSPModel_Striping::addCrossingVehs(), RODFDetectorCon::addDetector(), RONet::addEdge(), ROJTREdge::addFollowerProbability(), MSTLLogicControl::TLSLogicVariants::addLogic(), MSLane::addNeigh(), RONet::addNode(), NIImporter_SUMO::addPhase(), GUIEdge::addRerouter(), RONet::addRouteDef(), NIXMLEdgesHandler::addSplit(), NBTrafficLightLogic::addStep(), MSRouteHandler::addStop(), ROVehicle::addStop(), MSVehicle::addStop(), MSNet::addStoppingPlace(), MSVehicle::addTraciStop(), MSVehicle::addTraciStopAtStoppingPlace(), AGActivityTripWriter::addTrip(), NIXMLConnectionsHandler::addWalkingArea(), libsumo::Helper::applySubscriptionFilters(), GUITrafficLightLogicWrapper::begin2TrackPhases(), 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(), NIVissimEdge::buildNBEdge(), NGEdge::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(), IntermodalRouter< E, L, N, V >::compute(), ROJTRRouter::compute(), NBTrafficLightDefinition::compute(), NBNode::computeInternalLaneShape(), NBNode::computeLanes2Lanes(), NBNode::computeLogic(), NBOwnTLDef::computeLogicAndConts(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), NBNodeTypeComputer::computeNodeTypes(), RODFNet::computeRoutesFor(), NBTrafficLightLogicCont::computeSingleLogic(), NBNode::computeSmoothShape(), NBTurningDirectionsComputer::computeTurnDirectionsForNode(), MSVehicle::Manoeuvre::configureEntryManoeuvre(), MSVehicle::Manoeuvre::configureExitManoeuvre(), NGNet::connect(), NBOwnTLDef::corridorLike(), MSSOTLWaveTrafficLightLogic::countVehicles(), MSSOTLE2Sensors::countVehicles(), MSDevice_SSM::createEncounters(), GUINet::createTLWrapper(), MSActuatedTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decideNextPhase(), MSSOTLPolicyBasedTrafficLightLogic::decideNextPhase(), MSSwarmTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decidePolicy(), MSSwarmTrafficLightLogic::decidePolicy(), MSLane::detectCollisionBetween(), MSLane::detectCollisions(), MSLane::detectPedestrianJunctionCollision(), NIVissimDistrictConnection::dict_BuildDistrictNodes(), NIVissimDistrictConnection::dict_BuildDistricts(), MSE3Collector::enter(), MSVehicle::enterLaneAtMove(), MSVehicle::Manoeuvre::entryManoeuvreIsComplete(), METriggeredCalibrator::execute(), Command_SaveTLSProgram::execute(), Command_SaveTLSState::execute(), Command_SaveTLSSwitches::execute(), Command_SaveTLSSwitchStates::execute(), MSVTypeProbe::execute(), MSPModel_Striping::MovePedestrians::execute(), MSCalibrator::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(), GUITrafficLightLogicWrapper::getActiveTLLogic(), RODFDetectorCon::getAggFlowFor(), RODFDetectorCon::getAnyDetectorForEdge(), MSPModel_Striping::getArbitraryPath(), MSVehicle::getBackPosition(), MSVehicle::getBackPositionOnLane(), libsumo::Vehicle::getBestLanes(), NBOwnTLDef::getBestPair(), NBRailwayTopologyAnalyzer::getBrokenRailNodes(), MSLane::getCanonicalPredecessorLane(), MSLane::getCanonicalSuccessorLane(), MSVehicle::getCenterOnEdge(), MSDevice_Battery::getChargingStationID(), MSRailSignal::getClickableTLLinkID(), libsumo::TrafficLight::getControlledLinks(), MSLane::getCriticalLeader(), NBNodeShapeComputer::getDefaultRadius(), MSLink::getDescription(), NBTrafficLightDefinition::getDescription(), GUIPerson::getDestinationEdgeID(), RODFNet::getDetectorEdge(), MSActuatedTrafficLightLogic::getDetectorPriority(), GUIPerson::getEdgeID(), GUIMEVehicle::getEdgeID(), MSMeanData::getEdgeID(), libsumo::Lane::getEdgeID(), MSPModel_Remote::getFirstPedestrianLane(), MSLane::getFollower(), MSLane::getFollowersOnConsecutive(), GUIPerson::getFromEdgeID(), MSCalibrator::getID(), NBEdge::getID(), libsumo::InductionLoop::getLaneID(), libsumo::LaneArea::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(), GNEDialogACChooser::getObjectName(), MSLane::getOppositeFollower(), MSLane::getOppositeLeader(), MSLane::getOppositePos(), libsumo::Simulation::getParameter(), GUILane::getParameterWindow(), GUITrafficLightLogicWrapper::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(), MSContainer::MSContainerStage_Tranship::getStageSummary(), MSTransportable::Stage_Trip::getStageSummary(), MSTransportable::Stage_Waiting::getStageSummary(), MSPerson::MSPersonStage_Walking::getStageSummary(), MSPerson::MSPersonStage_Driving::getStageSummary(), MSNet::getStoppingPlaceID(), MSLane::getSurroundingVehicles(), MSActuatedTrafficLightLogic::getTarget(), MSRailSignal::getTLLinkID(), MSLane::getUpcomingLinks(), MSDevice_SSM::getUpstreamVehicles(), MSPModel_Striping::getVehicleObstacles(), MSDevice_SSM::getVehiclesOnJunction(), MSEdge::getWaitingVehicle(), MSLink::getZipperSpeed(), NBNode::guessCrossings(), RODFDetectorCon::guessEmptyFlows(), NBNodeCont::guessTLs(), GUITLLogicPhasesTrackerWindow::GUITLLogicPhasesTrackerWindow(), MSLane::handleCollisionBetween(), MSVehicle::haveValidStopEdges(), libsumo::POI::highlight(), MSVehicle::ignoreRed(), MSActuatedTrafficLightLogic::init(), MSDelayBasedTrafficLightLogic::init(), MSDeterministicHiLevelTrafficLightLogic::init(), MSRailSignal::init(), MSSOTLTrafficLightLogic::init(), MSSwarmTrafficLightLogic::init(), MSTrafficLightLogic::init(), MSE2Collector::initAuxiliaries(), NIImporter_SUMO::initTrafficLightLogic(), NIXMLTrafficLightsHandler::initTrafficLightLogic(), NBDistrictCont::insert(), NBNodeCont::insert(), NBTrafficLightLogicCont::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(), 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(), MSE2Collector::notifyEnter(), MSDevice_Bluelight::notifyEnter(), MSDevice_Example::notifyEnter(), MSDevice_SSM::notifyEnter(), MSDevice_Tripinfo::notifyEnter(), MSMeanData::MeanDataValues::notifyEnter(), MSMeanData::MeanDataValueTracker::notifyEnter(), MSMeanData_Net::MSLaneMeanDataValues::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSE3Collector::MSE3EntryReminder::notifyEnter(), MSE3Collector::MSE3LeaveReminder::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_Bluelight::notifyLeave(), MSDevice_Example::notifyLeave(), MSDevice_SSM::notifyLeave(), MSDevice_Transportable::notifyLeave(), MSDevice_Tripinfo::notifyLeave(), MSE2Collector::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_Bluelight::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSDevice_BTsender::notifyMove(), MSDevice_Example::notifyMove(), MSDevice_SSM::notifyMove(), MSE2Collector::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSDevice_ToC::notifyMove(), GNETLSEditorFrame::onCmdDefSwitch(), GUIViewTraffic::onGamingClick(), MSLink::opened(), RORouteHandler::openRoute(), MSLane::incoming_lane_priority_sorter::operator()(), MSLane::outgoing_lane_priority_sorter::operator()(), NBNetBuilder::by_id_sorter::operator()(), NBNode::nodes_by_id_sorter::operator()(), RODFNet::idComp::operator()(), NIImporter_VISUM::parse_Connectors_legacy(), 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(), MSDevice_ToC::requestToC(), MSBaseVehicle::reroute(), MSRailSignal::LinkInfo::reroute(), GUIVehicle::rerouteDRTStop(), MSTriggeredRerouter::rerouteParkingArea(), MSVehicle::rerouteParkingArea(), MSLane::resetManeuverReservation(), MSLane::resetPartialOccupation(), RODFNet::revalidateFlows(), NBRailwayTopologyAnalyzer::reverseEdges(), RONet::saveAndRemoveRoutesUntil(), ROPerson::Ride::saveAsXML(), ROVehicle::saveAsXML(), MSBaseVehicle::saveState(), MSLane::saveState(), MSDevice::saveState(), MSDevice_Routing::saveState(), MSDevice_Tripinfo::saveState(), MSDevice_Vehroutes::saveState(), MSTransportableDevice_Routing::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(), NBLoadedTLDef::setTLControllingInformation(), NBOwnTLDef::setTLControllingInformation(), NBTrafficLightLogicCont::setTLControllingInformation(), NBEdge::shiftPositionAtNode(), MSLane::sortManeuverReservations(), IntermodalNetwork< E, L, N, V >::splitEdge(), MSLaneChangerSublane::startChangeSublane(), MSStopOut::stopEnded(), MSStopOut::stopStarted(), MSLane::succLinkSec(), GUITrafficLightLogicWrapper::switchTLSLogic(), MELoop::teleportVehicle(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), MSSOTLTrafficLightLogic::trySwitch(), MSDevice_SSM::update(), PolygonDynamics::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(), MSInstantInductLoop::write(), NBParking::write(), MSFCDExport::write(), MSBatteryExport::write(), MSEmissionExport::write(), MSLink::writeApproaching(), MSRailSignal::writeBlocks(), NWWriter_DlrNavteq::writeConnectedLanes(), NWWriter_SUMO::writeDistrict(), MSMeanData::writeEdge(), NWWriter_SUMO::writeEdge(), MSFullExport::writeEdge(), MSXMLRawOut::writeEdge(), NWWriter_XML::writeEdgesAndConnections(), RODFDetector::writeEmitterDefinition(), RODFDetectorCon::writeEmitterPOIs(), RODFDetectorCon::writeEmitters(), RODFDetectorCon::writeEndRerouterDetectors(), NWWriter_OpenDrive::writeInternalEdge(), writeInterval(), NWWriter_SUMO::writeJunction(), MSFullExport::writeLane(), MSQueueExport::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(), SUMOPolygon::writeXML(), PointOfInterest::writeXML(), MSE2Collector::writeXMLOutput(), MSInductLoop::writeXMLOutput(), MSRouteProbe::writeXMLOutput(), and RONet::~RONet().

◆ getIDSecure()

template<class T >
static std::string Named::getIDSecure ( const T *  obj,
const std::string &  fallBack = "NULL" 
)
inlinestaticinherited

get an identifier for Named-like object which may be Null

Definition at line 69 of file Named.h.

Referenced by MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), MSLaneChanger::changeOpposite(), MSVehicle::checkRewindLinkLanes(), AStarRouter< E, V >::compute(), DijkstraRouter< E, V >::compute(), NBEdge::computeEdge2Edges(), NBEdge::computeLanes2Edges(), NBOwnTLDef::computeLogicAndConts(), MSLaneChanger::continueChange(), MSLane::detectCollisions(), MSRailSignal::DriveWay::findProtection(), NBPTLineCont::findWay(), MSCFModel_CACC::followSpeed(), MSCFModel_W99::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_SL2015::saveBlockerLength(), MSLCM_LC2013::saveBlockerLength(), MSLCM_LC2013::slowDownForBlocked(), MSLCM_SL2015::slowDownForBlocked(), MSLaneChangerSublane::startChangeSublane(), MSLeaderInfo::toString(), MSLeaderDistanceInfo::toString(), MSCriticalFollowerDistanceInfo::toString(), toString(), MSVehicle::updateBestLanes(), and MSAbstractLaneChangeModel::updateShadowLane().

◆ getIntended()

template<class E , class L , class N , class V >
virtual double IntermodalEdge< E, L, N, V >::getIntended ( const double  ,
std::string &   
) const
inlinevirtualinherited

get intended vehicle id and departure time of next public transport ride

Reimplemented in PublicTransportEdge< E, L, N, V >.

Definition at line 115 of file IntermodalEdge.h.

◆ getLength()

◆ getLengthGeometryFactor()

template<class E , class L , class N , class V >
double IntermodalEdge< E, L, N, V >::getLengthGeometryFactor ( ) const
inlineinherited

Definition at line 165 of file IntermodalEdge.h.

References IntermodalEdge< E, L, N, V >::myEdge.

◆ getLine()

template<class E , class L , class N , class V >
const std::string& IntermodalEdge< E, L, N, V >::getLine ( ) const
inlineinherited

Definition at line 55 of file IntermodalEdge.h.

References IntermodalEdge< E, L, N, V >::myLine.

◆ getMinimumTravelTime()

template<class E , class L , class N , class V >
double IntermodalEdge< E, L, N, V >::getMinimumTravelTime ( const IntermodalTrip< E, N, V > *const  trip) const
inlineinherited

◆ getNumericalID()

template<class E , class L , class N , class V >
int IntermodalEdge< E, L, N, V >::getNumericalID ( ) const
inlineinherited

◆ getSpeedLimit()

template<class E , class L , class N , class V >
double IntermodalEdge< E, L, N, V >::getSpeedLimit ( ) const
inlineinherited

Definition at line 160 of file IntermodalEdge.h.

References IntermodalEdge< E, L, N, V >::myEdge.

◆ getStartPos()

template<class E , class L , class N , class V >
double PedestrianEdge< E, L, N, V >::getStartPos ( ) const
inlinevirtual

Reimplemented from IntermodalEdge< E, L, N, V >.

Definition at line 88 of file PedestrianEdge.h.

References PedestrianEdge< E, L, N, V >::myStartPos.

◆ getSuccessors()

template<class E , class L , class N , class V >
virtual const std::vector<IntermodalEdge*>& IntermodalEdge< E, L, N, V >::getSuccessors ( SUMOVehicleClass  vClass = SVC_IGNORING) const
inlinevirtualinherited

Reimplemented in CarEdge< E, L, N, V >.

Definition at line 90 of file IntermodalEdge.h.

References IntermodalEdge< E, L, N, V >::myFollowingEdges, and UNUSED_PARAMETER.

◆ getTravelTime()

◆ getTravelTimeStatic()

template<class E , class L , class N , class V >
static double IntermodalEdge< E, L, N, V >::getTravelTimeStatic ( const IntermodalEdge< E, L, N, V > *const  edge,
const IntermodalTrip< E, N, V > *const  trip,
double  time 
)
inlinestaticinherited

◆ getTravelTimeStaticRandomized()

template<class E , class L , class N , class V >
static double IntermodalEdge< E, L, N, V >::getTravelTimeStaticRandomized ( const IntermodalEdge< E, L, N, V > *const  edge,
const IntermodalTrip< E, N, V > *const  trip,
double  time 
)
inlinestaticinherited

◆ getViaSuccessors()

template<class E , class L , class N , class V >
virtual const std::vector<std::pair<const IntermodalEdge*, const IntermodalEdge*> >& IntermodalEdge< E, L, N, V >::getViaSuccessors ( SUMOVehicleClass  vClass = SVC_IGNORING) const
inlinevirtualinherited

◆ hasEffort()

template<class E , class L , class N , class V >
virtual bool IntermodalEdge< E, L, N, V >::hasEffort ( ) const
inlinevirtualinherited

◆ includeInRoute()

template<class E , class L , class N , class V >
bool PedestrianEdge< E, L, N, V >::includeInRoute ( bool  allEdges) const
inlinevirtual

Reimplemented from IntermodalEdge< E, L, N, V >.

Definition at line 45 of file PedestrianEdge.h.

References IntermodalEdge< E, L, N, V >::getEdge().

◆ isInternal()

template<class E , class L , class N , class V >
bool IntermodalEdge< E, L, N, V >::isInternal ( ) const
inlineinherited

Definition at line 143 of file IntermodalEdge.h.

References IntermodalEdge< E, L, N, V >::myEdge.

◆ prohibits()

template<class E , class L , class N , class V >
bool PedestrianEdge< E, L, N, V >::prohibits ( const IntermodalTrip< E, N, V > *const  trip) const
inlinevirtual

◆ removeSuccessor()

template<class E , class L , class N , class V >
void IntermodalEdge< E, L, N, V >::removeSuccessor ( const IntermodalEdge< E, L, N, V > *const  edge)
inlineinherited

◆ restricts()

template<class E , class L , class N , class V >
virtual bool IntermodalEdge< E, L, N, V >::restricts ( const IntermodalTrip< E, N, V > * const  ) const
inlinevirtualinherited

Definition at line 106 of file IntermodalEdge.h.

◆ setID()

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

◆ setLength()

template<class E , class L , class N , class V >
void IntermodalEdge< E, L, N, V >::setLength ( const double  length)
inlineinherited

◆ transferSuccessors()

template<class E , class L , class N , class V >
void IntermodalEdge< E, L, N, V >::transferSuccessors ( IntermodalEdge< E, L, N, V > *  to)
inlineinherited

Field Documentation

◆ myEdge

template<class E , class L , class N , class V >
const E* const IntermodalEdge< E, L, N, V >::myEdge
privateinherited

◆ myEfforts

template<class E , class L , class N , class V >
ValueTimeLine<double>* IntermodalEdge< E, L, N, V >::myEfforts
privateinherited

Container for passing effort varying over time for the edge.

Definition at line 200 of file IntermodalEdge.h.

Referenced by IntermodalEdge< E, L, N, V >::hasEffort().

◆ myFollowingEdges

template<class E , class L , class N , class V >
std::vector<IntermodalEdge*> IntermodalEdge< E, L, N, V >::myFollowingEdges
protectedinherited

◆ myFollowingViaEdges

template<class E , class L , class N , class V >
std::vector<std::pair<const IntermodalEdge*, const IntermodalEdge*> > IntermodalEdge< E, L, N, V >::myFollowingViaEdges
protectedinherited

◆ myForward

template<class E , class L , class N , class V >
const bool PedestrianEdge< E, L, N, V >::myForward
private

the direction of this edge

Definition at line 101 of file PedestrianEdge.h.

Referenced by PedestrianEdge< E, L, N, V >::getEndPos(), and PedestrianEdge< E, L, N, V >::getTravelTime().

◆ myID

◆ myLane

template<class E , class L , class N , class V >
const L* PedestrianEdge< E, L, N, V >::myLane
private

the original edge

Definition at line 98 of file PedestrianEdge.h.

Referenced by PedestrianEdge< E, L, N, V >::getTravelTime().

◆ myLength

template<class E , class L , class N , class V >
double IntermodalEdge< E, L, N, V >::myLength
privateinherited

◆ myLine

template<class E , class L , class N , class V >
const std::string IntermodalEdge< E, L, N, V >::myLine
privateinherited

public transport line or ped vs car

Definition at line 194 of file IntermodalEdge.h.

Referenced by IntermodalEdge< E, L, N, V >::getLine().

◆ myNumericalID

template<class E , class L , class N , class V >
const int IntermodalEdge< E, L, N, V >::myNumericalID
privateinherited

the index in myEdges

Definition at line 188 of file IntermodalEdge.h.

Referenced by IntermodalEdge< E, L, N, V >::getNumericalID().

◆ myStartPos

template<class E , class L , class N , class V >
const double PedestrianEdge< E, L, N, V >::myStartPos
private

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