![]() |
Eclipse SUMO - Simulation of Urban MObility
|
A point in 2D or 3D with translation and scaling methods. More...
#include <Position.h>
Public Member Functions | |
void | add (const Position &pos) |
Adds the given position to this one. More... | |
void | add (double dx, double dy) |
Adds the given position to this one. More... | |
void | add (double dx, double dy, double dz) |
Adds the given position to this one. More... | |
bool | almostSame (const Position &p2, double maxDiv=POSITION_EPS) const |
check if two position is almost the sme as other More... | |
double | angleTo2D (const Position &other) const |
returns the angle in the plane of the vector pointing from here to the other position More... | |
Position | crossProduct (const Position &pos) |
returns the cross product between this point and the second one More... | |
double | distanceSquaredTo (const Position &p2) const |
returns the square of the distance to another position More... | |
double | distanceSquaredTo2D (const Position &p2) const |
returns the square of the distance to another position (Only using x and y positions) More... | |
double | distanceTo (const Position &p2) const |
returns the euclidean distance in 3 dimension More... | |
double | distanceTo2D (const Position &p2) const |
returns the euclidean distance in the x-y-plane More... | |
double | dotProduct (const Position &pos) |
returns the dot product (scalar product) between this point and the second one More... | |
bool | isNAN () const |
check if position is NAN More... | |
void | mul (double mx, double my) |
Multiplies position with the given values. More... | |
void | mul (double mx, double my, double mz) |
Multiplies position with the given values. More... | |
void | mul (double val) |
Multiplies both positions with the given value. More... | |
void | norm2d () |
bool | operator!= (const Position &p2) const |
difference operator More... | |
Position | operator* (double scalar) const |
keep the direction but modify the length of the (location) vector to length * scalar More... | |
Position | operator+ (const Position &p2) const |
add operator More... | |
Position | operator+ (double offset) const |
keep the direction but modify the length of the (location) vector to length + scalar More... | |
Position | operator- (const Position &p2) const |
sub operator More... | |
bool | operator< (const Position &p2) const |
lexicographical sorting for use in maps and sets More... | |
bool | operator== (const Position &p2) const |
comparation operator More... | |
Position () | |
default constructor More... | |
Position (double x, double y) | |
Parametrised constructor (only for x-y) More... | |
Position (double x, double y, double z) | |
Parametrised constructor. More... | |
Position | rotateAround2D (double rad, const Position &origin) |
rotate this position by rad around origin and return the result More... | |
void | set (const Position &pos) |
set position with another position More... | |
void | set (double x, double y) |
set positions x and y More... | |
void | set (double x, double y, double z) |
set positions x, y and z More... | |
void | setx (double x) |
set position x More... | |
void | sety (double y) |
set position y More... | |
void | setz (double z) |
set position z More... | |
void | sub (const Position &pos) |
Substracts the given position from this one. More... | |
void | sub (double dx, double dy) |
Substracts the given position from this one. More... | |
void | sub (double dx, double dy, double dz) |
Substracts the given position from this one. More... | |
void | swapXY () |
swap position X and Y More... | |
double | x () const |
Returns the x-position. More... | |
double | y () const |
Returns the y-position. More... | |
double | z () const |
Returns the z-position. More... | |
~Position () | |
Destructor. More... | |
Static Public Attributes | |
static const Position | INVALID |
used to indicate that a position is valid More... | |
Private Attributes | |
double | myX |
The x-position. More... | |
double | myY |
The y-position. More... | |
double | myZ |
The z-position. More... | |
Friends | |
std::ostream & | operator<< (std::ostream &os, const Position &p) |
output operator More... | |
A point in 2D or 3D with translation and scaling methods.
Definition at line 36 of file Position.h.
|
inline |
default constructor
Definition at line 39 of file Position.h.
Referenced by crossProduct(), GNEPOI::drawGL(), GUIPointOfInterest::drawInnerPOI(), operator*(), operator+(), operator-(), and rotateAround2D().
|
inline |
Parametrised constructor (only for x-y)
Definition at line 43 of file Position.h.
|
inline |
Parametrised constructor.
Definition at line 47 of file Position.h.
|
inline |
Destructor.
Definition at line 51 of file Position.h.
|
inline |
Adds the given position to this one.
Definition at line 124 of file Position.h.
Referenced by NBNodeCont::analyzeCluster(), GNEMoveElement::calculateMovementOverLane(), AGPosition::compute2dPosition(), NBNodeShapeComputer::computeNodeShapeDefault(), NIVissimDistrictConnection::dict_BuildDistrictNodes(), GNEEdge::drawEdgeName(), GUIEdge::drawGL(), GLHelper::drawTextBox(), PositionVector::extrapolate(), PositionVector::extrapolate2D(), NBNode::getEmptyDir(), GeoConvHelper::moveConvertedBy(), GNEPersonStop::moveGeometry(), GNEPersonTrip::moveGeometry(), GNERide::moveGeometry(), GNEStop::moveGeometry(), GNEWalk::moveGeometry(), NBPTPlatform::reshiftPosition(), NBPTStop::reshiftPosition(), NBDistrict::reshiftPosition(), NBEdge::reshiftPosition(), NBNode::reshiftPosition(), GUISUMOAbstractView::showToolTipFor(), and GeoConvHelper::x2cartesian_const().
|
inline |
Adds the given position to this one.
Definition at line 131 of file Position.h.
|
inline |
Adds the given position to this one.
Definition at line 137 of file Position.h.
|
inline |
check if two position is almost the sme as other
Definition at line 226 of file Position.h.
References distanceTo().
Referenced by NBNode::getEndPoints(), PositionVector::insert_noDoublePos(), AGPosition::operator==(), PositionVector::push_back_noDoublePos(), and PositionVector::push_front_noDoublePos().
|
inline |
returns the angle in the plane of the vector pointing from here to the other position
Definition at line 251 of file Position.h.
Referenced by libsumo::Helper::applySubscriptionFilterFieldOfVision(), NBNode::bezierControlPoints(), NBEdge::computeAngle(), MSVehicle::computeAngle(), GUIBaseVehicle::computeSeats(), GNENet::createRoundabout(), GNEBusStop::drawConnectionAccess(), GUIBusStop::drawGL(), GLHelper::drawTriangleAtEnd(), NBEdge::getShapeEndAngle(), NBEdgeCont::joinTramEdges(), LIBSUMO_NAMESPACE::Person::moveToXY(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), NBContHelper::relative_outgoing_edge_sorter::operator()(), NBContHelper::relative_incoming_edge_sorter::operator()(), GNENet::retrieve000180AngleEdges(), GNENet::retrieve180360AngleEdges(), PositionVector::rotationAtOffset(), and NWWriter_OpenDrive::writeGeomSmooth().
returns the cross product between this point and the second one
Definition at line 256 of file Position.h.
References myX, myY, myZ, and Position().
Referenced by NBHeightMapper::Triangle::normalVector().
|
inline |
returns the square of the distance to another position
Definition at line 236 of file Position.h.
Referenced by distanceTo(), GNEPerson::drawGL(), and GNEViewNet::drawTemporalJunction().
|
inline |
returns the square of the distance to another position (Only using x and y positions)
Definition at line 246 of file Position.h.
Referenced by distanceTo2D(), GNEEdge::drawEdgeGeometryPoints(), GNEGeometry::drawGeometry(), GNEGeometry::drawGeometryPoints(), GNEVehicle::drawGL(), GNEJunction::drawGL(), GNEGeometry::drawLaneGeometry(), GNEDemandElement::drawPersonPlanPartialLane(), GNEGeometry::drawSegmentGeometry(), GNEStoppingPlace::drawSign(), NBPTStopCont::getClosestPlatformToPTStopPosition(), RORouteHandler::getJunctionTaz(), GNEPoly::getMoveOperation(), GNETAZ::getMoveOperation(), GNEConnection::getMoveOperation(), GNECrossing::getMoveOperation(), GNEEdge::getMoveOperation(), and GNEJunction::getMoveOperation().
|
inline |
returns the euclidean distance in 3 dimension
Definition at line 231 of file Position.h.
References distanceSquaredTo().
Referenced by IntermodalNetwork< E, L, N, V >::addSchedule(), almostSame(), TraCIServerAPI_Simulation::commandDistanceRequest(), NBHelpers::distance(), AGPosition::distanceTo(), GLHelper::drawBoxLines(), GUIOverheadWire::drawGL(), GUIOverheadWireClamp::drawGL(), GLHelper::drawTriangleAtEnd(), PositionVector::extrapolate(), MSStoppingPlace::getAccessDistance(), LIBSUMO_NAMESPACE::Simulation::getDistance2D(), LIBSUMO_NAMESPACE::Simulation::getDistanceRoad(), GUIBusStop::GUIBusStop(), GUIChargingStation::GUIChargingStation(), GUIContainerStop::GUIContainerStop(), GUIOverheadWire::GUIOverheadWire(), GUIParkingArea::GUIParkingArea(), PositionVector::indexOfClosest(), NBEdge::init(), GUIE2Collector::MyWrapper::MyWrapper(), GeomHelper::nearest_offset_on_line_to_point25D(), MSDevice_Bluelight::notifyMove(), GNEViewNet::onCmdTransformPOI(), GUIViewTraffic::onGamingClick(), operator+(), PositionVector::positionAtOffset(), NIVissimEdge::remapOneOfNodes(), PositionVector::rotationAtOffset(), GNEVehicle::setColor(), GUIBaseVehicle::setFunctionalColor(), PositionVector::slopeDegreeAtOffset(), GUILane::splitAtSegments(), and MSDevice_BTreceiver::BTreceiverUpdate::updateVisibility().
|
inline |
returns the euclidean distance in the x-y-plane
Definition at line 241 of file Position.h.
References distanceSquaredTo2D().
Referenced by MSCFModel_CC::_consensus(), MSCFModel_CC::_v(), libsumo::Helper::applySubscriptionFilterFieldOfVision(), NBNode::bezierControlPoints(), NBNode::buildWalkingAreas(), GNEGeometry::calculateLength(), NGRandomNetBuilder::canConnect(), NBNode::checkCrossing(), MSLink::checkWalkingAreaFoe(), GUIBaseVehicle::computeSeats(), NIImporter_OpenDrive::computeShapes(), PositionVector::distance2D(), GUIVehicle::drawAction_drawCarriageClass(), GNEBusStop::drawConnectionAccess(), GUIBusStop::drawGL(), GNEEdge::editEndpoint(), PositionVector::extrapolate2D(), NBPTStopCont::findAccessEdgesForRailStops(), NBNodeCont::generateNodeClusters(), PositionVector::getMaxGrade(), MSPModel_NonInteracting::CState::getPosition(), NBEdge::getSignalOffset(), NBNodeShapeComputer::getSmoothCorner(), GUILane::GUILane(), MSVehicle::Influencer::implicitDeltaPosRemote(), MSVehicle::Influencer::implicitSpeedRemote(), MSPModel_Striping::initWalkingAreaPaths(), PositionVector::insertAtClosest(), PositionVector::intersects(), PositionVector::intersectsAtLengths2D(), PCLoaderOSM::loadIfSet(), PositionVector::move2side(), LIBSUMO_NAMESPACE::Vehicle::moveTo(), LIBSUMO_NAMESPACE::Person::moveToXY(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), GeomHelper::nearest_offset_on_line_to_point25D(), GeomHelper::nearest_offset_on_line_to_point2D(), PositionVector::nearest_offset_to_point25D(), PositionVector::nearest_offset_to_point2D(), GUIViewTraffic::onGamingClick(), PositionVector::positionAtOffset2D(), NBNodeCont::pruneClusterFringe(), PositionVector::removeClosest(), GNEEdge::resetEndpoint(), NBNodeCont::shortestEdge(), PositionVector::sideOffset(), PositionVector::simplified(), PositionVector::slopeDegreeAtOffset(), PositionVector::smoothedZFront(), PositionVector::transformToVectorCoordinates(), MSPerson::MSPersonStage_Walking::walkDistance(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomSmooth(), and NWWriter_OpenDrive::writeRoadObjects().
|
inline |
returns the dot product (scalar product) between this point and the second one
Definition at line 264 of file Position.h.
Referenced by NBHeightMapper::Triangle::getZ().
|
inline |
|
inline |
Multiplies position with the given values.
Definition at line 111 of file Position.h.
|
inline |
Multiplies position with the given values.
Definition at line 117 of file Position.h.
|
inline |
Multiplies both positions with the given value.
Definition at line 104 of file Position.h.
Referenced by NBNodeCont::analyzeCluster(), AGPosition::compute2dPosition(), GeoConvHelper::computeFinal(), NBNodeShapeComputer::computeNodeShapeDefault(), GNEEdge::drawEdgeName(), GUIEdge::drawGL(), NBNode::getEmptyDir(), NBDistrict::mirrorX(), NBNode::mirrorX(), NBPTStop::mirrorX(), PCPolyContainer::saveDlrTDP(), NWWriter_DlrNavteq::writeNodesUnsplitted(), and NWWriter_DlrNavteq::writeTrafficSignals().
|
inline |
Definition at line 164 of file Position.h.
Referenced by NBNode::getEmptyDir().
|
inline |
|
inline |
keep the direction but modify the length of the (location) vector to length * scalar
Definition at line 190 of file Position.h.
References myX, myY, myZ, and Position().
|
inline |
keep the direction but modify the length of the (location) vector to length + scalar
Definition at line 195 of file Position.h.
References distanceTo(), myX, myY, myZ, and Position().
|
inline |
lexicographical sorting for use in maps and sets
Definition at line 215 of file Position.h.
|
inline |
rotate this position by rad around origin and return the result
Definition at line 41 of file Position.cpp.
References Position(), x(), and y().
Referenced by GUISUMOAbstractView::applyGLTransform(), GUIJunctionWrapper::drawGL(), GUIDanielPerspectiveChanger::onMouseMove(), and GUISUMOAbstractView::screenPos2NetPos().
|
inline |
set position with another position
Definition at line 97 of file Position.h.
|
inline |
set positions x and y
Definition at line 84 of file Position.h.
References myX, myY, x(), and y().
Referenced by MSCFModel_CC::_consensus(), NIXMLNodesHandler::addNode(), ShapeHandler::addPOI(), NBNode::bezierControlPoints(), GeoConvHelper::cartesian2geo(), CC_VehicleVariables::CC_VehicleVariables(), TraCIServerAPI_Simulation::commandDistanceRequest(), TraCIServerAPI_Simulation::commandPositionConversion(), NBNodeShapeComputer::computeNodeShapeSmall(), GUISUMOAbstractView::destroyPopup(), GNEApplicationWindow::handleEvent_NetworkLoaded(), GUIApplicationWindow::handleEvent_SimulationLoaded(), GUICompleteSchemeStorage::init(), NBHeightMapper::loadTiff(), GUISettingsHandler::myStartElement(), NLJunctionControlBuilder::openJunction(), GNEAdditionalHandler::parseAndBuildPOI(), TraCIServerAPI_GUI::processSet(), GUICompleteSchemeStorage::saveViewport(), GNEPOI::setAttribute(), GNEPOI::setMoveShape(), NGNode::setX(), NGNode::setY(), GNEPOI::updateGeometry(), GeoConvHelper::x2cartesian(), and GeoConvHelper::x2cartesian_const().
|
inline |
|
inline |
set position x
Definition at line 69 of file Position.h.
Referenced by MSCFModel_CC::_consensus(), NIXMLNodesHandler::addJoinCluster(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), MSParkingArea::MSParkingArea(), GNEPOI::setAttribute(), and GUISUMOAbstractView::snapToActiveGrid().
|
inline |
set position y
Definition at line 74 of file Position.h.
Referenced by MSCFModel_CC::_consensus(), NIXMLNodesHandler::addJoinCluster(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), MSParkingArea::MSParkingArea(), GNEPOI::setAttribute(), and GUISUMOAbstractView::snapToActiveGrid().
|
inline |
set position z
Definition at line 79 of file Position.h.
Referenced by NIXMLNodesHandler::addJoinCluster(), GNEViewNetHelper::MoveSingleElementValues::calculateOffset(), GNEViewNetHelper::MoveMultipleElementValues::calculateOffset(), NBNodeShapeComputer::computeNodeShapeDefault(), LIBSUMO_NAMESPACE::Simulation::convert2D(), NBNodeCont::joinNodeCluster(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), MSParkingArea::MSParkingArea(), GNEPOI::setAttribute(), GUISUMOAbstractView::snapToActiveGrid(), NBEdge::startShapeAt(), NBNetBuilder::transformCoordinate(), and GeoConvHelper::x2cartesian_const().
|
inline |
Substracts the given position from this one.
Definition at line 157 of file Position.h.
|
inline |
Substracts the given position from this one.
Definition at line 144 of file Position.h.
Referenced by NBNode::bezierControlPoints(), GeoConvHelper::cartesian2geo(), AGPosition::compute2dPosition(), PositionVector::extrapolate(), PositionVector::extrapolate2D(), NBNode::getEmptyDir(), NBHeightMapper::Triangle::getZ(), and LIBSUMO_NAMESPACE::Vehicle::highlight().
|
inline |
Substracts the given position from this one.
Definition at line 150 of file Position.h.
|
inline |
swap position X and Y
Definition at line 272 of file Position.h.
Referenced by GNEPolygonFrame::GEOPOICreator::onCmdCreateGEOPOI(), and GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates().
|
inline |
Returns the x-position.
Definition at line 54 of file Position.h.
References myX.
Referenced by MSCFModel_CC::_consensus(), PositionVector::add(), Boundary::add(), libsumo::POI::add(), NIXMLNodesHandler::addNode(), MSPModel_Striping::addVehicleFoe(), GeomHelper::angle2D(), GUISUMOAbstractView::applyGLTransform(), GUISettingsHandler::applyViewport(), Boundary::around(), PositionVector::around(), PositionVector::bezier(), NBNode::bezierControlPoints(), GNEGeometry::calculateRotation(), NIImporter_OpenDrive::calculateStraightEndPoint(), GeoConvHelper::cartesian2geo(), GUIDanielPerspectiveChanger::centerTo(), NGRandomNetBuilder::checkAngles(), GUISUMOAbstractView::checkGDALImage(), TraCIServerAPI_Simulation::commandPositionConversion(), NBPTStopCont::computeCrossProductEdgePosition(), NBNodeShapeComputer::computeNodeShapeSmall(), NGRandomNetBuilder::createNewNode(), Boundary::distanceTo2D(), GUIVehicle::drawAction_drawCarriageClass(), GUILane::drawArrows(), GNELane::drawArrows(), GLHelper::drawBoxLine(), GLHelper::drawBoxLines(), GNECalibrator::drawCalibratorSymbol(), GUISUMOAbstractView::drawDecals(), GNEDetector::drawDetectorLogo(), GNEEdge::drawEdgeGeometryPoints(), GLHelper::drawFilledPoly(), GNEVehicle::drawFlowLabel(), GNEGeometry::drawGeometry(), GUIBusStop::drawGL(), GUICalibrator::drawGL(), GUIChargingStation::drawGL(), GUIContainer::drawGL(), GUIContainerStop::drawGL(), GUIJunctionWrapper::drawGL(), GUILaneSpeedTrigger::drawGL(), GUIOverheadWire::drawGL(), GUIOverheadWireClamp::drawGL(), GUIParkingArea::drawGL(), GUIPerson::drawGL(), GUITrafficLightLogicWrapper::drawGL(), GUITriggeredRerouter::GUITriggeredRerouterEdge::drawGL(), GNEDetectorE3::drawGL(), GNEParkingSpace::drawGL(), GNEPOI::drawGL(), GNEPoly::drawGL(), GNERerouter::drawGL(), GNETAZ::drawGL(), GNEVariableSpeedSign::drawGL(), GNEPerson::drawGL(), GNEVehicle::drawGL(), GNEJunction::drawGL(), GNELane::drawLane2LaneConnections(), GUILane::drawLane2LaneConnections(), GNEViewNet::drawLaneCandidates(), GNEGeometry::drawLaneGeometry(), GLHelper::drawLine(), GNEStoppingPlace::drawLines(), GUIBaseVehicle::drawLinkItem(), GUILane::drawLinkRule(), GUILane::drawLinkRules(), GNEViewNetHelper::LockIcon::drawLockIcon(), GNEGeometry::drawMovingHint(), GUIBaseVehicle::drawOnPos(), GNEDemandElement::drawPersonPlanPartialLane(), GNEGeometry::drawSegmentGeometry(), GNEStoppingPlace::drawSign(), GUIE3Collector::MyWrapper::drawSingleCrossing(), GNEVehicle::drawStackLabel(), GNEViewNet::drawTemporalJunction(), GNEViewNetHelper::TestingMode::drawTestingElements(), GLHelper::drawText(), GLHelper::drawTextAtEnd(), GLHelper::drawTextBox(), GNEJunction::drawTLSIcon(), GLHelper::drawTriangleAtEnd(), MSVTypeProbe::execute(), NBNodeCont::extract(), NBPTStopCont::findAccessEdgesForRailStops(), GeomHelper::findLineCircleIntersections(), NIImporter_OpenDrive::geomFromLine(), PointOfInterest::getCenter(), GUIPointOfInterest::getCenteringBoundary(), NBNode::getEmptyDir(), MSPModel_Striping::getNextLaneObstacles(), MSCFModel_CC::getParameter(), PositionVector::getPolygonCenter(), GNEPerson::getPositionInView(), MSVTKExport::getPositions(), LIBSUMO_NAMESPACE::InductionLoop::getTree(), GNEGeometry::getVertexCircleAroundPosition(), GUIDanielPerspectiveChanger::getXPos(), NBHeightMapper::getZ(), GUIBusStop::GUIBusStop(), GUIChargingStation::GUIChargingStation(), GUIContainerStop::GUIContainerStop(), GUIJunctionWrapper::GUIJunctionWrapper(), GUILane::GUILane(), GUIOverheadWire::GUIOverheadWire(), GUIParkingArea::GUIParkingArea(), GNEApplicationWindow::handleEvent_NetworkLoaded(), GUIApplicationWindow::handleEvent_SimulationLoaded(), NBNodeCont::insert(), PositionVector::insertAtClosest(), PositionVector::intersects(), PositionVector::isLeft(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), MSAbstractLaneChangeModel::laneChangeOutput(), NBHeightMapper::loadTiff(), libsumo::Helper::makeTraCIPosition(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::PState::moveToXY(), MSParkingArea::MSParkingArea(), GUISettingsHandler::myStartElement(), GUIE2Collector::MyWrapper::MyWrapper(), GUIInductLoop::MyWrapper::MyWrapper(), GUIInstantInductLoop::MyWrapper::MyWrapper(), GUIMEInductLoop::MyWrapper::MyWrapper(), GeomHelper::nearest_offset_on_line_to_point2D(), MSDevice_ToC::notifyMove(), GUIGLObjectPopupMenu::onCmdCopyCursorGeoPosition(), GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates(), GUIDanielPerspectiveChanger::onMouseMove(), PositionVector::as_poly_cw_sorter::operator()(), PositionVector::increasing_x_y_sorter::operator()(), NBNodeCont::paretoCheck(), TraCIServerAPI_GUI::processSet(), libsumo::POI::remove(), MSDevice_ToC::requestToC(), NBNodeCont::retrieve(), rotateAround2D(), PCPolyContainer::saveDlrTDP(), set(), GNEPOI::setAttribute(), GNEVehicle::setColor(), GUIBaseVehicle::setFunctionalColor(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), setx(), NGNode::setY(), PositionVector::sideOffset(), PositionVector::simplified(), GUISUMOAbstractView::snapToActiveGrid(), PositionVector::sub(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), GNEConnection::updateCenteringBoundary(), GNEJunction::updateCenteringBoundary(), GUISUMOAbstractView::updatePositionInformation(), MSElecHybridExport::write(), MSFCDExport::write(), MSBatteryExport::write(), MSEmissionExport::write(), GNEAdditional::writeAdditional(), MSElecHybridExport::writeAggregated(), NBSign::writeAsPOI(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), NWWriter_DlrNavteq::writeNodesUnsplitted(), NWFrame::writePositionLong(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), GeoConvHelper::x2cartesian(), GeoConvHelper::x2cartesian_const(), and GUIDanielPerspectiveChanger::zoom().
|
inline |
Returns the y-position.
Definition at line 59 of file Position.h.
References myY.
Referenced by MSCFModel_CC::_consensus(), PositionVector::add(), Boundary::add(), libsumo::POI::add(), MSParkingArea::addLotEntry(), NIXMLNodesHandler::addNode(), MSPModel_Striping::addVehicleFoe(), GeomHelper::angle2D(), GUISUMOAbstractView::applyGLTransform(), GUISettingsHandler::applyViewport(), Boundary::around(), PositionVector::around(), NBNode::bezierControlPoints(), GNEViewNetHelper::MoveSingleElementValues::calculateOffset(), GNEViewNetHelper::MoveMultipleElementValues::calculateOffset(), GNEGeometry::calculateRotation(), NIImporter_OpenDrive::calculateStraightEndPoint(), GeoConvHelper::cartesian2geo(), GUIDanielPerspectiveChanger::centerTo(), NGRandomNetBuilder::checkAngles(), GUISUMOAbstractView::checkGDALImage(), TraCIServerAPI_Simulation::commandPositionConversion(), NBPTStopCont::computeCrossProductEdgePosition(), NBNodeShapeComputer::computeNodeShapeSmall(), NGRandomNetBuilder::createNewNode(), Boundary::distanceTo2D(), GUIVehicle::drawAction_drawCarriageClass(), GUILane::drawArrows(), GNELane::drawArrows(), GLHelper::drawBoxLine(), GLHelper::drawBoxLines(), GNECalibrator::drawCalibratorSymbol(), GUISUMOAbstractView::drawDecals(), GNEDetector::drawDetectorLogo(), GNEEdge::drawEdgeGeometryPoints(), GLHelper::drawFilledPoly(), GNEVehicle::drawFlowLabel(), GNEGeometry::drawGeometry(), GUIBusStop::drawGL(), GUICalibrator::drawGL(), GUIChargingStation::drawGL(), GUIContainer::drawGL(), GUIContainerStop::drawGL(), GUIJunctionWrapper::drawGL(), GUILaneSpeedTrigger::drawGL(), GUIOverheadWire::drawGL(), GUIOverheadWireClamp::drawGL(), GUIParkingArea::drawGL(), GUIPerson::drawGL(), GUITrafficLightLogicWrapper::drawGL(), GUITriggeredRerouter::GUITriggeredRerouterEdge::drawGL(), GNEDetectorE3::drawGL(), GNEParkingSpace::drawGL(), GNEPOI::drawGL(), GNEPoly::drawGL(), GNERerouter::drawGL(), GNETAZ::drawGL(), GNEVariableSpeedSign::drawGL(), GNEPerson::drawGL(), GNEVehicle::drawGL(), GNEJunction::drawGL(), GNELane::drawLane2LaneConnections(), GUILane::drawLane2LaneConnections(), GNEViewNet::drawLaneCandidates(), GNEGeometry::drawLaneGeometry(), GLHelper::drawLine(), GNEStoppingPlace::drawLines(), GUIBaseVehicle::drawLinkItem(), GUILane::drawLinkRule(), GUILane::drawLinkRules(), GNEViewNetHelper::LockIcon::drawLockIcon(), GNEGeometry::drawMovingHint(), GUIBaseVehicle::drawOnPos(), GNEDemandElement::drawPersonPlanPartialLane(), GNEGeometry::drawSegmentGeometry(), GNEStoppingPlace::drawSign(), GUIE3Collector::MyWrapper::drawSingleCrossing(), GNEVehicle::drawStackLabel(), GNEViewNet::drawTemporalJunction(), GNEViewNetHelper::TestingMode::drawTestingElements(), GLHelper::drawText(), GLHelper::drawTextAtEnd(), GLHelper::drawTextBox(), GNEJunction::drawTLSIcon(), GLHelper::drawTriangleAtEnd(), MSVTypeProbe::execute(), NBNodeCont::extract(), NBPTStopCont::findAccessEdgesForRailStops(), GeomHelper::findLineCircleIntersections(), NIImporter_OpenDrive::geomFromLine(), PointOfInterest::getCenter(), GUIPointOfInterest::getCenteringBoundary(), NBNode::getEmptyDir(), MSPModel_Striping::getNextLaneObstacles(), MSCFModel_CC::getParameter(), PositionVector::getPolygonCenter(), GNEPerson::getPositionInView(), MSVTKExport::getPositions(), LIBSUMO_NAMESPACE::InductionLoop::getTree(), GNEGeometry::getVertexCircleAroundPosition(), GUIDanielPerspectiveChanger::getYPos(), NBHeightMapper::getZ(), GUIBusStop::GUIBusStop(), GUIChargingStation::GUIChargingStation(), GUIContainerStop::GUIContainerStop(), GUIJunctionWrapper::GUIJunctionWrapper(), GUILane::GUILane(), GUIOverheadWire::GUIOverheadWire(), GUIParkingArea::GUIParkingArea(), GNEApplicationWindow::handleEvent_NetworkLoaded(), GUIApplicationWindow::handleEvent_SimulationLoaded(), NBNodeCont::insert(), PositionVector::insertAtClosest(), PositionVector::intersects(), PositionVector::isLeft(), NBNodeCont::joinNodeCluster(), GNENet::joinSelectedJunctions(), MSAbstractLaneChangeModel::laneChangeOutput(), NBHeightMapper::loadTiff(), libsumo::Helper::makeTraCIPosition(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::PState::moveToXY(), MSParkingArea::MSParkingArea(), GUISettingsHandler::myStartElement(), GUIE2Collector::MyWrapper::MyWrapper(), GUIInductLoop::MyWrapper::MyWrapper(), GUIInstantInductLoop::MyWrapper::MyWrapper(), GUIMEInductLoop::MyWrapper::MyWrapper(), GeomHelper::nearest_offset_on_line_to_point2D(), MSDevice_ToC::notifyMove(), GUIGLObjectPopupMenu::onCmdCopyCursorGeoPosition(), GNEPolygonFrame::GEOPOICreator::onCmdSetCoordinates(), GUIDanielPerspectiveChanger::onMouseMove(), PositionVector::as_poly_cw_sorter::operator()(), PositionVector::increasing_x_y_sorter::operator()(), NBNodeCont::paretoCheck(), TraCIServerAPI_GUI::processSet(), libsumo::POI::remove(), MSDevice_ToC::requestToC(), NBNodeCont::retrieve(), rotateAround2D(), PCPolyContainer::saveDlrTDP(), set(), GNEPOI::setAttribute(), GNEVehicle::setColor(), GUIBaseVehicle::setFunctionalColor(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), NGNode::setX(), sety(), PositionVector::sideOffset(), PositionVector::simplified(), GUISUMOAbstractView::snapToActiveGrid(), PositionVector::sub(), MSDevice_ToC::triggerDownwardToC(), MSDevice_ToC::triggerMRM(), MSDevice_ToC::triggerUpwardToC(), GNEConnection::updateCenteringBoundary(), GNEJunction::updateCenteringBoundary(), GUISUMOAbstractView::updatePositionInformation(), MSElecHybridExport::write(), MSFCDExport::write(), MSBatteryExport::write(), MSEmissionExport::write(), GNEAdditional::writeAdditional(), MSElecHybridExport::writeAggregated(), NBSign::writeAsPOI(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), NWWriter_DlrNavteq::writeNodesUnsplitted(), NWFrame::writePositionLong(), NWWriter_DlrNavteq::writeTrafficSignals(), MSFCDExport::writeTransportable(), MSFullExport::writeVehicles(), PointOfInterest::writeXML(), GeoConvHelper::x2cartesian(), GeoConvHelper::x2cartesian_const(), and GUIDanielPerspectiveChanger::zoom().
|
inline |
Returns the z-position.
Definition at line 64 of file Position.h.
References myZ.
Referenced by PositionVector::add(), Boundary::add(), GUISettingsHandler::applyViewport(), Boundary::around(), NBNode::bezierControlPoints(), TraCIServerAPI_Simulation::commandPositionConversion(), NBEdge::computeEdgeShape(), NBNodeShapeComputer::computeNodeShapeDefault(), NBNodeShapeComputer::computeNodeShapeSmall(), GNEEdge::drawEdgeGeometryPoints(), GNEJunction::drawGL(), MSVTypeProbe::execute(), GUIJunctionWrapper::getColorValue(), GNEJunction::getColorValue(), PositionVector::getMaxGrade(), PositionVector::getOverlapWith(), PositionVector::getPolygonCenter(), GUILane::getPopUpMenu(), GNELane::getPopUpMenu(), MSVTKExport::getPositions(), NBNodeShapeComputer::getSmoothCorner(), NBNodeCont::joinNodeCluster(), libsumo::Helper::makeTraCIPosition(), PositionVector::move2side(), LIBSUMO_NAMESPACE::Vehicle::moveToXY(), MSParkingArea::MSParkingArea(), GUISettingsHandler::myStartElement(), GNENetHelper::AttributeCarriers::registerJunction(), set(), GNEPOI::setAttribute(), GUIDialog_EditViewport::setValues(), GUICompleteSchemeStorage::setViewport(), GUISUMOAbstractView::setViewportFromToRot(), setz(), PositionVector::slopeDegreeAtOffset(), GNEEdge::smoothElevation(), GNEEdge::smoothShape(), GUISUMOAbstractView::snapToActiveGrid(), NBEdge::startShapeAt(), GNEEdge::straightenElevation(), PositionVector::sub(), MSElecHybridExport::write(), MSFCDExport::write(), GNEAdditional::writeAdditional(), MSElecHybridExport::writeAggregated(), NWWriter_OpenDrive::writeGeomLines(), NWWriter_OpenDrive::writeGeomPP3(), NWFrame::writePositionLong(), and MSFCDExport::writeTransportable().
|
friend |
output operator
Definition at line 171 of file Position.h.
|
static |
used to indicate that a position is valid
Definition at line 282 of file Position.h.
Referenced by NIXMLNodesHandler::addJoinCluster(), MSPModel_Striping::addVehicleFoe(), NBEdge::append(), NBNodeShapeComputer::badIntersection(), NBNode::bezierControlPoints(), GNEGeometry::calculateLaneGeometricPath(), GNEMoveElement::commitMove(), MSVehicle::computeAngle(), MSLaneChanger::continueChange(), GNEPerson::drawGL(), GNEVehicle::drawGL(), GNEDemandElement::drawPersonPlanPartialLane(), MSVehicle::enterLaneAtInsertion(), MSVehicle::enterLaneAtLaneChange(), MSVehicle::enterLaneAtMove(), MSVehicle::executeFractionalMove(), MSVehicle::executeMove(), PositionVector::getCentroid(), GNEGeometry::SegmentGeometry::getFirstPosition(), GUIPerson::getGUIAngle(), GUIPerson::getGUIPosition(), GNEAdditionalHandler::getLanePos(), NIXMLShapeHandler::getLanePos(), NLShapeHandler::getLanePos(), PCLoaderXML::getLanePos(), GNEGeometry::SegmentGeometry::getLastPosition(), GNEPoly::getMoveOperation(), GNETAZ::getMoveOperation(), GNEConnection::getMoveOperation(), GNECrossing::getMoveOperation(), GNEEdge::getMoveOperation(), GNEJunction::getMoveOperation(), GUIPerson::getPosition(), MSVehicle::getPosition(), MSPModel_Striping::PState::getPosition(), MSStageMoving::getPosition(), MSStageDriving::getPosition(), MSVehicle::getPositionAlongBestLanes(), NBEdge::getSignalOffset(), MSParkingArea::getVehiclePosition(), NBNodeCont::guessTLs(), MSVehicle::handleCollisionStop(), MSVehicle::Influencer::implicitSpeedRemote(), PolygonDynamics::initTrackedPosition(), PositionVector::intersectionPosition2D(), NBNodeCont::joinNodeCluster(), PCLoaderOSM::loadIfSet(), MSDevice_SSM::makeStringWithNAs(), PositionVector::move2side(), GNEMoveElement::moveElement(), MSPModel_Striping::moveInDirection(), MSPModel_Striping::moveInDirectionOnLane(), MSPModel_Striping::PState::moveToXY(), GUIDialog_EditViewport::onCmdChanged(), GUIDialog_EditViewport::onCmdOk(), GNEAdditionalHandler::parseAndBuildPOI(), PositionVector::positionAtOffset(), PositionVector::positionAtOffset2D(), MSStageDriving::proceed(), NBEdge::reshiftPosition(), GUISUMOAbstractView::showViewportEditor(), MSLaneChangerSublane::startChangeSublane(), MSDevice_SSM::toGeo(), PositionVector::transformToVectorCoordinates(), PolygonDynamics::update(), GNEGeometry::updateGeometricPath(), GNEGeometry::Geometry::updateGeometry(), MSVehicle::updateState(), and MSVehicle::validatePosition().
|
private |
The x-position.
Definition at line 286 of file Position.h.
Referenced by add(), angleTo2D(), crossProduct(), distanceSquaredTo(), distanceSquaredTo2D(), dotProduct(), isNAN(), mul(), norm2d(), operator!=(), operator*(), operator+(), operator-(), operator<(), operator==(), set(), setx(), sub(), swapXY(), and x().
|
private |
The y-position.
Definition at line 289 of file Position.h.
Referenced by add(), angleTo2D(), crossProduct(), distanceSquaredTo(), distanceSquaredTo2D(), dotProduct(), isNAN(), mul(), norm2d(), operator!=(), operator*(), operator+(), operator-(), operator<(), operator==(), set(), sety(), sub(), swapXY(), and y().
|
private |
The z-position.
Definition at line 292 of file Position.h.
Referenced by add(), crossProduct(), distanceSquaredTo(), dotProduct(), isNAN(), mul(), operator!=(), operator*(), operator+(), operator-(), operator<(), operator==(), set(), setz(), sub(), and z().