Eclipse SUMO - Simulation of Urban MObility
MSTransportable Class Reference

#include <MSTransportable.h>

Inheritance diagram for MSTransportable:
[legend]
Collaboration diagram for MSTransportable:
[legend]

Public Types

typedef std::vector< MSStage * > MSTransportablePlan
 the structure holding the plan of a transportable More...
 

Public Member Functions

void addTo (const StoringVisitor &cont) const
 Adds this object to the given container. More...
 
void appendStage (MSStage *stage, int next=-1)
 Appends the given stage to the current plan. More...
 
virtual void checkAccess (const MSStage *const prior, const bool isDisembark=true)
 
virtual double getAngle () const
 return the current angle of the transportable More...
 
const MSEdgegetArrivalEdge () const
 returns the final arrival edge More...
 
double getArrivalPos () const
 returns the final arrival pos More...
 
PositionVector getBoundingBox () const
 return the bounding box of the person More...
 
MSStagegetCurrentStage () const
 Return the current stage. More...
 
std::string getCurrentStageDescription () const
 Returns the current stage description as a string. More...
 
MSStageType getCurrentStageType () const
 the current stage type of the transportable More...
 
SUMOTime getDesiredDepart () const
 Returns the desired departure time. More...
 
const MSEdgegetDestination () const
 Returns the current destination. More...
 
MSTransportableDevicegetDevice (const std::type_info &type) const
 Returns a device of the given type if it exists or 0. More...
 
const std::vector< MSTransportableDevice * > & getDevices () const
 Returns this vehicle's devices. More...
 
const MSEdgegetEdge () const
 Returns the current edge. More...
 
virtual double getEdgePos () const
 Return the position on the edge. More...
 
ConstMSEdgeVector getEdges (int next) const
 Return the edges of the nth next stage. More...
 
const MSEdgegetFromEdge () const
 Returns the departure edge. More...
 
const std::string & getID () const
 Returns the id. More...
 
const MSLanegetLane () const
 Returns the current lane (may be nullptr) More...
 
const MSEdgegetNextDestination () const
 Returns the destination after the current destination. More...
 
MSStagegetNextStage (int next) const
 Return the current stage. More...
 
int getNumRemainingStages () const
 Return the number of remaining stages (including the current) More...
 
int getNumStages () const
 Return the total number stages in this persons plan. More...
 
const SUMOVehicleParametergetParameter () const
 Returns the vehicle's parameter (including departure definition) More...
 
virtual Position getPosition () const
 Return the Network coordinate of the transportable. More...
 
std::mt19937 * getRNG () const
 returns the associated RNG More...
 
MSVehicleTypegetSingularType ()
 Replaces the current vehicle type with a new one used by this vehicle only. More...
 
virtual double getSpeed () const
 the current speed of the transportable More...
 
virtual double getSpeedFactor () const
 the current speed factor of the transportable (where applicable) More...
 
std::string getStageSummary (int stageIndex) const
 return textual summary for the given stage More...
 
MSStageType getStageType (int next) const
 the stage type for the nth next stage More...
 
SUMOVehiclegetVehicle () const
 The vehicle associated with this transportable. More...
 
const MSVehicleTypegetVehicleType () const
 Returns the object's "vehicle" type. More...
 
virtual double getWaitingSeconds () const
 the time this transportable spent waiting in seconds More...
 
bool hasArrived () const
 return whether the person has reached the end of its plan More...
 
bool hasDeparted () const
 return whether the transportable has started it's plan More...
 
virtual bool isVehicle () const
 Whether it is a vehicle. More...
 
bool isWaiting4Vehicle () const
 Whether the transportable waits for a vehicle. More...
 
bool isWaitingFor (const SUMOVehicle *vehicle) const
 Whether the transportable waits for the given vehicle in the current step. More...
 
void loadState (const std::string &state)
 Reconstructs the current state. More...
 
 MSTransportable (const SUMOVehicleParameter *pars, MSVehicleType *vtype, MSTransportablePlan *plan, const bool isPerson)
 constructor More...
 
virtual bool proceed (MSNet *net, SUMOTime time, const bool vehicleArrived=false)
 
void removeStage (int next)
 removes the nth next stage More...
 
void replaceVehicleType (MSVehicleType *type)
 Replaces the current vehicle type by the one given. More...
 
void rerouteParkingArea (MSStoppingPlace *orig, MSStoppingPlace *replacement)
 adapt plan when the vehicle reroutes and now stops at replacement instead of orig More...
 
void routeOutput (OutputDevice &os, const bool withRouteLength) const
 Called on writing vehroute output. More...
 
void saveState (OutputDevice &out)
 Saves the current state into the given stream. More...
 
void setDeparted (SUMOTime now)
 logs depart time of the current stage More...
 
void setID (const std::string &newID)
 set the id (inherited from Named but forbidden for transportables) More...
 
void setSpeed (double speed)
 sets the walking speed (ignored in other stages) More...
 
void tripInfoOutput (OutputDevice &os) const
 Called on writing tripinfo output. More...
 
virtual ~MSTransportable ()
 destructor More...
 
inherited from SUMOTrafficObject
bool isPerson () const
 Whether it is a person. More...
 
bool isContainer () const
 Whether it is a container. More...
 
bool isStopped () const
 Returns whether the object is at a stop. More...
 
double getSlope () const
 Returns the slope of the road at object's position in degrees. More...
 
double getChosenSpeedFactor () const
 
SUMOVehicleClass getVClass () const
 Returns the object's access class. More...
 
double getMaxSpeed () const
 Returns the object's maximum speed. More...
 
SUMOTime getWaitingTime () const
 
double getPreviousSpeed () const
 Returns the object's previous speed. More...
 
double getAcceleration () const
 Returns the object's acceleration. More...
 
double getPositionOnLane () const
 Get the object's position along the lane. More...
 
double getBackPositionOnLane (const MSLane *) const
 Get the object's back position along the given lane. More...
 
Position getPosition (const double) const
 Return current position (x/y, cartesian) 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::vector< MSTransportableDevice * > myDevices
 The devices this transportable has. More...
 
std::string myID
 The name of the object. More...
 
const SUMOVehicleParametermyParameter
 the plan of the transportable More...
 
MSTransportablePlanmyPlan
 the plan of the transportable More...
 
MSTransportablePlan::iterator myStep
 the iterator over the route More...
 
MSVehicleTypemyVType
 This transportable's type. (mainly used for drawing related information Note sure if it is really necessary. More...
 
bool myWriteEvents
 Whether events shall be written. More...
 

Private Member Functions

 MSTransportable (const MSTransportable &)
 Invalidated copy constructor. More...
 
MSTransportableoperator= (const MSTransportable &)
 Invalidated assignment operator. More...
 

Private Attributes

const bool myAmPerson
 

Detailed Description

The class holds a simulated moveable object

Definition at line 58 of file MSTransportable.h.

Member Typedef Documentation

◆ MSTransportablePlan

the structure holding the plan of a transportable

Definition at line 108 of file MSTransportable.h.

Constructor & Destructor Documentation

◆ MSTransportable() [1/2]

MSTransportable::MSTransportable ( const SUMOVehicleParameter pars,
MSVehicleType vtype,
MSTransportablePlan plan,
const bool  isPerson 
)

constructor

Definition at line 44 of file MSTransportable.cpp.

References MSDevice::buildTransportableDevices(), myDevices, myPlan, and myStep.

◆ ~MSTransportable()

◆ MSTransportable() [2/2]

MSTransportable::MSTransportable ( const MSTransportable )
private

Invalidated copy constructor.

Member Function Documentation

◆ 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 117 of file Named.h.

References Named::StoringVisitor::add().

◆ appendStage()

void MSTransportable::appendStage ( MSStage stage,
int  next = -1 
)

Appends the given stage to the current plan.

Definition at line 201 of file MSTransportable.cpp.

References Named::getID(), myPlan, myStep, and toString().

Referenced by LIBSUMO_NAMESPACE::Person::appendDrivingStage(), LIBSUMO_NAMESPACE::Person::appendStage(), LIBSUMO_NAMESPACE::Person::appendWaitingStage(), LIBSUMO_NAMESPACE::Person::appendWalkingStage(), LIBSUMO_NAMESPACE::Person::moveToXY(), removeStage(), LIBSUMO_NAMESPACE::Person::replaceStage(), MSPerson::reroute(), rerouteParkingArea(), and MSStageTrip::setArrived().

