Eclipse SUMO - Simulation of Urban MObility
MSDevice_Battery Class Reference

Battery device for electric vehicles. More...

#include <MSDevice_Battery.h>

Inheritance diagram for MSDevice_Battery:
Collaboration diagram for MSDevice_Battery:

Public Types

enum  Notification {
  NOTIFICATION_DEPARTED, NOTIFICATION_JUNCTION, NOTIFICATION_SEGMENT, NOTIFICATION_LANE_CHANGE,
  NOTIFICATION_TELEPORT, NOTIFICATION_PARKING, NOTIFICATION_ARRIVED, NOTIFICATION_VAPORIZED,
  NOTIFICATION_TELEPORT_ARRIVED, NOTIFICATION_PARKING_REROUTE
}
 Definition of a vehicle state. More...
 

Public Member Functions

void addTo (const StoringVisitor &cont) const
 Adds this object to the given container. More...
 
const std::string deviceName () const
 return the name for this type of device More...
 
virtual void generateOutput () const
 Called on writing tripinfo output. More...
 
double getActualBatteryCapacity () const
 Get the actual vehicle's Battery Capacity in kWh. More...
 
double getChargingStartTime () const
 Get charging start time. More...
 
std::string getChargingStationID () const
 Get current Charging Station ID. More...
 
double getConsum () const
 Get consum. More...
 
const std::string & getDescription () const
 
double getEnergyCharged () const
 Get charged energy. More...
 
const std::map< int, double > & getEnergyParams () const
 retrieve parameters for the energy consumption model More...
 
SUMOVehiclegetHolder () const
 Returns the vehicle that holds this device. More...
 
const std::string & getID () const
 Returns the id. More...
 
const MSLanegetLane () const
 Returns the lane the reminder works on. More...
 
double getMaximumBatteryCapacity () const
 Get the total vehicle's Battery Capacity in kWh. More...
 
double getMaximumPower () const
 Get the maximum power when accelerating. More...
 
SUMOVehicle::NumericalID getNumericalID () const
 
std::string getParameter (const std::string &key) const
 try to retrieve the given parameter from this device. Throw exception for unsupported key More...
 
double getStoppingTreshold () const
 Get stopping treshold. More...
 
int getVehicleStopped () const
 Get number of timestep that vehicle is stopped. More...
 
void increaseChargingStartTime ()
 Increase Charging Start time. More...
 
void increaseVehicleStoppedTimer ()
 Increase myVehicleStopped. More...
 
bool isChargingInTransit () const
 Get true if Vehicle it's charging, false if not. More...
 
bool isChargingStopped () const
 Get true if Vehicle is charging, false if not. More...
 
virtual void loadState (const SUMOSAXAttributes &attrs)
 Loads the state of the device from the given description. More...
 
virtual void notifyMoveInternal (const SUMOTrafficObject &veh, const double frontOnLane, const double timeOnLane, const double meanSpeedFrontOnLane, const double meanSpeedVehicleOnLane, const double travelledDistanceFrontOnLane, const double travelledDistanceVehicleOnLane, const double meanLengthOnLane)
 Internal notification about the vehicle moves. More...
 
void resetChargingStartTime ()
 Reset charging start time. More...
 
void resetVehicleStoppedTimer ()
 Reset myVehicleStopped. More...
 
virtual void saveState (OutputDevice &out) const
 Saves the state of the device. More...
 
void setActualBatteryCapacity (const double actualBatteryCapacity)
 Set actual vehicle's Battery Capacity in kWh. More...
 
void setDescription (const std::string &description)
 
void setID (const std::string &newID)
 resets the id More...
 
void setMaximumBatteryCapacity (const double maximumBatteryCapacity)
 Set total vehicle's Battery Capacity in kWh. More...
 
void setParameter (const std::string &key, const std::string &value)
 try to set the given parameter for this device. Throw exception for unsupported key More...
 
void setPowerMax (const double new_Pmax)
 Set maximum power when accelerating. More...
 
void setStoppingTreshold (const double stoppingTreshold)
 Set vehicle's stopping treshold. More...
 
 ~MSDevice_Battery ()
 Destructor. More...
 
Methods called on vehicle movement / state change, overwriting MSDevice
bool notifyMove (SUMOTrafficObject &veh, double oldPos, double newPos, double newSpeed)
 Checks for waiting steps when the vehicle moves. More...
 
Interface methods, to be derived by subclasses
virtual bool notifyEnter (SUMOTrafficObject &veh, Notification reason, const MSLane *enteredLane)
 Checks whether the reminder is activated by a vehicle entering the lane. More...
 
virtual bool notifyLeave (SUMOTrafficObject &veh, double lastPos, Notification reason, const MSLane *enteredLane=0)
 Called if the vehicle leaves the reminder's lane. More...
 
void updateDetector (SUMOTrafficObject &veh, double entryPos, double leavePos, SUMOTime entryTime, SUMOTime currentTime, SUMOTime leaveTime, bool cleanUp)
 

Static Public Member Functions

static void buildTransportableDevices (MSTransportable &p, std::vector< MSTransportableDevice * > &into)
 Build devices for the given person, if needed. More...
 
static void buildVehicleDevices (SUMOVehicle &v, std::vector< MSVehicleDevice * > &into)
 Build devices for the given vehicle, if needed. More...
 
static bool checkOptions (OptionsCont &oc)
 check device-specific options More...
 
static void cleanupAll ()
 perform cleanup for all devices More...
 
static std::mt19937 * getEquipmentRNG ()
 
template<class T >
static std::string getIDSecure (const T *obj, const std::string &fallBack="NULL")
 get an identifier for Named-like object which may be Null More...
 
static void insertOptions (OptionsCont &oc)
 Inserts MSDevice_Example-options. More...
 

Protected Member Functions

void removeFromVehicleUpdateValues (SUMOTrafficObject &veh)
 

Static Protected Member Functions

Helper methods for device assignment
static void insertDefaultAssignmentOptions (const std::string &deviceName, const std::string &optionsTopic, OptionsCont &oc, const bool isPerson=false)
 Adds common command options that allow to assign devices to vehicles. More...
 
template<class DEVICEHOLDER >
static bool equippedByDefaultAssignmentOptions (const OptionsCont &oc, const std::string &deviceName, DEVICEHOLDER &v, bool outputOptionSet, const bool isPerson=false)
 Determines whether a vehicle should get a certain device. More...
 
Helper methods for parsing parameters
static std::string getStringParam (const SUMOVehicle &v, const OptionsCont &oc, std::string paramName, std::string deflt, bool required)
 
static double getFloatParam (const SUMOVehicle &v, const OptionsCont &oc, std::string paramName, double deflt, bool required)
 
static bool getBoolParam (const SUMOVehicle &v, const OptionsCont &oc, std::string paramName, bool deflt, bool required)
 

Protected Attributes

MSChargingStationmyActChargingStation
 Parameter, Pointer to current charging station in which vehicle is placed (by default is NULL) More...
 
double myActualBatteryCapacity
 Parameter, The actual vehicles's Battery Capacity in kWh, [myActualBatteryCapacity <= myMaximumBatteryCapacity]. More...
 
bool myChargingInTransit
 Parameter, Flag: Vehicles it's charging in transit (by default is false) More...
 
double myChargingStartTime
 Parameter, Moment, wich the vehicle has beging to charging. More...
 
