Eclipse SUMO - Simulation of Urban MObility
StdDefs.h File Reference
#include <config.h>
#include <string>
#include <cmath>
#include <limits>
Include dependency graph for StdDefs.h:

Go to the source code of this file.

Macros

#define DEBUGOUT(cond, msg)   if (cond) {std::ostringstream oss; oss << msg; std::cout << oss.str();}
 
#define FALLTHROUGH   /* do nothing */
 
#define SUMO_MAX_CONNECTIONS   256
 the maximum number of connections across an intersection More...
 
#define UNUSED_PARAMETER(x)   ((void)(x))
 

Typedefs

typedef std::pair< int, double > MMVersion
 (M)ajor/(M)inor version for written networks and default version for loading More...
 

Functions

int getScalingQuota (double frac, int loaded)
 Returns the number of instances of the current object that shall be emitted given the number of loaded objects considering that "frac" of all objects shall be emitted overall. More...
 
template<typename T >
MAX2 (T a, T b)
 
template<typename T >
MAX3 (T a, T b, T c)
 
template<typename T >
MAX4 (T a, T b, T c, T d)
 
template<typename T >
MIN2 (T a, T b)
 
template<typename T >
MIN3 (T a, T b, T c)
 
template<typename T >
MIN4 (T a, T b, T c, T d)
 
const MMVersion NETWORK_VERSION (1, 20)
 
double roundBits (double x, int fractionBits)
 round to the given number of mantissa bits beyond the given number More...
 
double roundDecimal (double x, int precision)
 round to the given number of decimal digits More...
 
double truncate (double x, int fractionBits)
 discrds mantissa bits beyond the given number More...
 

Variables

bool gDebugFlag1
 global utility flags for debugging More...
 
bool gDebugFlag2
 
bool gDebugFlag3
 
bool gDebugFlag4
 
bool gDebugFlag5
 
bool gDebugFlag6
 
bool gHumanReadableTime
 
std::string gLanguage
 the language for GUI elements and messages More...
 
int gPrecision
 the precision for floating point outputs More...
 
int gPrecisionGeo
 
int gPrecisionRandom
 
bool gSimulation
 
double gWeightsRandomFactor
 
double gWeightsWalkOppositeFactor
 
const double INVALID_DOUBLE = std::numeric_limits<double>::max()
 invalid double More...
 
const int INVALID_INT = std::numeric_limits<int>::max()
 invalid int More...
 
const double SUMO_const_halfLaneWidth = SUMO_const_laneWidth / 2
 
const double SUMO_const_haltingSpeed = (double) 0.1
 the speed threshold at which vehicles are considered as halting More...
 
const double SUMO_const_laneMarkWidth = 0.1
 
const double SUMO_const_laneWidth = 3.2
 
const double SUMO_const_quarterLaneWidth = SUMO_const_laneWidth / 4
 
const double SUMO_const_waitingContainerDepth = 6.2
 
const double SUMO_const_waitingContainerWidth = 2.5
 
const double SUMO_const_waitingPersonDepth = 0.67
 
const double SUMO_const_waitingPersonWidth = 0.8
 

Detailed Description

Author
Daniel Krajzewicz
Laura Bieker
Michael Behrisch
Jakob Erdmann
Date
Fri, 29.04.2005

Definition in file StdDefs.h.

Macro Definition Documentation

◆ DEBUGOUT

#define DEBUGOUT (   cond,
  msg 
)    if (cond) {std::ostringstream oss; oss << msg; std::cout << oss.str();}

Definition at line 137 of file StdDefs.h.

◆ FALLTHROUGH

#define FALLTHROUGH   /* do nothing */

Definition at line 35 of file StdDefs.h.

◆ SUMO_MAX_CONNECTIONS

#define SUMO_MAX_CONNECTIONS   256

the maximum number of connections across an intersection

Definition at line 41 of file StdDefs.h.

◆ UNUSED_PARAMETER

#define UNUSED_PARAMETER (   x)    ((void)(x))

Definition at line 30 of file StdDefs.h.

Typedef Documentation

◆ MMVersion

typedef std::pair<int, double> MMVersion

(M)ajor/(M)inor version for written networks and default version for loading

Definition at line 67 of file StdDefs.h.

Function Documentation

◆ getScalingQuota()

int getScalingQuota ( double  frac,
int  loaded 
)

Returns the number of instances of the current object that shall be emitted given the number of loaded objects considering that "frac" of all objects shall be emitted overall.

Returns
the number of objects to create (something between 0 and ceil(frac))

Definition at line 59 of file StdDefs.cpp.

Referenced by MSVehicleControl::getQuota(), and ROMARouteHandler::myEndElement().

Here is the caller graph for this function:

◆ MAX2()

template<typename T >
T MAX2 ( a,
b 
)
inline

Definition at line 82 of file StdDefs.h.

