Uses of Class
edu.stanford.rsl.konrad.numerics.SimpleVector

Packages that use SimpleVector
edu.stanford.rsl.konrad.geometry Contains classes to describe various projection geometries. 
edu.stanford.rsl.konrad.geometry.motion   
edu.stanford.rsl.konrad.geometry.shapes.simple   
edu.stanford.rsl.konrad.geometry.splines Contains classes to model splines. 
edu.stanford.rsl.konrad.geometry.trajectories   
edu.stanford.rsl.konrad.geometry.transforms   
edu.stanford.rsl.konrad.numerics Contains Matrix and Vector objects and associated linear algebra operations. 
edu.stanford.rsl.konrad.numerics.mathexpressions   
edu.stanford.rsl.konrad.phantom.xcat   
edu.stanford.rsl.konrad.physics Contains classes to physical effects related to x-rays. 
edu.stanford.rsl.konrad.rendering   
edu.stanford.rsl.konrad.utils Contains various utility classes. 
 

Uses of SimpleVector in edu.stanford.rsl.konrad.geometry
 

Fields in edu.stanford.rsl.konrad.geometry declared as SimpleVector
static SimpleVector General.E_X
           
static SimpleVector General.E_Y
           
static SimpleVector General.E_Z
           
 

Methods in edu.stanford.rsl.konrad.geometry that return SimpleVector
static SimpleVector General.augmentToHomgeneous(SimpleVector v)
           
 SimpleVector Projection.computeCameraCenter()
          Compute the camera center in world coordinates.
 SimpleVector Projection.computeOffset(SimpleVector sizeUV)
          This convenience method computes the offset from the image center to the principal point.
 SimpleVector Projection.computePrincipalAxis()
          Compute the principal axis direction in world coordinates.
 SimpleVector Projection.computeRayDirection(SimpleVector p)
          Computes the direction of the ray corresponding to a given pixel.
static SimpleVector General.crossProduct(SimpleVector v1, SimpleVector v2)
           
 SimpleVector Axis.getAxisVector()
           
 SimpleVector Projection.getPrincipalPoint()
          Returns the principal point in pixels.
 SimpleVector Projection.getT()
          Returns a const reference to the translation vector t.
static SimpleVector General.normalizeFromHomogeneous(SimpleVector v)
           
 

Methods in edu.stanford.rsl.konrad.geometry with parameters of type SimpleVector
 double General.angle(SimpleVector a, SimpleVector b)
          Computes the angle between two vectors;
static boolean General.areColinear(SimpleVector v1, SimpleVector v2, double delta)
           
static SimpleVector General.augmentToHomgeneous(SimpleVector v)
           
 double Projection.computeDepth(SimpleVector v)
          Computes a given point's Eucledian distance to the camera.
 boolean Projection.computeGLMatrices(int imgMinU, int imgMinV, int imgSizeU, int imgSizeV, SimpleVector cubmin, SimpleVector cubmax, double[] glProjectionGlVec, double[] glModelviewGlVec)
          Compute the 4x4 OpenGL projection and modelview matrices from this Projection.
 SimpleVector Projection.computeOffset(SimpleVector sizeUV)
          This convenience method computes the offset from the image center to the principal point.
 SimpleVector Projection.computeRayDirection(SimpleVector p)
          Computes the direction of the ray corresponding to a given pixel.
 double[] Projection.computeSourceToDetectorDistance(SimpleVector spacingUV)
          This convenience method computes the source-to-detector distance in world corrdinate dimensions.
static SimpleMatrix General.createHomAffineMotionMatrix(SimpleMatrix A, SimpleVector t)
           
static SimpleMatrix General.createHomAffineMotionMatrix(SimpleVector t)
           
static SimpleMatrix Rotations.createRotationMatrixAboutAxis(SimpleVector axis, double angle)
           
static SimpleVector General.crossProduct(SimpleVector v1, SimpleVector v2)
           
static double General.euclideanDistance(SimpleVector v1, SimpleVector v2)
           
 void Projection.initFromSKRT(double s, SimpleMatrix K, SimpleMatrix R, SimpleVector t)
          Set the projection's intrinsic and extrinsic parameters all at once.
 boolean Projection.intersectRayWithCuboid(SimpleVector p, SimpleVector cubmin, SimpleVector cubmax, double[] distanceNearFar, SimpleVector C, SimpleVector d)
          Computes the two intersections of a ray with a cuboid, called entry and exit point where the ray is defined by this projection and the given pixel.