Here is the caller graph for this function:

◆ checkAccess()

virtual void MSTransportable::checkAccess ( const MSStage *const  prior,
const bool  isDisembark = true 
)
inlinevirtual

Reimplemented in MSPerson.

Definition at line 120 of file MSTransportable.h.

References UNUSED_PARAMETER.

Referenced by proceed().

Here is the caller graph for this function:

◆ getAcceleration()

double MSTransportable::getAcceleration ( ) const
inlinevirtual

Returns the object's acceleration.

Returns
The acceleration

Implements SUMOTrafficObject.

Definition at line 90 of file MSTransportable.h.

◆ getAngle()

double MSTransportable::getAngle ( ) const
virtual

return the current angle of the transportable

Implements SUMOTrafficObject.

Reimplemented in GUIContainer.

Definition at line 141 of file MSTransportable.cpp.

References MSNet::getCurrentTimeStep(), and MSNet::getInstance().

Referenced by GUIContainer::getAngle(), getBoundingBox(), GUIPerson::getGUIAngle(), GUIPerson::getNaviDegree(), GUIPerson::setFunctionalColor(), MSFCDExport::writeTransportable(), and MSXMLRawOut::writeTransportable().

Here is the caller graph for this function:

◆ getArrivalEdge()

const MSEdge* MSTransportable::getArrivalEdge ( ) const
inline

returns the final arrival edge

Definition at line 279 of file MSTransportable.h.

References myPlan.

Referenced by LIBSUMO_NAMESPACE::Person::appendWaitingStage(), and LIBSUMO_NAMESPACE::Person::convertTraCIStage().

Here is the caller graph for this function:

◆ getArrivalPos()

double MSTransportable::getArrivalPos ( ) const
inline

returns the final arrival pos

Definition at line 274 of file MSTransportable.h.

References myPlan.

Referenced by LIBSUMO_NAMESPACE::Person::appendWaitingStage(), LIBSUMO_NAMESPACE::Person::appendWalkingStage(), LIBSUMO_NAMESPACE::Person::convertTraCIStage(), GUIContainer::getParameterWindow(), MSPerson::MSPersonStage_Walking::moveToNextEdge(), and MSPerson::reroute().

Here is the caller graph for this function:

◆ getBackPositionOnLane()

double MSTransportable::getBackPositionOnLane ( const MSLane lane) const
inlinevirtual

Get the object's back position along the given lane.