Referenced by MSRoutingEngine::_initEdgeWeights(), MSLCM_LC2013::_patchSpeed(), MSLCM_SL2015::_patchSpeed(), MSCFModel_EIDM::_v(), MSCFModel_ACC::_v(), MSCFModel_IDM::_v(), MSCFModel_CACC::_v(), MSCFModel_CC::_v(), MSCFModel_Kerner::_v(), MSCFModel_Wiedemann::_v(), MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), HelpersEnergy::acceleration(), MSCFModel_ACC::accelGapControl(), MSVehicle::adaptToJunctionLeader(), MSVehicle::adaptToLeaders(), MSVehicle::adaptToOncomingLeader(), MSPModel_Striping::addCrossingVehs(), NBNode::addedLanesRight(), MSLane::addLeaders(), GUIParkingArea::addLotEntry(), MSLaneChangerSublane::addOutsideLeaders(), MSTriggeredRerouter::addParkValues(), PublicTransportEdge< E, L, N, V >::addSchedule(), GUILane::addSecondaryShape(), MSRouteHandler::addStop(), MSE2Collector::aggregateOutputValues(), MSLCM_LC2013::anticipateFollowSpeed(), libsumo::Helper::applySubscriptionFilterLanes(), libsumo::Helper::applySubscriptionFilterLateralDistance(), libsumo::Helper::applySubscriptionFilters(), MSCFModel_Wiedemann::approaching(), NBEdge::assignInternalLaneLength(), AStarRouter< E, V >::AStarRouter(), IDSupplier::avoid(), MSLaneChanger::avoidDeadlock(), MSBaseVehicle::basePos(), SUMOVehicleParserHelper::beginVTypeParsing(), NBNode::bezierControlPoints(), MSCFModel_EIDM::brakeGap(), NIVisumTL::build(), GNEViewNet::buildColorRainbow(), GUIViewTraffic::buildColorRainbow(), RODFNet::buildEdgeFlowMap(), NBNode::buildInnerEdges(), NBEdge::buildInnerEdges(), GNETLSEditorFrame::buildInternalLanes(), buildNetwork(), libsumo::Helper::buildStopParameters(), MSDevice_Routing::buildVehicleDevices(), MSDevice_Taxi::buildVehicleDevices(), NBNode::buildWalkingAreas(), MSBaseVehicle::calculateArrivalParams(), GawronCalculator< R, E, V >::calculateProbabilities(), MSE2Collector::calculateTimeLossAndTimeOnDetector(), NEMAPhase::calcVehicleExtension(), RGBColor::changedAlpha(), RGBColor::changedBrightness(), MSLaneChanger::changeOpposite(), MELoop::changeSegment(), MSPerson::checkAccess(), MSLCM_SL2015::checkBlocking(), MSLCM_SL2015::checkBlockingVehicles(), GUIVisualizationSettings::checkBoundarySizeDrawing(), MELoop::checkCar(), MSLaneChanger::checkChange(), NBOwnTLDef::checkCustomCrossingIndices(), GUIPolygon::checkDraw(), MSDevice_ToC::checkDynamicToC(), NBEdgeCont::checkGrade(), MSVehicle::checkLinkLeader(), MSLaneChanger::checkOppositeStop(), MSFrame::checkOptions(), MSE2Collector::checkPositioning(), MSVehicle::checkReversal(), MEVehicle::checkStop(), MSLCM_SL2015::checkStrategicChange(), MSLink::checkWalkingAreaFoe(), GUIParameterTableWindow::closeBuilding(), MSVehicle::collisionStopTime(), MSLCM_SL2015::commitManoeuvre(), Bresenham::compute(), AStarRouter< E, V >::compute(), HelpersHBEFA::compute(), HelpersHBEFA3::compute(), HelpersPHEMlight::compute(), HelpersPHEMlight5::compute(), NBNetBuilder::compute(), NBTrafficLightDefinition::computeBrakingTime(), MSVehicleType::computeChosenSpeedDeviation(), MSDispatch::computeDetourTime(), MSDispatch_Greedy::computeDispatch(), MSDispatch_GreedyClosest::computeDispatch(), MSLink::computeDistToDivergence(), MSPModel_NonInteracting::PState::computeDuration(), MSPModel_NonInteracting::CState::computeDuration(), NBNodeShapeComputer::computeEdgeBoundaries(), NBOwnTLDef::computeEscapeTime(), MSLCM_SL2015::computeGapFactor(), MSDevice_SSM::computeGlobalMeasures(), NBNode::computeLanes2Lanes(), NBOwnTLDef::computeLogicAndConts(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeTypeComputer::computeNodeTypes(), MSLaneChanger::computeOvertakingTime(), computeRoutes(), MSLaneChanger::computeSafeOppositeLength(), GUIBaseVehicle::computeSeats(), MSLCM_SL2015::computeSpeedGain(), MSLCM_LC2013::computeSpeedLat(), MSLCM_SL2015::computeSpeedLat(), MSCFModel_W99::computeThresholds(), MSTrainHelper::computeTrainDimensions(), libsumo::Helper::convertCartesianToRoadMap(), MSSOTLTrafficLightLogic::countVehicles(), NGRandomNetBuilder::createNewNode(), GNENet::createRoundabout(), MSCFModel_Daniel1::dawdle(), MSCFModel_KraussOrig1::dawdle(), MSCFModel_SmartSK::dawdle(), MSCFModel_Krauss::dawdle2(), MSCFModel_KraussX::dawdleX(), MSDevice_SSM::determineTTCandDRACandPPETandMDRAC(), MSDispatch_GreedyShared::dispatch(), MSDispatch_RouteExtension::dispatch(), MSCFModel::distAfterTime(), NBNodeShapeComputer::divisionWidth(), GUIBasePersonHelper::drawAction_drawAsCenteredCircle(), GUIBasePersonHelper::drawAction_drawAsCircle(), GUIBaseVehicleHelper::drawAction_drawVehicleAsCircle(), GUIVehicle::drawAction_drawVehicleBlinker(), GUIVehicle::drawBestLanes(), GNELane::drawDirectionIndicators(), GUILane::drawDirectionIndicators(), GUIOverheadWire::drawGL(), GNEVehicle::drawGL(), GUILane::drawGL(), GUILane::drawLinkRule(), GUIBaseVehicle::drawStopLabels(), GUITLLogicPhasesTrackerWindow::drawValues(), MSVehicle::enterLaneAtMove(), MSCFModel::estimateSpeedAfterDistance(), MSVehicle::estimateTimeToNextStop(), METriggeredCalibrator::execute(), MSCalibrator::execute(), MSVehicle::executeMove(), NBEdge::expandableBy(), NBEdge::extendGeometryAtNode(), MSCFModel::finalizeSpeed(), MSCFModel_CC::finalizeSpeed(), MSCFModel_Daniel1::finalizeSpeed(), MSCFModel_EIDM::finalizeSpeed(), MSRailSignal::DriveWay::findFlankProtection(), NBPTStop::findLaneAndComputeBusStopExtent(), NBEdgeCont::fixSplitCustomLength(), MSCFModel_CACC::followSpeed(), MSCFModel_Krauss::followSpeed(), MSCFModel_KraussOrig1::followSpeed(), MSCFModel_PWag2009::followSpeed(), MSCFModel_Rail::followSpeed(), MSCFModel_SmartSK::followSpeed(), MSCFModel_W99::followSpeed(), MSLCM_SL2015::forecastAverageSpeed(), MSCFModel_EIDM::freeSpeed(), MSCFModel::freeSpeed(), MSCFModel_Rail::freeSpeed(), MSCFModel_IDM::freeSpeed(), RGBColor::fromHSV(), libsumo::Helper::fuseLaneCoverage(), MSVehicle::Influencer::gapControlSpeed(), MSCFModel::gapExtrapolation(), MSDevice_Emissions::generateOutput(), NBEdgeCont::generateStreetSigns(), NBNode::geometryLike(), GUIMessageWindow::getActiveStringObject(), MSPModel_Striping::PState::getAngle(), MSVehicle::getArrivalTime(), MSAbstractLaneChangeModel::getAssumedDecelForLaneChangeDuration(), MSMeanData_Net::MSLaneMeanDataValues::getAttributeValue(), MSDevice_Tripinfo::getAvgDepartDelayWaiting(), MSVehicle::getBackPosition(), MSVehicle::getBoundingBox(), MSVehicle::getBoundingPoly(), GUIPerson::getCenteringBoundary(), MSLaneChanger::getColumnleader(), MEVehicle::getConservativeSpeed(), MSLane::getCriticalLeader(), GUIBusStop::getCroppedLastFreePos(), MSEdge::getCurrentTravelTime(), SUMOVTypeParameter::getDefaultEmergencyDecel(), NBNodeShapeComputer::getDefaultRadius(), MSVehicle::getDeltaPos(), SUMOVehicleParameter::getDepartPos(), SUMOVehicleParameter::getDepartPosLat(), SUMOVehicleParameter::getDepartSpeed(), ROVehicle::getDepartureTime(), NBNodeCont::getDiameter(), MSVehicle::getDistanceToLeaveJunction(), MSDevice_ToC::getDynamicMRMProbability(), MSRoutingEngine::getEffort(), MSRoutingEngine::getEffortBike(), GUIVisualizationSizeSettings::getExaggeration(), NBEdge::getFinalLength(), MSLane::getFollowersOnConsecutive(), GUISUMOAbstractView::getFPS(), MSDevice_Tripinfo::getGlobalParameter(), MSBaseVehicle::getImpatience(), MSPerson::getImpatience(), MSPModel_Striping::PState::getImpatience(), MSInductLoop::getIntervalOccupancy(), MSParkingArea::getLastFreePosWithReservation(), MSLane::getLastVehicleInformation(), MSLCM_SL2015::getLateralDrift(), MSSimpleTrafficLightLogic::getLatest(), LIBSUMO_NAMESPACE::Vehicle::getLeader(), MSLink::getLeaderInfo(), MSLane::getLeaderOnConsecutive(), MSLink::getLeaveTime(), GNELane::getLengthGeometryFactor(), MSActuatedTrafficLightLogic::getLinkMinDuration(), PositionVector::getMaxGrade(), NBLoadedSUMOTLDef::getMaxIndex(), MSAbstractLaneChangeModel::getMaxSpeedLat2(), MSStop::getMinDuration(), NIImporter_OpenStreetMap::getNeighboringNodes(), MESegment::getNextInsertionTime(), MSInductLoop::getOccupancy(), MSLaneChanger::getOncomingVehicle(), MSLane::getOppositePos(), PositionVector::getOverlapWith(), MSDevice_SSM::getParameter(), PedestrianEdge< E, L, N, V >::getPartialLength(), MSPModel_JuPedSim::getRadius(), NBNode::getReduction(), GUIVehicle::getRightSublaneOnEdge(), MSLCHelper::getRoundaboutDistBonus(), MSCFModel_CACC::getSecureGap(), MSCFModel_IDM::getSecureGap(), MSCFModel_Wiedemann::getSecureGap(), MSCFModel::getSecureGap(), MSCFModel_EIDM::getSecureGap(), NBNodeShapeComputer::getSmoothCorner(), MSPerson::MSPersonStage_Access::getSpeed(), MSCFModel::getSpeedAfterMaxDecel(), MSLCHelper::getSpeedPreservingSecureGap(), MSVehicle::getStopDelay(), LIBSUMO_NAMESPACE::Vehicle::getStops(), MSLeaderInfo::getSubLanes(), MSLane::getSurroundingVehicles(), MESegment::getTauJJ(), MSDevice_Tripinfo::getTotalDepartDelay(), NEMAPhase::getTransitionTime(), MSStoppingPlace::getTransportablesAbreast(), PedestrianEdge< E, L, N, V >::getTravelTime(), ROEdge::getTravelTime(), RailwayRouter< E, V >::getTravelTimeStatic(), MSTrainHelper::getUpscaleLength(), MSPModel_Striping::getVehicleObstacles(), GUIVehicle::getVisualAngle(), MEVehicle::getWaitingTime(), MSLink::getZipperSpeed(), NBLoadedSUMOTLDef::guessMinMaxDuration(), NBEdgeCont::guessRoundabouts(), GUIBusStop::GUIBusStop(), GUIJunctionWrapper::GUIJunctionWrapper(), GUITriggeredRerouter::GUITriggeredRerouterEdge::GUITriggeredRerouterEdge(), GUIApplicationWindow::handleEvent_SimulationLoaded(), MSVehicle::Influencer::implicitSpeedRemote(), MSEdge::inferEdgeType(), MSVehicle::Influencer::influenceSpeed(), MSLCM_DK2008::informBlocker(), MSLCM_SL2015::informFollower(), MSLCM_LC2013::informFollower(), MSLCM_SL2015::informLeader(), MSLCM_LC2013::informLeader(), RailEdge< E, V >::init(), MSTrafficLightLogic::initMesoTLSPenalties(), ROEdge::initPriorityFactor(), MESegment::initSegment(), NIImporter_OpenStreetMap::insertEdge(), MSCFModel_IDM::insertionFollowSpeed(), MSLane::insertVehicle(), MSCFModel::interactionGap(), MSCFModel_EIDM::interactionGap(), MSCFModel_IDM::interactionGap(), MSCFModel_EIDM::internalsecuregap(), MSCFModel_EIDM::internalspeedlimit(), MSVehicle::interpolateLateralZ(), NIImporter_OpenStreetMap::EdgesHandler::interpretLaneUse(), MSLane::isInsertionSuccess(), NBLoadedSUMOTLDef::joinLogic(), NBEdgeCont::joinTramEdges(), MSLCM_SL2015::keepLatGap(), LandmarkLookupTable< E, V >::LandmarkLookupTable(), MSTransportableControl::loadAnyWaiting(), GUINet::loadEdgeData(), PCLoaderOSM::loadIfSet(), SUMORouteLoaderControl::loadNext(), GUITLLogicPhasesTrackerWindow::loadSettings(), NBHeightMapper::loadTiff(), GUIPersistentWindowPos::loadWindowPos(), LandmarkLookupTable< E, V >::lowerBound(), MSE2Collector::makeMoveNotification(), MAX3(), MAX4(), MSCFModel::maximumSafeFollowSpeed(), MSCFModel_EIDM::maximumSafeFollowSpeed(), MSCFModel::maximumSafeStopSpeed(), MSCFModel::maximumSafeStopSpeedBallistic(), MSCFModel_KraussPS::maxNextSpeed(), MSCFModel_Rail::minNextSpeed(), MSCFModel::minNextSpeed(), MSCFModel_CC::minNextSpeed(), MSCFModel_IDM::minNextSpeed(), MSCFModel::minNextSpeedEmergency(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::PState::moveTo(), libsumo::Helper::moveToXYMap(), libsumo::Helper::moveToXYMap_matchingRoutePosition(), MSDevice_ToC::MRMExecutionStep(), MSParkingArea::MSParkingArea(), RGBColor::multiply(), NIImporter_SUMO::myEndElement(), GUINet::DiscoverAttributes::myStartElement(), NIImporter_OpenDrive::myStartElement(), MESegment::newArrival(), MSE2Collector::notifyLeave(), MSDevice_ElecHybrid::notifyMove(), MSDevice_Bluelight::notifyMove(), MSDevice_Transportable::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), MSPModel_Striping::numStripes(), GNEFrame::openHelpAttributesDialog(), NBContHelper::relative_outgoing_edge_sorter::operator()(), NBContHelper::relative_incoming_edge_sorter::operator()(), MSDispatch::time_sorter::operator()(), MSPModel_Striping::PState::otherStripe(), MSInductLoop::overrideTimeSinceDetection(), MSLCM_LC2013::overtakeDistance(), StringUtils::padFront(), NLTriggerBuilder::parseAndBuildStoppingPlace(), MSCFModel::passingTime(), NBLoadedSUMOTLDef::patchIfCrossingsAdded(), NBRampsComputer::patchRampGeometry(), MSLCM_DK2008::patchSpeed(), MSLCM_LC2013::patchSpeed(), MSLCM_SL2015::patchSpeed(), MSCFModel_Krauss::patchSpeedBeforeLC(), MSCFModel_KraussOrig1::patchSpeedBeforeLC(), MSCFModel_EIDM::patchSpeedBeforeLCEIDM(), MSRoutingEngine::patchSpeedForTurns(), MSVehicle::planMoveInternal(), MESegment::prepareDetectorForWriting(), MSLCM_LC2013::prepareStep(), MSLCM_SL2015::prepareStep(), MSDevice_Taxi::prepareStop(), SUMOVehicleParserHelper::processActionStepLength(), MSE2Collector::processJams(), MSVehicle::processLinkApproaches(), MSVehicle::processNextStop(), NBEdgeCont::processSplits(), MSVehicle::processTraCISpeedControl(), MSDelayBasedTrafficLightLogic::proposeProlongation(), NBNodeCont::pruneLongEdges(), StringUtils::pruneZeros(), MSEdge::recalcCache(), MESegment::receive(), MSLink::recheckSetRequestInformation(), NIImporter_OpenDrive::recomputeWidths(), NIImporter_OpenStreetMap::reconstructLayerElevation(), MSCalibrator::remainingVehicleCapacity(), GNETLSEditorFrame::TLSPhases::removePhase(), NBPTStop::replaceEdge(), NBEdge::replaceInConnections(), NIImporter_DlrNavteq::TimeRestrictionsHandler::report(), NBEdgeCont::retrievePossiblySplit(), MSStageWalking::routeOutput(), NIImporter_OpenDrive::sanitizeWidths(), MSLCM_LC2013::saveBlockerLength(), MSLCM_SL2015::saveBlockerLength(), MSBaseVehicle::saveState(), MSTransportable::saveState(), MSE2Collector::selectLanes(), MESegment::send(), Boundary::set(), MSDevice_ElecHybrid::setActualBatteryCapacity(), MSStageDriving::setArrived(), MSStageTrip::setArrived(), MSSimpleDriverState::setAwareness(), MSDevice_ToC::setAwareness(), GUIMessageWindow::setCursorPos(), NIImporter_OpenDrive::setLaneAttributes(), MSFrame::setMSGlobals(), GUILane::setMultiColor(), GNELane::setMultiColor(), MSParkingArea::setNumAlternatives(), MSLCM_SL2015::setOwnState(), MSVehicle::setPreviousSpeed(), NBEdgePriorityComputer::setPriorityJunctionPriorities(), MSLink::setRequestInformation(), MESegment::setSpeedForQueue(), GUIMainWindow::setWindowSizeAndPos(), GUIViewTraffic::showLaneReachability(), MSVehicle::slowDownForSchedule(), GNEEdge::smoothShape(), NBEdgeCont::splitAt(), IntermodalNetwork< E, L, N, V >::splitEdge(), MSCFModel_PWag2009::stopSpeed(), MSCFModel_SmartSK::stopSpeed(), MSPModel_Striping::PState::stripe(), MELoop::teleportVehicle(), time2string(), NGNet::toNB(), MSTriggeredRerouter::triggerRouting(), MSDelayBasedTrafficLightLogic::trySwitch(), AGFreeTime::typeFromHomeDay(), AGFreeTime::typeFromHomeEvening(), AGFreeTime::typeFromHomeNight(), NEMAPhase::update(), PolygonDynamics::update(), MSVehicle::updateBestLanes(), MSLCHelper::updateBlockerLength(), MSRailCrossing::updateCurrentPhase(), MSLCM_SL2015::updateGaps(), GNEConnection::updateGeometry(), CHBuilder< E, V >::CHInfo::updateLevel(), MSSwarmTrafficLightLogic::updatePheromoneLevels(), MSSimpleDriverState::updateReactionTime(), MSSwarmTrafficLightLogic::updateSensitivities(), MSVehicle::updateState(), NIImporter_OpenStreetMap::usableType(), MSVehicleControl::vehicleDeparted(), MFXWorkerThread::Pool::waitAll(), MSPModel_Striping::PState::walk(), MSStageWalking::walkDistance(), MSLCM_DK2008::wantsChangeToLeft(), MSLCM_DK2008::wantsChangeToRight(), MSLCM_SL2015::wantsKeepRight(), MSVehicle::workOnMoveReminders(), SUMOVehicleParameter::write(), MSMeanData_Net::MSLaneMeanDataValues::write(), MSEmissionExport::write(), ODMatrix::write(), RODFDetectorCon::writeEmitters(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), NWWriter_OpenDrive::writeGeomSmooth(), NWWriter_OpenDrive::writeInternalEdge(), NWWriter_SUMO::writeInternalEdges(), MSQueueExport::writeLane(), NWWriter_OpenDrive::writeNormalEdge(), NWWriter_OpenDrive::writeRoadObjectPOI(), NWWriter_OpenDrive::writeRoadObjectPoly(), RODFDetector::writeSingleSpeedTrigger(), MSE2Collector::writeXMLOutput(), MSInductLoop::writeXMLOutput(), and MSDevice_Taxi::~MSDevice_Taxi().

◆ MAX3()

◆ MAX4()

template<typename T >
T MAX4 ( a,
b,
c,
d 
)
inline

Definition at line 110 of file StdDefs.h.

References MAX2().

Referenced by GUIOSGPerspectiveChanger::updateViewport().

Here is the caller graph for this function:

◆ MIN2()

template<typename T >
T MIN2 ( a,
b 
)
inline

Definition at line 76 of file StdDefs.h.

Referenced by RailwayRouter< E, V >::_compute(), MSRoutingEngine::_initEdgeWeights(), MSLCM_LC2013::_patchSpeed(), MSLCM_SL2015::_patchSpeed(), MSCFModel_EIDM::_v(), MSCFModel_Kerner::_v(), MSCFModel_Wiedemann::_v(), MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), MSCFModel_ACC::accelGapControl(), MSVehicle::DriveProcessItem::adaptLeaveSpeed(), MSLCM_LC2013::adaptSpeedToPedestrians(), MSVehicle::adaptToJunctionLeader(), MSVehicle::adaptToLeader(), MSVehicle::adaptToOncomingLeader(), MSPModel_Striping::addCrossingVehs(), NBNode::addedLanesRight(), GNENet::addGreenVergeLane(), MSLeaderDistanceInfo::addLeaders(), MSLaneChangerSublane::addOutsideLeaders(), GNENet::addRestrictedLane(), MSBaseVehicle::addStop(), NBEdge::addStraightConnections(), MSMeanData_Net::MSLaneMeanDataValues::addTo(), MSLCM_LC2013::anticipateFollowSpeed(), MSDevice_ToC::awarenessRecoveryStep(), MSBaseVehicle::basePos(), NBNode::bezierControlPoints(), GNEViewNet::buildColorRainbow(), GUIViewTraffic::buildColorRainbow(), NLDetectorBuilder::buildInductLoop(), NBEdge::buildInnerEdges(), GNETLSEditorFrame::buildInternalLanes(), NBRampsComputer::buildOffRamp(), NBRampsComputer::buildOnRamp(), NBNode::buildWalkingAreas(), MSBaseVehicle::calculateArrivalParams(), NEMALogic::calculateForceOffs170(), NEMALogic::calculateForceOffsTS2(), GawronCalculator< R, E, V >::calculateProbabilities(), GNEPathManager::PathCalculator::calculateReachability(), MSE2Collector::calculateTimeLossAndTimeOnDetector(), NEMAPhase::calcVehicleExtension(), RGBColor::changedAlpha(), RGBColor::changedBrightness(), MSLaneChanger::changeOpposite(), MSLCM_SL2015::checkBlocking(), MSLCM_SL2015::checkBlockingVehicles(), MELoop::checkCar(), MSLaneChanger::checkChange(), NBOwnTLDef::checkCustomCrossingIndices(), MSLane::checkFailure(), MSVehicleTransfer::checkInsertions(), MSVehicle::checkLinkLeader(), MSE2Collector::checkPositioning(), MSVehicle::checkRewindLinkLanes(), MSLink::checkWalkingAreaFoe(), MSLCM_SL2015::commitFollowSpeed(), Bresenham::compute(), AStarRouter< E, V >::compute(), NBNetBuilder::compute(), NBEdge::computeAngle(), MSVehicle::computeAngle(), MSTrainHelper::computeCarriages(), MSDispatch_GreedyClosest::computeDispatch(), MSDevice_SSM::computeDRAC(), NBEdge::computeEdgeShape(), NBNode::computeLanes2Lanes(), MSParkingArea::computeLastFreePos(), NBOwnTLDef::computeLogicAndConts(), computeRoutes(), MSLaneChanger::computeSafeOppositeLength(), MSLCM_SL2015::computeSpeedGain(), MSLCM_LC2013::computeSpeedLat(), MSLCM_SL2015::computeSpeedLat(), MSTrainHelper::computeTrainDimensions(), GNENet::createRoundabout(), MSTLLogicControl::WAUTSwitchProcedure_Stretch::cutLogic(), MSDevice_SSM::determineTTCandDRACandPPETandMDRAC(), GUIBasePersonHelper::drawAction_drawAsCenteredCircle(), GUIBasePersonHelper::drawAction_drawAsCircle(), GUIVehicle::drawAction_drawCarriageClass(), GUIBaseVehicleHelper::drawAction_drawVehicleAsCircle(), GNELane::drawDirectionIndicators(), GUILane::drawDirectionIndicators(), GNEDemandElementPlan::drawEndPosition(), GUIBusStop::drawGL(), GUIChargingStation::drawGL(), GUIOverheadWire::drawGL(), GUIParkingArea::drawGL(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEContainerStop::drawGL(), GNEParkingArea::drawGL(), GNEVehicle::drawGL(), GUIInductLoop::MyWrapper::drawGL(), GLHelper::drawInverseMarkings(), GUILane::drawJunctionChangeProhibitions(), GUIEdge::drawMesoVehicles(), GUIBaseVehicle::drawOnPos(), GNELane::drawStartEndGeometryPoints(), MSDevice_GLOSA::earliest_arrival(), NEMAPhase::enter(), MSDevice_SSM::estimateConflictTimes(), MEVehicle::estimateLeaveSpeed(), MSCFModel::estimateSpeedAfterDistance(), MSVehicle::estimateTimeToNextStop(), NBNode::ApproachingDivider::execute(), MSPModel_JuPedSim::execute(), MSVehicle::executeMove(), NBEdge::extendGeometryAtNode(), MSCFModel::finalizeSpeed(), MSCFModel_Daniel1::finalizeSpeed(), MSCFModel_EIDM::finalizeSpeed(), LIBSUMO_NAMESPACE::Simulation::findIntermodalRoute(), NBPTStop::findLaneAndComputeBusStopExtent(), NBEdge::firstIntersection(), MSCFModel_ACC::followSpeed(), MSCFModel_CACC::followSpeed(), MSCFModel_Daniel1::followSpeed(), MSCFModel_Kerner::followSpeed(), MSCFModel_Krauss::followSpeed(), MSCFModel_KraussOrig1::followSpeed(), MSCFModel_PWag2009::followSpeed(), MSCFModel_Rail::followSpeed(), MSCFModel_SmartSK::followSpeed(), MSCFModel_W99::followSpeed(), MSLane::freeInsertion(), MSCFModel_IDM::freeSpeed(), RGBColor::fromHSV(), MSCFModel_Wiedemann::fullspeed(), libsumo::Helper::fuseLaneCoverage(), MSActuatedTrafficLightLogic::gapControl(), MSVehicle::Influencer::gapControlSpeed(), MSCFModel::gapExtrapolation(), MSMeanData_Net::MSLaneMeanDataValues::getAttributeValue(), MEVehicle::getAverageSpeed(), MSVehicle::getBackPositionOnLane(), MSVehicle::getBoundingBox(), MSVehicle::getBoundingPoly(), MSLane::getBruttoOccupancy(), GUIMEVehicle::getCenteringBoundary(), PollutantsInterface::Helper::getCoastingDecel(), GUIBaseVehicle::getContainerPosition(), NBNodeShapeComputer::getDefaultRadius(), MSEdge::getDepartLane(), MSEdge::getDepartPosBound(), MSLane::getDepartSpeed(), MSDevice_ToC::getDynamicMRMProbability(), MSSimpleTrafficLightLogic::getEarliest(), MSStageDriving::getEdgePos(), ROEdge::getEffort(), ROEdge::getEmissionEffort(), MESegment::getEntryBlockTimeSeconds(), MSE2Collector::getEstimateQueueLength(), GNEEdge::getGeometryPointRadius(), MSBaseVehicle::getImpatience(), MSPerson::getImpatience(), MSPModel_Striping::PState::getImpatience(), MSInductLoop::getIntervalOccupancy(), MSParkingArea::getLastFreePos(), MSParkingArea::getLastFreePosWithReservation(), MSLane::getLeadersOnConsecutive(), LIBSUMO_NAMESPACE::Lane::getLinks(), MSLane::getMaximumBrakeDist(), MSBaseVehicle::getMaxSpeed(), MSTransportable::getMaxSpeed(), RORoutable::getMaxSpeed(), GeomHelper::getMinAngleDiff(), MSActuatedTrafficLightLogic::getMinimumMinDuration(), ROEdge::getMinimumTravelTime(), NBNodesEdgesSorter::crossing_by_junction_angle_sorter::getMinRank(), HelpersPHEMlight::getModifiedAccel(), HelpersPHEMlight5::getModifiedAccel(), NIImporter_OpenStreetMap::getNeighboringNodes(), LIBSUMO_NAMESPACE::Vehicle::getNextLinks(), ROEdge::getNoiseEffort(), MSInductLoop::getOccupancy(), MSInductLoop::getOccupancyTime(), MSLaneChanger::getOncomingVehicle(), MSDevice_SSM::getParameter(), MSPModel_NonInteracting::CState::getPosition(), MSPModel_Striping::getReserved(), GUIBaseVehicle::getSeatPosition(), MSCFModel::getSecureGap(), MSCFModel_EIDM::getSecureGap(), NBEdge::getShapeEndAngle(), NBEdge::getShapeStartAngle(), MSLeaderInfo::getSublaneBorders(), MSLeaderInfo::getSubLanes(), MSLane::getSurroundingVehicles(), MSCFModel_Rail::TrainParams::getTraction(), PublicTransportEdge< E, L, N, V >::getTravelTime(), ROEdge::getTravelTime(), MSEdge::getTravelTimeAggregated(), MSLane::getVehicleMaxSpeed(), MSPModel_Striping::getVehicleObstacles(), MSLink::getZipperSpeed(), NBNodeCont::guessTLs(), GUITriggeredRerouter::GUITriggeredRerouterEdge::GUITriggeredRerouterEdge(), MSLane::handleCollisionBetween(), MSVehicle::handleCollisionStop(), MSLane::handleIntermodalCollisionBetween(), MESegment::hasSpaceFor(), LIBSUMO_NAMESPACE::POI::highlight(), LIBSUMO_NAMESPACE::Vehicle::highlight(), MSVehicle::Influencer::implicitDeltaPosRemote(), MSVehicle::Influencer::implicitSpeedRemote(), MSVehicle::Influencer::influenceSpeed(), MSLCM_LC2013::informFollower(), MSLCM_SL2015::informLeader(), MSLCM_LC2013::informLeader(), MSLCM_SL2015::informLeaders(), MSDelayBasedTrafficLightLogic::init(), MSActuatedTrafficLightLogic::init(), MSTrafficLightLogic::initMesoTLSPenalties(), ROEdge::initPriorityFactor(), MSCFModel_CACC::insertionFollowSpeed(), MSCFModel::insertionStopSpeed(), MSCFModel_EIDM::insertionStopSpeed(), MSLane::insertVehicle(), MSPModel_Striping::insertWalkArePaths(), MSCFModel::interactionGap(), MSCFModel_EIDM::internalspeedlimit(), MSLane::isInsertionSuccess(), MSLCM_SL2015::keepLatGap(), MSVehicle::keepStopping(), MSLane::lastInsertion(), SUMORouteLoaderControl::loadNext(), GUITLLogicPhasesTrackerWindow::loadSettings(), MESegment::loadState(), NBHeightMapper::loadTiff(), GUIPersistentWindowPos::loadWindowPos(), MSE2Collector::makeMoveNotification(), MSCFModel::maximumLaneSpeedCF(), MSCFModel_CACC::maximumLaneSpeedCF(), MSCFModel::maximumSafeFollowSpeed(), MSCFModel_EIDM::maximumSafeFollowSpeed(), MSCFModel::maximumSafeStopSpeed(), MSCFModel::maxNextSpeed(), MSCFModel_KraussPS::maxNextSpeed(), NIImporter_OpenStreetMap::mergeTurnSigns(), MIN3(), MIN4(), MSCFModel_IDM::minNextSpeed(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::PState::moveTo(), LIBSUMO_NAMESPACE::Person::moveToXY(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), libsumo::Helper::moveToXYMap(), libsumo::Helper::moveToXYMap_matchingRoutePosition(), MSEdgeControl::MSEdgeControl(), MSParkingArea::MSParkingArea(), RGBColor::multiply(), MSLCM_SL2015::mustOvertakeStopped(), GUINet::DiscoverAttributes::myStartElement(), NIImporter_OpenStreetMap::EdgesHandler::myStartElement(), NBEdge::NBEdge(), MESegment::newArrival(), TraCIServer::nextTargetTime(), MSDevice_GLOSA::notifyEnter(), MSDevice_Battery::notifyMove(), MSDevice_Bluelight::notifyMove(), MSMeanData::MeanDataValues::notifyMove(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), GUISUMOAbstractView::openPopupDialog(), NBContHelper::relative_outgoing_edge_sorter::operator()(), NBContHelper::relative_incoming_edge_sorter::operator()(), NBRequest::oppositeLeftTurnConflict(), MSPModel_Striping::PState::otherStripe(), MSInductLoop::overrideTimeSinceDetection(), MapMatcher< E, L, N >::parseGeoEdges(), MSCFModel::passingTime(), NBRampsComputer::patchRampGeometry(), MSLCM_DK2008::patchSpeed(), MSCFModel_Krauss::patchSpeedBeforeLC(), MSCFModel_EIDM::patchSpeedBeforeLCEIDM(), MSVehicle::planMoveInternal(), MSLCM_LC2013::prepareStep(), MSDevice_Taxi::prepareStop(), MSDevice_SSM::processEncounters(), MSVehicle::processLinkApproaches(), ROLoader::processRoutes(), NBNodeCont::pruneClusterFringe(), MSEdge::recalcCache(), MESegment::receive(), NBEdge::reinit(), NBEdge::replaceInConnections(), NIImporter_DlrNavteq::TimeRestrictionsHandler::report(), GUIVehicle::rerouteDRTStop(), MSTriggeredRerouter::rerouteParkingArea(), ROMAAssignments::resetFlows(), MSDevice_ToC::responseTimeMean(), MSLane::safeInsertionSpeed(), RONet::saveAndRemoveRoutesUntil(), ROPerson::PersonTrip::saveAsXML(), Boundary::set(), MSDevice_ElecHybrid::setActualBatteryCapacity(), MSStageDriving::setArrived(), MSStageTrip::setArrived(), MSDevice_ToC::setAwareness(), GUIMessageWindow::setCursorPos(), NIImporter_OpenDrive::setLaneAttributes(), MSLCM_SL2015::setOwnState(), NBEdgePriorityComputer::setPriorityJunctionPriorities(), MSLink::setRequestInformation(), MSDevice_ToC::setState(), GUIMainWindow::setWindowSizeAndPos(), NBEdge::shiftPositionAtNode(), NBEdge::shortenGeometryAtNode(), GUIViewTraffic::showLaneReachability(), MSCFModel_EIDM::slowToStartTerm(), PositionVector::smoothedZFront(), GNEEdge::smoothShape(), NBEdgeCont::splitAt(), NBEdge::startShapeAt(), MSCFModel_IDM::stopSpeed(), MSCFModel_Rail::stopSpeed(), MSCFModel_W99::stopSpeed(), MSCFModel_Wiedemann::stopSpeed(), MSCFModel_ACC::stopSpeed(), MSCFModel_CACC::stopSpeed(), MSCFModel_Daniel1::stopSpeed(), MSCFModel_Kerner::stopSpeed(), MSCFModel_Krauss::stopSpeed(), MSCFModel_KraussOrig1::stopSpeed(), MSCFModel_PWag2009::stopSpeed(), MSCFModel_SmartSK::stopSpeed(), MSPModel_Striping::PState::stripe(), time2string(), MSDelayBasedTrafficLightLogic::trySwitch(), MSActuatedTrafficLightLogic::trySwitch(), AGFreeTime::typeFromHomeNight(), MSVehicle::updateBestLanes(), MSLCM_SL2015::updateExpectedSublaneSpeeds(), MSLCM_SL2015::updateGaps(), GNEConnection::updateGeometry(), MSSwarmTrafficLightLogic::updatePheromoneLevels(), MSSwarmTrafficLightLogic::updateSensitivities(), MSVehicleControl::vehicleDeparted(), MSCFModel_KraussOrig1::vsafe(), MFXWorkerThread::Pool::waitAll(), MSPModel_Striping::PState::walk(), MSLCM_DK2008::wantsChangeToLeft(), MSLCM_DK2008::wantsChangeToRight(), MSMeanData_Emissions::MSLaneMeanDataValues::write(), MSMeanData_Harmonoise::MSLaneMeanDataValues::write(), MSMeanData_Net::MSLaneMeanDataValues::write(), NWWriter_OpenDrive::writeGeomSmooth(), NWWriter_OpenDrive::writeRoadObjectPOI(), NWWriter_OpenDrive::writeRoadObjectPoly(), MSE3Collector::writeXMLOutput(), MSInductLoop::writeXMLOutput(), and MSMeanData::writeXMLOutput().

◆ MIN3()

template<typename T >
T MIN3 ( a,
b,
c 
)
inline

◆ MIN4()

template<typename T >
T MIN4 ( a,
b,
c,
d 
)
inline

Definition at line 103 of file StdDefs.h.

References MIN2().

Referenced by MSCFModel_Kerner::_v(), GLHelper::drawBoxLines(), MSMeanData::MeanDataValues::notifyMove(), and GUIOSGPerspectiveChanger::updateViewport().

Here is the caller graph for this function:

◆ NETWORK_VERSION()

const MMVersion NETWORK_VERSION ( ,
20   
)

Referenced by NWWriter_XML::writeEdgesAndConnections(), NWWriter_XML::writeJoinedJunctions(), NWWriter_SUMO::writeNetwork(), NWWriter_XML::writeNodes(), NWWriter_XML::writeTrafficLights(), and NWWriter_XML::writeTypes().

Here is the caller graph for this function:

◆ roundBits()

double roundBits ( double  x,
int  fractionBits 
)

round to the given number of mantissa bits beyond the given number

Definition at line 46 of file StdDefs.cpp.

◆ roundDecimal()

double roundDecimal ( double  x,
int  precision 
)

round to the given number of decimal digits

Definition at line 52 of file StdDefs.cpp.

Referenced by MSVehicleType::computeChosenSpeedDeviation(), MSLane::getDepartPosLat(), MSLane::getDepartSpeed(), and MSLane::insertVehicle().

Here is the caller graph for this function:

◆ truncate()

double truncate ( double  x,
int  fractionBits 
)

discrds mantissa bits beyond the given number

Definition at line 42 of file StdDefs.cpp.

Variable Documentation

◆ gDebugFlag1

◆ gDebugFlag2

◆ gDebugFlag3

◆ gDebugFlag4

◆ gDebugFlag5

◆ gDebugFlag6

bool gDebugFlag6
extern

Definition at line 40 of file StdDefs.cpp.

Referenced by MSLink::blockedByFoe(), and MSLink::computeFoeArrivalTimeBraking().

◆ gHumanReadableTime

◆ gLanguage

std::string gLanguage
extern

the language for GUI elements and messages

Definition at line 33 of file StdDefs.cpp.

Referenced by SystemFrame::addReportOptions(), main(), GUIMainWindow::onCmdChangeLanguage(), and GUIMainWindow::onUpdChangeLanguage().

◆ gPrecision

◆ gPrecisionGeo

◆ gPrecisionRandom

◆ gSimulation

bool gSimulation
extern

Definition at line 30 of file StdDefs.cpp.

Referenced by LIBSUMO_NAMESPACE::Simulation::load(), and main().

◆ gWeightsRandomFactor

◆ gWeightsWalkOppositeFactor

double gWeightsWalkOppositeFactor
extern

◆ INVALID_DOUBLE

const double INVALID_DOUBLE = std::numeric_limits<double>::max()

invalid double

Definition at line 64 of file StdDefs.h.

Referenced by MSDevice_SSM::Encounter::add(), MSMeanData_Net::MSLaneMeanDataValues::addTo(), PositionVector::angleAt2D(), PositionVector::beginEndAngle(), GNEAdditionalHandler::buildAccess(), GNEStoppingPlace::calculateStoppingPlaceContour(), MSDevice_SSM::checkConflictEntryAndExit(), GNEAdditionalHandler::checkLaneDoublePosition(), MSDevice_SSM::classifyEncounter(), GNEVehicle::commitMoveShape(), MSTrainHelper::computeCarriages(), MSDevice_SSM::computeDRAC(), MSDevice_SSM::computeGlobalMeasures(), MSDevice_SSM::computeMDRAC(), MSDevice_SSM::computeSSMs(), MSDevice_SSM::computeTTC(), MSDevice_SSM::createEncounters(), MSDevice_SSM::determinePET(), MSDevice_SSM::determineTTCandDRACandPPETandMDRAC(), GNEStop::drawGeometryPoints(), GNEBusStop::drawGL(), GNEChargingStation::drawGL(), GNEContainerStop::drawGL(), GNEParkingArea::drawGL(), GNENeteditAttributes::drawLaneReference(), EnergyParams::EnergyParams(), MSCFModel::estimateArrivalTime(), MSDevice_SSM::estimateConflictTimes(), MSVehicle::estimateTimeToNextStop(), MSFrame::fillOptions(), ROFrame::fillOptions(), GNEAttributeCarrier::fillWireElements(), GNEAdditionalHandler::fixLaneDoublePosition(), MSDevice_SSM::flushConflicts(), MSDevice_SSM::flushGlobalMeasures(), MSPModel_Striping::PState::getAngle(), GNEAccess::getAttribute(), GNEBusStop::getAttribute(), GNEChargingStation::getAttribute(), GNEContainerStop::getAttribute(), GNEParkingArea::getAttribute(), GNETAZ::getAttribute(), GNEStop::getAttribute(), GNEParkingArea::getAttributeDouble(), GNEStoppingPlace::getAttributeDouble(), GNEStop::getAttributeDouble(), GNEViewNetHelper::IntervalBar::getBegin(), MSDevice_SSM::getDetectionRange(), EnergyParams::getDoubleOptional(), GNENeteditAttributes::getElementLength(), GNEViewNetHelper::IntervalBar::getEnd(), GNEStoppingPlace::getEndGeometryPositionOverLane(), MSDevice_SSM::getExtraTime(), GUIPerson::getGUIAngle(), MSLink::getLengthBeforeCrossing(), MSLink::getLengthsBeforeCrossing(), GNEStoppingPlace::getMoveOperation(), GNEStop::getMoveOperation(), GNEVehicle::getMoveOperation(), GUIPerson::getNaviDegree(), GNENeteditAttributes::getNeteditAttributesAndValues(), MSDevice_SSM::getParameter(), GNEDemandElementPlan::getPlanAttributeDouble(), MSPModel_Striping::PState::getPosition(), MSCFModel_Rail::TrainParams::getResistance(), GUIPerson::getStageArrivalPos(), GNEStoppingPlace::getStartGeometryPositionOverLane(), MSBaseVehicle::getStopArrivalDelay(), MSVehicle::getStopArrivalDelay(), LIBSUMO_NAMESPACE::Vehicle::getStopArrivalDelay(), LIBSUMO_NAMESPACE::Vehicle::getStopParameter(), GNEStopFrame::getStopParameter(), MSCFModel_Rail::TrainParams::getTraction(), GUIVisualizationSettings::initSumoGuiDefaults(), MSPModel_Striping::insertWalkArePaths(), GNEAccess::isAccessPositionFixed(), GNEAccess::isAdditionalValid(), GNEGenericData::isVisibleInspectDeleteSelect(), main(), MSCFModel_Rail::MSCFModel_Rail(), MSDevice_FCDReplay::FCDHandler::myStartElement(), PositionVector::nearest_offset_to_point25D(), PositionVector::nearest_offset_to_point2D(), MSMeanData_Net::MSLaneMeanDataValues::notifyMoveInternal(), GNENeteditAttributes::onCmdSetNeteditAttribute(), AdditionalHandler::parseBusStopAttributes(), AdditionalHandler::parseChargingStationAttributes(), AdditionalHandler::parseContainerStopAttributes(), AdditionalHandler::parseOverheadWire(), AdditionalHandler::parseParkingAreaAttributes(), SUMORouteHandler::parseStop(), RouteHandler::parseStopParameters(), AdditionalHandler::parseTrainStopAttributes(), MSDevice_SSM::processEncounters(), MSVehicle::processNextStop(), MSDevice_SSM::qualifiesAsConflict(), MSMeanData_Net::MSLaneMeanDataValues::reset(), MSVehicle::resumeFromStopping(), PositionVector::rotationAtOffset(), GNEAccess::setAttribute(), GNEBusStop::setAttribute(), GNEChargingStation::setAttribute(), GNEContainerStop::setAttribute(), GNEParkingArea::setAttribute(), GNEStop::setAttribute(), GNEVehicle::setAttribute(), GNENeteditAttributes::setEndPosition(), GNEVehicle::setMoveShape(), GNENeteditAttributes::setStartPosition(), GUIViewTraffic::showLaneReachability(), PositionVector::slopeDegreeAtOffset(), GNEStoppingPlace::splitEdgeGeometry(), GNEViewNetHelper::IntervalBar::updateIntervalBar(), MSDevice_SSM::updatePassedEncounter(), GNETAZ::updateTAZStatistic(), SUMOVehicleParameter::Stop::write(), MSFCDExport::write(), GNEBusStop::writeAdditional(), GNEChargingStation::writeAdditional(), GNEContainerStop::writeAdditional(), GNEParkingArea::writeAdditional(), GNEStop::writeDemandElement(), and MSDevice_SSM::writeOutConflict().

◆ INVALID_INT

const int INVALID_INT = std::numeric_limits<int>::max()

invalid int

Definition at line 61 of file StdDefs.h.

◆ SUMO_const_halfLaneWidth

const double SUMO_const_halfLaneWidth = SUMO_const_laneWidth / 2

Definition at line 49 of file StdDefs.h.

Referenced by GUILane::drawGL(), and NBEdgeCont::processSplits().

◆ SUMO_const_haltingSpeed

◆ SUMO_const_laneMarkWidth

◆ SUMO_const_laneWidth

◆ SUMO_const_quarterLaneWidth

const double SUMO_const_quarterLaneWidth = SUMO_const_laneWidth / 4

Definition at line 50 of file StdDefs.h.

◆ SUMO_const_waitingContainerDepth

const double SUMO_const_waitingContainerDepth = 6.2

Definition at line 55 of file StdDefs.h.

◆ SUMO_const_waitingContainerWidth

◆ SUMO_const_waitingPersonDepth

const double SUMO_const_waitingPersonDepth = 0.67

Definition at line 53 of file StdDefs.h.

◆ SUMO_const_waitingPersonWidth