static boolean General.intersectRayWithCuboid(SimpleVector origin, SimpleVector dir, SimpleVector cubmin, SimpleVector cubmax, double[] distanceNearAndFar)
          Computes the two intersections of a ray with a cuboid, called entry and exit point where the ray is specified by the given line origin and ray direction.
static SimpleVector General.normalizeFromHomogeneous(SimpleVector v)
           
 double Projection.project(SimpleVector volumePoint, SimpleVector pixel)
          Projects a given voxel to a pixel and determines its visibility.
 void Axis.setAxis(SimpleVector newAxis)
           
 void Projection.setKFromDistancesSpacingsSizeOffset(double sourceToDetector, SimpleVector spacingUV, SimpleVector sizeUV, SimpleVector offset, double dir, double skew)
          Constructs the K matrix from distance and offset parameters.
 void Projection.setPrincipalPointValue(SimpleVector p)
          Sets the principal point in pixels.
 double Projection.setRtFromCircularTrajectory(SimpleVector rotationCenter, SimpleVector rotationAxis, double rotationRadius, SimpleVector centerToCameraAtZeroAngle, Projection.CameraAxisDirection uDirection, Projection.CameraAxisDirection vDirection, double rotationAngle)
          Constructs the extrinsic parameters (R and t) of this projection from the extrensic parameters source-to-isocenter distance, rotation axis, rotation angle, and viewing axis.
 void Projection.setTVector(SimpleVector t)
          Set the translation part of the extrinsic parameters of the projection.
static void General.splitHomAffineMotionMatrix(SimpleMatrix At, SimpleMatrix A, SimpleVector t)
           
 

Constructors in edu.stanford.rsl.konrad.geometry with parameters of type SimpleVector
Axis(SimpleVector axisvec)
           
 

Uses of SimpleVector in edu.stanford.rsl.konrad.geometry.motion
 

Constructors in edu.stanford.rsl.konrad.geometry.motion with parameters of type SimpleVector
CompressionMotionField(PointND min, PointND max, SimpleVector direction)
           
MovingCenterRotationMotionField(PointND transformationCenter, MotionField centerTransform, SimpleVector rotationAxis, double angle)
           
PlanarMotionField(MotionField fullMotion, SimpleVector planeNormal)
           
RotationMotionField(PointND transformationCenter, SimpleVector axis, double angle)
          Creates a new rotational MotionField.
 

Uses of SimpleVector in edu.stanford.rsl.konrad.geometry.shapes.simple
 

Methods in edu.stanford.rsl.konrad.geometry.shapes.simple that return SimpleVector
 SimpleVector PointND.getAbstractVector()
          Returns the internal abstract vector to enable computations via the numerics library.
Changes to the vector will affect the point
 SimpleVector StraightLine.getDirection()
           
 SimpleVector Plane3D.getNormal()
           
 SimpleVector VectorPoint3D.getVector()
           
 

Methods in edu.stanford.rsl.konrad.geometry.shapes.simple with parameters of type SimpleVector
 void StraightLine.init(PointND point, SimpleVector dir)
           
 void PointND.setCoordinates(SimpleVector coordinates)
           
 void StraightLine.setDirection(SimpleVector direction)
           
 void VectorPoint3D.setVector(SimpleVector vector)
           
 

Constructors in edu.stanford.rsl.konrad.geometry.shapes.simple with parameters of type SimpleVector
Plane3D(PointND point, SimpleVector normal)
          Creates a plane from a given point in the plane and a vector normal to the plane so that $\{ \mathbf x : \mathbf{n}^T (\mathbf x - \mathbf P) = 0 \}$.
Plane3D(PointND p1, SimpleVector dirU, SimpleVector dirV)
          Creates a plane from the given parametric representation $\mathbf P + \alpha \cdot \mathbf u + \beta \cdot \mathbf v, \quad \alpha, \beta \in \mathbb R$.
Plane3D(SimpleVector normal, double offset)
          Creates a plane from the given normal form $\{ \mathbf x : \mathbf{n}^T \mathbf x = d \}$.
PointND(SimpleVector knotVector)
          Creates a new point of the specified dimension
SortablePoint(SimpleVector add)
           
StraightLine(PointND point, SimpleVector dir)
          Creates a StraightLine from point with direction dir
