SUMO - Simulation of Urban MObility
MSVehicle.h
Go to the documentation of this file.
1 /****************************************************************************/
15 // Representation of a vehicle in the micro simulation
16 /****************************************************************************/
17 // SUMO, Simulation of Urban MObility; see http://sumo-sim.org/
18 // Copyright (C) 2001-2014 DLR (http://www.dlr.de/) and contributors
19 /****************************************************************************/
20 //
21 // This file is part of SUMO.
22 // SUMO is free software: you can redistribute it and/or modify
23 // it under the terms of the GNU General Public License as published by
24 // the Free Software Foundation, either version 3 of the License, or
25 // (at your option) any later version.
26 //
27 /****************************************************************************/
28 #ifndef MSVehicle_h
29 #define MSVehicle_h
30 
31 
32 // ===========================================================================
33 // included modules
34 // ===========================================================================
35 #ifdef _MSC_VER
36 #include <windows_config.h>
37 #else
38 #include <config.h>
39 #endif
40 
41 #include <list>
42 #include <deque>
43 #include <map>
44 #include <set>
45 #include <string>
46 #include <vector>
47 #include "MSVehicleType.h"
48 #include "MSBaseVehicle.h"
49 #include "MSLink.h"
50 #include "MSLane.h"
51 
52 
53 // ===========================================================================
54 // class declarations
55 // ===========================================================================
56 class SUMOSAXAttributes;
57 class MSMoveReminder;
58 class MSLaneChanger;
59 class MSVehicleTransfer;
61 class MSBusStop;
62 class MSPerson;
63 class MSDevice;
65 class OutputDevice;
66 class Position;
67 class MSDevice_Person;
68 
69 
70 // ===========================================================================
71 // class definitions
72 // ===========================================================================
77 class MSVehicle : public MSBaseVehicle {
78 public:
79 
81  friend class MSLaneChanger;
82 
86  class State {
88  friend class MSVehicle;
89  friend class MSLaneChanger;
90 
91  public:
94 
96  State(const State& state);
97 
99  State& operator=(const State& state);
100 
102  bool operator!=(const State& state);
103 
105  SUMOReal pos() const;
106 
108  SUMOReal speed() const {
109  return mySpeed;
110  };
111 
112  private:
114  SUMOReal myPos;
115 
118 
119  };
120 
121 
134  };
135 
143  MSVehicle(SUMOVehicleParameter* pars, const MSRoute* route,
144  const MSVehicleType* type, SUMOReal speedFactor);
145 
147  virtual ~MSVehicle();
148 
149 
150 
152 
153 
163 
164 
165 
167 
168 
172  bool hasArrived() const;
173 
182  bool replaceRoute(const MSRoute* route, bool onInit = false, int offset = 0);
183 
184 
190  bool willPass(const MSEdge* const edge) const;
191 
192  unsigned int getRoutePosition() const;
193  void resetRoutePosition(unsigned int index);
194 
203 
204 
212  static inline SUMOReal gap(SUMOReal predPos, SUMOReal predLength, SUMOReal pos) {
213  return predPos - predLength - pos;
214  }
215 
216 
217 
219 
220 
238  void workOnMoveReminders(SUMOReal oldPos, SUMOReal newPos, SUMOReal newSpeed);
240 
241 
259  void planMove(const SUMOTime t, const MSVehicle* pred, const SUMOReal lengthsInFront);
260 
261 
274  bool executeMove();
275 
276 
278 
279 
284  return myState.myPos;
285  }
286 
287 
291  SUMOReal getSpeed() const {
292  return myState.mySpeed;
293  }
294 
295 
300  return myAcceleration;
301  }
303 
304 
305 
307 
308 
312  SUMOReal getSlope() const;
313 
314 
322  Position getPosition(const SUMOReal offset = 0) const;
323 
324 
328  MSLane* getLane() const {
329  return myLane;
330  }
331 
332 
336  inline bool isOnRoad() const {
337  return myAmOnNet;
338  }
339 
340 
346  const MSEdge* getRerouteOrigin() const {
347 #ifdef HAVE_INTERNAL_LANES
348  if (myLane != 0) {
349  return myLane->getInternalFollower();
350  }
351 #endif
352  return *myCurrEdge;
353  }
354 
355 
363  return myWaitingTime;
364  }
365 
366 
374  return STEPS2TIME(myWaitingTime);
375  }
376 
377 
381  SUMOReal getAngle() const;
383 
384 
386  static bool overlap(const MSVehicle* veh1, const MSVehicle* veh2) {
387  if (veh1->myState.myPos < veh2->myState.myPos) {
388  return veh2->myState.myPos - veh2->getVehicleType().getLengthWithGap() < veh1->myState.myPos;
389  }
390  return veh1->myState.myPos - veh1->getVehicleType().getLengthWithGap() < veh2->myState.myPos;
391  }
392 
393 
396  bool congested() const {
397  return myState.mySpeed < SUMOReal(60) / SUMOReal(3.6);
398  }
399 
400 
412 
419  bool enterLaneAtMove(MSLane* enteredLane, bool onTeleporting = false);
420 
421 
422 
430  void enterLaneAtInsertion(MSLane* enteredLane, SUMOReal pos, SUMOReal speed,
431  MSMoveReminder::Notification notification);
432 
433 
438  void enterLaneAtLaneChange(MSLane* enteredLane);
439 
440 
442  void leaveLane(const MSMoveReminder::Notification reason);
443 
444 
447 
450 
454  struct LaneQ {
468  std::vector<MSLane*> bestContinuations;
469  };
470 
474  const std::vector<LaneQ>& getBestLanes() const;
475 
493  void updateBestLanes(bool forceRebuild = false, const MSLane* startLane = 0);
494 
495 
500  const std::vector<MSLane*>& getBestLanesContinuation() const;
501 
506  const std::vector<MSLane*>& getBestLanesContinuation(const MSLane* const l) const;
507 
509  int getBestLaneOffset() const;
510 
512  void adaptBestLanesOccupation(int laneIndex, SUMOReal density);
513 
515 
517  bool fixPosition();
518 
519 
528  void replaceVehicleType(MSVehicleType* type);
529 
530 
538  inline const MSCFModel& getCarFollowModel() const {
539  return myType->getCarFollowModel();
540  }
541 
542 
548  return myCFVariables;
549  }
550 
551 
553 
554 
558  struct Stop {
562  const MSLane* lane;
574  bool triggered;
576  bool parking;
578  bool reached;
580  std::set<std::string> awaitedPersons;
581  };
582 
583 
590  bool addStop(const SUMOVehicleParameter::Stop& stopPar, SUMOTime untilOffset = 0);
591 
592 
596  bool hasStops() const {
597  return !myStops.empty();
598  }
599 
603  bool isStopped() const;
604 
608  bool isParking() const;
609 
610 
614  bool isStoppedTriggered() const;
616 
617  bool knowsEdgeTest(MSEdge& edge) const;
618  unsigned int getLaneIndex() const;
619 
629  SUMOReal getDistanceToPosition(SUMOReal destPos, const MSEdge* destEdge);
630 
631 
638  SUMOReal processNextStop(SUMOReal currentVelocity);
639 
647  std::pair<const MSVehicle* const, SUMOReal> getLeader(SUMOReal dist = 0) const;
648 
655  SUMOReal getTimeGap() const;
656 
657 
659 
660 
664  SUMOReal getCO2Emissions() const;
665 
666 
670  SUMOReal getCOEmissions() const;
671 
672 
676  SUMOReal getHCEmissions() const;
677 
678 
682  SUMOReal getNOxEmissions() const;
683 
684 
688  SUMOReal getPMxEmissions() const;
689 
690 
695 
696 
702 
703 
704 
706 
707 
711  void addPerson(MSPerson* person);
712 
713 
717  unsigned int getPersonNumber() const;
718 
721 
725  enum Signalling {
756  };
757 
758 
764  LC_NEVER = 0, // lcModel shall never trigger changes at this level
765  LC_NOCONFLICT = 1, // lcModel may trigger changes if not in conflict with TraCI request
766  LC_ALWAYS = 2 // lcModel may always trigger changes of this level regardless of requests
767  };
768 
769 
772  LCP_ALWAYS = 0, // change regardless of blockers, adapt own speed and speed of blockers
773  LCP_NOOVERLAP = 1, // change unless overlapping with blockers, adapt own speed and speed of blockers
774  LCP_URGENT = 2, // change if not blocked, adapt own speed and speed of blockers
775  LCP_OPPORTUNISTIC = 3 // change if not blocked
776  };
777 
778 
782  void switchOnSignal(int signal) {
783  mySignals |= signal;
784  }
785 
786 
790  void switchOffSignal(int signal) {
791  mySignals &= ~signal;
792  }
793 
794 
798  int getSignals() const {
799  return mySignals;
800  }
801 
802 
807  bool signalSet(int which) const {
808  return (mySignals & which) != 0;
809  }
811 
812 
813 #ifndef NO_TRACI
814 
822 
833  bool addTraciStop(MSLane* lane, SUMOReal pos, SUMOReal radius, SUMOTime duration, bool parking, bool triggered);
834 
839  Stop& getNextStop();
840 
845  bool resumeFromStopping();
846 
847 
860  class Influencer {
861  public:
863  Influencer();
864 
865 
867  ~Influencer();
868 
869 
873  void setSpeedTimeLine(const std::vector<std::pair<SUMOTime, SUMOReal> >& speedTimeLine);
874 
875 
879  void setLaneTimeLine(const std::vector<std::pair<SUMOTime, unsigned int> >& laneTimeLine);
880 
881 
893  SUMOReal influenceSpeed(SUMOTime currentTime, SUMOReal speed, SUMOReal vSafe, SUMOReal vMin, SUMOReal vMax);
894 
902  int influenceChangeDecision(const SUMOTime currentTime, const MSEdge& currentEdge, const unsigned int currentLaneIndex, int state);
903 
904 
910  SUMOReal changeRequestRemainingSeconds(const SUMOTime currentTime) const;
911 
915  void setConsiderSafeVelocity(bool value);
916 
917 
921  void setConsiderMaxAcceleration(bool value);
922 
923 
927  void setConsiderMaxDeceleration(bool value);
928 
929 
933  void setRespectJunctionPriority(bool value);
934 
935 
939  inline bool getRespectJunctionPriority() const {
941  }
942 
943 
947  void setEmergencyBrakeRedLight(bool value);
948 
949 
953  inline bool getEmergencyBrakeRedLight() const {
955  }
956 
957 
961  void setLaneChangeMode(int value);
962 
963 
967  inline SUMOReal getOriginalSpeed() const {
968  return myOriginalSpeed;
969  }
970 
971  void setVTDControlled(bool c, MSLane* l, SUMOReal pos, int edgeOffset, const MSEdgeVector& route) {
972  myAmVTDControlled = c;
973  myVTDLane = l;
974  myVTDPos = pos;
975  myVTDEdgeOffset = edgeOffset;
976  myVTDRoute = route;
977  }
978 
979  void postProcessVTD(MSVehicle* v);
980 
981  inline bool isVTDControlled() const {
982  return myAmVTDControlled;
983  }
984 
985  private:
987  std::vector<std::pair<SUMOTime, SUMOReal> > mySpeedTimeLine;
988 
990  std::vector<std::pair<SUMOTime, unsigned int> > myLaneTimeLine;
991 
994 
997 
1000 
1003 
1006 
1009 
1012 
1018 
1020 
1032 
1033  };
1034 
1035 
1042 
1043  bool hasInfluencer() const {
1044  return myInfluencer != 0;
1045  }
1046 
1048  int influenceChangeDecision(int state);
1049 
1050 
1051 #endif
1052 
1054 
1055 
1057  void saveState(OutputDevice& out);
1058 
1061  void loadState(const SUMOSAXAttributes& attrs, const SUMOTime offset);
1063 
1064 protected:
1065 
1066  SUMOReal getSpaceTillLastStanding(const MSLane* l, bool& foundStopped) const;
1067 
1070 
1086  void adaptLaneEntering2MoveReminder(const MSLane& enteredLane);
1088 
1089 
1090 
1091  void setBlinkerInformation();
1092 
1094  void updateOccupancyAndCurrentBestLane(const MSLane* startLane);
1095 
1096 
1099 
1102 
1105 
1107 
1110 
1111  std::vector<std::vector<LaneQ> > myBestLanes;
1112  std::vector<LaneQ>::iterator myCurrentLaneInBestLanes;
1113  static std::vector<MSLane*> myEmptyLaneVector;
1114 
1116  std::list<Stop> myStops;
1117 
1120 
1123 
1125  std::vector<MSLane*> myFurtherLanes;
1126 
1129 
1132 
1135 
1137 
1139 
1140 protected:
1154 
1155  DriveProcessItem(MSLink* link, SUMOReal vPass, SUMOReal vWait, bool setRequest,
1156  SUMOTime arrivalTime, SUMOReal arrivalSpeed,
1157  SUMOTime arrivalTimeBraking, SUMOReal arrivalSpeedBraking,
1158  SUMOReal distance,
1159  SUMOReal leaveSpeed = -1.) :
1160  myLink(link), myVLinkPass(vPass), myVLinkWait(vWait), mySetRequest(setRequest),
1161  myArrivalTime(arrivalTime), myArrivalSpeed(arrivalSpeed),
1162  myArrivalTimeBraking(arrivalTimeBraking), myArrivalSpeedBraking(arrivalSpeedBraking),
1163  myDistance(distance),
1164  accelV(leaveSpeed), hadVehicle(false), availableSpace(-1.) {
1165  assert(vWait >= 0);
1166  assert(vPass >= 0);
1167  };
1168 
1171  myLink(0), myVLinkPass(vWait), myVLinkWait(vWait), mySetRequest(false),
1172  myArrivalTime(0), myArrivalSpeed(0),
1173  myArrivalTimeBraking(0), myArrivalSpeedBraking(0),
1174  myDistance(distance),
1175  accelV(-1), hadVehicle(false), availableSpace(-1.) {
1176  assert(vWait >= 0);
1177  };
1178 
1179 
1180  inline void adaptLeaveSpeed(const SUMOReal v) {
1181  if (accelV < 0) {
1182  accelV = v;
1183  } else {
1184  accelV = MIN2(accelV, v);
1185  }
1186  }
1187  inline SUMOReal getLeaveSpeed() const {
1188  return accelV < 0 ? myVLinkPass : accelV;
1189  }
1190  };
1191 
1192  typedef std::vector< DriveProcessItem > DriveItemVector;
1193 
1195  DriveItemVector myLFLinkLanes;
1196 
1197  void planMoveInternal(const SUMOTime t, const MSVehicle* pred, DriveItemVector& lfLinks) const;
1198  void checkRewindLinkLanes(const SUMOReal lengthsInFront, DriveItemVector& lfLinks) const;
1199 
1201  inline SUMOReal estimateLeaveSpeed(const MSLink* const link, const SUMOReal vLinkPass) const {
1202  // estimate leave speed for passing time computation
1203  // l=linkLength, a=accel, t=continuousTime, v=vLeave
1204  // l=v*t + 0.5*a*t^2, solve for t and multiply with a, then add v
1205  return MIN2(link->getViaLaneOrLane()->getVehicleMaxSpeed(this),
1207  }
1208 
1209  /* @brief estimate speed while accelerating for the given distance
1210  * @param[in] dist The distance during which accelerating takes place
1211  * @param[in] v The initial speed
1212  * @param[in] accel The acceleration
1213  */
1214  inline SUMOReal estimateSpeedAfterDistance(const SUMOReal dist, const SUMOReal v, const SUMOReal accel) const {
1215  // dist=v*t + 0.5*accel*t^2, solve for t and multiply with accel, then add v
1216  return MIN2(getVehicleType().getMaxSpeed(),
1217  (SUMOReal)sqrt(2 * dist * accel + v * v));
1218  }
1219 
1220 
1221  /* @brief estimate speed while accelerating for the given distance
1222  * @param[in] leaderInfo The leading vehicle and the (virtual) distance to it
1223  * @param[in] seen the distance to the end of the current lane
1224  * @param[in] lastLink the lastLink index
1225  * @param[in] lane The current Lane the vehicle is on
1226  * @param[in,out] the safe velocity for driving
1227  * @param[in,out] the safe velocity for arriving at the next link
1228  * @param[in] distToCrossing The distance to the crossing point with the current leader where relevant or -1
1229  */
1230  void adaptToLeader(const std::pair<const MSVehicle*, SUMOReal> leaderInfo,
1231  const SUMOReal seen, DriveProcessItem* const lastLink,
1232  const MSLane* const lane, SUMOReal& v, SUMOReal& vLinkPass,
1233  SUMOReal distToCrossing = -1) const;
1234 
1235 #ifdef HAVE_INTERNAL_LANES
1236  mutable std::set<std::string> myLinkLeaders;
1238 #endif
1239 
1240 private:
1241  /* @brief The vehicle's knowledge about edge efforts/travel times; @see MSEdgeWeightsStorage
1242  * @note member is initialized on first access */
1244 
1247 
1248 #ifndef NO_TRACI
1251 #endif
1252 
1253 private:
1255  MSVehicle();
1256 
1258  MSVehicle(const MSVehicle&);
1259 
1261  MSVehicle& operator=(const MSVehicle&);
1262 
1264 
1265 };
1266 
1267 
1268 #endif
1269 
1270 /****************************************************************************/
1271 
void resetRoutePosition(unsigned int index)
Definition: MSVehicle.cpp:530
bool signalSet(int which) const
Returns whether the given signal is on.
Definition: MSVehicle.h:807
const MSLane * myLastBestLanesInternalLane
Definition: MSVehicle.h:1109
const MSVehicleType * myType
This Vehicle's type.
void replaceVehicleType(MSVehicleType *type)
Replaces the current vehicle type by the one given.
Definition: MSVehicle.cpp:2250
bool enterLaneAtMove(MSLane *enteredLane, bool onTeleporting=false)
Update when the vehicle enters a new lane in the move step.
Definition: MSVehicle.cpp:1594
Representation of a vehicle in the micro simulation.
Definition: MSVehicle.h:77
SUMOReal speed() const
Speed of this state.
Definition: MSVehicle.h:108
MSEdgeWeightsStorage * myEdgeWeights
Definition: MSVehicle.h:1243
const MSEdge * myLastBestLanesEdge
Definition: MSVehicle.h:1108
LaneChangeMode
modes for resolving conflicts between external control (traci) and vehicle control over lane changing...
Definition: MSVehicle.h:763
MSAbstractLaneChangeModel * myLaneChangeModel
Definition: MSVehicle.h:1106
bool myAmOnNet
Whether the vehicle is on the network (not parking, teleported, vaporized, or arrived) ...
Definition: MSVehicle.h:1131
LaneChangeMode myRightDriveLC
changing to the rightmost lane
Definition: MSVehicle.h:1028
const MSEdge * getInternalFollower() const
Returns the lane's follower if it is an internal lane, the edge of the lane otherwise.
Definition: MSLane.cpp:817
std::vector< std::vector< LaneQ > > myBestLanes
Definition: MSVehicle.h:1111
const MSCFModel & getCarFollowModel() const
Returns the vehicle's car following model definition.
Definition: MSVehicle.h:538
std::vector< MSLane * > myFurtherLanes
The information into which lanes the vehicle laps into.
Definition: MSVehicle.h:1125
State myState
This Vehicles driving state (pos and speed)
Definition: MSVehicle.h:1101
Stop & getNextStop()
Definition: MSVehicle.cpp:2322
SUMOReal getMaxSpeed() const
Returns the maximum speed.
DriveItemVector myLFLinkLanes
Container for used Links/visited Lanes during lookForward.
Definition: MSVehicle.h:1195
SUMOReal pos() const
Position of this state.
Definition: MSVehicle.cpp:137
bool resumeFromStopping()
Definition: MSVehicle.cpp:2294
bool myAmRegisteredAsWaitingForPerson
Whether this vehicle is registered as waiting for a person (for deadlock-recognition) ...
Definition: MSVehicle.h:1134
bool hasInfluencer() const
Definition: MSVehicle.h:1043
SUMOReal getLengthWithGap() const
Get vehicle's length including the minimum gap [m].
int bestLaneOffset
The (signed) number of lanes to be crossed to get to the lane which allows to continue the drive...
Definition: MSVehicle.h:464
void setBlinkerInformation()
Definition: MSVehicle.cpp:2219
SUMOReal getLeaveSpeed() const
Definition: MSVehicle.h:1187
SUMOReal myAcceleration
The current acceleration after dawdling in m/s.
Definition: MSVehicle.h:1122
MSEdgeVector::const_iterator MSRouteIterator
Definition: MSRoute.h:60
SUMOReal getSpeedWithoutTraciInfluence() const
Returns the uninfluenced velocity.
Definition: MSVehicle.cpp:2337
void setRespectJunctionPriority(bool value)
Sets whether junction priority rules shall be respected.
Definition: MSVehicle.cpp:324
bool isVTDControlled() const
Definition: MSVehicle.h:981
SUMOTime getWaitingTime() const
Returns the SUMOTime waited (speed was lesser than 0.1m/s)
Definition: MSVehicle.h:362
bool congested() const
Definition: MSVehicle.h:396
The front lights are on (no visualisation)
Definition: MSVehicle.h:737
Signalling
Some boolean values which describe the state of some vehicle parts.
Definition: MSVehicle.h:725
Position getPosition(const SUMOReal offset=0) const
Return current position (x/y, cartesian)
Definition: MSVehicle.cpp:616
bool hasArrived() const
Returns whether this vehicle has already arived (reached the arrivalPosition on its final edge) ...
Definition: MSVehicle.cpp:462
The car-following model abstraction.
Definition: MSCFModel.h:58
bool myConsiderMaxAcceleration
Whether the maximum acceleration shall be regarded.
Definition: MSVehicle.h:1002
State(SUMOReal pos, SUMOReal speed)
Constructor.
Definition: MSVehicle.cpp:142
The high beam lights are on (no visualisation)
Definition: MSVehicle.h:741
Notification
Definition of a vehicle state.
bool replaceRoute(const MSRoute *route, bool onInit=false, int offset=0)
Replaces the current route by the given one.
Definition: MSVehicle.cpp:469
Changes the wished vehicle speed / lanes.
Definition: MSVehicle.h:860
SUMOReal getHCEmissions() const
Returns HC emission of the current state.
Definition: MSVehicle.cpp:2159
bool myRespectJunctionPriority
Whether the junction priority rules are respected.
Definition: MSVehicle.h:1008
bool reached
Information whether the stop has been reached.
Definition: MSVehicle.h:578
State & operator=(const State &state)
Assignment operator.
Definition: MSVehicle.cpp:122
The backwards driving lights are on (no visualisation)
Definition: MSVehicle.h:743
vehicle doesn't want to change
Definition: MSVehicle.h:127
unsigned int getPersonNumber() const
Returns the number of persons.
Definition: MSVehicle.cpp:2212
TraciLaneChangePriority
modes for prioritizing traci lane change requests
Definition: MSVehicle.h:771
void postProcessVTD(MSVehicle *v)
Definition: MSVehicle.cpp:346
SUMOReal estimateLeaveSpeed(const MSLink *const link, const SUMOReal vLinkPass) const
estimate leaving speed when accelerating across a link
Definition: MSVehicle.h:1201
SUMOReal mySpeed
the stored speed
Definition: MSVehicle.h:117
Definition of vehicle stop (position and duration)
Definition: MSVehicle.h:558
SUMOReal getCO2Emissions() const
Returns CO2 emission of the current state.
Definition: MSVehicle.cpp:2147
bool executeMove()
Executes planned vehicle movements with regards to right-of-way.
Definition: MSVehicle.cpp:1129
std::pair< const MSVehicle *const, SUMOReal > getLeader(SUMOReal dist=0) const
Returns the leader of the vehicle looking for a fixed distance.
Definition: MSVehicle.cpp:2113
SUMOReal getPositionOnLane() const
Get the vehicle's position along the lane.
Definition: MSVehicle.h:283
DriveProcessItem(MSLink *link, SUMOReal vPass, SUMOReal vWait, bool setRequest, SUMOTime arrivalTime, SUMOReal arrivalSpeed, SUMOTime arrivalTimeBraking, SUMOReal arrivalSpeedBraking, SUMOReal distance, SUMOReal leaveSpeed=-1.)
Definition: MSVehicle.h:1155
The base class for microscopic and mesoscopic vehicles.
Definition: MSBaseVehicle.h:58
bool myHaveToWaitOnNextLink
Definition: MSVehicle.h:1136
SUMOReal processNextStop(SUMOReal currentVelocity)
Processes stops, returns the velocity needed to reach the stop.
Definition: MSVehicle.cpp:773
A storage for edge travel times and efforts.
bool hasStops() const
Returns whether the vehicle has to stop somewhere.
Definition: MSVehicle.h:596
SUMOReal length
The overall length which may be driven when using this lane without a lane change.
Definition: MSVehicle.h:458
int influenceChangeDecision(const SUMOTime currentTime, const MSEdge &currentEdge, const unsigned int currentLaneIndex, int state)
Applies stored LaneChangeMode information and laneTimeLine.
Definition: MSVehicle.cpp:216
void enterLaneAtLaneChange(MSLane *enteredLane)
Update when the vehicle enters a new lane in the laneChange step.
Definition: MSVehicle.cpp:1626
const MSEdge * getRerouteOrigin() const
Returns the starting point for reroutes (usually the current edge)
Definition: MSVehicle.h:346
The car-following model and parameter.
Definition: MSVehicleType.h:74
bool triggered
whether an arriving person lets the vehicle continue
Definition: MSVehicle.h:574
MSAbstractLaneChangeModel & getLaneChangeModel()
Definition: MSVehicle.cpp:1750
MSCFModel::VehicleVariables * myCFVariables
The per vehicle variables of the car following model.
Definition: MSVehicle.h:1246
const MSCFModel & getCarFollowModel() const
Returns the vehicle type's car following model definition (const version)
Right blinker lights are switched on.
Definition: MSVehicle.h:729
SUMOReal nextOccupation
As occupation, but without the first lane.
Definition: MSVehicle.h:462
void enterLaneAtInsertion(MSLane *enteredLane, SUMOReal pos, SUMOReal speed, MSMoveReminder::Notification notification)
Update when the vehicle enters a new lane in the emit step.
Definition: MSVehicle.cpp:1678
SUMOReal influenceSpeed(SUMOTime currentTime, SUMOReal speed, SUMOReal vSafe, SUMOReal vMin, SUMOReal vMax)
Applies stored velocity information on the speed to use.
Definition: MSVehicle.cpp:183
bool operator!=(const State &state)
Operator !=.
Definition: MSVehicle.cpp:130
Performs lane changing of vehicles.
Definition: MSLaneChanger.h:55
A road/street connecting two junctions.
Definition: MSEdge.h:74
MSLane * lane
The described lane.
Definition: MSVehicle.h:456
void checkRewindLinkLanes(const SUMOReal lengthsInFront, DriveItemVector &lfLinks) const
Definition: MSVehicle.cpp:1401
Left blinker lights are switched on.
Definition: MSVehicle.h:731
void setEmergencyBrakeRedLight(bool value)
Sets whether red lights shall be a reason to brake.
Definition: MSVehicle.cpp:330
DriveProcessItem(SUMOReal vWait, SUMOReal distance)
constructor if the link shall not be passed
Definition: MSVehicle.h:1170
The wipers are on.
Definition: MSVehicle.h:745
void workOnMoveReminders(SUMOReal oldPos, SUMOReal newPos, SUMOReal newSpeed)
Processes active move reminder.
Definition: MSVehicle.cpp:561
vehicle want's to change to right lane
Definition: MSVehicle.h:131
bool addTraciStop(MSLane *lane, SUMOReal pos, SUMOReal radius, SUMOTime duration, bool parking, bool triggered)
Definition: MSVehicle.cpp:2266
Encapsulated SAX-Attributes.
std::vector< const MSEdge * > MSEdgeVector
Definition: MSPerson.h:57
void setLaneTimeLine(const std::vector< std::pair< SUMOTime, unsigned int > > &laneTimeLine)
Sets a new lane timeline.
Definition: MSVehicle.cpp:177
ChangeRequest
Requests set via TraCI.
Definition: MSVehicle.h:125
const std::vector< MSLane * > & getBestLanesContinuation() const
Returns the subpart of best lanes that describes the vehicle's current lane and their successors...
Definition: MSVehicle.cpp:2035
A point in 2D or 3D with translation and scaling methods.
Definition: Position.h:46
TraciLaneChangePriority myTraciLaneChangePriority
flags for determining the priority of traci lane change requests
Definition: MSVehicle.h:1031
bool willPass(const MSEdge *const edge) const
Returns whether the vehicle wil pass the given edge.
Definition: MSVehicle.cpp:518
A lane area vehicles can halt at.
Definition: MSBusStop.h:64
void updateBestLanes(bool forceRebuild=false, const MSLane *startLane=0)
computes the best lanes to use in order to continue the route
Definition: MSVehicle.cpp:1768
Position myCachedPosition
Definition: MSVehicle.h:1138
const MSLane * lane
The lane to stop at.
Definition: MSVehicle.h:562
static SUMOReal gap(SUMOReal predPos, SUMOReal predLength, SUMOReal pos)
Uses the given values to compute the brutto-gap.
Definition: MSVehicle.h:212
SUMOReal myOriginalSpeed
The velocity before influence.
Definition: MSVehicle.h:993
std::list< Stop > myStops
The vehicle's list of stops.
Definition: MSVehicle.h:1116
bool isStopped() const
Returns whether the vehicle is at a stop.
Definition: MSVehicle.cpp:755
void setVTDControlled(bool c, MSLane *l, SUMOReal pos, int edgeOffset, const MSEdgeVector &route)
Definition: MSVehicle.h:971
bool myConsiderMaxDeceleration
Whether the maximum deceleration shall be regarded.
Definition: MSVehicle.h:1005
#define STEPS2TIME(x)
Definition: SUMOTime.h:65
void adaptLeaveSpeed(const SUMOReal v)
Definition: MSVehicle.h:1180
MSLane * myLane
The lane the vehicle is on.
Definition: MSVehicle.h:1104
bool getRespectJunctionPriority() const
Returns whether junction priority rules shall be respected.
Definition: MSVehicle.h:939
Blinker lights on both sides are switched on.
Definition: MSVehicle.h:733
Influencer * myInfluencer
An instance of a velocity/lane influencing instance; built in "getInfluencer".
Definition: MSVehicle.h:1250
std::vector< LaneQ >::iterator myCurrentLaneInBestLanes
Definition: MSVehicle.h:1112
SUMOReal getSpaceTillLastStanding(const MSLane *l, bool &foundStopped) const
Definition: MSVehicle.cpp:1383
SUMOTime duration
The stopping duration.
Definition: MSVehicle.h:570
MSVehicle()
invalidated default constructor
T MIN2(T a, T b)
Definition: StdDefs.h:66
The brake lights are on.
Definition: MSVehicle.h:735
SUMOReal estimateSpeedAfterDistance(const SUMOReal dist, const SUMOReal v, const SUMOReal accel) const
Definition: MSVehicle.h:1214
A blue emergency light is on.
Definition: MSVehicle.h:751
A structure representing the best lanes for continuing the route.
Definition: MSVehicle.h:454
void loadState(const SUMOSAXAttributes &attrs, const SUMOTime offset)
Loads the state of this vehicle from the given description.
Definition: MSVehicle.cpp:2374
Everything is switched off.
Definition: MSVehicle.h:727
void onRemovalFromNet(const MSMoveReminder::Notification reason)
Called when the vehicle is removed from the network.
Definition: MSVehicle.cpp:448
Something on a lane to be noticed about vehicle movement.
SUMOReal changeRequestRemainingSeconds(const SUMOTime currentTime) const
Return the remaining number of seconds of the current laneTimeLine assuming one exists.
Definition: MSVehicle.cpp:298
bool addStop(const SUMOVehicleParameter::Stop &stopPar, SUMOTime untilOffset=0)
Adds a stop.
Definition: MSVehicle.cpp:673
SUMOTime myWaitingTime
The time the vehicle waits (is not faster than 0.1m/s) in seconds.
Definition: MSVehicle.h:1098
One of the left doors is opened.
Definition: MSVehicle.h:747
LaneChangeMode mySpeedGainLC
lane changing to travel with higher speed
Definition: MSVehicle.h:1026
bool isParking() const
Returns whether the vehicle is parking.
Definition: MSVehicle.cpp:761
LaneChangeMode myCooperativeLC
lane changing with the intent to help other vehicles
Definition: MSVehicle.h:1024
const std::vector< LaneQ > & getBestLanes() const
Returns the description of best lanes to use in order to continue the route.
Definition: MSVehicle.cpp:1762
bool knowsEdgeTest(MSEdge &edge) const
bool allowsContinuation
Whether this lane allows to continue the drive.
Definition: MSVehicle.h:466
SUMOReal getHarmonoise_NoiseEmissions() const
Returns noise emissions of the current state.
Definition: MSVehicle.cpp:2183
Container that holds the vehicles driving state (position+speed).
Definition: MSVehicle.h:86
void saveState(OutputDevice &out)
Saves the states of a vehicle.
Definition: MSVehicle.cpp:2360
void planMoveInternal(const SUMOTime t, const MSVehicle *pred, DriveItemVector &lfLinks) const
Definition: MSVehicle.cpp:859
SUMOReal getOriginalSpeed() const
Returns the originally longitudinal speed to use.
Definition: MSVehicle.h:967
MSCFModel::VehicleVariables * getCarFollowVariables() const
Returns the vehicle's car following model variables.
Definition: MSVehicle.h:547
SUMOReal getNOxEmissions() const
Returns NOx emission of the current state.
Definition: MSVehicle.cpp:2165
bool myEmergencyBrakeRedLight
Whether red lights are a reason to brake.
Definition: MSVehicle.h:1011
MSEdgeWeightsStorage & _getWeightsStorage() const
Definition: MSVehicle.cpp:551
Influencer()
Constructor.
Definition: MSVehicle.cpp:150
MSEdgeVector myVTDRoute
Definition: MSVehicle.h:1017
void leaveLane(const MSMoveReminder::Notification reason)
Update of members if vehicle leaves a new lane in the lane change step or at arrival.
Definition: MSVehicle.cpp:1710
SUMOReal getMaxAccel() const
Get the vehicle type's maximum acceleration [m/s^2].
Definition: MSCFModel.h:157
SUMOReal getPMxEmissions() const
Returns PMx emission of the current state.
Definition: MSVehicle.cpp:2171
SUMOReal getCOEmissions() const
Returns CO emission of the current state.
Definition: MSVehicle.cpp:2153
Abstract in-vehicle device.
Definition: MSDevice.h:69
void updateOccupancyAndCurrentBestLane(const MSLane *startLane)
updates LaneQ::nextOccupation and myCurrentLaneInBestLanes
Definition: MSVehicle.cpp:2018
vehicle want's to change to left lane
Definition: MSVehicle.h:129
~Influencer()
Destructor.
Definition: MSVehicle.cpp:166
void setSpeedTimeLine(const std::vector< std::pair< SUMOTime, SUMOReal > > &speedTimeLine)
Sets a new velocity timeline.
Definition: MSVehicle.cpp:170
MSVehicle & operator=(const MSVehicle &)
invalidated assignment operator
Influencer & getInfluencer()
Returns the velocity/lane influencer.
Definition: MSVehicle.cpp:2328
Structure representing possible vehicle parameter.
Definition of vehicle stop (position and duration)
bool getEmergencyBrakeRedLight() const
Returns whether red lights shall be a reason to brake.
Definition: MSVehicle.h:953
std::vector< std::pair< SUMOTime, SUMOReal > > mySpeedTimeLine
The velocity time line to apply.
Definition: MSVehicle.h:987
SUMOReal getSlope() const
Returns the slope of the road at vehicle's position.
Definition: MSVehicle.cpp:605
void setConsiderMaxDeceleration(bool value)
Sets whether the maximum deceleration shall be regarded.
Definition: MSVehicle.cpp:318
bool fixPosition()
repair errors in vehicle position after changing between internal edges
Definition: MSVehicle.cpp:2081
SUMOReal occupation
The overall vehicle sum on consecutive lanes which can be passed without a lane change.
Definition: MSVehicle.h:460
SUMOReal getAcceleration() const
Returns the vehicle's acceleration in m/s.
Definition: MSVehicle.h:299
int mySignals
State of things of the vehicle that can be on or off.
Definition: MSVehicle.h:1128
std::vector< MSLane * > bestContinuations
Consecutive lane that can be followed without a lane change (contribute to length and occupation) ...
Definition: MSVehicle.h:468
Definition of vehicle stop (position and duration)
std::set< std::string > awaitedPersons
IDs of persons the vehicle has to wait for until departing.
Definition: MSVehicle.h:580
SUMOReal getFuelConsumption() const
Returns fuel consumption of the current state.
Definition: MSVehicle.cpp:2177
void adaptToLeader(const std::pair< const MSVehicle *, SUMOReal > leaderInfo, const SUMOReal seen, DriveProcessItem *const lastLink, const MSLane *const lane, SUMOReal &v, SUMOReal &vLinkPass, SUMOReal distToCrossing=-1) const
Definition: MSVehicle.cpp:1101
const MSVehicleType & getVehicleType() const
Returns the vehicle's type definition.
Definition: MSBaseVehicle.h:95
SUMOTime until
The time at which the vehicle may continue its journey.
Definition: MSVehicle.h:572
void setConsiderSafeVelocity(bool value)
Sets whether the safe velocity shall be regarded.
Definition: MSVehicle.cpp:306
MSRouteIterator edge
The edge in the route to stop at.
Definition: MSVehicle.h:560
SUMOReal getDistanceToPosition(SUMOReal destPos, const MSEdge *destEdge)
Definition: MSVehicle.cpp:2092
SUMOReal getSpeed() const
Returns the vehicle's current speed.
Definition: MSVehicle.h:291
int SUMOTime
Definition: SUMOTime.h:43
void setLaneChangeMode(int value)
Sets lane changing behavior.
Definition: MSVehicle.cpp:336
SUMOReal myPos
the stored position
Definition: MSVehicle.h:110
SUMOReal getWaitingSeconds() const
Returns the number of seconds waited (speed was lesser than 0.1m/s)
Definition: MSVehicle.h:373
MSBusStop * busstop
(Optional) bus stop if one is assigned to the stop
Definition: MSVehicle.h:564
bool isStoppedTriggered() const
Returns whether the vehicle is on a triggered stop.
Definition: MSVehicle.cpp:767
std::vector< DriveProcessItem > DriveItemVector
Definition: MSVehicle.h:1192
std::vector< std::pair< SUMOTime, unsigned int > > myLaneTimeLine
The lane usage time line to apply.
Definition: MSVehicle.h:990
void planMove(const SUMOTime t, const MSVehicle *pred, const SUMOReal lengthsInFront)
Compute safe velocities for the upcoming lanes based on positions and speeds from the last time step...
Definition: MSVehicle.cpp:851
SUMOReal endPos
The stopping position end.
Definition: MSVehicle.h:568
vehicle want's to keep the current lane
Definition: MSVehicle.h:133
int getSignals() const
Returns the signals.
Definition: MSVehicle.h:798
Static storage of an output device and its base (abstract) implementation.
Definition: OutputDevice.h:71
#define SUMOReal
Definition: config.h:215
void switchOffSignal(int signal)
Switches the given signal off.
Definition: MSVehicle.h:790
void switchOnSignal(int signal)
Switches the given signal on.
Definition: MSVehicle.h:782
static std::vector< MSLane * > myEmptyLaneVector
Definition: MSVehicle.h:1113
void adaptBestLanesOccupation(int laneIndex, SUMOReal density)
update occupation from MSLaneChanger
Definition: MSVehicle.cpp:2073
static bool overlap(const MSVehicle *veh1, const MSVehicle *veh2)
Definition: MSVehicle.h:386
MSRouteIterator myCurrEdge
Iterator to current route-edge.
virtual ~MSVehicle()
Destructor.
Definition: MSVehicle.cpp:367
SUMOReal getVehicleMaxSpeed(const SUMOVehicle *const veh) const
Returns the lane's maximum speed, given a vehicle's speed limit adaptation.
Definition: MSLane.h:354
bool isOnRoad() const
Returns the information whether the vehicle is on a road (is simulated)
Definition: MSVehicle.h:336
bool mySpeedAdaptationStarted
Whether influencing the speed has already started.
Definition: MSVehicle.h:996
MSLane * getLane() const
Returns the lane the vehicle is on.
Definition: MSVehicle.h:328
int influenceChangeDecision(int state)
allow TraCI to influence a lane change decision
Definition: MSVehicle.cpp:2346
void activateReminders(const MSMoveReminder::Notification reason)
"Activates" all current move reminder
Definition: MSVehicle.cpp:1563
SUMOReal getTimeGap() const
Returns the time gap in seconds to the leader of the vehicle looking for a fixed distance.
Definition: MSVehicle.cpp:2137
void addPerson(MSPerson *person)
Adds a passenger.
Definition: MSVehicle.cpp:2189
SUMOReal startPos
The stopping position start.
Definition: MSVehicle.h:566
A red emergency light is on.
Definition: MSVehicle.h:753
Representation of a lane in the micro simulation.
Definition: MSLane.h:77
const MSEdgeWeightsStorage & getWeightsStorage() const
Returns the vehicle's internal edge travel times/efforts container.
Definition: MSVehicle.cpp:539
void adaptLaneEntering2MoveReminder(const MSLane &enteredLane)
Adapts the vehicle's entering of a new lane.
Definition: MSVehicle.cpp:585
LaneChangeMode myStrategicLC
lane changing which is necessary to follow the current route
Definition: MSVehicle.h:1022
unsigned int getRoutePosition() const
Definition: MSVehicle.cpp:524
One of the right doors is opened.
Definition: MSVehicle.h:749
Interface for lane-change models.
MSDevice_Person * myPersonDevice
The passengers this vehicle may have.
Definition: MSVehicle.h:1119
int getBestLaneOffset() const
returns the current offset from the best lane
Definition: MSVehicle.cpp:2063
bool myConsiderSafeVelocity
Whether the safe velocity shall be regarded.
Definition: MSVehicle.h:999
void setConsiderMaxAcceleration(bool value)
Sets whether the maximum acceleration shall be regarded.
Definition: MSVehicle.cpp:312
The fog lights are on (no visualisation)
Definition: MSVehicle.h:739
bool parking
whether the vehicle is removed from the net while stopping
Definition: MSVehicle.h:576
SUMOReal getAngle() const
Returns the vehicle's direction in degrees.
Definition: MSVehicle.cpp:643
A yellow emergency light is on.
Definition: MSVehicle.h:755
unsigned int getLaneIndex() const
Definition: MSVehicle.cpp:2258