71 #ifdef CHECK_MEMORY_LEAKS
73 #endif // CHECK_MEMORY_LEAKS
89 myShape(shape), myNumericalID(numericalID),
90 myVehicles(), myLength(length), myWidth(width), myEdge(edge), myMaxSpeed(maxSpeed),
91 myPermissions(permissions),
92 myLogicalPredecessorLane(0),
93 myBruttoVehicleLengthSum(0), myNettoVehicleLengthSum(0), myInlappingVehicleEnd(10000), myInlappingVehicle(0),
94 myLengthGeometryFactor(myShape.length() / myLength) {}
98 for (MSLinkCont::iterator i =
myLinks.begin(); i !=
myLinks.end(); ++i) {
115 (*veh)->addReminder(rem);
155 if (leader.first != 0) {
157 vIn = leader.first->getSpeed();
158 leaderDecel = leader.first->getCarFollowModel().getMaxDecel();
164 const SUMOReal vHlp = 0.5 * (vIn + mspeed);
168 for (
int i = 0; i <= 10; i++) {
179 }
else if (x > maxPos) {
199 if (leader.first != 0) {
201 vIn = leader.first->getSpeed();
207 const SUMOReal vHlp = 0.5 * (mspeed + vIn);
211 }
else if (xIn > maxPos) {
225 MSLane::VehCont::iterator predIt =
myVehicles.begin();
228 MSLane::VehCont::iterator maxIt =
myVehicles.begin();
247 const SUMOReal lhs = nettoGap / tau + tauDecel - fSpeed - fSpeed * fSpeed / (2 * tauDecel) + leaderSpeed * leaderSpeed / (2 * tauDecel);
248 if (lhs >= sqrt(tauDecel * tauDecel + leaderSpeed * leaderSpeed)) {
250 const SUMOReal currentMaxSpeed = lhs - tauDecel;
251 if (
MIN2(currentMaxSpeed, mspeed) > maxSpeed) {
252 maxSpeed = currentMaxSpeed;
253 maxPos = leaderRearPos + frontGap;
271 bool adaptableSpeed =
true;
281 if (adaptableSpeed) {
285 if (leaderPos - frontGapNeeded >= 0) {
294 MSLane::VehCont::iterator predIt =
myVehicles.begin();
302 if (adaptableSpeed && leader != 0) {
314 frontMax = leaderRearPos - frontGapNeeded;
322 if (frontMax > 0 && backMin +
POSITION_EPS < frontMax) {
339 bool patchSpeed =
true;
375 for (
unsigned int i = 0; i < 10; i++) {
407 if (nspeed < speed) {
409 speed =
MIN2(nspeed, speed);
412 if (errorMsg !=
"") {
413 WRITE_ERROR(
"Vehicle '" + aVehicle->
getID() +
"' will not be able to depart using the given velocity (" + errorMsg +
")!");
430 aVehicle->
getID() +
"'. Inserting at lane end instead.");
436 std::vector<MSLane*>::const_iterator ri = bestLaneConts.begin();
441 unsigned int nRouteSuccs = 1;
442 MSLane* currentLane =
this;
445 while (seen < dist && ri != bestLaneConts.end()) {
447 MSLinkCont::const_iterator link =
succLinkSec(*aVehicle, nRouteSuccs, *currentLane, bestLaneConts);
453 patchSpeed,
"arrival speed too low")) {
461 patchSpeed,
"junction too close")) {
469 || !(*link)->havePriority()) {
471 std::string errorMsg =
"";
472 const LinkState state = (*link)->getState();
478 errorMsg =
"unpriorised junction too close";
481 patchSpeed, errorMsg)) {
488 nextLane = (*link)->getViaLaneOrLane();
508 if (
checkFailure(aVehicle, speed, dist, nspeed, patchSpeed,
"")) {
515 if (nspeed < speed) {
517 speed =
MIN2(cfModel.
freeSpeed(aVehicle, speed, seen, nspeed), speed);
521 WRITE_ERROR(
"Vehicle '" + aVehicle->
getID() +
"' will not be able to depart using the given velocity (slow lane ahead)!");
531 if ((*link)->hasApproachingFoe(arrivalTime, leaveTime, speed, cfModel.
getMaxDecel())) {
539 currentLane = nextLane;
540 #ifdef HAVE_INTERNAL_LANES
541 if ((*link)->getViaLane() == 0) {
559 if (gap < frontGapNeeded) {
571 if (gap < backGapNeeded) {
584 if (missingRearGap > 0) {
586 const SUMOReal neededStartPos = pos + missingRearGap;
589 pos = neededStartPos;
616 if (leftVehicleLength > myLength) {
634 std::pair<MSVehicle*, SUMOReal>
640 return std::make_pair(last, pos);
646 return std::make_pair<MSVehicle*, SUMOReal>(0, 0);
657 if ((*veh)->getLane() ==
this) {
658 (*veh)->planMove(t, pred, cumulatedVehLength);
672 VehCont::iterator lastVeh =
myVehicles.end() - 1;
673 for (VehCont::iterator veh =
myVehicles.begin(); veh != lastVeh;) {
674 VehCont::iterator pred = veh + 1;
675 if ((*veh)->hasInfluencer() && (*veh)->getInfluencer().isVTDControlled()) {
679 if ((*pred)->hasInfluencer() && (*pred)->getInfluencer().isVTDControlled()) {
683 SUMOReal gap = (*pred)->getPositionOnLane() - (*pred)->getVehicleType().getLength() - (*veh)->getPositionOnLane() - (*veh)->getVehicleType().getMinGap();
688 + (*pred)->getID() +
"', lane='" +
getID() +
"', gap=" +
toString(gap)
701 + (*pred)->getID() +
"', lane='" +
getID() +
"', gap=" +
toString(gap)
741 }
else if (target != 0 && moved) {
752 into.push_back(target);
755 if (shadowLane != 0) {
756 into.push_back(shadowLane);
769 WRITE_WARNING(
"Teleporting vehicle '" + veh->
getID() +
"'; beyond end of lane, targetLane='" +
getID() +
"', time=" +
780 i = VehCont::reverse_iterator(
myVehicles.erase(i.base()));
791 const bool minorLink = !wrongLane && (link !=
myLinks.end()) && !((*link)->havePriority());
792 const std::string reason = (wrongLane ?
" (wrong lane)" : (minorLink ?
" (yield)" :
" (jam)"));
799 + (r2 ?
" (highway)" :
"")
803 }
else if (minorLink) {
830 DictType::iterator it =
myDict.find(
id);
833 myDict.insert(DictType::value_type(
id, ptr));
842 DictType::iterator it =
myDict.find(
id);
853 for (DictType::iterator i =
myDict.begin(); i !=
myDict.end(); ++i) {
862 for (DictType::iterator i =
myDict.begin(); i !=
myDict.end(); ++i) {
863 into.push_back((*i).first);
868 template<
class RTREE>
void
870 for (DictType::iterator i =
myDict.begin(); i !=
myDict.end(); ++i) {
876 into.Insert(cmin, cmax, l);
880 template void MSLane::fill<NamedRTree>(
NamedRTree& into);
900 return (link !=
myLinks.end());
949 MSLinkCont::const_iterator
951 const MSLane& succLinkSource,
const std::vector<MSLane*>& conts) {
954 if (nRouteEdge == 0) {
956 return succLinkSource.
myLinks.end();
960 assert(succLinkSource.
myLinks.size() == 1);
962 return succLinkSource.
myLinks.begin();
972 MSLinkCont::const_iterator link;
973 if (nRouteSuccs < conts.size()) {
975 for (link = succLinkSource.
myLinks.begin(); link != succLinkSource.
myLinks.end(); ++link) {
976 if ((*link)->getLane() != 0 && (*link)->getLane()->myEdge == nRouteEdge && (*link)->getLane()->allowsVehicleClass(veh.
getVehicleType().
getVehicleClass())) {
978 if ((*link)->getLane() == conts[nRouteSuccs]) {
985 return succLinkSource.
myLinks.end();
989 WRITE_WARNING(
"Could not find connection between '" + succLinkSource.
getID() +
"' and '" + conts[nRouteSuccs]->getID() +
992 return succLinkSource.
myLinks.end();
1013 if (remVehicle == *it) {
1061 std::map<MSEdge*, std::vector<MSLane*> >::const_iterator i =
myApproachingLanes.find(edge);
1065 const std::vector<MSLane*>& lanes = (*i).second;
1066 return find(lanes.begin(), lanes.end(), lane) != lanes.end();
1072 inline int operator()(
const std::pair<const MSVehicle* , SUMOReal>& p1,
const std::pair<const MSVehicle* , SUMOReal>& p2)
const {
1073 return p1.second < p2.second;
1083 std::set<MSLane*> visited;
1084 std::vector<MSLane::IncomingLaneInfo> newFound;
1086 while (toExamine.size() != 0) {
1087 for (std::vector<MSLane::IncomingLaneInfo>::iterator i = toExamine.begin(); i != toExamine.end(); ++i) {
1088 MSLane* next = (*i).lane;
1094 result =
MAX2(result, missingRearGap);
1096 if ((*i).length < dist) {
1097 const std::vector<MSLane::IncomingLaneInfo>& followers = next->
getIncomingLanes();
1098 for (std::vector<MSLane::IncomingLaneInfo>::const_iterator j = followers.begin(); j != followers.end(); ++j) {
1099 if (visited.find((*j).lane) == visited.end()) {
1100 visited.insert((*j).lane);
1102 ili.
lane = (*j).lane;
1103 ili.
length = (*j).length + (*i).length;
1105 newFound.push_back(ili);
1112 swap(newFound, toExamine);
1118 std::pair<MSVehicle* const, SUMOReal>
1123 std::pair<MSVehicle*, SUMOReal> result(static_cast<MSVehicle*>(0), -1);
1125 std::set<MSLane*> visited;
1126 std::vector<MSLane::IncomingLaneInfo> newFound;
1128 while (toExamine.size() != 0) {
1129 for (std::vector<MSLane::IncomingLaneInfo>::iterator i = toExamine.begin(); i != toExamine.end(); ++i) {
1130 MSLane* next = (*i).lane;
1135 if (missingRearGap > missingRearGapMax) {
1136 missingRearGapMax = missingRearGap;
1138 result.second = agap;
1141 if ((*i).length < dist) {
1142 const std::vector<MSLane::IncomingLaneInfo>& followers = next->
getIncomingLanes();
1143 for (std::vector<MSLane::IncomingLaneInfo>::const_iterator j = followers.begin(); j != followers.end(); ++j) {
1144 if (visited.find((*j).lane) == visited.end()) {
1145 visited.insert((*j).lane);
1147 ili.
lane = (*j).lane;
1148 ili.
length = (*j).length + (*i).length;
1150 newFound.push_back(ili);
1157 swap(newFound, toExamine);
1163 std::pair<MSVehicle* const, SUMOReal>
1165 const std::vector<MSLane*>& bestLaneConts)
const {
1167 return std::make_pair(static_cast<MSVehicle*>(0), -1);
1169 unsigned int view = 1;
1174 const MSLane* nextLane =
this;
1178 MSLinkCont::const_iterator link =
succLinkSec(veh, view, *nextLane, bestLaneConts);
1183 #ifdef HAVE_INTERNAL_LANES
1186 if (linkLeaders.size() > 0) {
1189 return linkLeaders[0].first;
1191 bool nextInternal = (*link)->getViaLane() != 0;
1193 nextLane = (*link)->getViaLaneOrLane();
1194 if (nextLane == 0) {
1200 return std::make_pair(leader, seen + leader->getPositionOnLane() - leader->getVehicleType().getLength() - veh.
getVehicleType().
getMinGap());
1211 #ifdef HAVE_INTERNAL_LANES
1212 if (!nextInternal) {
1218 }
while (seen <= dist);
1219 return std::make_pair(static_cast<MSVehicle*>(0), -1);
1231 for (std::vector<MSEdge*>::iterator i = pred.begin(); i != pred.end();) {
1240 if (pred.size() != 0) {
1242 MSEdge* best = *pred.begin();
1309 wtime += (*i)->getWaitingSeconds();
1322 for (VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1323 v += (*i)->getSpeed();
1335 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1336 ret += (*i)->getCO2Emissions();
1347 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1348 ret += (*i)->getCOEmissions();
1359 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1360 ret += (*i)->getPMxEmissions();
1371 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1372 ret += (*i)->getNOxEmissions();
1383 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1384 ret += (*i)->getHCEmissions();
1395 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1396 ret += (*i)->getFuelConsumption();
1407 if (vehs.size() == 0) {
1411 for (MSLane::VehCont::const_iterator i = vehs.begin(); i != vehs.end(); ++i) {
1412 SUMOReal sv = (*i)->getHarmonoise_NoiseEmissions();
1413 ret += (
SUMOReal) pow(10., (sv / 10.));
1433 myLaneDir(e->getLanes()[0]->
getShape().getBegLine().atan2PositiveAngle())
1442 if (ae1 != 0 && ae1->size() != 0) {
1446 if (ae2 != 0 && ae2->size() != 0) {
1465 for (std::vector<std::string>::const_iterator it = vehIds.begin(); it != vehIds.end(); ++it) {
void forceVehicleInsertion(MSVehicle *veh, SUMOReal pos)
Inserts the given vehicle at the given position.
void loadState(std::vector< std::string > &vehIDs, MSVehicleControl &vc)
Loads the state of this segment with the given parameters.
virtual const std::vector< LaneQ > & getBestLanes(bool forceRebuild=false, MSLane *startLane=0) const
Returns the description of best lanes to use in order to continue the route.
OutputDevice & writeAttr(const SumoXMLAttr attr, const T &val)
writes a named attribute
VehCont myVehicles
The lane's vehicles. The entering vehicles are inserted at the front of this container and the leavin...
MSEdge & getEdge() const
Returns the lane's edge.
Representation of a vehicle in the micro simulation.
bool isLinkEnd(MSLinkCont::const_iterator &i) const
SUMOVehicleClass getVehicleClass() const
Get this vehicle type's vehicle class.
void descheduleDeparture(SUMOVehicle *veh)
stops trying to emit the given vehicle
SUMOReal getWaitingSeconds() const
Returns the overall waiting time on this lane.
static void insertIDs(std::vector< std::string > &into)
Adds the ids of all stored lanes into the given vector.
const MSEdge * getInternalFollower() const
Returns the lane's follower if it is an internal lane, the edge of the lane otherwise.
virtual void releaseVehicles() const
Allows to use the container for microsimulation again.
const MSCFModel & getCarFollowModel() const
Returns the vehicle's car following model definition.
int operator()(MSVehicle *v1, MSVehicle *v2) const
Comparing operator.
bool isChangingLanes() const
return true if the vehicle currently performs a lane change maneuver
void endLaneChangeManeuver()
SUMOReal getMaxSpeed() const
Returns the maximum speed.
virtual const MSEdge * succEdge(unsigned int nSuccs) const =0
Returns the nSuccs'th successor of edge the vehicle is currently at.
bool hasInfluencer() const
SUMOReal getLengthWithGap() const
Get vehicle's length including the minimum gap [m].
SUMOReal getImpatience() const
Returns this vehicles impatience.
void registerTeleportYield()
register one non-collision-related teleport
static void fill(RTREE &into)
Fills the given RTree with lane instances.
MSEdgeVector::const_iterator MSRouteIterator
The vehicle arrived at a junction.
bool isVTDControlled() const
SUMOTime getWaitingTime() const
Returns the SUMOTime waited (speed was lesser than 0.1m/s)
SUMOReal ymin() const
Returns minimum y-coordinate.
virtual SUMOReal followSpeed(const MSVehicle *const veh, SUMOReal speed, SUMOReal gap2pred, SUMOReal predSpeed, SUMOReal predMaxDecel) const =0
Computes the vehicle's safe speed (no dawdling)
This is an uncontrolled, minor link, has to stop.
const MSEdge * getLastEdge() const
returns the destination edge
SUMOReal getLength() const
Returns the lane's length.
SUMOReal departSpeed
(optional) The initial speed of the vehicle
virtual SUMOReal maxNextSpeed(SUMOReal speed, const MSVehicle *const veh) const
Returns the maximum speed given the current speed.
bool hasArrived() const
Returns whether this vehicle has already arived (reached the arrivalPosition on its final edge) ...
std::vector< IncomingLaneInfo > myIncomingLanes
The car-following model abstraction.
void addLink(MSLink *link)
Delayed initialization.
virtual bool integrateNewVehicle(SUMOTime t)
Insert buffered vehicle into the real lane.
SUMOReal arrivalSpeed
(optional) The final speed of the vehicle (not used yet)
std::vector< MSVehicle * > VehCont
Container for vehicles.
SUMOReal xmin() const
Returns minimum x-coordinate.
Notification
Definition of a vehicle state.
static SUMOReal rand()
Returns a random real number in [0, 1)
std::string time2string(SUMOTime t)
SUMOReal getFuelConsumption() const
Returns the sum of last step fuel consumption.
A RT-tree for efficient storing of SUMO's Named objects.
SUMOReal getLength() const
Get vehicle's length [m].
virtual MSVehicle * removeVehicle(MSVehicle *remVehicle, MSMoveReminder::Notification notification, bool notify=true)
virtual void incorporateVehicle(MSVehicle *veh, SUMOReal pos, SUMOReal speed, const MSLane::VehCont::iterator &at, MSMoveReminder::Notification notification=MSMoveReminder::NOTIFICATION_DEPARTED)
Inserts the vehicle into this lane, and informs it about entering the network.
MSLane(const std::string &id, SUMOReal maxSpeed, SUMOReal length, MSEdge *const edge, unsigned int numericalID, const PositionVector &shape, SUMOReal width, SVCPermissions permissions)
Constructor.
void addIncomingLane(MSLane *lane, MSLink *viaLink)
static MSNet * getInstance()
Returns the pointer to the unique instance of MSNet (singleton).
SUMOReal getNettoOccupancy() const
Returns the netto (excluding minGaps) occupancy of this lane during the last step (including minGaps)...
const MSRoute & getRoute() const
Returns the current route.
by_connections_to_sorter(const MSEdge *const e)
constructor
The speed is chosen randomly.
virtual void addMoveReminder(MSMoveReminder *rem)
Add a move-reminder to move-reminder container.
The vehicle got vaporized.
void leftByLaneChange(MSVehicle *v)
SUMOReal getSecureGap(const SUMOReal speed, const SUMOReal leaderSpeed, const SUMOReal leaderMaxDecel) const
Returns the minimum gap to reserve if the leader is braking at maximum.
This is an uncontrolled, right-before-left link.
bool executeMove()
Executes planned vehicle movements with regards to right-of-way.
ArrivalSpeedDefinition arrivalSpeedProcedure
Information how the vehicle's end speed shall be chosen.
SUMOReal getPositionOnLane() const
Get the vehicle's position along the lane.
int operator()(const MSEdge *const e1, const MSEdge *const e2) const
comparing operator
void gotActive(MSLane *l)
Informs the control that the given lane got active.
bool pWagGenericInsertion(MSVehicle &veh, SUMOReal speed, SUMOReal maxPos, SUMOReal minPos)
SUMOTime getCurrentTimeStep() const
Returns the current simulation step.
bool freeInsertion(MSVehicle &veh, SUMOReal speed, MSMoveReminder::Notification notification=MSMoveReminder::NOTIFICATION_DEPARTED)
Tries to insert the given vehicle on any place.
The position is chosen randomly.
This is an uncontrolled, all-way stop link.
SUMOReal myMaxSpeed
Lane-wide speedlimit [m/s].
SUMOReal getBruttoVehLenSum() const
Returns the sum of lengths of vehicles, including their minGaps, which were on the lane during the la...
SUMOReal xmax() const
Returns maximum x-coordinate.
Generic max-flow insertion by P.Wagner.
A class that stores a 2D geometrical boundary.
SUMOReal setPartialOccupation(MSVehicle *v, SUMOReal leftVehicleLength)
Sets the information about a vehicle lapping into this lane.
static MSLinkCont::const_iterator succLinkSec(const SUMOVehicle &veh, unsigned int nRouteSuccs, const MSLane &succLinkSource, const std::vector< MSLane * > &conts)
#define WRITE_WARNING(msg)
A gap is chosen where the maximum speed may be achieved.
MSAbstractLaneChangeModel & getLaneChangeModel()
SUMOReal getHCEmissions() const
Returns the sum of last step HC emissions.
virtual const VehCont & getVehiclesSecure() const
Returns the vehicles container; locks it for microsimulation.
SUMOReal getPartialOccupatorEnd() const
Returns the position of the in-lapping vehicle's end.
std::map< std::string, MSLane * > DictType
definition of the static dictionary type
virtual bool executeMovements(SUMOTime t, std::vector< MSLane * > &into)
Executes planned vehicle movements with regards to right-of-way.
virtual void detectCollisions(SUMOTime timestep, const std::string &stage)
Check if vehicles are too close.
static DictType myDict
Static dictionary to associate string-ids with objects.
void enterLaneAtInsertion(MSLane *enteredLane, SUMOReal pos, SUMOReal speed, MSMoveReminder::Notification notification)
Update when the vehicle enters a new lane in the emit step.
const std::string & getID() const
Returns the id.
A road/street connecting two junctions.
bool insertVehicle(MSVehicle &v)
Tries to insert the given vehicle.
virtual bool isInsertionSuccess(MSVehicle *vehicle, SUMOReal speed, SUMOReal pos, bool recheckNextLanes, MSMoveReminder::Notification notification=MSMoveReminder::NOTIFICATION_DEPARTED)
Tries to insert the given vehicle with the given state (speed and pos)
MSLane * getLogicalPredecessorLane() const
SUMOReal brakeGap(const SUMOReal speed) const
Returns the distance the vehicle needs to halt including driver's reaction time.
DepartSpeedDefinition departSpeedProcedure
Information how the vehicle's initial speed shall be chosen.
std::pair< MSVehicle *const, SUMOReal > getLeaderOnConsecutive(SUMOReal dist, SUMOReal seen, SUMOReal speed, const MSVehicle &veh, const std::vector< MSLane * > &bestLaneConts) const
Returns the leader and the distance to him.
void workOnMoveReminders(SUMOReal oldPos, SUMOReal newPos, SUMOReal newSpeed)
Processes active move reminder.
void resetPartialOccupation(MSVehicle *v)
Removes the information about a vehicle lapping into this lane.
void addVeh(const SUMOTime t, MSVehicle *veh)
Adds a vehicle to this transfer object.
Representation of a vehicle.
std::vector< MSVehicle * > myVehBuffer
DepartPosDefinition departPosProcedure
Information how the vehicle shall choose the departure position.
SUMOReal getMinGap() const
Get the free space in front of vehicles of this class.
This is an uncontrolled, minor link, has to brake.
bool alreadyMoved() const
reset the flag whether a vehicle already moved to false
Sorts vehicles by their position (descending)
const std::vector< MSLane * > & getBestLanesContinuation() const
Returns the subpart of best lanes that describes the vehicle's current lane and their successors...
void enteredByLaneChange(MSVehicle *v)
MSVehicleControl & getVehicleControl()
Returns the vehicle control.
MSLane * getParallelLane(int offset) const
Returns the lane with the given offset parallel to this one or 0 if it does not exist.
SUMOReal getMeanSpeed() const
Returns the mean speed on this lane.
static SUMOReal gap(SUMOReal predPos, SUMOReal predLength, SUMOReal pos)
Uses the given values to compute the brutto-gap.
const MSEdge * succEdge(unsigned int nSuccs) const
Returns the nSuccs'th successor of edge the vehicle is currently at.
The vehicle arrived at its destination (is deleted)
bool isStopped() const
Returns whether the vehicle is at a stop.
std::pair< MSVehicle *, SUMOReal > getLastVehicleInformation() const
Returns the last vehicle which is still on the lane.
LinkState
The right-of-way state of a link between two lanes used when constructing a NBTrafficLightLogic, in MSLink and GNEInternalLane.
The maximum speed is used.
bool isVaporizing() const
Returns whether vehicles on this edge shall be vaporized.
virtual SUMOReal stopSpeed(const MSVehicle *const veh, const SUMOReal speed, SUMOReal gap2pred) const =0
Computes the vehicle's safe speed for approaching a non-moving obstacle (no dawdling) ...
SUMOReal getSpeedLimit() const
Returns the lane's maximum allowed speed.
MSEdge * myEdge
The lane's edge, for routing only.
No information given; use default.
void onRemovalFromNet(const MSMoveReminder::Notification reason)
Called when the vehicle is removed from the network.
MSLane * myLogicalPredecessorLane
Something on a lane to be noticed about vehicle movement.
SUMOReal myLength
Lane length [m].
SUMOReal getMaxDecel() const
Get the vehicle type's maximum deceleration [m/s^2].
virtual MSVehicle * getLastVehicle() const
returns the last vehicle
MSLane * getShadowLane() const
Returns the lane the vehicles shadow is on during continuouss lane change.
virtual void swapAfterLaneChange(SUMOTime t)
moves myTmpVehicles int myVehicles after a lane change procedure
std::string toString(const T &t, std::streamsize accuracy=OUTPUT_ACCURACY)
virtual const MSVehicle * getFirstVehicle() const
void registerTeleportJam()
register one non-collision-related teleport
virtual SUMOReal getHeadwayTime() const
Get the driver's reaction time [s].
If a fixed number of random choices fails, a free position is chosen.
bool isParking() const
Returns whether the vehicle is parking.
std::map< MSEdge *, std::vector< MSLane * > > myApproachingLanes
Base class for objects which have an id.
std::vector< MSMoveReminder * > myMoveReminders
This lane's move reminder.
bool pWagSimpleInsertion(MSVehicle &veh, SUMOReal speed, SUMOReal maxPos, SUMOReal minPos)
static MSVehicleTransfer * getInstance()
Returns the instance of this object.
void leaveLane(const MSMoveReminder::Notification reason)
Update of members if vehicle leaves a new lane in the lane change step or at arrival.
const std::vector< MSLane * > * allowedLanes(const MSEdge &destination, SUMOVehicleClass vclass=SVC_UNKNOWN) const
Get the allowed lanes to reach the destination-edge.
static bool dictionary(const std::string &id, MSLane *lane)
Static (sic!) container methods {.
SUMOReal getNOxEmissions() const
Returns the sum of last step NOx emissions.
static SUMOTime gTimeToGridlockHighways
Boundary & grow(SUMOReal by)
extends the boundary by the given amount
SUMOReal getPMxEmissions() const
Returns the sum of last step PMx emissions.
EdgeBasicFunction getPurpose() const
Returns the edge type (EdgeBasicFunction)
const std::vector< MSEdge * > & getIncomingEdges() const
Returns the list of edges from which this edge may be reached.
Influencer & getInfluencer()
Returns the velocity/lane influencer.
void scheduleVehicleRemoval(SUMOVehicle *veh)
Removes a vehicle after it has ended.
Structure representing possible vehicle parameter.
virtual SUMOReal freeSpeed(const MSVehicle *const veh, SUMOReal speed, SUMOReal seen, SUMOReal maxSpeed) const
Computes the vehicle's safe speed without a leader.
bool operator()(const MSVehicle *cmp, SUMOReal pos) const
compares vehicle position to the detector position
MSVehicle * myInlappingVehicle
The vehicle which laps into this lane.
SUMOReal myBruttoVehicleLengthSum
The current length of all vehicles on this lane, including their minGaps.
MSLane * parallelLane(const MSLane *const lane, int offset) const
Returns the lane with the given offset parallel to the given lane one or 0 if it does not exist...
MSInsertionControl & getInsertionControl()
Returns the insertion control.
static void clear()
Clears the dictionary.
SUMOReal getCO2Emissions() const
Returns the sum of last step CO2 emissions.
SUMOReal getCOEmissions() const
Returns the sum of last step CO emissions.
bool checkFailure(MSVehicle *aVehicle, SUMOReal &speed, SUMOReal &dist, const SUMOReal nspeed, const bool patchSpeed, const std::string errorMsg) const
The link has red light (must brake)
static SUMOReal getMinAngleDiff(SUMOReal angle1, SUMOReal angle2)
Returns the minimum distance (clockwise/counter-clockwise) between both angles.
SUMOReal myInlappingVehicleEnd
End position of a vehicle which laps into this lane.
const MSVehicleType & getVehicleType() const
Returns the vehicle's type definition.
bool maxSpeedGapInsertion(MSVehicle &veh, SUMOReal mspeed)
std::pair< MSVehicle *const, SUMOReal > getFollowerOnConsecutive(SUMOReal dist, SUMOReal leaderSpeed, SUMOReal backOffset, SUMOReal predMaxDecel) const
bool isApproachedFrom(MSEdge *const edge)
static SUMOReal sum(SUMOReal val)
Computes the resulting noise.
SUMOReal getSpeed() const
Returns the vehicle's current speed.
static SUMOTime gTimeToGridlock
const SUMOVehicleParameter & getParameter() const
Returns the vehicle's parameter (including departure definition)
SUMOReal departPos
(optional) The position the vehicle shall depart from
SUMOVehicle * getVehicle(const std::string &id) const
Returns the vehicle with the given id.
SUMOReal getMissingRearGap(SUMOReal dist, SUMOReal backOffset, SUMOReal leaderSpeed, SUMOReal leaderMaxDecel) const
return by how much further the leader must be inserted to avoid rear end collisions ...
const MSEdge * getFollower(unsigned int n) const
Returns the n-th of the following edges.
void saveState(OutputDevice &out)
Saves the state of this lane into the given stream.
const PositionVector & getShape() const
Returns this lane's shape.
MSVehicle * getPartialOccupator() const
Returns the vehicle which laps into this lane.
Static storage of an output device and its base (abstract) implementation.
bool closeTag()
Closes the most recently opened tag.
void registerCollision()
registers one collision-related teleport
SUMOReal ymax() const
Returns maximum y-coordinate.
MSEdgeControl & getEdgeControl()
Returns the edge control.
virtual ~MSLane()
Destructor.
int operator()(const std::pair< const MSVehicle *, SUMOReal > &p1, const std::pair< const MSVehicle *, SUMOReal > &p2) const
SUMOReal myNettoVehicleLengthSum
The current length of all vehicles on this lane, excluding their minGaps.
std::vector< std::pair< std::pair< MSVehicle *, SUMOReal >, SUMOReal > > LinkLeaders
const MSLinkCont & getLinkCont() const
returns the container with all links !!!
No information given; use default.
A free position is chosen.
The class responsible for building and deletion of vehicles.
Simple max-flow insertion by P.Wagner.
SUMOReal getVehicleMaxSpeed(const SUMOVehicle *const veh) const
Returns the lane's maximum speed, given a vehicle's speed limit adaptation.
SUMOReal getHarmonoise_NoiseEmissions() const
Returns the sum of last step noise emissions.
MSLane * getLane() const
Returns the lane the vehicle is on.
const std::vector< IncomingLaneInfo > & getIncomingLanes() const
The edge is an internal edge.
SUMOReal getBruttoOccupancy() const
Returns the brutto (including minGaps) occupancy of this lane during the last step.
Boundary getBoxBoundary() const
Returns a boundary enclosing this list of lines.
void registerTeleportWrongLane()
register one non-collision-related teleport
Representation of a lane in the micro simulation.
virtual const std::string & getID() const =0
Get the vehicle's ID.
void addApproachingLane(MSLane *lane)
OutputDevice & openTag(const std::string &xmlElement)
Opens an XML tag.
MSRouteIterator begin() const
Returns the begin of the list of edges to pass.
virtual bool appropriate(const MSVehicle *veh)
The vehicle is being teleported.
virtual void planMovements(const SUMOTime t)
Compute safe velocities for all vehicles based on positions and speeds from the last time step...
const std::string & getID() const
Returns the name of the vehicle.
virtual const MSVehicleType & getVehicleType() const =0
Returns the vehicle's type.
unsigned int getLaneIndex() const