VectorPoint3D(double x, double y, double z, SimpleVector vector)
          Creates a new VectorPoint3D at coordinates (x, y, z).
VectorPoint3D(PointND point, SimpleVector vector)
          Creates a new VectorPoint3D at point.
 

Uses of SimpleVector in edu.stanford.rsl.konrad.geometry.splines
 

Methods in edu.stanford.rsl.konrad.geometry.splines that return SimpleVector
 SimpleVector SurfaceBSplineVolumePhantom.getBounds()
          Returns an SimpleVector that specifies the bounding box of the BSpline Phantom with six entries:
Minimum X Coordinate Minimum Y Coordinate Minimum Z Coordinate Maximum X Coordinate Maximum Y Coordinate Maximum Z Coordinate
 SimpleVector SurfaceBSpline.getUKnots()
           
 SimpleVector SurfaceBSpline.getVKnots()
           
 

Constructors in edu.stanford.rsl.konrad.geometry.splines with parameters of type SimpleVector
BSpline(java.util.ArrayList<PointND> controlPoints, SimpleVector knotVector)
          Constructor for a BSpline using ArbitraryPoints and a weight vector as SimpleVector
SurfaceBSpline(java.util.ArrayList<PointND> controlPoints, SimpleVector uKnots, SimpleVector vKnots)
          Constructor for a surface BSpline.
 

Uses of SimpleVector in edu.stanford.rsl.konrad.geometry.trajectories
 

Methods in edu.stanford.rsl.konrad.geometry.trajectories with parameters of type SimpleVector
 void CircularTrajectory.setTrajectory(int numProjectionMatrices, double sourceToCenterOfRotationDistance, double averageAngularIncrement, double detectorOffsetX, double detectorOffsetY, Projection.CameraAxisDirection uDirection, Projection.CameraAxisDirection vDirection, SimpleVector rotationAxis)
           
 

Uses of SimpleVector in edu.stanford.rsl.konrad.geometry.transforms
 

Methods in edu.stanford.rsl.konrad.geometry.transforms that return SimpleVector
 SimpleVector Translation.getData()
           
 SimpleVector Translation.transform(SimpleVector dir)
           
abstract  SimpleVector Transform.transform(SimpleVector dir)
           
 SimpleVector ScaleRotate.transform(SimpleVector dir)
           
 SimpleVector ComboTransform.transform(SimpleVector dir)
          Transforms the given vector
 

Methods in edu.stanford.rsl.konrad.geometry.transforms with parameters of type SimpleVector
 SimpleVector Translation.transform(SimpleVector dir)
           
abstract  SimpleVector Transform.transform(SimpleVector dir)
           
 SimpleVector ScaleRotate.transform(SimpleVector dir)
           
 SimpleVector ComboTransform.transform(SimpleVector dir)
          Transforms the given vector
 

Constructors in edu.stanford.rsl.konrad.geometry.transforms with parameters of type SimpleVector
AffineTransform(SimpleMatrix scaleRotate, SimpleVector translatorVec)
           
Quaternion(double scaler, SimpleVector vector)
           
Translation(SimpleVector t)
           
 

Uses of SimpleVector in edu.stanford.rsl.konrad.numerics
 

Methods in edu.stanford.rsl.konrad.numerics that return SimpleVector
static SimpleVector SimpleOperators.add(SimpleVector... addends)
          Computes the sum of supplied vectors
 SimpleVector SimpleVector.clone()
           
static SimpleVector SimpleOperators.concatenateVertically(SimpleVector... parts)
          Creates a new vector which is composed of all input vectors, stacked over each other.
 SimpleVector SimpleVector.dividedBy(double divisor)
           
static SimpleVector SimpleOperators.divideElementWise(SimpleVector v1, SimpleVector v2)
          Computes the element wise division of v1 by v2.
 SimpleVector SimpleMatrix.getCol(int col)
          Retrieve column from index col of matrix
 SimpleVector SimpleMatrix.getDiag()
           
 SimpleVector SimpleMatrix.getRow(int row)
          Retrieve row from index row of matrix
 SimpleVector SimpleMatrix.getSubCol(int firstRow, int col, int sizeRows)
          Returns a vector containing a sub column in current matrix.
 SimpleVector SimpleMatrix.getSubRow(int row, int firstCol, int sizeCols)
          Returns a vector containing a sub row in current matrix.
 SimpleVector SimpleVector.getSubVec(int firstInd, int size)
           