bool myChargingStopped
 Parameter, Flag: Vehicles it's charging stopped (by default is false) More...
 
double myConsum
 Parameter, Vehicle consum during a time step (by default is 0.) More...
 
std::string myDescription
 a description of this moveReminder More...
 
double myEnergyCharged
 Parameter, Energy charged in each timestep. More...
 
SUMOVehiclemyHolder
 The vehicle that stores the device. More...
 
std::string myID
 The name of the object. More...
 
MSLane *const myLane
 Lane on which the reminder works. More...
 
double myLastAngle
 Parameter, Vehicle's last angle. More...
 
double myMaximumBatteryCapacity
 Parameter, The total vehicles's Battery Capacity in kWh, [myMaximumBatteryCapacity >= 0]. More...
 
std::map< int, double > myParam
 Parameter collection. More...
 
double myPowerMax
 Parameter, The Maximum Power when accelerating, [myPowerMax >= 0]. More...
 
double myStoppingTreshold
 Parameter, stopping vehicle treshold [myStoppingTreshold >= 0]. More...
 
int myVehicleStopped
 Parameter, How many timestep the vehicle is stopped. More...
 

Private Member Functions

void checkParam (const SumoXMLAttr paramKey, const double lower=0., const double upper=std::numeric_limits< double >::infinity())
 
 MSDevice_Battery (const MSDevice_Battery &)
 Invalidated copy constructor. More...
 
 MSDevice_Battery (SUMOVehicle &holder, const std::string &id, const double actualBatteryCapacity, const double maximumBatteryCapacity, const double powerMax, const double stoppingTreshold, const std::map< int, double > &param)
 Constructor. More...
 
MSDevice_Batteryoperator= (const MSDevice_Battery &)
 Invalidated assignment operator. More...
 

Private Attributes

std::map< SUMOTrafficObject *, std::pair< SUMOTime, double > > myLastVehicleUpdateValues
 

Static Private Attributes

static std::mt19937 myEquipmentRNG
 A random number generator used to choose from vtype/route distributions and computing the speed factors. More...
 
static std::map< std::string, std::set< std::string > > myExplicitIDs
 vehicles which explicitly carry a device, sorted by device, first More...
 

Detailed Description

Battery device for electric vehicles.

Definition at line 45 of file MSDevice_Battery.h.

Member Enumeration Documentation

◆ Notification

Definition of a vehicle state.

Enumerator
NOTIFICATION_DEPARTED 

The vehicle has departed (was inserted into the network)

NOTIFICATION_JUNCTION 

The vehicle arrived at a junction.

NOTIFICATION_SEGMENT 

The vehicle changes the segment (meso only)

NOTIFICATION_LANE_CHANGE 

The vehicle changes lanes (micro only)

NOTIFICATION_TELEPORT 

The vehicle is being teleported.

NOTIFICATION_PARKING 

The vehicle starts or ends parking.

NOTIFICATION_ARRIVED 

The vehicle arrived at its destination (is deleted)

NOTIFICATION_VAPORIZED 

The vehicle got vaporized.

NOTIFICATION_TELEPORT_ARRIVED 

The vehicle was teleported out of the net.

NOTIFICATION_PARKING_REROUTE 

The vehicle needs another parking area.

Definition at line 91 of file MSMoveReminder.h.

Constructor & Destructor Documentation

◆ ~MSDevice_Battery()

MSDevice_Battery::~MSDevice_Battery ( )

Destructor.

Definition at line 267 of file MSDevice_Battery.cpp.

◆ MSDevice_Battery() [1/2]

MSDevice_Battery::MSDevice_Battery ( SUMOVehicle holder,
const std::string &  id,
const double  actualBatteryCapacity,
const double  maximumBatteryCapacity,
const double  powerMax,
const double  stoppingTreshold,
const std::map< int, double > &  param 
)
private

◆ MSDevice_Battery() [2/2]

MSDevice_Battery::MSDevice_Battery ( const MSDevice_Battery )
private

Invalidated copy constructor.

Member Function Documentation

◆ addTo()

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

Adds this object to the given container.

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

Definition at line 126 of file Named.h.

References Named::StoringVisitor::add().

◆ buildTransportableDevices()

void MSDevice::buildTransportableDevices ( MSTransportable p,
std::vector< MSTransportableDevice * > &  into 
)
staticinherited

Build devices for the given person, if needed.

Parameters
[in]pThe person for which a device may be built
[filled]into The vector to store the built device in

Definition at line 112 of file MSDevice.cpp.

References MSTransportableDevice_FCD::buildDevices(), and MSTransportableDevice_Routing::buildDevices().

Referenced by MSTransportable::MSTransportable().

◆ buildVehicleDevices()

◆ checkOptions()

bool MSDevice::checkOptions ( OptionsCont oc)
staticinherited

check device-specific options

Parameters
[filled]oc The options container with the user-defined options

Definition at line 86 of file MSDevice.cpp.

References MSDevice_Routing::checkOptions().

Referenced by MSFrame::checkOptions().

◆ checkParam()

void MSDevice_Battery::checkParam ( const SumoXMLAttr  paramKey,
const double  lower = 0.,
const double  upper = std::numeric_limits<double>::infinity() 
)
private

◆ cleanupAll()

void MSDevice::cleanupAll ( )
staticinherited

perform cleanup for all devices

Definition at line 119 of file MSDevice.cpp.

References MSDevice_FCD::cleanup(), MSRoutingEngine::cleanup(), and MSDevice_Tripinfo::cleanup().

Referenced by MSNet::clearAll().

◆ deviceName()

const std::string MSDevice_Battery::deviceName ( ) const
inlinevirtual

return the name for this type of device

Implements MSDevice.

Definition at line 83 of file MSDevice_Battery.h.

Referenced by getParameter(), and setParameter().

◆ equippedByDefaultAssignmentOptions()

template<class DEVICEHOLDER >
bool MSDevice::equippedByDefaultAssignmentOptions ( const OptionsCont oc,
const std::string &  deviceName,
DEVICEHOLDER &  v,
bool  outputOptionSet,
const bool  isPerson = false 
)
staticprotectedinherited

◆ generateOutput()

virtual void MSDevice::generateOutput ( ) const
inlinevirtualinherited

Called on writing tripinfo output.

The device may write some statistics into the tripinfo output. It is assumed that the written information is a valid xml-snipplet, which will be embedded within the vehicle's information.

The device should use the openTag / closeTag methods of the OutputDevice for correct indentation.

Exceptions
IOErrornot yet implemented

Reimplemented in MSDevice_SSM, MSDevice_Tripinfo, MSDevice_Bluelight, MSDevice_Example, MSDevice_Vehroutes, and MSDevice_Emissions.

Definition at line 124 of file MSDevice.h.

◆ getActualBatteryCapacity()

double MSDevice_Battery::getActualBatteryCapacity ( ) const

Get the actual vehicle's Battery Capacity in kWh.

Definition at line 347 of file MSDevice_Battery.cpp.

References myActualBatteryCapacity.

Referenced by MSChargingStation::addChargeValueForOutput(), getParameter(), notifyMove(), and MSBatteryExport::write().

◆ getBoolParam()

bool MSDevice::getBoolParam ( const SUMOVehicle v,
const OptionsCont oc,
std::string  paramName,
bool  deflt,
bool  required 
)
staticprotectedinherited

◆ getChargingStartTime()

