Package | Description |
---|---|
org.osm2world.core.heightmap.data | |
org.osm2world.core.map_elevation.creation | |
org.osm2world.core.map_elevation.data | |
org.osm2world.core.math |
classes for geometric objects that are used throughout OSM2World
|
org.osm2world.core.math.algorithms | |
org.osm2world.core.target |
export targets for the generated models
|
org.osm2world.core.target.common | |
org.osm2world.core.target.common.lighting | |
org.osm2world.core.target.common.material | |
org.osm2world.core.target.common.rendering | |
org.osm2world.core.target.jogl | |
org.osm2world.core.target.obj |
target that creates Wavefront .obj and .mtl files
|
org.osm2world.core.target.povray |
target that creates .pov files for the POVRay raytracer
|
org.osm2world.core.target.statistics | |
org.osm2world.core.world.data | |
org.osm2world.core.world.modules.common | |
org.osm2world.core.world.network |
functionality used by groups of features that aren't isolated, but form a "network" of nodes, ways and areas
|
org.osm2world.viewer.view.debug |
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
TerrainPoint.getPosXYZ() |
Modifier and Type | Field and Description |
---|---|
VectorXYZ[] |
DelaunayTriangulation.NaturalNeighbors.neighbors |
VectorXYZ |
DelaunayTriangulation.DelaunayTriangle.p0 |
VectorXYZ |
DelaunayTriangulation.DelaunayTriangle.p1 |
VectorXYZ |
DelaunayTriangulation.DelaunayTriangle.p2 |
VectorXYZ |
LeastSquaresInterpolator.SiteWithPolynomial.pos |
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
DelaunayTriangulation.DelaunayTriangle.getPoint(int i) |
VectorXYZ |
TerrainInterpolator.interpolateEle(VectorXZ pos) |
VectorXYZ |
InverseDistanceWeightingInterpolator.interpolateEle(VectorXZ pos) |
VectorXYZ |
NaturalNeighborInterpolator.interpolateEle(VectorXZ pos) |
VectorXYZ |
LeastSquaresInterpolator.interpolateEle(VectorXZ pos) |
VectorXYZ |
ZeroInterpolator.interpolateEle(VectorXZ pos) |
VectorXYZ |
LinearInterpolator.interpolateEle(VectorXZ pos) |
Modifier and Type | Method and Description |
---|---|
Collection<VectorXYZ> |
SRTMData.getSites(double minLon,
double minLat,
double maxLon,
double maxLat) |
Collection<VectorXYZ> |
TerrainElevationData.getSites(double minLon,
double minLat,
double maxLon,
double maxLat) |
Collection<VectorXYZ> |
SRTMData.getSites(MapData mapData)
variant of getSites which calculates minimum and maximum lat/lon
from the bounds of a
MapData instance
TODO: make projection reversible, then replace both getSites methods
with a single getSite(AxisAlignedBoundingBox dataBounds) method |
Collection<VectorXYZ> |
TerrainElevationData.getSites(MapData mapData) |
Modifier and Type | Method and Description |
---|---|
List<DelaunayTriangulation.DelaunayTriangle> |
DelaunayTriangulation.getIncidentTriangles(VectorXYZ point) |
DelaunayTriangulation.DelaunayTriangle |
DelaunayTriangulation.DelaunayTriangle.getLeftNeighbor(VectorXYZ atPoint) |
DelaunayTriangulation.DelaunayTriangle |
DelaunayTriangulation.DelaunayTriangle.getRightNeighbor(VectorXYZ atPoint) |
List<TriangleXZ> |
DelaunayTriangulation.getVoronoiCellSectors(VectorXYZ point) |
List<TriangleXZ> |
DelaunayTriangulation.getVoronoiCellSectors(VectorXYZ point,
Collection<DelaunayTriangulation.DelaunayTriangle> incidentTriangles)
TODO describe effect of incident triangles
|
double |
DelaunayTriangulation.getVoronoiCellSize(VectorXYZ point,
Collection<DelaunayTriangulation.DelaunayTriangle> incidentTriangles)
returns the size of a voronoi cell or a part of the voronoi cell.
|
int |
DelaunayTriangulation.DelaunayTriangle.indexOfPoint(VectorXYZ point) |
Stack<DelaunayTriangulation.Flip> |
DelaunayTriangulation.insert(VectorXYZ point) |
Modifier and Type | Method and Description |
---|---|
void |
TerrainInterpolator.setKnownSites(Collection<VectorXYZ> sites) |
void |
InverseDistanceWeightingInterpolator.setKnownSites(Collection<VectorXYZ> sites) |
void |
NaturalNeighborInterpolator.setKnownSites(Collection<VectorXYZ> sites) |
void |
LeastSquaresInterpolator.setKnownSites(Collection<VectorXYZ> siteVectors) |
void |
ZeroInterpolator.setKnownSites(Collection<VectorXYZ> sites) |
void |
LinearInterpolator.setKnownSites(Collection<VectorXYZ> sites) |
Constructor and Description |
---|
DelaunayTriangulation.DelaunayTriangle(VectorXYZ p0,
VectorXYZ p1,
VectorXYZ p2) |
LeastSquaresInterpolator.SiteWithPolynomial(VectorXYZ site) |
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
NodeElevationProfile.getPointWithEle() |
VectorXYZ |
EleConnector.getPosXYZ()
returns the 3d position after it has been calculated.
|
VectorXYZ |
LPVariablePair.getPosXYZ()
EleConnector.getPosXYZ() for this set |
VectorXYZ |
EleConnectorGroup.getPosXYZ(VectorXZ pos) |
VectorXYZ |
ElevationProfile.getWithEle(VectorXZ pos) |
VectorXYZ |
AreaElevationProfile.getWithEle(VectorXZ pos) |
VectorXYZ |
NodeElevationProfile.getWithEle(VectorXZ pos) |
Modifier and Type | Method and Description |
---|---|
abstract Collection<VectorXYZ> |
ElevationProfile.getPointsWithEle() |
Collection<VectorXYZ> |
AreaElevationProfile.getPointsWithEle()
returns all points on the area where elevation values exist.
|
Collection<VectorXYZ> |
NodeElevationProfile.getPointsWithEle() |
List<VectorXYZ> |
WaySegmentElevationProfile.getPointsWithEle()
returns all points along the line where elevation values exist.
|
List<VectorXYZ> |
EleConnectorGroup.getPosXYZ(Collection<VectorXZ> positions) |
List<VectorXYZ> |
ElevationProfile.getWithEle(List<VectorXZ> posList) |
Modifier and Type | Method and Description |
---|---|
void |
AreaElevationProfile.addPointWithEle(VectorXYZ pointWithEle)
adds a result of
ElevationCalculator . |
void |
WaySegmentElevationProfile.addPointWithEle(VectorXYZ pointWithEle)
adds a result of
ElevationCalculator . |
void |
EleConnector.setPosXYZ(VectorXYZ posXYZ)
assigns the elevation that has been calculated for this connector.
|
void |
LPVariablePair.setPosXYZ(VectorXYZ posXYZ)
EleConnector.setPosXYZ(VectorXYZ) for all connectors in this set |
Modifier and Type | Method and Description |
---|---|
void |
AreaElevationProfile.setEleFunction(Function<VectorXZ,VectorXYZ> eleFunction) |
Modifier and Type | Field and Description |
---|---|
VectorXYZ |
TriangleXYZWithNormals.n1 |
VectorXYZ |
TriangleXYZWithNormals.n2 |
VectorXYZ |
TriangleXYZWithNormals.n3 |
static VectorXYZ |
VectorXYZ.NULL_VECTOR |
VectorXYZ |
LineSegmentXYZ.p1 |
VectorXYZ |
LineSegmentXYZ.p2 |
VectorXYZ |
TriangleXYZ.v1 |
VectorXYZ |
TriangleXYZ.v2 |
VectorXYZ |
TriangleXYZ.v3 |
static VectorXYZ |
VectorXYZ.X_UNIT |
static VectorXYZ |
VectorXYZ.Y_UNIT |
static VectorXYZ |
VectorXYZ.Z_UNIT |
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
VectorXYZ.add(double x,
double y,
double z) |
VectorXYZ |
VectorXYZ.add(VectorXYZ other) |
VectorXYZ |
VectorXYZ.add(VectorXZ other) |
VectorXYZ |
VectorXYZ.addY(double y) |
VectorXYZ |
AxisAlignedBoundingBoxXYZ.center() |
VectorXYZ |
VectorXYZ.cross(VectorXYZ other) |
VectorXYZ |
VectorXYZ.crossNormalized(VectorXYZ other)
same result as calling
normalize() after
cross(VectorXYZ) , but avoids creating a temporary vector |
VectorXYZ |
TriangleXYZ.getCenter() |
VectorXYZ |
TriangleXYZ.getNormal()
returns the normalized normal vector of this triangle
|
static VectorXYZ |
GeometryUtil.interpolateBetween(VectorXYZ pos1,
VectorXYZ pos2,
double influenceRatioPos2)
three-dimensional version of
GeometryUtil.interpolateBetween(VectorXZ, VectorXZ, double) |
static VectorXYZ |
GeometryUtil.interpolateElevation(VectorXZ posForEle,
VectorXYZ pos1,
VectorXYZ pos2)
performs linear interpolation of elevation information
for a position on a line segment
|
VectorXYZ |
VectorXYZ.invert() |
VectorXYZ |
VectorXYZ.mult(double scalar) |
VectorXYZ |
VectorXYZ.normalize() |
VectorXYZ |
VectorXYZ.rotateVec(double angleRad,
VectorXYZ n)
returns the result of rotating this vector around the
given normalized vector n
|
VectorXYZ |
VectorXYZ.rotateVec(double angleRad,
VectorXYZ rotOrigin,
VectorXYZ rotAxis)
returns the result of rotating this vector around a freely chosen
axis and origin
|
VectorXYZ |
VectorXYZ.rotateX(double angleRad)
returns the result of rotating this vector around the x axis
|
VectorXYZ |
VectorXYZ.rotateY(double angleRad)
returns the result of rotating this vector around the y axis
|
VectorXYZ |
VectorXYZ.rotateZ(double angleRad)
returns the result of rotating this vector around the z axis
|
VectorXYZ |
VectorXYZ.subtract(VectorXYZ other) |
VectorXYZ |
VectorXYZ.subtract(VectorXZ other) |
static VectorXYZ |
JTSConversionUtil.vectorXYZFromJTSCoordinate(Coordinate c) |
VectorXYZ |
VectorXYZ.x(double x) |
VectorXYZ |
VectorXYZW.xyz() |
VectorXYZ |
VectorXZ.xyz(double y) |
static VectorXYZ |
VectorXYZ.xyz(VectorXYZ vector3D)
creates a VectorXYZ for any Vector3D object.
|
VectorXYZ |
VectorXYZ.y(double y) |
VectorXYZ |
VectorXYZ.z(double z) |
Modifier and Type | Method and Description |
---|---|
static List<VectorXYZ> |
VectorXYZ.addYList(List<VectorXYZ> list,
double addY) |
Collection<VectorXYZ> |
AxisAlignedBoundingBoxXYZ.corners() |
static List<VectorXYZ> |
GeometryUtil.equallyDistributePointsAlong(double preferredDistance,
boolean pointsAtStartAndEnd,
List<VectorXYZ> points)
distributes points along a 3D line segment sequence.
|
List<VectorXYZ> |
TriangleXYZWithNormals.getNormals() |
List<VectorXYZ> |
PolygonXYZ.getVertexLoop()
returns the polygon's vertices.
|
List<VectorXYZ> |
TriangleXYZ.getVertices() |
List<VectorXYZ> |
PolygonXYZ.getVertices()
returns the polygon's vertices.
|
static List<VectorXYZ> |
VectorXZ.listXYZ(List<VectorXZ> vs,
double y) |
static List<VectorXYZ> |
GeometryUtil.sequenceAbove(List<VectorXYZ> sequence,
double yDistance)
returns a sequence of vectors at a distance above an original sequence
|
static Function<VectorXZ,VectorXYZ> |
VectorXZ.xyzFunction(double y) |
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
VectorXYZ.add(VectorXYZ other) |
double |
VectorXYZ.angleTo(VectorXYZ other)
calculates the angle between this vector and other,
but only if both are normalized!
|
boolean |
AxisAlignedBoundingBoxXYZ.contains(VectorXYZ v) |
VectorXYZ |
VectorXYZ.cross(VectorXYZ other) |
VectorXYZ |
VectorXYZ.crossNormalized(VectorXYZ other)
same result as calling
normalize() after
cross(VectorXYZ) , but avoids creating a temporary vector |
double |
VectorXYZ.distanceTo(VectorXYZ other) |
double |
VectorXYZ.distanceToSquared(VectorXYZ other) |
double |
VectorXYZ.distanceToXZ(VectorXYZ other) |
double |
VectorXYZ.dot(VectorXYZ other) |
static VectorXYZ |
GeometryUtil.interpolateBetween(VectorXYZ pos1,
VectorXYZ pos2,
double influenceRatioPos2)
three-dimensional version of
GeometryUtil.interpolateBetween(VectorXZ, VectorXZ, double) |
static VectorXYZ |
GeometryUtil.interpolateElevation(VectorXZ posForEle,
VectorXYZ pos1,
VectorXYZ pos2)
performs linear interpolation of elevation information
for a position on a line segment
|
VectorXYZ |
VectorXYZ.rotateVec(double angleRad,
VectorXYZ n)
returns the result of rotating this vector around the
given normalized vector n
|
VectorXYZ |
VectorXYZ.rotateVec(double angleRad,
VectorXYZ rotOrigin,
VectorXYZ rotAxis)
returns the result of rotating this vector around a freely chosen
axis and origin
|
VectorXYZ |
VectorXYZ.subtract(VectorXYZ other) |
static Coordinate |
JTSConversionUtil.vectorXYZToJTSCoordinate(VectorXYZ v) |
static VectorXYZ |
VectorXYZ.xyz(VectorXYZ vector3D)
creates a VectorXYZ for any Vector3D object.
|
Modifier and Type | Method and Description |
---|---|
static List<VectorXYZ> |
VectorXYZ.addYList(List<VectorXYZ> list,
double addY) |
static List<VectorXYZW> |
GeometryUtil.calculateShadowVolumesPerTriangle(List<VectorXYZ> vertices,
VectorXYZW lightPos)
Calculate per triangle shadow volumes.
|
static List<VectorXYZW> |
GeometryUtil.calculateTangentVectorsForTexLayer(List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<VectorXZ> texCoords)
Calculate consistent tangent vectors for given vertices and vertex normals and texture coordinates.
|
static List<VectorXYZW> |
GeometryUtil.calculateTangentVectorsForTexLayer(List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<VectorXZ> texCoords)
Calculate consistent tangent vectors for given vertices and vertex normals and texture coordinates.
|
static List<VectorXYZ> |
GeometryUtil.equallyDistributePointsAlong(double preferredDistance,
boolean pointsAtStartAndEnd,
List<VectorXYZ> points)
distributes points along a 3D line segment sequence.
|
static List<VectorXYZ> |
GeometryUtil.sequenceAbove(List<VectorXYZ> sequence,
double yDistance)
returns a sequence of vectors at a distance above an original sequence
|
static List<TriangleXYZ> |
GeometryUtil.trianglesFromTriangleFan(List<? extends VectorXYZ> vs) |
static List<TriangleXYZ> |
GeometryUtil.trianglesFromTriangleStrip(List<? extends VectorXYZ> vs) |
static List<TriangleXYZ> |
GeometryUtil.trianglesFromVertexList(List<? extends VectorXYZ> vs) |
Constructor and Description |
---|
LineSegmentXYZ(VectorXYZ p1,
VectorXYZ p2) |
TriangleXYZ(VectorXYZ v1,
VectorXYZ v2,
VectorXYZ v3) |
TriangleXYZWithNormals(TriangleXYZ t,
VectorXYZ n1,
VectorXYZ n2,
VectorXYZ n3) |
TriangleXYZWithNormals(VectorXYZ v1,
VectorXYZ v2,
VectorXYZ v3,
VectorXYZ n1,
VectorXYZ n2,
VectorXYZ n3) |
VectorXYZW(VectorXYZ v,
double w2) |
Constructor and Description |
---|
PolygonXYZ(List<VectorXYZ> vertexLoop) |
Modifier and Type | Method and Description |
---|---|
static List<VectorXYZ> |
NormalCalculationUtil.calculateTriangleFanNormals(List<VectorXYZ> vertices,
boolean smooth) |
static List<VectorXYZ> |
NormalCalculationUtil.calculateTriangleNormals(List<VectorXYZ> vertices,
boolean smooth)
calculates normals for a collection of triangles
|
static List<VectorXYZ> |
NormalCalculationUtil.calculateTriangleStripNormals(List<VectorXYZ> vertices,
boolean smooth) |
Modifier and Type | Method and Description |
---|---|
static List<VectorXYZ> |
NormalCalculationUtil.calculateTriangleFanNormals(List<VectorXYZ> vertices,
boolean smooth) |
static List<VectorXYZ> |
NormalCalculationUtil.calculateTriangleNormals(List<VectorXYZ> vertices,
boolean smooth)
calculates normals for a collection of triangles
|
static List<VectorXYZ> |
NormalCalculationUtil.calculateTriangleStripNormals(List<VectorXYZ> vertices,
boolean smooth) |
Modifier and Type | Method and Description |
---|---|
void |
Target.drawBox(Material material,
VectorXYZ bottomCenter,
VectorXZ faceDirection,
double height,
double width,
double depth)
draws a box with outward-facing polygons.
|
void |
Target.drawColumn(Material material,
Integer corners,
VectorXYZ base,
double height,
double radiusBottom,
double radiusTop,
boolean drawBottom,
boolean drawTop)
draws a column with outward-facing polygons around a point.
|
void |
Target.drawShape(Material material,
SimpleClosedShapeXZ shape,
VectorXYZ point,
VectorXYZ frontVector,
VectorXYZ upVector)
draws a flat shape in 3D space, at an arbitrary rotation.
|
Modifier and Type | Method and Description |
---|---|
void |
Target.drawConvexPolygon(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists)
draws a convex polygon
|
void |
Target.drawExtrudedShape(Material material,
ShapeXZ shape,
List<VectorXYZ> path,
List<VectorXYZ> upVectors,
List<Double> scaleFactors,
List<List<VectorXZ>> texCoordLists,
EnumSet<ExtrudeOption> options)
extrudes a 2d shape along a path.
|
void |
Target.drawExtrudedShape(Material material,
ShapeXZ shape,
List<VectorXYZ> path,
List<VectorXYZ> upVectors,
List<Double> scaleFactors,
List<List<VectorXZ>> texCoordLists,
EnumSet<ExtrudeOption> options)
extrudes a 2d shape along a path.
|
void |
Target.drawTriangleFan(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists)
draws a triangle fan.
|
void |
Target.drawTriangleStrip(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists)
draws a triangle strip.
|
Modifier and Type | Field and Description |
---|---|
VectorXYZ |
FaceTarget.Face.normal |
VectorXYZ |
FaceTarget.IsolatedTriangle.normal |
Modifier and Type | Field and Description |
---|---|
List<VectorXYZ> |
Primitive.normals |
List<VectorXYZ> |
Primitive.vertices |
List<VectorXYZ> |
FaceTarget.Face.vs |
Modifier and Type | Method and Description |
---|---|
void |
AbstractTarget.drawBox(Material material,
VectorXYZ bottomCenter,
VectorXZ faceDirection,
double height,
double width,
double depth) |
void |
AbstractTarget.drawColumn(Material material,
Integer corners,
VectorXYZ base,
double height,
double radiusBottom,
double radiusTop,
boolean drawBottom,
boolean drawTop)
|
void |
AbstractTarget.drawShape(Material material,
SimpleClosedShapeXZ shape,
VectorXYZ point,
VectorXYZ frontVector,
VectorXYZ upVector) |
protected static boolean |
FaceTarget.normalAlmostEquals(VectorXYZ n1,
VectorXYZ n2) |
Modifier and Type | Method and Description |
---|---|
void |
AbstractTarget.drawConvexPolygon(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
void |
FaceTarget.drawConvexPolygon(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
void |
AbstractTarget.drawExtrudedShape(Material material,
ShapeXZ shape,
List<VectorXYZ> path,
List<VectorXYZ> upVectors,
List<Double> scaleFactors,
List<List<VectorXZ>> texCoordLists,
EnumSet<ExtrudeOption> options)
draws an extruded shape using
AbstractTarget.drawTriangleStrip(Material, List, List) calls. |
void |
AbstractTarget.drawExtrudedShape(Material material,
ShapeXZ shape,
List<VectorXYZ> path,
List<VectorXYZ> upVectors,
List<Double> scaleFactors,
List<List<VectorXZ>> texCoordLists,
EnumSet<ExtrudeOption> options)
draws an extruded shape using
AbstractTarget.drawTriangleStrip(Material, List, List) calls. |
abstract void |
FaceTarget.drawFace(Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
abstract void |
FaceTarget.drawFace(Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected abstract void |
PrimitiveTarget.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected abstract void |
PrimitiveTarget.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
void |
AbstractTarget.drawTriangleFan(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
void |
PrimitiveTarget.drawTriangleFan(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
void |
AbstractTarget.drawTriangleStrip(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
void |
PrimitiveTarget.drawTriangleStrip(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
Constructor and Description |
---|
FaceTarget.Face(List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists,
VectorXYZ normal) |
FaceTarget.IsolatedTriangle(TriangleXYZ triangle,
VectorXYZ normal,
int texCoordOffset,
List<List<VectorXZ>> texCoordLists) |
Constructor and Description |
---|
FaceTarget.Face(List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists,
VectorXYZ normal) |
Primitive(Primitive.Type type,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
Primitive(Primitive.Type type,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
Modifier and Type | Field and Description |
---|---|
VectorXYZ |
GlobalLightingParameters.lightFromDirection
source of the scene's directional lighting;
null disables it and leaves only ambient lighting
|
Modifier and Type | Method and Description |
---|---|
List<VectorXZ> |
TexCoordFunction.apply(List<VectorXYZ> vs,
TextureData textureData)
calculates a texture coordinate for each vertex
|
List<VectorXZ> |
NamedTexCoordFunction.apply(List<VectorXYZ> vs,
TextureData textureData) |
static List<List<VectorXZ>> |
TexCoordUtil.texCoordLists(List<VectorXYZ> vs,
Material material,
TexCoordFunction defaultCoordFunction)
calculates the texture coordinate lists based on the
TexCoordFunction associated with each TextureData layer |
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
Camera.getLookAt() |
VectorXYZ |
Camera.getPos() |
VectorXYZ |
Camera.getRight()
returns the vector that is orthogonal to the connection
between pos and lookAt and points to the right of it.
|
VectorXYZ |
Camera.getUp() |
VectorXYZ |
Camera.getViewDirection()
returns the view direction vector with length 1
|
Modifier and Type | Method and Description |
---|---|
void |
Camera.move(VectorXYZ move)
moves both pos and lookAt by the given vector
|
void |
Camera.setPos(VectorXYZ pos) |
Modifier and Type | Method and Description |
---|---|
protected void |
JOGLTargetShader.drawBox(Color color,
VectorXYZ v1,
VectorXYZ v2,
VectorXYZ v3,
VectorXYZ v4)
Draw a colored 2D box as line loop.
|
protected void |
JOGLTargetShader.drawLine(Color color,
VectorXYZ v1,
VectorXYZ v2)
Draw a colored line between two points.
|
void |
JOGLTarget.drawLineStrip(Color color,
int width,
VectorXYZ... vs) |
void |
AbstractJOGLTarget.drawLineStrip(Color color,
int width,
VectorXYZ... vs) |
void |
JOGLTarget.drawPoints(Color color,
VectorXYZ... vs) |
void |
AbstractJOGLTarget.drawPoints(Color color,
VectorXYZ... vs) |
protected abstract void |
VBOData.put(BufferT buffer,
VectorXYZ v)
add 3d vertex data to the vbo buffer
|
Modifier and Type | Method and Description |
---|---|
void |
JOGLTarget.drawLineLoop(Color color,
int width,
List<VectorXYZ> vs) |
void |
AbstractJOGLTarget.drawLineLoop(Color color,
int width,
List<VectorXYZ> vs) |
void |
JOGLTarget.drawLineStrip(Color color,
int width,
List<VectorXYZ> vs) |
void |
AbstractJOGLTarget.drawLineStrip(Color color,
int width,
List<VectorXYZ> vs) |
static void |
JOGLTargetFixedFunction.drawPrimitive(GL2 gl,
int glPrimitiveType,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
static void |
JOGLTargetFixedFunction.drawPrimitive(GL2 gl,
int glPrimitiveType,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected void |
PrimitiveBuffer.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected void |
PrimitiveBuffer.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected void |
AbstractJOGLTarget.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected void |
AbstractJOGLTarget.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vertices,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
Modifier and Type | Method and Description |
---|---|
void |
ObjTarget.drawFace(Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
void |
ObjTarget.drawFace(Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
Modifier and Type | Method and Description |
---|---|
void |
POVRayTarget.appendPolygon(VectorXYZ... vs) |
void |
POVRayTarget.appendTriangle(VectorXYZ a,
VectorXYZ b,
VectorXYZ c) |
void |
POVRayTarget.appendTriangle(VectorXYZ a,
VectorXYZ b,
VectorXYZ c,
VectorXYZ na,
VectorXYZ nb,
VectorXYZ nc,
boolean smooth) |
void |
POVRayTarget.appendTriangle(VectorXYZ a,
VectorXYZ b,
VectorXYZ c,
VectorXYZ na,
VectorXYZ nb,
VectorXYZ nc,
VectorXZ ta,
VectorXZ tb,
VectorXZ tc,
boolean smooth,
boolean texture) |
void |
POVRayTarget.appendVector(VectorXYZ vector)
alternative to
POVRayTarget.appendVector(double, double)
using a vector object as parameter instead of individual coordinates |
void |
POVRayTarget.drawColumn(Material material,
Integer corners,
VectorXYZ base,
double height,
double radiusBottom,
double radiusTop,
boolean drawBottom,
boolean drawTop) |
void |
POVRayTarget.drawColumn(Material material,
Integer corners,
VectorXYZ base,
VectorXYZ cap,
double radiusBottom,
double radiusTop,
boolean drawBottom,
boolean drawTop)
variant of
POVRayTarget.drawColumn(Material, Integer, VectorXYZ, double, double, double, boolean, boolean)
that allows arbitrarily placed columns |
Modifier and Type | Method and Description |
---|---|
void |
POVRayTarget.drawConvexPolygon(Material material,
List<VectorXYZ> vs,
List<List<VectorXZ>> texCoordLists) |
Modifier and Type | Method and Description |
---|---|
protected void |
StatisticsTarget.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
protected void |
StatisticsTarget.drawPrimitive(Primitive.Type type,
Material material,
List<VectorXYZ> vs,
List<VectorXYZ> normals,
List<List<VectorXZ>> texCoordLists) |
Modifier and Type | Method and Description |
---|---|
protected VectorXYZ |
NoOutlineNodeWorldObject.getBase()
provides subclasses with the 3d position of the
MapNode . |
protected VectorXYZ |
NoOutlineWaySegmentWorldObject.getEndXYZ()
returns the 3d end position.
|
protected VectorXYZ |
NoOutlineWaySegmentWorldObject.getStartXYZ()
returns the 3d start position.
|
Modifier and Type | Method and Description |
---|---|
protected List<VectorXYZ> |
NoOutlineWaySegmentWorldObject.getBaseline()
returns the 3d vertex sequence running along the segment.
|
Modifier and Type | Method and Description |
---|---|
static List<VectorXYZ> |
WorldModuleGeometryUtil.createLineBetween(List<VectorXYZ> leftOutline,
List<VectorXYZ> rightOutline,
float ratio) |
static List<VectorXYZ> |
WorldModuleGeometryUtil.createTriangleStripBetween(List<VectorXYZ> leftOutline,
List<VectorXYZ> rightOutline)
creates a triangle strip between two outlines with identical number of vectors
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.createVerticalTriangleStrip(List<? extends VectorXYZ> baseLine,
float stripLowerYBound,
float stripUpperYBound)
creates the vectors for a vertical triangle strip
at a given elevation above a line of points
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.rotateShapeX(List<VectorXYZ> shape,
double angle,
double posY,
double posZ)
creates an rotated version of a list of vectors
by rotating them by the given angle around the parallel of the x axis
defined by the given Y and Z coordinates
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.transformShape(List<VectorXYZ> shape,
VectorXYZ center,
VectorXYZ forward,
VectorXYZ up)
moves a shape that was defined at the origin to a new position.
|
Modifier and Type | Method and Description |
---|---|
static void |
WorldModuleBillboardUtil.renderCrosstree(Target<?> target,
Material material,
VectorXYZ pos,
double width,
double height,
boolean mirroredTextures)
renders a "cross tree" shape.
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.transformShape(List<VectorXYZ> shape,
VectorXYZ center,
VectorXYZ forward,
VectorXYZ up)
moves a shape that was defined at the origin to a new position.
|
Modifier and Type | Method and Description |
---|---|
static List<VectorXYZ> |
WorldModuleGeometryUtil.createLineBetween(List<VectorXYZ> leftOutline,
List<VectorXYZ> rightOutline,
float ratio) |
static List<VectorXYZ> |
WorldModuleGeometryUtil.createLineBetween(List<VectorXYZ> leftOutline,
List<VectorXYZ> rightOutline,
float ratio) |
static List<VectorXYZ> |
WorldModuleGeometryUtil.createTriangleStripBetween(List<VectorXYZ> leftOutline,
List<VectorXYZ> rightOutline)
creates a triangle strip between two outlines with identical number of vectors
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.createTriangleStripBetween(List<VectorXYZ> leftOutline,
List<VectorXYZ> rightOutline)
creates a triangle strip between two outlines with identical number of vectors
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.createVerticalTriangleStrip(List<? extends VectorXYZ> baseLine,
float stripLowerYBound,
float stripUpperYBound)
creates the vectors for a vertical triangle strip
at a given elevation above a line of points
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.rotateShapeX(List<VectorXYZ> shape,
double angle,
double posY,
double posZ)
creates an rotated version of a list of vectors
by rotating them by the given angle around the parallel of the x axis
defined by the given Y and Z coordinates
|
static List<VectorXYZ> |
WorldModuleGeometryUtil.transformShape(List<VectorXYZ> shape,
VectorXYZ center,
VectorXYZ forward,
VectorXYZ up)
moves a shape that was defined at the origin to a new position.
|
Modifier and Type | Method and Description |
---|---|
VectorXYZ |
AbstractNetworkWaySegmentWorldObject.getPointOnCut(boolean start,
double relativePosFromLeft)
returns a point on the start or end cut line.
|
Modifier and Type | Method and Description |
---|---|
List<VectorXYZ> |
AbstractNetworkWaySegmentWorldObject.getCenterline()
3d version of
AbstractNetworkWaySegmentWorldObject.getCenterlineXZ() . |
List<VectorXYZ> |
AbstractNetworkWaySegmentWorldObject.getOutline(boolean right)
provides the left or right border (a line at an appropriate distance
from the center line), taking into account cut vectors, offsets and
elevation information.
|
Modifier and Type | Method and Description |
---|---|
protected static void |
DebugView.drawArrow(JOGLTarget target,
Color color,
float headLength,
VectorXYZ... vs) |
protected static void |
DebugView.drawBox(JOGLTarget target,
Color color,
VectorXYZ v1,
VectorXYZ v2,
VectorXYZ v3,
VectorXYZ v4) |
protected static void |
DebugView.drawBoxAround(JOGLTarget target,
VectorXYZ center,
Color color,
float halfWidth) |