static SimpleVector SimpleOperators.max(SimpleVector... vectors)
          Computes and returns the element-wise maximum of all given vectors.
static SimpleVector SimpleOperators.min(SimpleVector... vectors)
          Computes and returns the element-wise minimum of all given vectors.
 SimpleVector SimpleVector.multipliedBy(double factor)
          Returns a scaled instance of the vector.
static SimpleVector SimpleOperators.multiply(SimpleMatrix M, SimpleVector v)
          Performs a standard matrix-vector product.
static SimpleVector SimpleOperators.multiply(SimpleVector v, SimpleMatrix M)
          Performs a vector-matrix product, assuming a row vector.
static SimpleVector SimpleOperators.multiplyElementWise(SimpleVector... factors)
          Multiplies the supplied vectors element wise
 SimpleVector SimpleVector.negated()
           
 SimpleVector SimpleVector.normalizedL2()
           
 SimpleVector DecompositionRQ.solve(SimpleVector b)
          Computes solution Vector $\mathbf{x}$ for the right-hand-side $\mathbf b$.
 SimpleVector DecompositionQR.solve(SimpleVector b)
          Computes solution Vector $\mathbf x$ for the right-hand-side $\mathbf b$.
static SimpleVector Solvers.solveLinearLeastSquares(SimpleMatrix A, SimpleVector b)
          Solves the linear least squares problem $\min_{\mathbf{x}} \| \mathbf{A} \cdot \mathbf{x} - \mathbf{b} \|^2$ with a matrix A (with as least as much rows as columns).
static SimpleVector Solvers.solveLinearSysytemOfEquations(SimpleMatrix A, SimpleVector b)
          Solves the linear system of equations $\mathbf{A} \cdot \mathbf{x} = \mathbf{b}$ with a square matrix A.
static SimpleVector Solvers.solveLowerTriangular(SimpleMatrix L, SimpleVector b)
          Solves the linear system of equations L*x = b with a square, lower-triangular matrix L using forward substitution.
static SimpleVector Solvers.solveUpperTriangular(SimpleMatrix U, SimpleVector b)
          Solves the linear system of equations U*x = b with a square, upper-triangular matrix U using backward substitution.
static SimpleVector SimpleOperators.subtract(SimpleVector v1, SimpleVector v2)
          subtracts v2 from v1
 

Methods in edu.stanford.rsl.konrad.numerics with parameters of type SimpleVector
 void SimpleVector.add(SimpleVector... addends)
          Method to add other vectors to this vector in place.
static SimpleVector SimpleOperators.add(SimpleVector... addends)
          Computes the sum of supplied vectors
static SimpleMatrix SimpleOperators.concatenateHorizontally(SimpleVector... columns)
          Creates a new matrix which is composed of all input column vectors, stacked next to each other.
static SimpleVector SimpleOperators.concatenateVertically(SimpleVector... parts)
          Creates a new vector which is composed of all input vectors, stacked over each other.
static SimpleVector SimpleOperators.divideElementWise(SimpleVector v1, SimpleVector v2)
          Computes the element wise division of v1 by v2.
 void SimpleVector.divideElementWiseBy(SimpleVector... divisors)
           
static boolean SimpleOperators.equalElementWise(SimpleVector v1, SimpleVector v2, double delta)
           
 void SimpleVector.init(SimpleVector otherVec)
          Initialize vector with otherVec
static SimpleVector SimpleOperators.max(SimpleVector... vectors)
          Computes and returns the element-wise maximum of all given vectors.
static SimpleVector SimpleOperators.min(SimpleVector... vectors)
          Computes and returns the element-wise minimum of all given vectors.
static SimpleVector SimpleOperators.multiply(SimpleMatrix M, SimpleVector v)
          Performs a standard matrix-vector product.
static SimpleVector SimpleOperators.multiply(SimpleVector v, SimpleMatrix M)
          Performs a vector-matrix product, assuming a row vector.
static SimpleVector SimpleOperators.multiplyElementWise(SimpleVector... factors)
          Multiplies the supplied vectors element wise
 void SimpleVector.multiplyElementWiseBy(SimpleVector... factors)
           
static double SimpleOperators.multiplyInnerProd(SimpleVector v1, SimpleVector v2)
           Computes the inner product multiplication (dot product) of v1 and v2.