double MSDevice_Battery::getChargingStartTime ( ) const

Get charging start time.

Definition at line 383 of file MSDevice_Battery.cpp.

References myChargingStartTime.

Referenced by MSChargingStation::addChargeValueForOutput(), and notifyMove().

◆ getChargingStationID()

std::string MSDevice_Battery::getChargingStationID ( ) const

Get current Charging Station ID.

Definition at line 389 of file MSDevice_Battery.cpp.

References Named::getID(), and myActChargingStation.

Referenced by getParameter(), and MSBatteryExport::write().

◆ getConsum()

double MSDevice_Battery::getConsum ( ) const

Get consum.

Definition at line 365 of file MSDevice_Battery.cpp.

References myConsum.

Referenced by getParameter(), and MSBatteryExport::write().

◆ getDescription()

const std::string& MSMoveReminder::getDescription ( ) const
inlineinherited

Definition at line 230 of file MSMoveReminder.h.

References MSMoveReminder::myDescription.

◆ getEnergyCharged()

double MSDevice_Battery::getEnergyCharged ( ) const

Get charged energy.

Definition at line 398 of file MSDevice_Battery.cpp.

References myEnergyCharged.

Referenced by getParameter(), and MSBatteryExport::write().

◆ getEnergyParams()

const std::map<int, double>& MSDevice_Battery::getEnergyParams ( ) const
inline

retrieve parameters for the energy consumption model

Definition at line 165 of file MSDevice_Battery.h.

References myParam.

Referenced by MSBaseVehicle::getEmissionParameters().

◆ getEquipmentRNG()

static std::mt19937* MSDevice::getEquipmentRNG ( )
inlinestaticinherited

◆ getFloatParam()

◆ getHolder()

SUMOVehicle& MSVehicleDevice::getHolder ( ) const
inlineinherited

Returns the vehicle that holds this device.

Returns
The vehicle that holds this device

Definition at line 74 of file MSVehicleDevice.h.

References MSVehicleDevice::myHolder.

Referenced by MSChargingStation::addChargeValueForOutput().

◆ getID()

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

Returns the id.

Returns
The stored id

Definition at line 76 of file Named.h.

References Named::myID.

