![]() |
Eclipse SUMO - Simulation of Urban MObility
|
Representation of a vehicle, person, or container. More...
#include <SUMOTrafficObject.h>
Public Member Functions | |
void | addTo (const StoringVisitor &cont) const |
Adds this object to the given container. More... | |
virtual double | getAcceleration () const =0 |
Returns the object's acceleration. More... | |
virtual double | getAngle () const =0 |
Returns the object's angle in degrees. More... | |
virtual double | getBackPositionOnLane (const MSLane *lane) const =0 |
Get the object's back position along the given lane. More... | |
virtual double | getChosenSpeedFactor () const =0 |
virtual const MSEdge * | getEdge () const =0 |
Returns the edge the object is currently at. More... | |
const std::string & | getID () const |
Returns the id. More... | |
virtual const MSLane * | getLane () const =0 |
Returns the lane the object is currently at. More... | |
virtual double | getMaxSpeed () const =0 |
Returns the object's maximum speed. More... | |
virtual const SUMOVehicleParameter & | getParameter () const =0 |
Returns the vehicle's parameter (including departure definition) More... | |
virtual Position | getPosition (const double offset=0) const =0 |
Return current position (x/y, cartesian) More... | |
virtual double | getPositionOnLane () const =0 |
Get the object's position along the lane. More... | |
virtual double | getPreviousSpeed () const =0 |
Returns the object's previous speed. More... | |
virtual std::mt19937 * | getRNG () const =0 |
Returns the associated RNG for this object. More... | |
virtual double | getSlope () const =0 |
Returns the slope of the road at object's position in degrees. More... | |
virtual double | getSpeed () const =0 |
Returns the object's current speed. More... | |
virtual SUMOVehicleClass | getVClass () const =0 |
Returns the object's access class. More... | |
virtual const MSVehicleType & | getVehicleType () const =0 |
Returns the object's "vehicle" type. More... | |
virtual SUMOTime | getWaitingTime () const =0 |
virtual bool | hasArrived () const =0 |
Returns whether this object has arrived. More... | |
virtual bool | isContainer () const |
Whether it is a container. More... | |
virtual bool | isPerson () const |
Whether it is a person. More... | |
virtual bool | isStopped () const =0 |
Returns whether the object is at a stop. More... | |
virtual bool | isVehicle () const |
Whether it is a vehicle. More... | |
virtual void | replaceVehicleType (MSVehicleType *type)=0 |
Replaces the current vehicle type by the one given. More... | |
virtual void | setID (const std::string &newID) |
resets the id More... | |
SUMOTrafficObject (const std::string &id) | |
Constructor. More... | |
virtual | ~SUMOTrafficObject () |
Destructor. 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::string | myID |
The name of the object. More... | |
Representation of a vehicle, person, or container.
Definition at line 46 of file SUMOTrafficObject.h.
|
inline |
Constructor.
Definition at line 50 of file SUMOTrafficObject.h.
|
inlinevirtual |
Destructor.
Definition at line 53 of file SUMOTrafficObject.h.
|
inlineinherited |
Adds this object to the given container.
[in,filled] | cont The container to add this item to |
Definition at line 117 of file Named.h.
References Named::StoringVisitor::add().
|
pure virtual |
Returns the object's acceleration.
Implemented in MSTransportable, MSVehicle, and MSBaseVehicle.
Referenced by MSE2Collector::makeMoveNotification(), MSDevice_Battery::notifyMove(), MSDevice_Emissions::notifyMove(), MSDevice_Emissions::notifyMoveInternal(), MSMeanData_Harmonoise::MSLaneMeanDataValues::notifyMoveInternal(), MSMeanData_Emissions::MSLaneMeanDataValues::notifyMoveInternal(), MSElecHybridExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), MSAmitranTrajectories::writeVehicle(), and MSFullExport::writeVehicles().
|
pure virtual |
Returns the object's angle in degrees.
Implemented in SUMOVehicle, MSTransportable, MSVehicle, MEVehicle, GUIMEVehicle, GUIVehicle, and GUIContainer.
Referenced by PolygonDynamics::initTrackedPosition(), and PolygonDynamics::update().
|
pure virtual |
Get the object's back position along the given lane.
Implemented in MSVehicle, MEVehicle, and MSTransportable.
Referenced by MSE2Collector::notifyEnter(), MSE3Collector::MSE3EntryReminder::notifyEnter(), MSE3Collector::MSE3LeaveReminder::notifyEnter(), and MSInductLoop::notifyEnter().
|
pure virtual |
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSDevice_Tripinfo::generateOutput(), MSLane::getVehicleMaxSpeed(), MSRoutingEngine::initRouter(), MSEdge::validateDepartSpeed(), and MSVehicleControl::vehicleDeparted().
|
pure virtual |
Returns the edge the object is currently at.
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSStageDriving::abort(), MSDevice_Vehroutes::addRoute(), MSInsertionControl::checkCandidates(), MSDispatch::computePickupTime(), libsumo::Helper::debugPrint(), MSDevice_Taxi::dispatchShared(), MSDevice_SSM::findFoeConflictLane(), MSDevice_Tripinfo::generateOutput(), MSStageDriving::getEdge(), MSVehicleControl::getVehicleMeanSpeeds(), MSDevice_ElecHybrid::notifyEnter(), MSDevice_Bluelight::notifyEnter(), MSDevice_Example::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_ElecHybrid::notifyLeave(), MSDevice_Bluelight::notifyLeave(), MSDevice_Example::notifyLeave(), MSDevice_Transportable::notifyLeave(), MSDevice_Tripinfo::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_Vehroutes::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSDevice_BTsender::notifyMove(), MSDevice_Transportable::notifyMove(), MSDevice_Tripinfo::notifyMoveInternal(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), MSTriggeredRerouter::rerouteParkingArea(), MSStopOut::stopEnded(), MSStopOut::stopStarted(), MSInsertionControl::tryInsert(), MSFCDExport::write(), and MSEmissionExport::write().
|
inlineinherited |
Returns the 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(), MSTransportable::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(), MSTransportable::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(), MSTransportable::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(), MSTransportable::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(), MSTransportable::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().
|
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().
|
pure virtual |
Returns the lane the object is currently at.
Implemented in MSTransportable, MSVehicle, and MEVehicle.
Referenced by MSStageDriving::abort(), MSBaseVehicle::addStop(), libsumo::Helper::applySubscriptionFilters(), MSE2Collector::calculateTimeLossAndTimeOnDetector(), LIBSUMO_NAMESPACE::Vehicle::getDrivingDistance(), MSStageDriving::getEdge(), MSStoppingPlace::getLastFreePos(), MSParkingArea::getLastFreePosWithReservation(), MSBaseVehicle::getRNG(), MSBaseVehicle::getRNGIndex(), MSBaseVehicle::haveValidStopEdges(), LIBSUMO_NAMESPACE::Vehicle::isOnInit(), MSE2Collector::notifyEnter(), MSDevice_SSM::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSDevice_SSM::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_Battery::notifyMove(), MSDevice_ToC::notifyMove(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), LIBSUMO_NAMESPACE::Vehicle::remove(), MSBaseVehicle::replaceRoute(), MSDevice_ToC::requestToC(), MSBaseVehicle::reroute(), LIBSUMO_NAMESPACE::Vehicle::setRoute(), LIBSUMO_NAMESPACE::Vehicle::setRouteID(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), MSElecHybridExport::write(), MSFCDExport::write(), and MSElecHybridExport::writeAggregated().
|
pure virtual |
Returns the object's maximum speed.
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSEdge::getTravelTimeAggregated(), and MSLane::getVehicleMaxSpeed().
|
pure virtual |
Returns the vehicle's parameter (including departure definition)
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSVehicleContainer::add(), MSVehicleControl::addVehicle(), MSDevice_Battery::buildVehicleDevices(), MSDevice_ElecHybrid::buildVehicleDevices(), MSDevice_Example::buildVehicleDevices(), MSDevice_Routing::buildVehicleDevices(), MSDevice_Taxi::buildVehicleDevices(), MSDevice_Vehroutes::buildVehicleDevices(), MSRouteHandler::closeVehicle(), MSRailSignal::constraintsAllow(), MSDevice_Tripinfo::generateOutputForUnfinished(), MSDevice_SSM::getDetectionRange(), MSDevice_SSM::getExtraTime(), MSDevice_SSM::getMeasuresAndThresholds(), MSDevice_ToC::getOutputFilename(), MSDevice_SSM::getOutputFilename(), MSDevice::getStringParam(), MSRailSignalConstraint::getVehID(), MSTriggeredRerouter::getWeight(), MSEdge::insertVehicle(), MSStageDriving::isWaitingFor(), MSDevice_Routing::MSDevice_Routing(), MSDevice_Taxi::MSDevice_Taxi(), MSDevice_Vehroutes::notifyEnter(), MSRailSignalConstraint_Predecessor::PassedTracker::notifyEnter(), MSCalibrator::VehicleRemover::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSDevice_Routing::preInsertionReroute(), MSStageDriving::proceed(), MSVehicleContainer::remove(), MSDevice_SSM::requestsTrajectories(), MSStageDriving::setVehicle(), MSDevice_ToC::setVehicleColor(), MSInsertionControl::tryInsert(), MSDevice_SSM::useGeoCoords(), MSEdge::validateDepartSpeed(), MSVehicleControl::vehicleDeparted(), and MSDevice_Vehroutes::writeOutput().
|
pure virtual |
Return current position (x/y, cartesian)
If the object is not in the net, Position::INVALID.
[in] | offset | optional offset in longitudinal direction |
Implemented in MSTransportable, MSVehicle, MEVehicle, GUIMEVehicle, and GUIVehicle.
Referenced by libsumo::Helper::applySubscriptionFilterFieldOfVision(), libsumo::Helper::applySubscriptionFilterLateralDistanceSinglePass(), MSVTypeProbe::execute(), LIBSUMO_NAMESPACE::Vehicle::getPosition(), MSStageDriving::getPosition(), LIBSUMO_NAMESPACE::Vehicle::highlight(), PolygonDynamics::initTrackedPosition(), LIBSUMO_NAMESPACE::Vehicle::moveTo(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_Bluelight::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSDevice_BTsender::notifyMove(), MSDevice_ToC::notifyMove(), MSDevice_ToC::requestToC(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), PolygonDynamics::update(), MSElecHybridExport::write(), MSFCDExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), and MSFullExport::writeVehicles().
|
pure virtual |
Get the object's position along the lane.
Implemented in MSTransportable, MSVehicle, and MEVehicle.
Referenced by MSBaseVehicle::addStop(), MSDispatch::computePickupTime(), MSDevice_Taxi::dispatchShared(), MSParkingArea::enter(), MSStoppingPlace::enter(), MSVTypeProbe::execute(), MSDevice_Tripinfo::generateOutput(), LIBSUMO_NAMESPACE::Vehicle::getDrivingDistance(), LIBSUMO_NAMESPACE::Vehicle::getDrivingDistance2D(), MSStageDriving::getEdgePos(), LIBSUMO_NAMESPACE::Vehicle::getLanePosition(), MSStoppingPlace::getLastFreePos(), MSBaseVehicle::getOdometer(), MSBaseVehicle::haveValidStopEdges(), MSE2Collector::makeVehicleInfo(), MSDevice_Tripinfo::notifyEnter(), MSDevice_Vehroutes::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSInductLoop::notifyEnter(), MSDevice_Tripinfo::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_Battery::notifyMove(), MSDevice_ToC::notifyMove(), MSDevice_Battery::notifyParking(), MSBaseVehicle::onDepart(), MSOverheadWire::vehicle_position_sorter::operator()(), MSBaseVehicle::replaceRoute(), MSDevice_ToC::requestToC(), MSBaseVehicle::reroute(), MSTriggeredRerouter::rerouteParkingArea(), MSStageDriving::setArrived(), MSStopOut::stopEnded(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), MSElecHybridExport::write(), MSFCDExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), MSXMLRawOut::writeVehicle(), and MSFullExport::writeVehicles().
|
pure virtual |
Returns the object's previous speed.
Implemented in MSTransportable, MSVehicle, and MSBaseVehicle.
Referenced by MSE2Collector::calculateTimeLossAndTimeOnDetector(), MSInductLoop::notifyMove(), MSInstantInductLoop::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSE3Collector::MSE3LeaveReminder::notifyMove(), and MSE3Collector::MSE3EntryReminder::notifyMove().
|
pure virtual |
Returns the associated RNG for this object.
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSLink::blockedAtTime(), and MSTriggeredRerouter::notifyEnter().
|
pure virtual |
Returns the slope of the road at object's position in degrees.
Implemented in MSTransportable, MSVehicle, and MEVehicle.
Referenced by MSDevice_ElecHybrid::acceleration(), MSDevice_ElecHybrid::consumption(), MSBaseVehicle::getCO2Emissions(), MSBaseVehicle::getCOEmissions(), MSBaseVehicle::getElectricityConsumption(), MSBaseVehicle::getFuelConsumption(), MSBaseVehicle::getHCEmissions(), MSBaseVehicle::getNOxEmissions(), MSBaseVehicle::getPMxEmissions(), LIBSUMO_NAMESPACE::Vehicle::getSlope(), MSDevice_Battery::notifyMove(), MSDevice_Emissions::notifyMove(), MSDevice_Emissions::notifyMoveInternal(), MSMeanData_Emissions::MSLaneMeanDataValues::notifyMoveInternal(), MSElecHybridExport::write(), MSFCDExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), and MSFullExport::writeVehicles().
|
pure virtual |
Returns the object's current speed.
Implemented in MSTransportable, MSVehicle, MEVehicle, GUIPerson, and GUIContainer.
Referenced by MSChargingStation::addChargeValueForOutput(), MSE2Collector::calculateTimeLossAndTimeOnDetector(), MSInductLoop::collectVehiclesOnDet(), MSE3Collector::detectorUpdate(), GUIBaseVehicle::drawOnPos(), MSE3Collector::enter(), MSVTypeProbe::execute(), MSVehicle::Influencer::gapControlSpeed(), MSBaseVehicle::getCO2Emissions(), MSBaseVehicle::getCOEmissions(), MSRailSignal::LinkInfo::getDriveWay(), MSBaseVehicle::getElectricityConsumption(), MSBaseVehicle::getFuelConsumption(), MSVehicleControl::getHaltingVehicleNo(), MSBaseVehicle::getHarmonoise_NoiseEmissions(), MSBaseVehicle::getHCEmissions(), MSStoppingPlace::getLastFreePos(), MSBaseVehicle::getNOxEmissions(), MSBaseVehicle::getPMxEmissions(), MSCFModel_CC::getRadarMeasurements(), MSStageDriving::getSpeed(), LIBSUMO_NAMESPACE::Vehicle::getSpeed(), LIBSUMO_NAMESPACE::Vehicle::getSpeedWithoutTraCI(), MSVehicleControl::getVehicleMeanSpeeds(), MSRailSignal::hasOncomingRailTraffic(), MSE3Collector::leave(), MSDevice_Tripinfo::notifyEnter(), MSDevice_Vehroutes::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_Tripinfo::notifyLeave(), MSInstantInductLoop::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_Battery::notifyMove(), MSDevice_Bluelight::notifyMove(), MSDevice_Battery::notifyParking(), MSLink::setApproaching(), MSElecHybridExport::write(), MSFCDExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), MSXMLRawOut::writeVehicle(), MSAmitranTrajectories::writeVehicle(), and MSFullExport::writeVehicles().
|
pure virtual |
Returns the object's access class.
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSVehicleControl::addVehicle(), MSDevice_Taxi::buildVehicleDevices(), MSDevice_Taxi::dispatchShared(), LIBSUMO_NAMESPACE::Simulation::findRoute(), MSRoutingEngine::getEffortExtra(), MSDevice_Taxi::getStopLane(), MSLane::getVehicleMaxSpeed(), MSRoutingEngine::initRouter(), MSDevice_Routing::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSEdge::prohibits(), MSDevice_Routing::reroute(), MSRoutingEngine::reroute(), MSStageDriving::setVehicle(), MSVehicleControl::vehicleDeparted(), and MSRailSignalControl::vehicleStateChanged().
|
pure virtual |
Returns the object's "vehicle" type.
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSChargingStation::addChargeValueForOutput(), MSOverheadWire::addChargeValueForOutput(), MSLink::blockedAtTime(), MSLink::blockedByFoe(), MSTransportableControl::boardAnyWaiting(), MSDevice_Battery::buildVehicleDevices(), MSDevice_ElecHybrid::buildVehicleDevices(), MSDevice_Example::buildVehicleDevices(), MSDevice_Taxi::buildVehicleDevices(), MSDevice_SSM::computeGlobalMeasures(), MSDispatch_GreedyShared::dispatch(), MSDispatch_RouteExtension::dispatch(), MSParkingArea::enter(), MSStoppingPlace::enter(), MSVTypeProbe::execute(), MSStoppingPlace::fits(), MSDevice_Tripinfo::generateOutput(), MSDevice_SSM::getDetectionRange(), MSDevice_SSM::getExtraTime(), MSParkingArea::getLastFreePos(), MSStoppingPlace::getLastFreePos(), MSParkingArea::getLastFreePosWithReservation(), MSDevice_SSM::getMeasuresAndThresholds(), MSDevice_ToC::getOutputFilename(), MSDevice_SSM::getOutputFilename(), MSDevice::getStringParam(), MSTriggeredRerouter::getWeight(), MSEdge::insertVehicle(), MSTransportableControl::loadAnyWaiting(), MSE2Collector::makeVehicleInfo(), MSDevice_ToC::MSDevice_ToC(), MSMeanData_Amitran::MSLaneMeanDataValues::notifyEnter(), MSCalibrator::VehicleRemover::notifyEnter(), MSE3Collector::MSE3EntryReminder::notifyEnter(), MSDevice_Emissions::notifyIdle(), MSMeanData_Emissions::MSLaneMeanDataValues::notifyIdle(), MSDevice_Bluelight::notifyMove(), MSDevice_Emissions::notifyMove(), MSE2Collector::notifyMove(), MSInductLoop::notifyMove(), MSInstantInductLoop::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSE3Collector::MSE3LeaveReminder::notifyMove(), MSDevice_Emissions::notifyMoveInternal(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), MSMeanData_Harmonoise::MSLaneMeanDataValues::notifyMoveInternal(), MSMeanData_Amitran::MSLaneMeanDataValues::notifyMoveInternal(), MSMeanData_Emissions::MSLaneMeanDataValues::notifyMoveInternal(), MSDevice_Taxi::prepareStop(), MSDevice_SSM::requestsTrajectories(), MSLink::setApproaching(), MSStageDriving::setVehicle(), MSStopOut::stopEnded(), MSLane::succLinkSec(), MSDevice_SSM::useGeoCoords(), MSEdge::validateDepartSpeed(), MSDetectorFileOutput::vehicleApplies(), MSTriggeredRerouter::vehicleApplies(), MSVehicleControl::vehicleDeparted(), MSInstantInductLoop::write(), MSFCDExport::write(), MSEmissionExport::write(), MSElecHybridExport::writeAggregated(), MSDevice_Vehroutes::writeOutput(), MSAmitranTrajectories::writeVehicle(), and MSFullExport::writeVehicles().
|
pure virtual |
Implemented in MSTransportable, MSVehicle, and MEVehicle.
Referenced by MSBaseVehicle::getImpatience(), MSTriggeredRerouter::notifyEnter(), MSDevice_Bluelight::notifyMove(), and MSDevice_Tripinfo::notifyMoveInternal().
|
pure virtual |
Returns whether this object has arrived.
Implemented in MSTransportable, MSVehicle, MSBaseVehicle, and MEVehicle.
Referenced by MSMeanData::MeanDataValues::notifyMove().
|
inlinevirtual |
Whether it is a container.
Reimplemented in MSTransportable.
Definition at line 72 of file SUMOTrafficObject.h.
|
inlinevirtual |
Whether it is a person.
Reimplemented in MSTransportable.
Definition at line 65 of file SUMOTrafficObject.h.
|
pure virtual |
Returns whether the object is at a stop.
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSVehicleControl::getVehicleMeanSpeeds(), MSDevice_Taxi::notifyMove(), MSDevice_Transportable::notifyMove(), MSDevice_Tripinfo::notifyMove(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), and MSDevice_Transportable::removeTransportable().
|
inlinevirtual |
Whether it is a vehicle.
Reimplemented in MSBaseVehicle.
Definition at line 58 of file SUMOTrafficObject.h.
Referenced by libsumo::Helper::debugPrint(), MSDevice_ElecHybrid::notifyEnter(), MSE2Collector::notifyEnter(), MSDevice_SSM::notifyEnter(), MSMeanData_Net::MSLaneMeanDataValues::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSDevice_Tripinfo::notifyIdle(), MSMeanData_Emissions::MSLaneMeanDataValues::notifyIdle(), MSDevice_ElecHybrid::notifyLeave(), MSDevice_SSM::notifyLeave(), MSE2Collector::notifyLeave(), MSMeanData_Net::MSLaneMeanDataValues::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_Battery::notifyMove(), MSDevice_Example::notifyMove(), MSE2Collector::notifyMove(), MSMeanData_Emissions::MSLaneMeanDataValues::notifyMoveInternal(), and MSDetectorFileOutput::vehicleApplies().
|
pure virtual |
Replaces the current vehicle type by the one given.
If the currently used vehicle type is marked as being used by this object only, it is deleted, first. The new, given type is then assigned to "myVType".
[in] | type | The new vehicle type |
Implemented in MSTransportable, and MSBaseVehicle.
Referenced by MSCalibrator::VehicleRemover::notifyEnter().
|
inlinevirtualinherited |
resets the id
[in] | newID | The new id of this object |
Reimplemented in MSTransportable, and MSBaseVehicle.
Definition at line 81 of file Named.h.
References Named::myID.
Referenced by Distribution_Parameterized::parse(), NBLoadedSUMOTLDef::reconstructLogic(), NBEdgeCont::rename(), NBNodeCont::rename(), GNEJunction::setAttribute(), and IntermodalNetwork< E, L, N, V >::splitEdge().
|
protectedinherited |
The name of the object.
Definition at line 124 of file Named.h.
Referenced by MSE2Collector::addDetectorToLanes(), RODFDetector::buildDestinationDistribution(), NGEdge::buildNBEdge(), NGNode::buildNBNode(), MSSOTLTrafficLightLogic::checkPhases(), NBNode::computeNodeShape(), MSE2Collector::detectorUpdate(), GNEPOI::getAttribute(), GNEPoly::getAttribute(), MSLane::getCanonicalPredecessorLane(), MSLane::getCanonicalSuccessorLane(), Named::getID(), NBEdge::getLaneID(), ROEdge::getStoredEffort(), MSLane::getSurroundingVehicles(), ROEdge::getTravelTime(), NBEdge::init(), MSActuatedTrafficLightLogic::init(), MSDelayBasedTrafficLightLogic::init(), MSSOTLTrafficLightLogic::init(), MSLane::isInsertionSuccess(), NBNode::NBNode(), MSE2Collector::notifyEnter(), MSE2Collector::notifyLeave(), MSE2Collector::notifyMove(), MSMeanData::openInterval(), RORouteDef::preComputeCurrentRoute(), NBEdge::reinitNodes(), MSRoute::release(), GNEPOI::setAttribute(), GNEPoly::setAttribute(), Named::setID(), MSSOTLTrafficLightLogic::setToATargetPhase(), Distribution_Parameterized::toStr(), MSChargingStation::writeChargingStationOutput(), RODFDetector::writeEmitterDefinition(), MSOverheadWire::writeOverheadWireSegmentOutput(), RODFDetector::writeSingleSpeedTrigger(), MEInductLoop::writeXMLOutput(), and MSE3Collector::writeXMLOutput().