static SimpleMatrix SimpleOperators.multiplyOuterProd(SimpleVector v1, SimpleVector v2)
          Computes the outer product multiplication of v1 and v2; i.e v1 x v2
 void SimpleMatrix.setColValue(int col, SimpleVector newCol)
          Replace col with newCol
 void SimpleMatrix.setDiagValue(SimpleVector diag)
          Replace diagonal entries of matrix with diag
 void SimpleMatrix.setRowValue(int row, SimpleVector newRow)
          Replace row with newRow
 void SimpleMatrix.setSubColValue(int firstRow, int col, SimpleVector subCol)
          Replace the entries of sub column starting at [col,firstRow] with subCol
 void SimpleMatrix.setSubRowValue(int row, int firstCol, SimpleVector subRow)
          Replace the entries of sub row starting at [row,firstCol] with subRow
 void SimpleVector.setSubVecValue(int firstInd, SimpleVector subVector)
           
 SimpleVector DecompositionRQ.solve(SimpleVector b)
          Computes solution Vector $\mathbf{x}$ for the right-hand-side $\mathbf b$.
 SimpleVector DecompositionQR.solve(SimpleVector b)
          Computes solution Vector $\mathbf x$ for the right-hand-side $\mathbf b$.
static SimpleVector Solvers.solveLinearLeastSquares(SimpleMatrix A, SimpleVector b)
          Solves the linear least squares problem $\min_{\mathbf{x}} \| \mathbf{A} \cdot \mathbf{x} - \mathbf{b} \|^2$ with a matrix A (with as least as much rows as columns).
static SimpleVector Solvers.solveLinearSysytemOfEquations(SimpleMatrix A, SimpleVector b)
          Solves the linear system of equations $\mathbf{A} \cdot \mathbf{x} = \mathbf{b}$ with a square matrix A.
static SimpleVector Solvers.solveLowerTriangular(SimpleMatrix L, SimpleVector b)
          Solves the linear system of equations L*x = b with a square, lower-triangular matrix L using forward substitution.
static SimpleVector Solvers.solveUpperTriangular(SimpleMatrix U, SimpleVector b)
          Solves the linear system of equations U*x = b with a square, upper-triangular matrix U using backward substitution.
 void SimpleVector.subtract(SimpleVector... subtrahends)
           
static SimpleVector SimpleOperators.subtract(SimpleVector v1, SimpleVector v2)
          subtracts v2 from v1
 

Constructors in edu.stanford.rsl.konrad.numerics with parameters of type SimpleVector
SimpleVector(SimpleVector otherVec)
          Creates a new vector from otherVec.
 

Uses of SimpleVector in edu.stanford.rsl.konrad.numerics.mathexpressions
 

Methods in edu.stanford.rsl.konrad.numerics.mathexpressions that return SimpleVector
static SimpleVector Evaluator.getVectorValue(java.lang.String expression)
          Evaluates the string literals in a string vector;
static SimpleVector Evaluator.getVectorValue(java.lang.String expression, java.util.Map<java.lang.String,java.lang.Double> variablesMap)
          Evaluates the string literals in a string vector and replaces variables with values in map;
 

Uses of SimpleVector in edu.stanford.rsl.konrad.phantom.xcat
 

Methods in edu.stanford.rsl.konrad.phantom.xcat that return SimpleVector
 SimpleVector BreathingScene.getDiaphragmMotionVector(double initialTime, double time)
          Returns the Motion Vector of the top of the diaphragm from initialTime to time
 

Uses of SimpleVector in edu.stanford.rsl.konrad.physics
 

Constructors in edu.stanford.rsl.konrad.physics with parameters of type SimpleVector
PhysicalPoint(SimpleVector add)
           
 

Uses of SimpleVector in edu.stanford.rsl.konrad.rendering
 

Methods in edu.stanford.rsl.konrad.rendering that return SimpleVector
 SimpleVector RayDetector.getPrincipalPointInMM()
           
 SimpleVector RayDetector.getPrincipalPointInPixels()
           
 

Uses of SimpleVector in edu.stanford.rsl.konrad.utils
 

Methods in edu.stanford.rsl.konrad.utils that return SimpleVector
static SimpleVector TestingTools.randVector(int len)
          Randomly generates a vector of the given length.
 

Methods in edu.stanford.rsl.konrad.utils with parameters of type SimpleVector
static void TestingTools.assertEqualElementWise(SimpleVector v1, SimpleVector v2, double delta)
          own assert for vectors