Referenced by MSLCM_LC2013::adaptSpeedToPedestrians(), MSVehicle::adaptToLeader(), MSVehicle::adaptToLeaders(), MSPModel_Remote::add(), MSPModel_Striping::add(), LaneStoringVisitor::add(), MSVehicleTransfer::add(), PCPolyContainer::add(), MSDetectorControl::add(), Named::StoringVisitor::add(), ShapeContainer::add(), NLTriggerBuilder::addAccess(), RORouteDef::addAlternative(), MSLane::addApproachingLane(), NBLoadedSUMOTLDef::addConnection(), NLHandler::addConnection(), MSPModel_Striping::addCrossingVehs(), RODFDetectorCon::addDetector(), RONet::addEdge(), ROJTREdge::addFollowerProbability(), MSTLLogicControl::TLSLogicVariants::addLogic(), MSLane::addNeigh(), RONet::addNode(), NIImporter_SUMO::addPhase(), GUIEdge::addRerouter(), RONet::addRouteDef(), NIXMLEdgesHandler::addSplit(), NBTrafficLightLogic::addStep(), ROVehicle::addStop(), MSRouteHandler::addStop(), MSVehicle::addStop(), MSNet::addStoppingPlace(), MSVehicle::addTraciStop(), MSVehicle::addTraciStopAtStoppingPlace(), AGActivityTripWriter::addTrip(), NIXMLConnectionsHandler::addWalkingArea(), libsumo::Helper::applySubscriptionFilters(), GUITrafficLightLogicWrapper::begin2TrackPhases(), MSTransportable::Stage_Waiting::beginEventOutput(), MSTransportable::Stage_Driving::beginEventOutput(), MSPModel_Striping::blockedAtDist(), MSLink::blockedAtTime(), MSLink::blockedByFoe(), NLEdgeControlBuilder::build(), NIVisumTL::build(), RODFNet::buildApproachList(), MSSOTLE2Sensors::buildContinueSensior(), MSSOTLE2Sensors::buildCountSensorForLane(), MSSOTLE2Sensors::buildCountSensorForOutLane(), NBNode::buildCrossings(), NBNode::buildCrossingsAndWalkingAreas(), NIImporter_VISUM::buildDistrictNode(), MSRailSignal::LinkInfo::buildDriveWay(), NLDetectorBuilder::buildE2Detector(), RODFNet::buildEdgeFlowMap(), GNETLSEditorFrame::buildIinternalLanes(), NBEdge::buildInnerEdges(), NGEdge::buildNBEdge(), NIVissimEdge::buildNBEdge(), NBRampsComputer::buildOffRamp(), NBRampsComputer::buildOnRamp(), MSRailSignal::DriveWay::buildRoute(), MELoop::buildSegmentsFor(), MSSOTLE2Sensors::buildSensorForLane(), MSSOTLE2Sensors::buildSensorForOutLane(), NBNode::buildWalkingAreas(), MSBaseVehicle::calculateArrivalParams(), MSSwarmTrafficLightLogic::calculateEtaDiff(), MSSwarmTrafficLightLogic::calculateEtaRatio(), MSSOTLPolicyBasedTrafficLightLogic::canRelease(), MSVehicle::canReverse(), MSLaneChanger::changeOpposite(), MELoop::changeSegment(), MSSimpleTrafficLightLogic::changeStepAndDuration(), MSEdge::checkAndRegisterBiDirEdge(), MSRailSignal::DriveWay::checkCrossingFlanks(), MSLane::checkForPedestrians(), MSVehicleTransfer::checkInsertions(), MSVehicle::checkLinkLeader(), checkParam(), MSE2Collector::checkPositioning(), MSVehicle::checkRewindLinkLanes(), MSLCM_SL2015::checkStrategicChange(), MSSwarmTrafficLightLogic::choosePolicy(), MSDevice_SSM::classifyEncounter(), ShapeContainer::clearHighlights(), NBTrafficLightLogic::closeBuilding(), ODDistrictHandler::closeDistrict(), NLHandler::closeEdge(), RORouteHandler::closeRouteDistribution(), RORouteHandler::closeVehicle(), NBTrafficLightDefinition::collectAllLinks(), NBTrafficLightDefinition::collectEdges(), NBLoadedSUMOTLDef::collectEdgeVectors(), NBLoadedTLDef::collectLinks(), ROJTRRouter::compute(), IntermodalRouter< E, L, N, V >::compute(), NBTrafficLightDefinition::compute(), NBNode::computeInternalLaneShape(), NBNode::computeLanes2Lanes(), NBNode::computeLogic(), NBOwnTLDef::computeLogicAndConts(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), NBNodeTypeComputer::computeNodeTypes(), RODFNet::computeRoutesFor(), NBTrafficLightLogicCont::computeSingleLogic(), NBNode::computeSmoothShape(), NBTurningDirectionsComputer::computeTurnDirectionsForNode(), MSVehicle::Manoeuvre::configureEntryManoeuvre(), MSVehicle::Manoeuvre::configureExitManoeuvre(), NGNet::connect(), NBOwnTLDef::corridorLike(), MSSOTLWaveTrafficLightLogic::countVehicles(), MSSOTLE2Sensors::countVehicles(), MSDevice_SSM::createEncounters(), GUINet::createTLWrapper(), MSDeterministicHiLevelTrafficLightLogic::decideNextPhase(), MSSOTLPolicyBasedTrafficLightLogic::decideNextPhase(), MSActuatedTrafficLightLogic::decideNextPhase(), MSSwarmTrafficLightLogic::decideNextPhase(), MSDeterministicHiLevelTrafficLightLogic::decidePolicy(), MSSwarmTrafficLightLogic::decidePolicy(), MSLane::detectCollisionBetween(), MSLane::detectCollisions(), MSLane::detectPedestrianJunctionCollision(), NIVissimDistrictConnection::dict_BuildDistrictNodes(), NIVissimDistrictConnection::dict_BuildDistricts(), MSTransportable::Stage_Waiting::endEventOutput(), MSTransportable::Stage_Driving::endEventOutput(), MSE3Collector::enter(), MSVehicle::enterLaneAtMove(), MSVehicle::Manoeuvre::entryManoeuvreIsComplete(), METriggeredCalibrator::execute(), Command_SaveTLSState::execute(), Command_SaveTLSSwitchStates::execute(), Command_SaveTLSProgram::execute(), Command_SaveTLSSwitches::execute(), MSVTypeProbe::execute(), MSCalibrator::execute(), MSPModel_Striping::MovePedestrians::execute(), MSVehicle::executeMove(), MSLane::executeMovements(), NBNodeCont::extract(), NBTrafficLightLogicCont::extract(), libsumo::Helper::findCloserLane(), MSRailSignal::DriveWay::findFlankProtection(), MSDevice_SSM::findFoeConflictLane(), libsumo::Simulation::findIntermodalRoute(), MSDevice_SSM::findSurroundingVehicles(), MSDevice_SSM::flushConflicts(), NBTrafficLightDefinition::forbids(), NBNodeCont::generateNodeClusters(), GUITrafficLightLogicWrapper::getActiveTLLogic(), RODFDetectorCon::getAggFlowFor(), RODFDetectorCon::getAnyDetectorForEdge(), MSPModel_Striping::getArbitraryPath(), MSVehicle::getBackPosition(), MSVehicle::getBackPositionOnLane(), libsumo::Vehicle::getBestLanes(), NBOwnTLDef::getBestPair(), NBRailwayTopologyAnalyzer::getBrokenRailNodes(), MSVehicle::getCenterOnEdge(), getChargingStationID(), MSRailSignal::getClickableTLLinkID(), libsumo::TrafficLight::getControlledLinks(), MSLane::getCriticalLeader(), NBNodeShapeComputer::getDefaultRadius(), NBTrafficLightDefinition::getDescription(), MSLink::getDescription(), GUIPerson::getDestinationEdgeID(), RODFNet::getDetectorEdge(), MSActuatedTrafficLightLogic::getDetectorPriority(), libsumo::Lane::getEdgeID(), GUIMEVehicle::getEdgeID(), GUIPerson::getEdgeID(), MSMeanData::getEdgeID(), MSPModel_Remote::getFirstPedestrianLane(), MSLane::getFollower(), MSLane::getFollowersOnConsecutive(), GUIPerson::getFromEdgeID(), MSCalibrator::getID(), NBEdge::getID(), libsumo::LaneArea::getLaneID(), libsumo::InductionLoop::getLaneID(), libsumo::Vehicle::getLaneID(), MSParkingArea::getLastFreePosWithReservation(), MSLane::getLastVehicleInformation(), MSVehicle::getLatOffset(), MSLane::getLeader(), MSLink::getLeaderInfo(), MSLane::getLeaderOnConsecutive(), MSLane::getLeadersOnConsecutive(), MSLink::getLengthBeforeCrossing(), MSLane::getLinkTo(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForInputLanes(), MSDeterministicHiLevelTrafficLightLogic::getMeanSpeedForOutputLanes(), NIImporter_VISUM::getNamedEdgeContinuating(), MSPerson::getNextEdge(), MSPModel_Striping::getNextLane(), MSLane::getOppositeFollower(), MSLane::getOppositeLeader(), MSLane::getOppositePos(), libsumo::Simulation::getParameter(), GUITrafficLightLogicWrapper::getParameterWindow(), GUILane::getParameterWindow(), GUILane::getParentName(), MSLane::getPartialBehind(), MSSOTLTrafficLightLogic::getPhaseIndexWithMaxCTS(), MSSwarmTrafficLightLogic::getPheromoneForInputLanes(), MSSwarmTrafficLightLogic::getPheromoneForOutputLanes(), PolygonDynamics::getPolygonID(), GUITrafficLightLogicWrapper::getPopUpMenu(), NLTriggerBuilder::getPosition(), NLDetectorBuilder::getPositionChecking(), libsumo::Person::getRoadID(), libsumo::Vehicle::getRoadID(), MSLCM_LC2013::getRoundaboutDistBonus(), libsumo::Vehicle::getRouteID(), MSVehicle::getSafeFollowSpeed(), libsumo::Person::getStage(), MSContainer::MSContainerStage_Driving::getStageSummary(), MSPerson::MSPersonStage_Walking::getStageSummary(), MSContainer::MSContainerStage_Tranship::getStageSummary(), MSPerson::MSPersonStage_Driving::getStageSummary(), MSTransportable::Stage_Trip::getStageSummary(), MSTransportable::Stage_Waiting::getStageSummary(), MSNet::getStoppingPlaceID(), MSLane::getSurroundingVehicles(), MSActuatedTrafficLightLogic::getTarget(), MSRailSignal::getTLLinkID(), MSLane::getUpcomingLinks(), MSDevice_SSM::getUpstreamVehicles(), MSPModel_Striping::getVehicleObstacles(), MSDevice_SSM::getVehiclesOnJunction(), MSEdge::getWaitingVehicle(), MSLink::getZipperSpeed(), NBNode::guessCrossings(), RODFDetectorCon::guessEmptyFlows(), NBNodeCont::guessTLs(), GUITLLogicPhasesTrackerWindow::GUITLLogicPhasesTrackerWindow(), MSLane::handleCollisionBetween(), MSVehicle::haveValidStopEdges(), libsumo::POI::highlight(), MSVehicle::ignoreRed(), MSDeterministicHiLevelTrafficLightLogic::init(), MSRailSignal::init(), MSActuatedTrafficLightLogic::init(), MSDelayBasedTrafficLightLogic::init(), MSTrafficLightLogic::init(), MSSOTLTrafficLightLogic::init(), MSSwarmTrafficLightLogic::init(), MSE2Collector::initAuxiliaries(), NIImporter_SUMO::initTrafficLightLogic(), NIXMLTrafficLightsHandler::initTrafficLightLogic(), NBDistrictCont::insert(), NBTrafficLightLogicCont::insert(), NBNodeCont::insert(), MSEdge::insertVehicle(), MSLane::integrateNewVehicles(), GNEJunction::invalidateTLS(), NBNode::invalidateTLS(), MSTLLogicControl::isActive(), MSPedestrianPushButton::isActiveForEdge(), MSPedestrianPushButton::isActiveOnAnySideOfTheRoad(), RODFNet::isDestination(), RODFNet::isFalseSource(), MSLane::isInsertionSuccess(), MSVehicle::isLeader(), MESegment::isOpen(), RODFNet::isSource(), NIImporter_VISUM::isSplitEdge(), MSSOTLTrafficLightLogic::isThresholdPassed(), MESegment::jamThresholdForSpeed(), NBNodeShapeComputer::joinSameDirectionEdges(), NBEdgeCont::joinSameNodeConnectingEdges(), MSAbstractLaneChangeModel::laneChangeOutput(), MSE3Collector::leave(), MSE3Collector::leaveFront(), MSDevice_BTreceiver::BTreceiverUpdate::leaveRange(), MSPedestrianPushButton::loadCrossingEdgeMap(), NIImporter_OpenDrive::loadNetwork(), MSPedestrianPushButton::loadPushButtons(), ODDistrictCont::makeDistricts(), MSE2Collector::makeVehicleInfo(), MSSOTLE2Sensors::meanVehiclesSpeed(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::moveInDirectionOnLane(), MSPModel_Striping::PState::moveToNextLane(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), libsumo::Helper::moveToXYMap(), MSCalibrator::MSCalibrator(), MSChargingStation::MSChargingStation(), MSDevice_Battery(), MSE2Collector::MSE2Collector(), NBLoadedTLDef::myCompute(), NIImporter_SUMO::myEndElement(), MSLaneSpeedTrigger::myStartElement(), MSTriggeredRerouter::myStartElement(), MSPModel_Striping::nextBlocking(), MSE3Collector::MSE3EntryReminder::notifyEnter(), MSMeanData::MeanDataValues::notifyEnter(), MSDevice_BTsender::notifyEnter(), MSDevice_Bluelight::notifyEnter(), MSDevice_BTreceiver::notifyEnter(), MSDevice_Example::notifyEnter(), MSMeanData_Net::MSLaneMeanDataValues::notifyEnter(), MSTriggeredRerouter::notifyEnter(), MSE3Collector::MSE3LeaveReminder::notifyEnter(), MSMeanData::MeanDataValueTracker::notifyEnter(), MSE2Collector::notifyEnter(), MSDevice_SSM::notifyEnter(), MSDevice_Transportable::notifyLeave(), MSDevice_Bluelight::notifyLeave(), MSDevice_Example::notifyLeave(), MSDevice_BTsender::notifyLeave(), MSDevice_BTreceiver::notifyLeave(), MSE2Collector::notifyLeave(), MSDevice_SSM::notifyLeave(), MSDevice_Bluelight::notifyMove(), MSDevice_Example::notifyMove(), MSDevice_BTsender::notifyMove(), MSDevice_BTreceiver::notifyMove(), MSDevice_ToC::notifyMove(), MSE2Collector::notifyMove(), MSDevice_SSM::notifyMove(), GUIViewTraffic::onGamingClick(), MSLink::opened(), RORouteHandler::openRoute(), RODFNet::idComp::operator()(), NBNetBuilder::by_id_sorter::operator()(), NBNode::nodes_by_id_sorter::operator()(), MSLane::incoming_lane_priority_sorter::operator()(), MSLane::outgoing_lane_priority_sorter::operator()(), NIImporter_VISUM::parse_Connectors_legacy(), NIImporter_VISUM::parse_EdgePolys(), NIImporter_VISUM::parse_Lanes(), NIImporter_VISUM::parse_Turns(), NLTriggerBuilder::parseAndBuildCalibrator(), MSRouteHandler::parseWalkPositions(), NBLoadedSUMOTLDef::patchIfCrossingsAdded(), MSLCM_LC2013::patchSpeed(), MSLCM_SL2015::patchSpeed(), NBLoadedTLDef::SignalGroup::patchTYellow(), MSVehicle::planMove(), MSVehicle::planMoveInternal(), MSLane::planMovements(), MSInternalJunction::postloadInit(), MSRightOfWayJunction::postloadInit(), AGStreet::print(), MSDevice_SSM::processEncounters(), MSVehicle::processLaneAdvances(), MSVehicle::processLinkApproaches(), MSVehicle::processNextStop(), NIXMLNodesHandler::processNodeType(), TraCIServerAPI_Vehicle::processSet(), MEVehicle::processStop(), NIXMLNodesHandler::processTrafficLightDefinitions(), MSDelayBasedTrafficLightLogic::proposeProlongation(), NBNodeCont::pruneClusterFringe(), MSPModel_Striping::PState::PState(), MSOffTrafficLightLogic::rebuildPhase(), NBEdge::recheckLanes(), NBEdgeCont::recheckPostProcessConnections(), NIImporter_OpenStreetMap::reconstructLayerElevation(), NBLoadedSUMOTLDef::reconstructLogic(), MSLink::removeApproaching(), MSVehicle::removePassedDriveItems(), GNEJunction::removeTLSConnections(), NBNodeCont::rename(), GNENet::renameJunction(), RORouteDef::repairCurrentRoute(), GNEJunction::replaceIncomingConnections(), MSVehicle::replaceParkingArea(), MSVehicle::replaceRoute(), MSBaseVehicle::replaceRouteEdges(), NIImporter_DlrNavteq::TrafficlightsHandler::report(), NLEdgeControlBuilder::reportCurrentEdgeOrLane(), MSDevice_ToC::requestToC(), MSBaseVehicle::reroute(), MSRailSignal::LinkInfo::reroute(), GUIVehicle::rerouteDRTStop(), MSTriggeredRerouter::rerouteParkingArea(), MSVehicle::rerouteParkingArea(), MSLane::resetManeuverReservation(), MSLane::resetPartialOccupation(), RODFNet::revalidateFlows(), NBRailwayTopologyAnalyzer::reverseEdges(), RONet::saveAndRemoveRoutesUntil(), ROVehicle::saveAsXML(), ROPerson::Ride::saveAsXML(), MSTransportableDevice_Routing::saveState(), MSDevice_Routing::saveState(), MSDevice::saveState(), MSDevice_Vehroutes::saveState(), MSDevice_Tripinfo::saveState(), MSBaseVehicle::saveState(), MSLane::saveState(), GUIVehicle::selectBlockingFoes(), MSE2Collector::selectLanes(), MSLink::setApproaching(), NBNodeCont::setAsTLControlled(), GNEEdge::setAttribute(), MSChargingStation::setChargeDelay(), MSChargingStation::setChargingPower(), NLEdgeControlBuilder::setDefaultStopOffsets(), MSChargingStation::setEfficency(), MSLane::setManeuverReservation(), setMaximumBatteryCapacity(), NBEdge::setNodeBorder(), NIXMLEdgesHandler::setNodes(), NIImporter_OpenDrive::setNodeSecure(), MSLane::setPartialOccupation(), setPowerMax(), MSLink::setRequestInformation(), setStoppingTreshold(), NBLoadedSUMOTLDef::setTLControllingInformation(), NBOwnTLDef::setTLControllingInformation(), NBTrafficLightLogicCont::setTLControllingInformation(), NBLoadedTLDef::setTLControllingInformation(), NBEdge::shiftPositionAtNode(), MSLane::sortManeuverReservations(), IntermodalNetwork< E, L, N, V >::splitEdge(), MSLaneChangerSublane::startChangeSublane(), MSStopOut::stopEnded(), MSStopOut::stopStarted(), MSLane::succLinkSec(), GUITrafficLightLogicWrapper::switchTLSLogic(), MELoop::teleportVehicle(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), MSSOTLTrafficLightLogic::trySwitch(), PolygonDynamics::update(), MSDevice_SSM::update(), MSDevice_SSM::updateAndWriteOutput(), MSVehicle::updateBestLanes(), MSLCM_SL2015::updateCFRelated(), MSSOTLTrafficLightLogic::updateCTS(), NLEdgeControlBuilder::updateCurrentLaneStopOffsets(), MSVehicle::updateDriveItems(), GNETLSEditorFrame::TLSJunction::updateJunctionDescription(), MSSwarmTrafficLightLogic::updatePheromoneLevels(), MSSwarmTrafficLightLogic::updateSensitivities(), MSAbstractLaneChangeModel::updateTargetLane(), MSDevice_BTreceiver::BTreceiverUpdate::updateVisibility(), NBNodeTypeComputer::validateRailCrossings(), MSLCM_LC2013::wantsChange(), MSLCM_SL2015::wantsChange(), MSLCM_SL2015::wantsChangeSublane(), NBParking::write(), MSEmissionExport::write(), MSBatteryExport::write(), MSFCDExport::write(), MSInstantInductLoop::write(), MSLink::writeApproaching(), MSRailSignal::writeBlocks(), NWWriter_DlrNavteq::writeConnectedLanes(), NWWriter_SUMO::writeDistrict(), MSFullExport::writeEdge(), MSXMLRawOut::writeEdge(), NWWriter_SUMO::writeEdge(), MSMeanData::writeEdge(), NWWriter_XML::writeEdgesAndConnections(), RODFDetector::writeEmitterDefinition(), RODFDetectorCon::writeEmitterPOIs(), RODFDetectorCon::writeEmitters(), RODFDetectorCon::writeEndRerouterDetectors(), NWWriter_OpenDrive::writeInternalEdge(), writeInterval(), NWWriter_SUMO::writeJunction(), MSQueueExport::writeLane(), MSFullExport::writeLane(), MSXMLRawOut::writeLane(), NWWriter_DlrNavteq::writeLinksUnsplitted(), NWWriter_OpenDrive::writeNetwork(), NWWriter_XML::writeNodes(), NWWriter_DlrNavteq::writeNodesUnsplitted(), NWWriter_SUMO::writeRoundabout(), RODFDetectorCon::writeSpeedTrigger(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), RODFDetectorCon::writeValidationDetectors(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), SUMOPolygon::writeXML(), MSRouteProbe::writeXMLOutput(), MSInductLoop::writeXMLOutput(), MSE2Collector::writeXMLOutput(), and RONet::~RONet().

◆ getIDSecure()

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

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

Definition at line 69 of file Named.h.

Referenced by MSLCM_LC2013::_wantsChange(), MSLCM_SL2015::_wantsChangeSublane(), MSLaneChanger::changeOpposite(), MSVehicle::checkRewindLinkLanes(), DijkstraRouter< E, V >::compute(), AStarRouter< E, V >::compute(), NBEdge::computeEdge2Edges(), NBEdge::computeLanes2Edges(), NBOwnTLDef::computeLogicAndConts(), MSLaneChanger::continueChange(), MSLane::detectCollisions(), MSRailSignal::DriveWay::findProtection(), NBPTLineCont::findWay(), MSCFModel_W99::followSpeed(), MSCFModel_CACC::followSpeed(), MSVehicle::getBackPositionOnLane(), NBOwnTLDef::getBestCombination(), NBOwnTLDef::getBestPair(), MSVehicle::getCenterOnEdge(), MSLaneChanger::getColumnleader(), NBEdge::Connection::getDescription(), MSLane::getFollowersOnConsecutive(), GUIVehicle::getLaneID(), MSVehicle::getLatOffset(), MSLane::getLeaderOnConsecutive(), MSLaneChanger::getRealLeader(), GUIVehicle::getShadowLaneID(), GUIVehicle::getTargetLaneID(), NBEdge::init(), MSLane::isInsertionSuccess(), MESegment::isOpen(), joinNamedToString(), joinNamedToStringSorting(), MSPModel_Striping::PState::moveToNextLane(), libsumo::Person::moveToXY(), libsumo::Vehicle::moveToXY(), libsumo::Helper::moveToXYMap(), operator<<(), NBEdge::recheckLanes(), MSTriggeredRerouter::rerouteParkingArea(), MSLCM_LC2013::saveBlockerLength(), MSLCM_SL2015::saveBlockerLength(), MSLCM_LC2013::slowDownForBlocked(), MSLCM_SL2015::slowDownForBlocked(), MSLaneChangerSublane::startChangeSublane(), toString(), MSLeaderInfo::toString(), MSLeaderDistanceInfo::toString(), MSCriticalFollowerDistanceInfo::toString(), MSVehicle::updateBestLanes(), and MSAbstractLaneChangeModel::updateShadowLane().

◆ getLane()

const MSLane* MSMoveReminder::getLane ( ) const
inlineinherited

◆ getMaximumBatteryCapacity()

double MSDevice_Battery::getMaximumBatteryCapacity ( ) const

Get the total vehicle's Battery Capacity in kWh.

Definition at line 353 of file MSDevice_Battery.cpp.

References myMaximumBatteryCapacity.

Referenced by MSChargingStation::addChargeValueForOutput(), getParameter(), notifyMove(), and MSBatteryExport::write().

◆ getMaximumPower()

double MSDevice_Battery::getMaximumPower ( ) const

Get the maximum power when accelerating.

Definition at line 359 of file MSDevice_Battery.cpp.

References myPowerMax.

◆ getNumericalID()

SUMOVehicle::NumericalID MSVehicleDevice::getNumericalID ( ) const
inlineinherited

Definition at line 78 of file MSVehicleDevice.h.

References SUMOVehicle::getNumericalID(), and MSVehicleDevice::myHolder.

◆ getParameter()

std::string MSDevice_Battery::getParameter ( const std::string &  key) const
virtual

◆ getStoppingTreshold()

double MSDevice_Battery::getStoppingTreshold ( ) const

Get stopping treshold.

Definition at line 410 of file MSDevice_Battery.cpp.

References myStoppingTreshold.

Referenced by MSChargingStation::addChargeValueForOutput().

◆ getStringParam()

std::string MSDevice::getStringParam ( const SUMOVehicle v,
const OptionsCont oc,
std::string  paramName,
std::string  deflt,
bool  required 
)
staticprotectedinherited

◆ getVehicleStopped()

int MSDevice_Battery::getVehicleStopped ( ) const

Get number of timestep that vehicle is stopped.

Definition at line 404 of file MSDevice_Battery.cpp.

References myVehicleStopped.

Referenced by MSBatteryExport::write().

◆ increaseChargingStartTime()

void MSDevice_Battery::increaseChargingStartTime ( )

Increase Charging Start time.

Definition at line 329 of file MSDevice_Battery.cpp.

References myChargingStartTime, and TS.

Referenced by notifyMove().

◆ increaseVehicleStoppedTimer()

void MSDevice_Battery::increaseVehicleStoppedTimer ( )

Increase myVehicleStopped.

Definition at line 341 of file MSDevice_Battery.cpp.

References myVehicleStopped.

Referenced by notifyMove().

◆ insertDefaultAssignmentOptions()

void MSDevice::insertDefaultAssignmentOptions ( const std::string &  deviceName,
const std::string &  optionsTopic,
OptionsCont oc,
const bool  isPerson = false 
)
staticprotectedinherited

◆ insertOptions()

void MSDevice_Battery::insertOptions ( OptionsCont oc)
static

Inserts MSDevice_Example-options.

Parameters
[filled]oc The options container to add the options to

Definition at line 47 of file MSDevice_Battery.cpp.

References MSDevice::insertDefaultAssignmentOptions().

Referenced by MSDevice::insertOptions().

◆ isChargingInTransit()

bool MSDevice_Battery::isChargingInTransit ( ) const

Get true if Vehicle it's charging, false if not.

Definition at line 377 of file MSDevice_Battery.cpp.

References myChargingInTransit.

Referenced by MSBatteryExport::write().

◆ isChargingStopped()

bool MSDevice_Battery::isChargingStopped ( ) const

Get true if Vehicle is charging, false if not.

Definition at line 371 of file MSDevice_Battery.cpp.

References myChargingStopped.

Referenced by MSBatteryExport::write().

◆ loadState()

void MSDevice::loadState ( const SUMOSAXAttributes attrs)
virtualinherited

Loads the state of the device from the given description.

The default implementation does nothing.

Parameters
[in]attrsXML attributes describing the current state

Reimplemented in MSDevice_Tripinfo, MSDevice_Vehroutes, MSDevice_Routing, and MSTransportableDevice_Routing.

Definition at line 148 of file MSDevice.cpp.

◆ notifyEnter()

virtual bool MSMoveReminder::notifyEnter ( SUMOTrafficObject veh,
Notification  reason,
const MSLane enteredLane 
)
inlinevirtualinherited

Checks whether the reminder is activated by a vehicle entering the lane.

Lane change means in this case that the vehicle changes to the lane the reminder is placed at.

Parameters
[in]vehThe entering vehicle.
[in]reasonhow the vehicle enters the lane
Returns
True if vehicle enters the reminder.
See also
Notification

Reimplemented in MSInductLoop, MSDevice_BTreceiver, MSDevice_BTsender, MSE3Collector::MSE3LeaveReminder, MSE3Collector::MSE3EntryReminder, MSDevice_SSM, MSMeanData::MeanDataValueTracker, MSCalibrator::VehicleRemover, MSTriggeredRerouter, MSDevice_Tripinfo, MSDevice_Routing, MSMeanData_Net::MSLaneMeanDataValues, MSMeanData_Amitran::MSLaneMeanDataValues, MSDevice_Bluelight, MSDevice_Example, MSMeanData::MeanDataValues, MSDevice_Vehroutes, MSRouteProbe, MSDevice_Transportable, MSE2Collector, and MSDevice_FCD.

Definition at line 130 of file MSMoveReminder.h.

References UNUSED_PARAMETER.

◆ notifyLeave()

virtual bool MSMoveReminder::notifyLeave ( SUMOTrafficObject veh,
double  lastPos,
Notification  reason,
const MSLane enteredLane = 0 
)
inlinevirtualinherited

Called if the vehicle leaves the reminder's lane.

Informs if vehicle leaves reminder lane (due to lane change, removal from the network, or leaving to the next lane). The default is to do nothing.

Parameters
[in]vehThe leaving vehicle.
[in]lastPosPosition on the lane when leaving.
[in]reasonhow the vehicle leaves the lane
See also
Notification
Returns
True if the reminder wants to receive further info.

Reimplemented in MSDevice_BTreceiver, MSDevice_BTsender, MSDevice_Vehroutes, MSDevice_SSM, MSE2Collector, MSMeanData::MeanDataValueTracker, MSE3Collector::MSE3LeaveReminder, MSTriggeredRerouter, MSInductLoop, MSDevice_Tripinfo, MSMeanData::MeanDataValues, MSE3Collector::MSE3EntryReminder, MSDevice_Bluelight, MSDevice_Example, MSInstantInductLoop, MSMeanData_Net::MSLaneMeanDataValues, and MSDevice_Transportable.

Definition at line 176 of file MSMoveReminder.h.

References UNUSED_PARAMETER.

◆ notifyMove()

bool MSDevice_Battery::notifyMove ( SUMOTrafficObject veh,
double  oldPos,
double  newPos,
double  newSpeed 
)
virtual

◆ notifyMoveInternal()

virtual void MSMoveReminder::notifyMoveInternal ( const SUMOTrafficObject veh,
const double  frontOnLane,
const double  timeOnLane,
const double  meanSpeedFrontOnLane,
const double  meanSpeedVehicleOnLane,
const double  travelledDistanceFrontOnLane,
const double  travelledDistanceVehicleOnLane,
const double  meanLengthOnLane 
)
inlinevirtualinherited

Internal notification about the vehicle moves.

Note
meso uses this though it never calls notifyMove()

Indicator if the reminders is still active for the passed vehicle/parameters. If false, the vehicle will erase this reminder from it's reminder-container.

Parameters
[in]vehVehicle that asks this reminder.
[in]frontOnLanetime the front of the vehicle spent on the lane.
[in]timeOnLanetime some part of the vehicle spent on the lane.
[in]meanSpeedFrontOnLaneAverage speed for the time that the front is on the lane.
[in]meanSpeedVehicleOnLaneAverage speed for the time that the vehicle is on the lane (with front or back).
[in]travelledDistanceFrontOnLanedistance travelled while overlapping with the lane.
[in]travelledDistanceVehicleOnLanedistance travelled while front was on the lane.
[in]meanLengthOnLanethe average length of the vehicle's part on the lane during the last step (==complete length in meso case)

Reimplemented in MSMeanData_Amitran::MSLaneMeanDataValues, MSMeanData_Emissions::MSLaneMeanDataValues, MSMeanData_Harmonoise::MSLaneMeanDataValues, MSMeanData_Net::MSLaneMeanDataValues, MSDevice_Tripinfo, MSDevice_Transportable, MSMeanData::MeanDataValueTracker, and MSDevice_Emissions.

Definition at line 208 of file MSMoveReminder.h.

References UNUSED_PARAMETER.

Referenced by MSMoveReminder::updateDetector().

◆ operator=()

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

Invalidated assignment operator.

◆ removeFromVehicleUpdateValues()

void MSMoveReminder::removeFromVehicleUpdateValues ( SUMOTrafficObject veh)
protectedinherited

◆ resetChargingStartTime()

void MSDevice_Battery::resetChargingStartTime ( )

Reset charging start time.

Definition at line 323 of file MSDevice_Battery.cpp.

References myChargingStartTime.

Referenced by notifyMove().

◆ resetVehicleStoppedTimer()

void MSDevice_Battery::resetVehicleStoppedTimer ( )

Reset myVehicleStopped.

Definition at line 335 of file MSDevice_Battery.cpp.

References myVehicleStopped.

Referenced by notifyMove().

◆ saveState()

void MSDevice::saveState ( OutputDevice out) const
virtualinherited

Saves the state of the device.

The default implementation writes a warning and does nothing.

Parameters
[in]outThe OutputDevice to write the information into

Reimplemented in MSDevice_Tripinfo, MSDevice_Vehroutes, MSDevice_Routing, MSTransportableDevice_Routing, MSDevice_FCD, and MSTransportableDevice_FCD.

Definition at line 142 of file MSDevice.cpp.

References Named::getID(), and WRITE_WARNING.

◆ setActualBatteryCapacity()

void MSDevice_Battery::setActualBatteryCapacity ( const double  actualBatteryCapacity)

Set actual vehicle's Battery Capacity in kWh.

Definition at line 281 of file MSDevice_Battery.cpp.

References myActualBatteryCapacity, and myMaximumBatteryCapacity.

Referenced by notifyMove(), and setParameter().

◆ setDescription()

void MSMoveReminder::setDescription ( const std::string &  description)
inlineinherited

◆ setID()

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

◆ setMaximumBatteryCapacity()

void MSDevice_Battery::setMaximumBatteryCapacity ( const double  maximumBatteryCapacity)

Set total vehicle's Battery Capacity in kWh.

Definition at line 293 of file MSDevice_Battery.cpp.

References Named::getID(), myMaximumBatteryCapacity, SUMO_ATTR_MAXIMUMBATTERYCAPACITY, toString(), and WRITE_WARNING.

Referenced by setParameter().

◆ setParameter()

void MSDevice_Battery::setParameter ( const std::string &  key,
const std::string &  value 
)
virtual

try to set the given parameter for this device. Throw exception for unsupported key

Reimplemented from MSDevice.

Definition at line 435 of file MSDevice_Battery.cpp.

References deviceName(), myParam, setActualBatteryCapacity(), setMaximumBatteryCapacity(), SUMO_ATTR_ACTUALBATTERYCAPACITY, SUMO_ATTR_MAXIMUMBATTERYCAPACITY, SUMO_ATTR_VEHICLEMASS, StringUtils::toDouble(), and toString().

◆ setPowerMax()

void MSDevice_Battery::setPowerMax ( const double  new_Pmax)

Set maximum power when accelerating.

Definition at line 303 of file MSDevice_Battery.cpp.

References Named::getID(), myPowerMax, SUMO_ATTR_MAXIMUMPOWER, toString(), and WRITE_WARNING.

◆ setStoppingTreshold()

void MSDevice_Battery::setStoppingTreshold ( const double  stoppingTreshold)

Set vehicle's stopping treshold.

Definition at line 313 of file MSDevice_Battery.cpp.

References Named::getID(), myStoppingTreshold, SUMO_ATTR_STOPPINGTRESHOLD, toString(), and WRITE_WARNING.

◆ updateDetector()

void MSMoveReminder::updateDetector ( SUMOTrafficObject veh,
double  entryPos,
double  leavePos,
SUMOTime  entryTime,
SUMOTime  currentTime,
SUMOTime  leaveTime,
bool  cleanUp 
)
inherited

Field Documentation

◆ myActChargingStation

MSChargingStation* MSDevice_Battery::myActChargingStation
protected

Parameter, Pointer to current charging station in which vehicle is placed (by default is NULL)

Definition at line 201 of file MSDevice_Battery.h.

Referenced by getChargingStationID(), and notifyMove().

◆ myActualBatteryCapacity

double MSDevice_Battery::myActualBatteryCapacity
protected

Parameter, The actual vehicles's Battery Capacity in kWh, [myActualBatteryCapacity <= myMaximumBatteryCapacity].

Definition at line 171 of file MSDevice_Battery.h.

Referenced by getActualBatteryCapacity(), MSDevice_Battery(), and setActualBatteryCapacity().

◆ myChargingInTransit

bool MSDevice_Battery::myChargingInTransit
protected

Parameter, Flag: Vehicles it's charging in transit (by default is false)

Definition at line 192 of file MSDevice_Battery.h.

Referenced by isChargingInTransit(), and notifyMove().

◆ myChargingStartTime

double MSDevice_Battery::myChargingStartTime
protected

Parameter, Moment, wich the vehicle has beging to charging.

Definition at line 195 of file MSDevice_Battery.h.

Referenced by getChargingStartTime(), increaseChargingStartTime(), and resetChargingStartTime().

◆ myChargingStopped

bool MSDevice_Battery::myChargingStopped
protected

Parameter, Flag: Vehicles it's charging stopped (by default is false)

Definition at line 189 of file MSDevice_Battery.h.

Referenced by isChargingStopped(), and notifyMove().

◆ myConsum

double MSDevice_Battery::myConsum
protected

Parameter, Vehicle consum during a time step (by default is 0.)

Definition at line 198 of file MSDevice_Battery.h.

Referenced by getConsum(), and notifyMove().

◆ myDescription

std::string MSMoveReminder::myDescription
protectedinherited

a description of this moveReminder

Definition at line 242 of file MSMoveReminder.h.

Referenced by MSMoveReminder::getDescription(), and MSMoveReminder::setDescription().

◆ myEnergyCharged

double MSDevice_Battery::myEnergyCharged
protected

Parameter, Energy charged in each timestep.

Definition at line 204 of file MSDevice_Battery.h.

Referenced by getEnergyCharged(), and notifyMove().

◆ myEquipmentRNG

std::mt19937 MSDevice::myEquipmentRNG
staticprivateinherited

A random number generator used to choose from vtype/route distributions and computing the speed factors.

Definition at line 189 of file MSDevice.h.

Referenced by MSDevice::equippedByDefaultAssignmentOptions(), and MSDevice::getEquipmentRNG().

◆ myExplicitIDs

std::map< std::string, std::set< std::string > > MSDevice::myExplicitIDs
staticprivateinherited

vehicles which explicitly carry a device, sorted by device, first

Definition at line 186 of file MSDevice.h.

Referenced by MSDevice::equippedByDefaultAssignmentOptions().

◆ myHolder

◆ myID

◆ myLane

◆ myLastAngle

double MSDevice_Battery::myLastAngle
protected

Parameter, Vehicle's last angle.

Definition at line 186 of file MSDevice_Battery.h.

Referenced by notifyMove().

◆ myLastVehicleUpdateValues

std::map<SUMOTrafficObject*, std::pair<SUMOTime, double> > MSMoveReminder::myLastVehicleUpdateValues
privateinherited

◆ myMaximumBatteryCapacity

double MSDevice_Battery::myMaximumBatteryCapacity
protected

Parameter, The total vehicles's Battery Capacity in kWh, [myMaximumBatteryCapacity >= 0].

Definition at line 174 of file MSDevice_Battery.h.

Referenced by getMaximumBatteryCapacity(), MSDevice_Battery(), setActualBatteryCapacity(), and setMaximumBatteryCapacity().

◆ myParam

std::map<int, double> MSDevice_Battery::myParam
protected

Parameter collection.

Definition at line 183 of file MSDevice_Battery.h.

Referenced by checkParam(), getEnergyParams(), getParameter(), notifyMove(), and setParameter().

◆ myPowerMax

double MSDevice_Battery::myPowerMax
protected

Parameter, The Maximum Power when accelerating, [myPowerMax >= 0].

Definition at line 177 of file MSDevice_Battery.h.

Referenced by getMaximumPower(), MSDevice_Battery(), and setPowerMax().

◆ myStoppingTreshold

double MSDevice_Battery::myStoppingTreshold
protected

Parameter, stopping vehicle treshold [myStoppingTreshold >= 0].

Definition at line 180 of file MSDevice_Battery.h.

Referenced by getStoppingTreshold(), MSDevice_Battery(), notifyMove(), and setStoppingTreshold().

◆ myVehicleStopped

int MSDevice_Battery::myVehicleStopped
protected

Parameter, How many timestep the vehicle is stopped.

Definition at line 207 of file MSDevice_Battery.h.

Referenced by getVehicleStopped(), increaseVehicleStoppedTimer(), and resetVehicleStoppedTimer().


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