Returns
The position of the object (in m from the given lane's begin)

Implements SUMOTrafficObject.

Definition at line 98 of file MSTransportable.h.

References getEdgePos().

◆ getBoundingBox()

PositionVector MSTransportable::getBoundingBox ( ) const

◆ getChosenSpeedFactor()

double MSTransportable::getChosenSpeedFactor ( ) const
inlinevirtual

Implements SUMOTrafficObject.

Definition at line 76 of file MSTransportable.h.

Referenced by GUISUMOViewParent::onUpdSpeedFactor().

Here is the caller graph for this function:

◆ getCurrentStage()

◆ getCurrentStageDescription()

std::string MSTransportable::getCurrentStageDescription ( ) const
inline

Returns the current stage description as a string.

Definition at line 206 of file MSTransportable.h.

References myAmPerson.

Referenced by GUIContainer::getParameterWindow(), GUIPerson::getParameterWindow(), LIBSUMO_NAMESPACE::Person::moveTo(), LIBSUMO_NAMESPACE::Person::moveToXY(), and MSXMLRawOut::writeTransportable().

Here is the caller graph for this function:

◆ getCurrentStageType()

MSStageType MSTransportable::getCurrentStageType ( ) const
inline

the current stage type of the transportable

Definition at line 191 of file MSTransportable.h.

Referenced by MSPModel_Remote::add(), MSPModel_Striping::add(), GUIContainer::drawGL(), GUIPerson::drawGLAdditional(), GUIContainer::getColorValue(), GUIPerson::getColorValue(), GUIPerson::getGUIAngle(), GUIPerson::getGUIPosition(), MSPerson::getNextEdgePtr(), GUIContainer::getPosition(), isStopped(), rerouteParkingArea(), LIBSUMO_NAMESPACE::Person::rerouteTraveltime(), and ~MSTransportable().

Here is the caller graph for this function:

◆ getDesiredDepart()

SUMOTime MSTransportable::getDesiredDepart ( ) const

Returns the desired departure time.

Definition at line 121 of file MSTransportable.cpp.

References SUMOVehicleParameter::depart, and myParameter.

Referenced by tripInfoOutput().

Here is the caller graph for this function:

◆ getDestination()

const MSEdge* MSTransportable::getDestination ( ) const
inline

Returns the current destination.

Definition at line 146 of file MSTransportable.h.

Referenced by GUIPerson::getDestinationEdgeID(), GUIContainer::getParameterWindow(), MSPerson::MSPersonStage_Walking::getStageSummary(), MSDevice_Transportable::notifyLeave(), MSDevice_Transportable::notifyMove(), and rerouteParkingArea().

Here is the caller graph for this function:

◆ getDevice()

MSTransportableDevice * MSTransportable::getDevice ( const std::type_info &  type) const

Returns a device of the given type if it exists or 0.

Definition at line 359 of file MSTransportable.cpp.

References myDevices.

Referenced by MSFCDExport::writeTransportable().

Here is the caller graph for this function:

◆ getDevices()

const std::vector<MSTransportableDevice*>& MSTransportable::getDevices ( ) const
inline

Returns this vehicle's devices.

Returns
This vehicle's devices

Definition at line 322 of file MSTransportable.h.

References myDevices.

◆ getEdge()

◆ getEdgePos()

double MSTransportable::getEdgePos ( ) const
virtual

Return the position on the edge.

Reimplemented in GUIPerson, and GUIContainer.

Definition at line 131 of file MSTransportable.cpp.

References MSNet::getCurrentTimeStep(), and MSNet::getInstance().

Referenced by getBackPositionOnLane(), GUIContainer::getEdgePos(), GUIPerson::getEdgePos(), getPositionOnLane(), getSlope(), LIBSUMO_NAMESPACE::Person::getSlope(), LIBSUMO_NAMESPACE::Person::moveToXY(), removeStage(), LIBSUMO_NAMESPACE::Person::rerouteTraveltime(), MSFCDExport::writeTransportable(), and MSXMLRawOut::writeTransportable().

Here is the caller graph for this function:

◆ getEdges()

ConstMSEdgeVector MSTransportable::getEdges ( int  next) const
inline

Return the edges of the nth next stage.

Definition at line 223 of file MSTransportable.h.

References myPlan, and myStep.

Referenced by LIBSUMO_NAMESPACE::Person::getEdges(), and LIBSUMO_NAMESPACE::Person::rerouteTraveltime().

Here is the caller graph for this function:

◆ getFromEdge()

const MSEdge* MSTransportable::getFromEdge ( ) const
inline

Returns the departure edge.

Definition at line 166 of file MSTransportable.h.

Referenced by GUIPerson::getFromEdgeID(), and GUIContainer::getParameterWindow().

Here is the caller graph for this function:

◆ getID()

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

Returns the id.

Returns
The stored id

Definition at line 73 of file Named.h.

References Named::myID.

Referenced by MSLCM_LC2013::_patchSpeed(), MSLCM_SL2015::_patchSpeed(), MSCFModel_ACC::_v(), MSCFModel_CACC::_v(), MSCFModel_Wiedemann::_v(), MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), MSTransportableControl::abortAnyWaitingForVehicle(), MSLaneChangerSublane::abortLCManeuver(), MSLCM_LC2013::adaptSpeedToPedestrians(), MSVehicle::adaptToLeader(), MSVehicle::adaptToLeaders(), MSVehicleTransfer::add(), MSPModel_Striping::add(), PCPolyContainer::add(), ShapeContainer::add(), MSDetectorControl::add(), NLTriggerBuilder::addAccess(), RORouteDef::addAlternative(), MSLane::addApproachingLane(), MSChargingStation::addChargeValueForOutput(), MSOverheadWire::addChargeValueForOutput(), NBNodeCont::addCluster2Join(), NLHandler::addConnection(), NBLoadedSUMOTLDef::addConnection(), MSPModel_Striping::addCrossingVehs(), RODFDetectorCon::addDetector(), RONet::addEdge(), ROJTREdge::addFollowerProbability(), MSLCM_SL2015::addLCSpeedAdvice(), MSTLLogicControl::TLSLogicVariants::addLogic(), MSLane::addNeigh(), RONet::addNode(), MSTractionSubstation::addOverheadWireClampToCircuit(), MSTractionSubstation::addOverheadWireInnerSegmentToCircuit(), MSTractionSubstation::addOverheadWireSegmentToCircuit(), NIImporter_SUMO::addPhase(), GUIEdge::addRerouter(), MSDispatch::addReservation(), MSRouteHandler::addRide(), RONet::addRouteDef(), NIXMLEdgesHandler::addSplit(), NBTrafficLightLogic::addStep(), MSRouteHandler::addStop(), RORouteHandler::addStop(), ROVehicle::addStop(), MSBaseVehicle::addStop(), MSNet::addStoppingPlace(), MSVehicle::addTransportable(), AGActivityTripWriter::addTrip(), MSRouteHandler::addVehicleStopsToImplicitRoute(), NIXMLConnectionsHandler::addWalkingArea(), appendStage(), LIBSUMO_NAMESPACE::Person::appendWalkingStage(), MSCFModel::applyHeadwayAndSpeedDifferencePerceptionErrors(), MSCFModel::applyHeadwayPerceptionError(), libsumo::Helper::applySubscriptionFilterLateralDistanceSinglePass(), libsumo::Helper::applySubscriptionFilters(), MSDevice_ToC::awarenessRecoveryStep(), GUITrafficLightLogicWrapper::begin2TrackPhases(), MSPModel_Striping::blockedAtDist(), MSLink::blockedAtTime(), MSLink::blockedByFoe(), MSVehicle::boardTransportables(), NLEdgeControlBuilder::build(), NIVisumTL::build(), RODFNet::buildApproachList(), MSSOTLE2Sensors::buildContinueSensior(), MSSOTLE2Sensors::buildCountSensorForLane(), MSSOTLE2Sensors::buildCountSensorForOutLane(), NBNode::buildCrossings(), NBNode::buildCrossingsAndWalkingAreas(), MSTransportableDevice_Routing::buildDevices(), MSTransportableDevice_FCD::buildDevices(), NIImporter_VISUM::buildDistrictNode(), MSRailSignal::LinkInfo::buildDriveWay(), NLDetectorBuilder::buildE2Detector(), RODFNet::buildEdgeFlowMap(), NBEdge::buildInnerEdges(), NLTriggerBuilder::buildInnerOverheadWireSegments(), GNETLSEditorFrame::buildInternalLanes(), NIVissimEdge::buildNBEdge(), NGEdge::buildNBEdge(), NBRampsComputer::buildOffRamp(), NBRampsComputer::buildOnRamp(), MSRailSignal::DriveWay::buildRoute(), MELoop::buildSegmentsFor(), MSSOTLE2Sensors::buildSensorForLane(), MSSOTLE2Sensors::buildSensorForOutLane(), LIBSUMO_NAMESPACE::Vehicle::buildStopParameters(), MSDevice_Battery::buildVehicleDevices(), MSDevice_Bluelight::buildVehicleDevices(), MSDevice_BTreceiver::buildVehicleDevices(), MSDevice_BTsender::buildVehicleDevices(), MSDevice_DriverState::buildVehicleDevices(), MSDevice_ElecHybrid::buildVehicleDevices(), MSDevice_Emissions::buildVehicleDevices(), MSDevice_Example::buildVehicleDevices(), MSDevice_FCD::buildVehicleDevices(), MSDevice_Routing::buildVehicleDevices(), MSDevice_SSM::buildVehicleDevices(), MSDevice_Taxi::buildVehicleDevices(), MSDevice_ToC::buildVehicleDevices(), MSDevice_Tripinfo::buildVehicleDevices(), MSDevice_Transportable::buildVehicleDevices(), MSDevice_Vehroutes::buildVehicleDevices(), NBNode::buildWalkingAreas(), MSBaseVehicle::calculateArrivalParams(), MSSwarmTrafficLightLogic::calculateEtaDiff(), MSSwarmTrafficLightLogic::calculateEtaRatio(), MSE2Collector::calculateTimeLossAndTimeOnDetector(), MSSOTLPolicyBasedTrafficLightLogic::canRelease(), MSLaneChanger::change(), MSLaneChangerSublane::change(), MSLCM_SL2015::changed(), MSLaneChanger::changeOpposite(), MELoop::changeSegment(), MSSimpleTrafficLightLogic::changeStepAndDuration(), LIBSUMO_NAMESPACE::Vehicle::changeTarget(), MSTLLogicControl::check2Switch(), MSEdge::checkAndRegisterBiDirEdge(), MSLaneChanger::checkChange(), MSLaneChangerSublane::checkChangeSublane(), NBEdgeCont::checkConsistency(), MSRailSignal::DriveWay::checkCrossingFlanks(), MSDevice_ToC::checkDynamicToC(), MSLane::checkFailure(), MSLane::checkForPedestrians(), GUIApplicationWindow::checkGamingEvents(), MSVehicleTransfer::checkInsertions(), MSVehicle::checkLinkLeader(), MSDevice_Battery::checkParam(), MSDevice_ElecHybrid::checkParam(), MSE2Collector::checkPositioning(), MSVehicle::checkReversal(), MSVehicle::checkRewindLinkLanes(), MSLCM_SL2015::checkStrategicChange(), MSAbstractLaneChangeModel::checkTraCICommands(), MSLaneChanger::checkTraCICommands(), MSSwarmTrafficLightLogic::choosePolicy(), MSDevice_SSM::classifyEncounter(), ShapeContainer::clearHighlights(), NBTrafficLightLogic::closeBuilding(), ODDistrictHandler::closeDistrict(), NLHandler::closeEdge(), MSDevice_SSM::closeEncounter(), MSRouteHandler::closeFlow(), RORouteHandler::closeRouteDistribution(), RORouteHandler::closeVehicle(), NBTrafficLightDefinition::collectAllLinks(), NBTrafficLightDefinition::collectEdges(), NBLoadedSUMOTLDef::collectEdgeVectors(), NBLoadedTLDef::collectLinks(), MSLCM_SL2015::commitManoeuvre(), IntermodalRouter< E, L, N, V >::compute(), ROJTRRouter::compute(), NBTrafficLightDefinition::compute(), MSVehicle::computeAngle(), MSDispatch::computeDetourTime(), NBNodeShapeComputer::computeEdgeBoundaries(), NBNode::computeInternalLaneShape(), NBNode::computeLanes2Lanes(), NBNode::computeLogic(), NBOwnTLDef::computeLogicAndConts(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), NBNodeTypeComputer::computeNodeTypes(), RODFNet::computeRoutesFor(), NBTrafficLightLogicCont::computeSingleLogic(), NBNode::computeSmoothShape(), MSLCM_SL2015::computeSpeedLat(), MSDevice_SSM::computeSSMs(), NBTurningDirectionsComputer::computeTurnDirectionsForNode(), MSVehicle::Manoeuvre::configureEntryManoeuvre(), MSVehicle::Manoeuvre::configureExitManoeuvre(), NGNet::connect(), MSRailSignal::constraintsAllow(), MSLaneChanger::continueChange(), MSLaneChangerSublane::continueChangeSublane(), LIBSUMO_NAMESPACE::Person::convertTraCIStage(), NBLoadedSUMOTLDef::copyIndices(), NBOwnTLDef::corridorLike(), MSSOTLWaveTrafficLightLogic::countVehicles(), MSSOTLE2Sensors::countVehicles(), MSDevice_SSM::createEncounters(), GUINet::createTLWrapper(), MSDevice_Taxi::customerArrived(), MSDevice_ToC::deactivateDeliberateLCs(), MSRailSignal::DriveWay::deadlockLaneOccupied(), libsumo::Helper::debugPrint(), MSLCM_SL2015::decideDirection(), MSActuatedTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decideNextPhase(), MSSOTLPolicyBasedTrafficLightLogic::decideNextPhase(), MSSwarmTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decidePolicy(), MSSwarmTrafficLightLogic::decidePolicy(), MSVehicleControl::deleteVehicle(), MSDevice_ElecHybrid::deleteVehicleFromCircuit(), MSLane::detectCollisionBetween(), MSLane::detectCollisions(), MSE3Collector::detectorUpdate(), MSLane::detectPedestrianJunctionCollision(), NIVissimDistrictConnection::dict_BuildDistrictNodes(), NIVissimDistrictConnection::dict_BuildDistricts(), NBNodeCont::discardTrafficLights(), MSDispatch_Greedy::dispatch(), MSDispatch_GreedyShared::dispatch(), MSDispatch_RouteExtension::dispatch(), MSDevice_Taxi::dispatchShared(), MSDevice_SSM::Encounter::Encounter(), MSAbstractLaneChangeModel::endLaneChangeManeuver(), MSE3Collector::enter(), MSVehicle::enterLaneAtMove(), MSVehicle::Manoeuvre::entryManoeuvreIsComplete(), MSTransportableControl::erase(), 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(), MSCFModel::finalizeSpeed(), MSCFModel_Daniel1::finalizeSpeed(), MSLaneChanger::findCandidate(), libsumo::Helper::findCloserLane(), MSRailSignal::DriveWay::findFlankProtection(), MSDevice_SSM::findFoeConflictLane(), LIBSUMO_NAMESPACE::Simulation::findIntermodalRoute(), MSDevice_SSM::findSurroundingVehicles(), MSDevice_SSM::flushConflicts(), MSDevice_SSM::flushGlobalMeasures(), MSCFModel_CACC::followSpeed(), MSCFModel_W99::followSpeed(), NBTrafficLightDefinition::forbids(), NBNodeCont::generateNodeClusters(), MSDevice_Tripinfo::generateOutput(), GUITrafficLightLogicWrapper::getActiveTLLogic(), RODFDetectorCon::getAggFlowFor(), RODFDetectorCon::getAnyDetectorForEdge(), MSPModel_Striping::getArbitraryPath(), MSVehicle::getBackPosition(), MSVehicle::getBackPositionOnLane(), LIBSUMO_NAMESPACE::Vehicle::getBestLanes(), NBOwnTLDef::getBestPair(), NBRailwayTopologyAnalyzer::getBrokenRailNodes(), MSLane::getCanonicalPredecessorLane(), MSLane::getCanonicalSuccessorLane(), MSVehicle::getCenterOnEdge(), MSDevice_Battery::getChargingStationID(), MSRailSignal::getClickableTLLinkID(), GUIVehicle::getColorValue(), MSLaneChanger::getColumnleader(), LIBSUMO_NAMESPACE::TrafficLight::getControlledLinks(), MSLane::getCriticalLeader(), NBNodeShapeComputer::getDefaultRadius(), MSLink::getDescription(), MSStop::getDescription(), NBTrafficLightDefinition::getDescription(), GUIPerson::getDestinationEdgeID(), MSDevice_SSM::getDetectionRange(), RODFNet::getDetectorEdge(), MSActuatedTrafficLightLogic::getDetectorPriority(), MSRailSignal::LinkInfo::getDriveWay(), GUIPerson::getEdgeID(), GUIMEVehicle::getEdgeID(), MSMeanData::getEdgeID(), libsumo::Calibrator::getEdgeID(), LIBSUMO_NAMESPACE::RouteProbe::getEdgeID(), MSDevice_SSM::getExtraTime(), MSPModel_Remote::getFirstPedestrianLane(), MSLane::getFirstVehicleInformation(), MSLane::getFollower(), MSLane::getFollowersOnConsecutive(), GUIPerson::getFromEdgeID(), MSCalibrator::getID(), NBEdge::getID(), MSRailSignal::getJunctionLinkID(), RORouteHandler::getJunctionTaz(), libsumo::Calibrator::getLaneID(), MSParkingArea::getLastFreePosWithReservation(), MSLane::getLastVehicleInformation(), MSVehicle::getLatOffset(), MSLane::getLeader(), MSLink::getLeaderInfo(), MSLane::getLeaderOnConsecutive(), MSLaneChangerSublane::getLeaders(), MSLane::getLeadersOnConsecutive(), MSLink::getLengthBeforeCrossing(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForInputLanes(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForOutputLanes(), MSDevice_SSM::getMeasuresAndThresholds(), NIImporter_VISUM::getNamedEdgeContinuating(), MSPModel_Striping::getNeighboringObstacles(), MSPerson::getNextEdge(), MSPModel_Striping::getNextLane(), MSPModel_Striping::getNextLaneObstacles(), MSLane::getOppositeFollower(), MSLane::getOppositeLeader(), MSLane::getOppositePos(), MSDevice_SSM::getOutputFilename(), MSDevice_ElecHybrid::getOverheadWireSegmentID(), MSOverheadWire::getOverheadWireSegmentName(), MSDevice_ToC::getParameter(), LIBSUMO_NAMESPACE::Simulation::getParameter(), GUIContainer::getParameterWindow(), GUILane::getParameterWindow(), GUITrafficLightLogicWrapper::getParameterWindow(), GUILane::getParentName(), MSLane::getPartialBehind(), MSSimpleDriverState::getPerceivedHeadway(), MSSimpleDriverState::getPerceivedSpeedDifference(), MSSOTLTrafficLightLogic::getPhaseIndexWithMaxCTS(), MSSwarmTrafficLightLogic::getPheromoneForInputLanes(), MSSwarmTrafficLightLogic::getPheromoneForOutputLanes(), PolygonDynamics::getPolygonID(), GUITrafficLightLogicWrapper::getPopUpMenu(), NLTriggerBuilder::getPosition(), NLDetectorBuilder::getPositionChecking(), MSBaseVehicle::getPrefixedParameter(), MSCFModel_CC::getRadarMeasurements(), MSLaneChanger::getRealFollower(), MSLaneChanger::getRealLeader(), LIBSUMO_NAMESPACE::Vehicle::getRoadID(), MSLCHelper::getRoundaboutDistBonus(), LIBSUMO_NAMESPACE::Vehicle::getRouteID(), libsumo::Calibrator::getRouteProbeID(), MSBaseVehicle::getRouteValidity(), MSVehicle::getSafeFollowSpeed(), MSAbstractLaneChangeModel::getShadowLane(), MSBaseVehicle::getSingularType(), getSingularType(), LIBSUMO_NAMESPACE::Person::getStage(), MSPerson::MSPersonStage_Walking::getStageSummary(), MSStageTrip::getStageSummary(), MSStageWaiting::getStageSummary(), MSStageDriving::getStageSummary(), MSStageTranship::getStageSummary(), MSDevice_Taxi::getStopLane(), MSNet::getStoppingPlaceID(), MSDevice::getStringParam(), MSLane::getSurroundingVehicles(), MSActuatedTrafficLightLogic::getTarget(), LIBSUMO_NAMESPACE::Person::getTaxiReservations(), MSRailSignal::getTLLinkID(), NIImporter_OpenDrive::getTLSSecure(), MSDevice_ElecHybrid::getTractionSubstationID(), PedestrianEdge< E, L, N, V >::getTravelTime(), MSVehicle::getUpcomingLanesUntil(), MSLane::getUpcomingLinks(), MSDevice_SSM::getUpstreamVehicles(), LIBSUMO_NAMESPACE::Person::getVehicle(), MSPModel_Striping::getVehicleObstacles(), MSDevice_SSM::getVehiclesOnJunction(), MSRailSignalConstraint::getVehID(), MSStageDriving::getWaitingDescription(), MSEdge::getWaitingVehicle(), MSLink::getZipperSpeed(), GNEEdge::GNEEdge(), NBNode::guessCrossings(), RODFDetectorCon::guessEmptyFlows(), NBNodeCont::guessTLs(), GUITLLogicPhasesTrackerWindow::GUITLLogicPhasesTrackerWindow(), MSLane::handleCollisionBetween(), MSRailSignal::hasInsertionConstraint(), MSRailSignal::hasOncomingRailTraffic(), MSBaseVehicle::hasValidRouteStart(), MSVehicle::hasValidRouteStart(), MSBaseVehicle::haveValidStopEdges(), libsumo::POI::highlight(), LIBSUMO_NAMESPACE::Vehicle::highlight(), MSIdling_Stop::idle(), MSIdling_RandomCircling::idle(), MSVehicle::ignoreRed(), MSLCM_LC2013::inform(), MSLCM_SL2015::inform(), MSLCM_SL2015::informFollower(), MSLCM_LC2013::informFollower(), MSLCM_SL2015::informLeader(), MSLCM_LC2013::informLeader(), NBEdge::init(), MSActuatedTrafficLightLogic::init(), MSDelayBasedTrafficLightLogic::init(), MSDeterministicHiLevelTrafficLightLogic::init(), MSRailSignal::init(), MSSOTLTrafficLightLogic::init(), MSSwarmTrafficLightLogic::init(), MSTrafficLightLogic::init(), MSE2Collector::initAuxiliaries(), MESegment::initialise(), MSTrafficLightLogic::initMesoTLSPenalties(), PolygonDynamics::initTrackedPosition(), NIImporter_SUMO::initTrafficLightLogic(), NIXMLTrafficLightsHandler::initTrafficLightLogic(), NBDistrictCont::insert(), NBNodeCont::insert(), NBTrafficLightLogicCont::insert(), MSCFModel_IDM::insertionFollowSpeed(), 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(), MSStageDriving::isWaitingFor(), MESegment::jamThresholdForSpeed(), NBNodeCont::joinSameJunctions(), MSVehicle::joinTrainPartFront(), MSAbstractLaneChangeModel::laneChangeOutput(), MSVehicle::lateralDistanceToLane(), MSE3Collector::leave(), MSE3Collector::leaveFront(), MSVehicle::leaveLane(), MSDevice_BTreceiver::BTreceiverUpdate::leaveRange(), MSPedestrianPushButton::loadCrossingEdgeMap(), NIImporter_OpenDrive::loadNetwork(), MSPedestrianPushButton::loadPushButtons(), ODDistrictCont::makeDistricts(), MSE2Collector::makeMoveNotification(), MSE2Collector::makeVehicleInfo(), MSSOTLE2Sensors::meanVehiclesSpeed(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::moveInDirectionOnLane(), MSPModel_Striping::PState::moveToNextLane(), LIBSUMO_NAMESPACE::Person::moveToXY(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), MSPModel_Striping::PState::moveToXY(), libsumo::Helper::moveToXYMap(), MSDevice_ToC::MRMExecutionStep(), MSChargingStation::MSChargingStation(), MSDevice_Battery::MSDevice_Battery(), MSDevice_ElecHybrid::MSDevice_ElecHybrid(), MSDevice_Taxi::MSDevice_Taxi(), MSDevice_ToC::MSDevice_ToC(), MSE2Collector::MSE2Collector(), MSLCM_LC2013::MSLCM_LC2013(), MSSimpleDriverState::MSSimpleDriverState(), NBLoadedTLDef::myCompute(), NIImporter_SUMO::myEndElement(), MSStateHandler::myStartElement(), MSLaneSpeedTrigger::myStartElement(), MSTriggeredRerouter::myStartElement(), MSPModel_Striping::nextBlocking(), MSDevice_ElecHybrid::notifyEnter(), MSE2Collector::notifyEnter(), MSDevice_Bluelight::notifyEnter(), MSDevice_Example::notifyEnter(), MSDevice_SSM::notifyEnter(), MSDevice_Tripinfo::notifyEnter(), MSMeanData::MeanDataValues::notifyEnter(), MSMeanData::MeanDataValueTracker::notifyEnter(), MSMeanData_Net::MSLaneMeanDataValues::notifyEnter(), MSRailSignalConstraint_Predecessor::PassedTracker::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSE3Collector::MSE3EntryReminder::notifyEnter(), MSE3Collector::MSE3LeaveReminder::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_ElecHybrid::notifyLeave(), MSDevice_Bluelight::notifyLeave(), MSDevice_Example::notifyLeave(), MSDevice_SSM::notifyLeave(), MSDevice_Transportable::notifyLeave(), MSDevice_Tripinfo::notifyLeave(), MSE2Collector::notifyLeave(), MSE3Collector::MSE3EntryReminder::notifyLeave(), MSE3Collector::MSE3LeaveReminder::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_Battery::notifyMove(), MSDevice_Bluelight::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSDevice_BTsender::notifyMove(), MSDevice_Example::notifyMove(), MSDevice_SSM::notifyMove(), MSDevice_Transportable::notifyMove(), MSE2Collector::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSDevice_ToC::notifyMove(), MSE3Collector::MSE3LeaveReminder::notifyMove(), MSE3Collector::MSE3EntryReminder::notifyMove(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), GNETLSEditorFrame::onCmdDefSwitch(), GUIViewTraffic::onGamingClick(), MSVehicle::onRemovalFromNet(), MSLink::opened(), RORouteHandler::openRoute(), MSLane::incoming_lane_priority_sorter::operator()(), MSLane::outgoing_lane_priority_sorter::operator()(), MSEdge::transportable_by_position_sorter::operator()(), NBNetBuilder::by_id_sorter::operator()(), NBNode::nodes_by_id_sorter::operator()(), RODFNet::idComp::operator()(), MSLaneChangerSublane::outputLCStarted(), NIImporter_VISUM::parse_Connectors_legacy(), NIImporter_VISUM::parse_EdgePolys(), NIImporter_VISUM::parse_Lanes(), NIImporter_VISUM::parse_Turns(), NLTriggerBuilder::parseAndBuildCalibrator(), NLTriggerBuilder::parseAndBuildOverheadWireSection(), MSRouteHandler::parseWalkPositions(), NBLoadedSUMOTLDef::patchIfCrossingsAdded(), MSLCM_LC2013::patchSpeed(), MSLCM_SL2015::patchSpeed(), NBLoadedTLDef::SignalGroup::patchTYellow(), MSCFModel_CC::performAutoLaneChange(), MSVehicle::planMove(), MSVehicle::planMoveInternal(), MSLane::planMovements(), PolygonDynamics::PolygonDynamics(), MSInternalJunction::postloadInit(), MSRightOfWayJunction::postloadInit(), MSLCM_SL2015::prepareStep(), MSDevice_Taxi::prepareStop(), MSAbstractLaneChangeModel::primaryLaneChanged(), AGStreet::print(), MSStageDriving::proceed(), MSDevice_SSM::processEncounters(), MSVehicle::processLaneAdvances(), MSVehicle::processLinkApproaches(), MSVehicle::processNextStop(), NIXMLNodesHandler::processNodeType(), TraCIServerAPI_Vehicle::processSet(), MEVehicle::processStop(), MSVehicle::processTraCISpeedControl(), NIXMLNodesHandler::processTrafficLightDefinitions(), MSDelayBasedTrafficLightLogic::proposeProlongation(), NBNodeCont::pruneClusterFringe(), NBNodeCont::pruneSlipLaneNodes(), MSPModel_Striping::PState::PState(), MSOffTrafficLightLogic::rebuildPhase(), NBEdge::recheckLanes(), NBEdgeCont::recheckPostProcessConnections(), NIImporter_OpenStreetMap::reconstructLayerElevation(), NBLoadedSUMOTLDef::reconstructLogic(), MSRailSignalControl::registerProtectedDriveway(), MSLink::removeApproaching(), MSVehicle::removePassedDriveItems(), GNEJunction::removeTLSConnections(), NBNodeCont::rename(), RORouteDef::repairCurrentRoute(), GNEJunction::replaceIncomingConnections(), MSVehicle::replaceParkingArea(), MSBaseVehicle::replaceRouteEdges(), MSVehicle::replaceStop(), NIImporter_DlrNavteq::TrafficlightsHandler::report(), NLEdgeControlBuilder::reportCurrentEdgeOrLane(), MSDevice_SSM::requestsTrajectories(), MSDevice_ToC::requestToC(), MSPerson::reroute(), MSBaseVehicle::reroute(), MSRailSignal::LinkInfo::reroute(), GUIVehicle::rerouteDRTStop(), MSTriggeredRerouter::rerouteParkingArea(), MSVehicle::rerouteParkingArea(), rerouteParkingArea(), MSDevice_ToC::resetDeliberateLCs(), MSLane::resetManeuverReservation(), MSLane::resetPartialOccupation(), LIBSUMO_NAMESPACE::Vehicle::resume(), MSRailSignal::retrieveDriveWay(), NIImporter_OpenDrive::retrieveSignalEdges(), RODFNet::revalidateFlows(), NBRailwayTopologyAnalyzer::reverseEdges(), MSStageWaiting::routeOutput(), MSStageDriving::routeOutput(), MSLane::safeInsertionSpeed(), LIBSUMO_NAMESPACE::RouteProbe::sampleCurrentRouteID(), LIBSUMO_NAMESPACE::RouteProbe::sampleLastRouteID(), RONet::saveAndRemoveRoutesUntil(), ROPerson::Ride::saveAsXML(), ROVehicle::saveAsXML(), MSLCM_SL2015::saveBlockerLength(), MSLCM_LC2013::saveBlockerLength(), MSBaseVehicle::saveState(), MSLane::saveState(), saveState(), MESegment::saveState(), MSDevice::saveState(), MSDevice_Routing::saveState(), MSDevice_Transportable::saveState(), MSDevice_Tripinfo::saveState(), MSDevice_Vehroutes::saveState(), MSTransportableDevice_Routing::saveState(), MSStageDriving::saveState(), MSCalibrator::scheduleRemoval(), GUIVehicle::selectBlockingFoes(), MSE2Collector::selectLanes(), MSVehicle::setAngle(), MSLink::setApproaching(), MSVehicle::setApproachingForAllLinks(), MSStageTrip::setArrived(), NBNodeCont::setAsTLControlled(), MSSimpleDriverState::setAwareness(), MSChargingStation::setChargeDelay(), MSChargingStation::setChargingPower(), NLEdgeControlBuilder::setDefaultStopOffsets(), MSChargingStation::setEfficency(), MSAbstractLaneChangeModel::setManeuverDist(), MSLane::setManeuverReservation(), MSDevice_Battery::setMaximumBatteryCapacity(), NBEdge::setNodeBorder(), MSLCM_SL2015::setOwnState(), MSActuatedTrafficLightLogic::setParameter(), MSDevice_ToC::setParameter(), MSCFModel_CACC::setParameter(), MSCFModel_CC::setParameter(), MSLane::setPartialOccupation(), MSDevice_Battery::setPowerMax(), NBEdgePriorityComputer::setPriorityJunctionPriorities(), libsumo::Helper::setRemoteControlled(), MSLink::setRequestInformation(), LIBSUMO_NAMESPACE::Vehicle::setRoute(), LIBSUMO_NAMESPACE::Vehicle::setRouteID(), MSDevice_Battery::setStoppingTreshold(), NBLoadedSUMOTLDef::setTLControllingInformation(), NBLoadedTLDef::setTLControllingInformation(), NBOwnTLDef::setTLControllingInformation(), NBTrafficLightLogicCont::setTLControllingInformation(), MSStageDriving::setVehicle(), MSOverheadWire::setVoltage(), NBEdge::shiftPositionAtNode(), MSLCM_LC2013::slowDownForBlocked(), MSLCM_SL2015::slowDownForBlocked(), MSLane::sortManeuverReservations(), IntermodalNetwork< E, L, N, V >::splitEdge(), MSLaneChangerSublane::startChangeSublane(), MSStopOut::stopEnded(), MSStopOut::stopStarted(), MSLane::succLinkSec(), MSDevice_ToC::switchHolderType(), GUITrafficLightLogicWrapper::switchTLSLogic(), MELoop::teleportVehicle(), MSDevice_ToC::ToCPreparationStep(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), tripInfoOutput(), MSPerson::MSPersonStage_Access::tripInfoOutput(), METriggeredCalibrator::tryEmit(), MSSOTLTrafficLightLogic::trySwitch(), MSDevice_SSM::update(), MSSimpleDriverState::update(), PolygonDynamics::update(), MSDevice_SSM::updateAndWriteOutput(), MSVehicle::updateBestLanes(), MSLCM_SL2015::updateCFRelated(), MSSOTLTrafficLightLogic::updateCTS(), NLEdgeControlBuilder::updateCurrentLaneStopOffsets(), MSVehicle::updateDriveItems(), MSRailSignal::updateDriveway(), MSLCM_SL2015::updateExpectedSublaneSpeeds(), MSVehicle::updateFurtherLanes(), MSLCM_SL2015::updateGaps(), GNETLSEditorFrame::TLSJunction::updateJunctionDescription(), GNENetHelper::AttributeCarriers::updateJunctionID(), MSSwarmTrafficLightLogic::updatePheromoneLevels(), MSSwarmTrafficLightLogic::updateSensitivities(), MSAbstractLaneChangeModel::updateShadowLane(), MSVehicle::updateState(), MSAbstractLaneChangeModel::updateTargetLane(), MSDevice_BTreceiver::BTreceiverUpdate::updateVisibility(), MSDevice_SSM::useGeoCoords(), NBNodeTypeComputer::validateRailCrossings(), libsumo::Helper::VehicleStateListener::vehicleStateChanged(), TraCIServer::vehicleStateChanged(), MSDynamicShapeUpdater::vehicleStateChanged(), MSLCM_LC2013::wantsChange(), MSLCM_SL2015::wantsChange(), MSLCM_SL2015::wantsChangeSublane(), MSInstantInductLoop::write(), NBParking::write(), MSElecHybridExport::write(), MSFCDExport::write(), MSBatteryExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), 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(), MSTractionSubstation::writeOut(), MSDevice_ToC::writeOutput(), MSNet::writeOutput(), MSDevice_Vehroutes::writeOutput(), MSOverheadWire::writeOverheadWireSegmentOutput(), NWWriter_SUMO::writeRoundabout(), RODFDetectorCon::writeSpeedTrigger(), NWWriter_SUMO::writeTrafficLight(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), MSXMLRawOut::writeTransportable(), RODFDetectorCon::writeValidationDetectors(), MSXMLRawOut::writeVehicle(), MSAmitranTrajectories::writeVehicle(), MSFullExport::writeVehicles(), SUMOPolygon::writeXML(), PointOfInterest::writeXML(), MSE2Collector::writeXMLOutput(), MSInductLoop::writeXMLOutput(), MSRouteProbe::writeXMLOutput(), MSDevice_Transportable::~MSDevice_Transportable(), MSTriggeredRerouter::~MSTriggeredRerouter(), 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 66 of file Named.h.

Referenced by MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), NBRailwayTopologyAnalyzer::assignDirectionPriority(), MSLaneChanger::changeOpposite(), MSVehicle::checkReversal(), MSVehicle::checkRewindLinkLanes(), AStarRouter< E, V >::compute(), DijkstraRouter< E, V >::compute(), 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(), LIBSUMO_NAMESPACE::Person::getLaneID(), MSVehicle::getLatOffset(), MSLane::getLeaderOnConsecutive(), MSLaneChanger::getRealLeader(), GUIVehicle::getShadowLaneID(), GUIVehicle::getTargetLaneID(), MSDevice_SSM::getVehiclesOnJunction(), MSCFModel_IDM::insertionFollowSpeed(), MSLane::isInsertionSuccess(), MESegment::isOpen(), joinNamedToString(), joinNamedToStringSorting(), MSPModel_Striping::PState::moveToNextLane(), LIBSUMO_NAMESPACE::Person::moveToXY(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), MSPModel_Striping::PState::moveToXY(), libsumo::Helper::moveToXYMap(), MSBaseVehicle::reroute(), 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().

◆ getLane()

const MSLane* MSTransportable::getLane ( ) const
inlinevirtual

Returns the current lane (may be nullptr)

Implements SUMOTrafficObject.

Definition at line 161 of file MSTransportable.h.

Referenced by LIBSUMO_NAMESPACE::TrafficLight::getServedPersonCount(), and MSPerson::MSPersonStage_Access::proceed().

Here is the caller graph for this function:

◆ getMaxSpeed()

double MSTransportable::getMaxSpeed ( ) const
virtual

Returns the object's maximum speed.

Returns
The object's maximum speed

Implements SUMOTrafficObject.

Definition at line 382 of file MSTransportable.cpp.

References MSVehicleType::getMaxSpeed(), getSpeedFactor(), and getVehicleType().

Referenced by MSStageTrip::setArrived(), and MSPerson::MSPersonStage_Walking::tripInfoOutput().

Here is the caller graph for this function:

◆ getNextDestination()

const MSEdge* MSTransportable::getNextDestination ( ) const
inline

Returns the destination after the current destination.

Definition at line 151 of file MSTransportable.h.

References myStep.

◆ getNextStage()

MSStage* MSTransportable::getNextStage ( int  next) const
inline

Return the current stage.

Definition at line 216 of file MSTransportable.h.

References myPlan, and myStep.

Referenced by LIBSUMO_NAMESPACE::Person::getStage(), MSPerson::reroute(), LIBSUMO_NAMESPACE::Person::rerouteTraveltime(), and MSStageTrip::setArrived().

Here is the caller graph for this function:

◆ getNumRemainingStages()

int MSTransportable::getNumRemainingStages ( ) const

Return the number of remaining stages (including the current)

Definition at line 157 of file MSTransportable.cpp.

References myPlan, and myStep.

Referenced by LIBSUMO_NAMESPACE::Person::getEdges(), GUIContainer::getParameterWindow(), LIBSUMO_NAMESPACE::Person::getStage(), GUIPerson::getStageIndexDescription(), LIBSUMO_NAMESPACE::Person::moveToXY(), MSDevice_Transportable::notifyMove(), MSStageDriving::proceed(), LIBSUMO_NAMESPACE::Person::removeStage(), LIBSUMO_NAMESPACE::Person::replaceStage(), LIBSUMO_NAMESPACE::Person::rerouteTraveltime(), and MSStageTrip::setArrived().

Here is the caller graph for this function:

◆ getNumStages()

int MSTransportable::getNumStages ( ) const

Return the total number stages in this persons plan.

Definition at line 163 of file MSTransportable.cpp.

References myPlan.

Referenced by LIBSUMO_NAMESPACE::Person::getEdges(), GUIContainer::getParameterWindow(), LIBSUMO_NAMESPACE::Person::getStage(), GUIPerson::getStageIndexDescription(), GUIContainer::GUIContainerPopupMenu::onCmdShowPlan(), GUIPerson::GUIPersonPopupMenu::onCmdShowPlan(), MSStageDriving::proceed(), and MSStageTrip::setArrived().

Here is the caller graph for this function:

◆ getParameter()

const SUMOVehicleParameter& MSTransportable::getParameter ( ) const
inlinevirtual

Returns the vehicle's parameter (including departure definition)

Returns
The vehicle's parameter

Implements SUMOTrafficObject.

Definition at line 128 of file MSTransportable.h.

References myParameter.

Referenced by MSTransportableControl::add(), MSTransportableDevice_Routing::buildDevices(), GUIContainer::getParameterWindow(), GUIPerson::getParameterWindow(), MSTransportableDevice_Routing::MSTransportableDevice_Routing(), MSDevice_Transportable::notifyMove(), MSStageDriving::proceed(), MSStageTrip::setArrived(), GUIContainer::setFunctionalColor(), and GUIPerson::setFunctionalColor().

Here is the caller graph for this function:

◆ getPosition() [1/2]

Position MSTransportable::getPosition ( ) const
virtual

Return the Network coordinate of the transportable.

Reimplemented in GUIPerson, and GUIContainer.

Definition at line 136 of file MSTransportable.cpp.

References MSNet::getCurrentTimeStep(), and MSNet::getInstance().

Referenced by getBoundingBox(), GUIPerson::getGUIPosition(), GUIContainer::getPosition(), GUIPerson::getPosition(), and getPosition().

Here is the caller graph for this function:

◆ getPosition() [2/2]

Position MSTransportable::getPosition ( const double  offset) const
inlinevirtual

Return current position (x/y, cartesian)

If the object is not in the net, Position::INVALID.

Parameters
[in]offsetoptional offset in longitudinal direction
Returns
The current position (in cartesian coordinates)
See also
myLane

Implements SUMOTrafficObject.

Definition at line 102 of file MSTransportable.h.

References getPosition().

Referenced by MSLink::checkWalkingAreaFoe(), LIBSUMO_NAMESPACE::Person::moveToXY(), and MSFCDExport::writeTransportable().

Here is the caller graph for this function:

◆ getPositionOnLane()

double MSTransportable::getPositionOnLane ( ) const
inlinevirtual

Get the object's position along the lane.

Returns
The position of the object (in m from the lane's begin)

Implements SUMOTrafficObject.

Definition at line 94 of file MSTransportable.h.

References getEdgePos().

◆ getPreviousSpeed()

double MSTransportable::getPreviousSpeed ( ) const
inlinevirtual

Returns the object's previous speed.

Returns
The object's previous speed

Implements SUMOTrafficObject.

Definition at line 86 of file MSTransportable.h.

References getSpeed().

◆ getRNG()

std::mt19937 * MSTransportable::getRNG ( ) const
virtual

returns the associated RNG

Implements SUMOTrafficObject.

Definition at line 77 of file MSTransportable.cpp.

References getEdge(), and MSEdge::getLanes().

◆ getSingularType()

MSVehicleType & MSTransportable::getSingularType ( )

Replaces the current vehicle type with a new one used by this vehicle only.

If the currently used vehicle type is already marked as being used by this vehicle only, no new type is created.

Returns
The new modifiable vehicle type
See also
MSTransportable::myVType

Definition at line 255 of file MSTransportable.cpp.

References MSVehicleType::buildSingularType(), MSVehicleType::getID(), Named::getID(), MSVehicleType::isVehicleSpecific(), myVType, and replaceVehicleType().

Referenced by TraCIServerAPI_Person::processSet().

Here is the caller graph for this function:

◆ getSlope()

double MSTransportable::getSlope ( ) const
virtual

Returns the slope of the road at object's position in degrees.

Returns
The slope

Implements SUMOTrafficObject.

Definition at line 369 of file MSTransportable.cpp.

References getEdge(), getEdgePos(), and MSEdge::getLanes().

◆ getSpeed()

double MSTransportable::getSpeed ( ) const
virtual

the current speed of the transportable

Implements SUMOTrafficObject.

Reimplemented in GUIPerson, and GUIContainer.

Definition at line 151 of file MSTransportable.cpp.

Referenced by MSLink::checkWalkingAreaFoe(), getPreviousSpeed(), GUIContainer::getSpeed(), GUIPerson::getSpeed(), and MSFCDExport::writeTransportable().

Here is the caller graph for this function:

◆ getSpeedFactor()

virtual double MSTransportable::getSpeedFactor ( ) const
inlinevirtual

the current speed factor of the transportable (where applicable)

Reimplemented in MSPerson.

Definition at line 186 of file MSTransportable.h.

Referenced by getMaxSpeed(), MSPerson::MSPersonStage_Walking::getMaxSpeed(), and GUIContainer::getParameterWindow().

Here is the caller graph for this function:

◆ getStageSummary()

std::string MSTransportable::getStageSummary ( int  stageIndex) const

return textual summary for the given stage

Definition at line 284 of file MSTransportable.cpp.

References myAmPerson, and myPlan.

Referenced by GUIContainer::GUIContainerPopupMenu::onCmdShowPlan(), and GUIPerson::GUIPersonPopupMenu::onCmdShowPlan().

Here is the caller graph for this function:

◆ getStageType()

MSStageType MSTransportable::getStageType ( int  next) const
inline

the stage type for the nth next stage

Definition at line 196 of file MSTransportable.h.

References myPlan, and myStep.

Referenced by LIBSUMO_NAMESPACE::Person::moveToXY(), MSPerson::Influencer::postProcessRemoteControl(), and LIBSUMO_NAMESPACE::Person::rerouteTraveltime().

Here is the caller graph for this function:

◆ getVClass()

SUMOVehicleClass MSTransportable::getVClass ( ) const
virtual

Returns the object's access class.

Returns
The object's access class

Implements SUMOTrafficObject.

Definition at line 387 of file MSTransportable.cpp.

References MSVehicleType::getVehicleClass(), and getVehicleType().

Referenced by LIBSUMO_NAMESPACE::Person::moveToXY().

Here is the caller graph for this function:

◆ getVehicle()

SUMOVehicle* MSTransportable::getVehicle ( ) const
inline

The vehicle associated with this transportable.

Definition at line 260 of file MSTransportable.h.

◆ getVehicleType()

◆ getWaitingSeconds()

double MSTransportable::getWaitingSeconds ( ) const
virtual

the time this transportable spent waiting in seconds

Reimplemented in GUIPerson, and GUIContainer.

Definition at line 146 of file MSTransportable.cpp.

References MSNet::getCurrentTimeStep(), MSNet::getInstance(), and STEPS2TIME.

Referenced by GUIContainer::getWaitingSeconds(), GUIPerson::getWaitingSeconds(), and MSPedestrianPushButton::isActiveForEdge().

Here is the caller graph for this function:

◆ getWaitingTime()

SUMOTime MSTransportable::getWaitingTime ( ) const
virtual

Implements SUMOTrafficObject.

Definition at line 377 of file MSTransportable.cpp.

References MSNet::getCurrentTimeStep(), and MSNet::getInstance().

◆ hasArrived()

bool MSTransportable::hasArrived ( ) const
virtual

return whether the person has reached the end of its plan

Implements SUMOTrafficObject.

Definition at line 292 of file MSTransportable.cpp.

References myPlan, and myStep.

Referenced by GUIPerson::getDestinationEdgeID(), GUIPerson::getEdgeID(), GUIPerson::getEdgePos(), GUIPerson::getFromEdgeID(), GUIPerson::getGUIAngle(), GUIPerson::getGUIPosition(), GUIPerson::getNaviDegree(), GUIPerson::getPosition(), GUIPerson::getSpeed(), GUIPerson::getStageArrivalPos(), GUIPerson::getStageIndexDescription(), GUIPerson::getWaitingSeconds(), and routeOutput().

Here is the caller graph for this function:

◆ hasDeparted()

bool MSTransportable::hasDeparted ( ) const

return whether the transportable has started it's plan

Definition at line 297 of file MSTransportable.cpp.

References myPlan.

◆ isContainer()

bool MSTransportable::isContainer ( ) const
inlinevirtual

Whether it is a container.

Returns
true for containers, false otherwise

Reimplemented from SUMOTrafficObject.

Definition at line 66 of file MSTransportable.h.

References myAmPerson.

Referenced by routeOutput().

Here is the caller graph for this function:

◆ isPerson()

◆ isStopped()

bool MSTransportable::isStopped ( ) const
inlinevirtual

Returns whether the object is at a stop.

Returns
Whether it has stopped

Implements SUMOTrafficObject.

Definition at line 70 of file MSTransportable.h.

References getCurrentStageType(), and WAITING.

◆ isVehicle()

◆ isWaiting4Vehicle()

bool MSTransportable::isWaiting4Vehicle ( ) const
inline

Whether the transportable waits for a vehicle.

Definition at line 255 of file MSTransportable.h.

Referenced by GUIContainer::drawGL(), GUIContainer::getColorValue(), GUIPerson::getColorValue(), GUIPerson::getGUIAngle(), and GUIPerson::getGUIPosition().

Here is the caller graph for this function:

◆ isWaitingFor()

bool MSTransportable::isWaitingFor ( const SUMOVehicle vehicle) const
inline

Whether the transportable waits for the given vehicle in the current step.

Definition at line 250 of file MSTransportable.h.

Referenced by MSEdge::getWaitingVehicle().

Here is the caller graph for this function:

◆ loadState()

void MSTransportable::loadState ( const std::string &  state)

Reconstructs the current state.

Definition at line 417 of file MSTransportable.cpp.

References myParameter, myPlan, myStep, and SUMOVehicleParameter::parametersSet.

◆ operator=()

MSTransportable& MSTransportable::operator= ( const MSTransportable )
private

Invalidated assignment operator.

◆ proceed()

◆ removeStage()

void MSTransportable::removeStage ( int  next)

removes the nth next stage

Definition at line 217 of file MSTransportable.cpp.

References appendStage(), getEdge(), getEdgePos(), MSNet::getInstance(), myPlan, myStep, and proceed().

Referenced by LIBSUMO_NAMESPACE::Person::moveToXY(), LIBSUMO_NAMESPACE::Person::removeStage(), LIBSUMO_NAMESPACE::Person::replaceStage(), MSPerson::reroute(), and rerouteParkingArea().

Here is the caller graph for this function:

◆ replaceVehicleType()

void MSTransportable::replaceVehicleType ( MSVehicleType type)
virtual

Replaces the current vehicle type by the one given.

If the currently used vehicle type is marked as being used by this vehicle only, it is deleted, first. The new, given type is then assigned to "myVType".

Parameters
[in]typeThe new vehicle type
See also
MSTransportable::myVType

Implements SUMOTrafficObject.

Definition at line 246 of file MSTransportable.cpp.

References MSNet::getInstance(), MSNet::getVehicleControl(), MSVehicleType::isVehicleSpecific(), myVType, and MSVehicleControl::removeVType().

Referenced by getSingularType().

Here is the caller graph for this function:

◆ rerouteParkingArea()

◆ routeOutput()

void MSTransportable::routeOutput ( OutputDevice os,
const bool  withRouteLength 
) const

Called on writing vehroute output.

Parameters
[in]osThe stream to write the information into
Exceptions
IOErrornot yet implemented

Definition at line 182 of file MSTransportable.cpp.

References OutputDevice::closeTag(), DEFAULT_CONTAINERTYPE_ID, DEFAULT_PEDTYPE_ID, MSVehicleType::getID(), MSNet::getInstance(), OptionsCont::getOptions(), getVehicleType(), hasArrived(), isContainer(), isPerson(), OutputDevice::lf(), myAmPerson, myParameter, myPlan, MSStage::routeOutput(), SUMO_TAG_CONTAINER, SUMO_TAG_PERSON, time2string(), SUMOVehicleParameter::write(), and OutputDevice::writeAttr().

Referenced by MSTransportableControl::erase().

Here is the caller graph for this function:

◆ saveState()

◆ setDeparted()

void MSTransportable::setDeparted ( SUMOTime  now)

logs depart time of the current stage

Definition at line 126 of file MSTransportable.cpp.

◆ setID()

void MSTransportable::setID ( const std::string &  newID)
virtual

set the id (inherited from Named but forbidden for transportables)

Reimplemented from Named.

Definition at line 116 of file MSTransportable.cpp.

◆ setSpeed()

void MSTransportable::setSpeed ( double  speed)

sets the walking speed (ignored in other stages)

Definition at line 238 of file MSTransportable.cpp.

References myPlan.

◆ tripInfoOutput()

void MSTransportable::tripInfoOutput ( OutputDevice os) const

Called on writing tripinfo output.

Parameters
[in]osThe stream to write the information into
Exceptions
IOErrornot yet implemented

Definition at line 169 of file MSTransportable.cpp.

References OutputDevice::closeTag(), getDesiredDepart(), Named::getID(), getVehicleType(), isPerson(), myPlan, OutputDevice::openTag(), time2string(), and OutputDevice::writeAttr().

Referenced by MSTransportableControl::erase().

Here is the caller graph for this function:

Field Documentation

◆ myAmPerson

const bool MSTransportable::myAmPerson
private

◆ myDevices

std::vector<MSTransportableDevice*> MSTransportable::myDevices
protected

The devices this transportable has.

Definition at line 352 of file MSTransportable.h.

Referenced by getDevice(), getDevices(), MSTransportable(), and ~MSTransportable().

◆ myID

◆ myParameter

const SUMOVehicleParameter* MSTransportable::myParameter
protected

the plan of the transportable

Definition at line 336 of file MSTransportable.h.

Referenced by getDesiredDepart(), getParameter(), loadState(), routeOutput(), saveState(), and ~MSTransportable().

◆ myPlan

◆ myStep

◆ myVType

MSVehicleType* MSTransportable::myVType
protected

This transportable's type. (mainly used for drawing related information Note sure if it is really necessary.

Definition at line 340 of file MSTransportable.h.

Referenced by getSingularType(), GUIContainer::getTypeParameterWindow(), GUIPerson::getTypeParameterWindow(), getVehicleType(), replaceVehicleType(), and ~MSTransportable().

◆ myWriteEvents

bool MSTransportable::myWriteEvents
protected

Whether events shall be written.

Definition at line 343 of file MSTransportable.h.


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