Public Member Functions | Static Public Member Functions | Static Public Attributes | Protected Attributes | Private Member Functions | Private Attributes
ON_Viewport Class Reference

#include <opennurbs_viewport.h>

Inheritance diagram for ON_Viewport:
Inheritance graph
[legend]

List of all members.

Public Member Functions

ON_3dVector CameraDirection () const
bool CameraDirectionIsLocked () const
ON_3dPoint CameraLocation () const
bool CameraLocationIsLocked () const
ON_3dVector CameraUp () const
bool CameraUpIsLocked () const
ON_3dVector CameraX () const
ON_3dVector CameraY () const
ON_3dVector CameraZ () const
bool ChangeToParallelProjection (bool bSymmetricFrustum)
bool ChangeToPerspectiveProjection (double target_distance, bool bSymmetricFrustum, double lens_length)
bool ChangeToSymmetricFrustum (bool bLeftRightSymmetric, bool bTopBottomSymmetric, double target_distance)
bool ChangeToTwoPointPerspectiveProjection (double target_distance, ON_3dVector up, double lens_length)
void ChangeViewportId (const ON_UUID &viewport_id)
double ClipCoordDepthBias (double relative_depth_bias, double clip_z, double clip_w) const
ON_Xform ClipModInverseXform () const
ON_Xform ClipModXform () const
bool ClipModXformIsIdentity () const
int Dimension () const
bool DollyCamera (const ON_3dVector &dolly_vector)
bool DollyFrustum (double dolly_distance)
void Dump (ON_TextLog &) const
bool Extents (double half_view_angle, const ON_BoundingBox &world_bbox)
bool Extents (double half_view_angle, const ON_3dPoint &center, double radius)
double FrustumBottom () const
ON_3dPoint FrustumCenterPoint (double target_distance) const
double FrustumFar () const
double FrustumHeight () const
bool FrustumIsLeftRightSymmetric () const
bool FrustumIsTopBottomSymmetric () const
double FrustumLeft () const
double FrustumMaximumDiameter () const
double FrustumMinimumDiameter () const
double FrustumNear () const
double FrustumRight () const
double FrustumTop () const
double FrustumWidth () const
ON_BOOL32 GetBBox (double *, double *, ON_BOOL32=false) const
bool GetBoundingBoxDepth (ON_BoundingBox bbox, double *near_dist, double *far_dist, bool bGrowNearFar=false) const
bool GetCamera35mmLenseLength (double *lens_length) const
bool GetCamera35mmLensLength (double *lens_length) const
bool GetCameraAngle (double *half_diagonal_angle, double *half_vertical_angle, double *half_horizontal_angle) const
bool GetCameraAngle (double *half_smallest_angle) const
bool GetCameraExtents (int, int, const double *, ON_BoundingBox &cambbox, int bGrowBox=false) const
bool GetCameraExtents (const ON_BoundingBox &, ON_BoundingBox &cambbox, int bGrowBox=false) const
bool GetCameraExtents (ON_3dPoint &, double, ON_BoundingBox &cambox, int bGrowBox=false) const
bool GetCameraFrame (double *, double *, double *, double *) const
bool GetClipCoordDepthBiasXform (double relative_depth_bias, ON_Xform &clip_bias) const
bool GetCoordinateSprite (int, int, int, int[3], double[3][2]) const
bool GetDollyCameraVector (int screen_x0, int screen_y0, int screen_x1, int screen_y1, double proj_plane_dist, ON_3dVector &dolly_vector) const
bool GetFarPlane (ON_Plane &far_plane) const
bool GetFarPlaneEquation (ON_PlaneEquation &far_plane_equation) const
bool GetFarRect (ON_3dPoint &left_bottom, ON_3dPoint &right_bottom, ON_3dPoint &left_top, ON_3dPoint &right_top) const
bool GetFrustum (double *left, double *right, double *bottom, double *top, double *near_dist=NULL, double *far_dist=NULL) const
bool GetFrustumAspect (double &) const
bool GetFrustumBottomPlane (ON_Plane &bottom_plane) const
bool GetFrustumBottomPlaneEquation (ON_PlaneEquation &bottom_plane_equation) const
bool GetFrustumCenter (double *) const
bool GetFrustumLeftPlane (ON_Plane &left_plane) const
bool GetFrustumLeftPlaneEquation (ON_PlaneEquation &left_plane_equation) const
bool GetFrustumLine (double screenx, double screeny, ON_Line &world_line) const
bool GetFrustumRightPlane (ON_Plane &right_plane) const
bool GetFrustumRightPlaneEquation (ON_PlaneEquation &right_plane_equation) const
bool GetFrustumTopPlane (ON_Plane &top_plane) const
bool GetFrustumTopPlaneEquation (ON_PlaneEquation &top_plane_equation) const
bool GetNearPlane (ON_Plane &near_plane) const
bool GetNearPlaneEquation (ON_PlaneEquation &near_plane_equation) const
bool GetNearRect (ON_3dPoint &left_bottom, ON_3dPoint &right_bottom, ON_3dPoint &left_top, ON_3dPoint &right_top) const
bool GetPointDepth (ON_3dPoint point, double *near_dist, double *far_dist, bool bGrowNearFar=false) const
bool GetPointDepth (ON_3dPoint point, double *view_plane_depth) const
bool GetScreenPort (int *left, int *right, int *port_bottom, int *port_top, int *port_near=NULL, int *port_far=NULL) const
bool GetScreenPortAspect (double &) const
bool GetSphereDepth (ON_Sphere sphere, double *near_dist, double *far_dist, bool bGrowNearFar=false) const
bool GetViewPlane (double view_plane_depth, ON_Plane &view_plane) const
bool GetViewPlaneEquation (double view_plane_depth, ON_PlaneEquation &view_plane_equation) const
bool GetViewPlaneRect (double view_plane_depth, ON_3dPoint &left_bottom, ON_3dPoint &right_bottom, ON_3dPoint &left_top, ON_3dPoint &right_top) const
void GetViewScale (double *x, double *y) const
bool GetWorldToScreenScale (const ON_3dPoint &point_in_frustum, double *pixels_per_unit) const
bool GetXform (ON::coordinate_system srcCS, ON::coordinate_system destCS, ON_Xform &matrix) const
void Initialize ()
bool IsCameraFrameWorldPlan (int *, int *, int *)
bool IsParallelProjection () const
bool IsPerspectiveProjection () const
bool IsTwoPointPerspectiveProjection () const
ON_BOOL32 IsValid (ON_TextLog *text_log=NULL) const
bool IsValidCamera () const
bool IsValidFrustum () const
 ON_Viewport ()
ON_Viewportoperator= (const ON_Viewport &)
double PerspectiveMinNearDist () const
double PerspectiveMinNearOverFar () const
ON::view_projection Projection () const
ON_BOOL32 Read (ON_BinaryArchive &)
int ScreenPortHeight () const
int ScreenPortWidth () const
bool SetCamera35mmLenseLength (double lens_length)
bool SetCamera35mmLensLength (double lens_length)
bool SetCameraAngle (double half_smallest_angle)
bool SetCameraDirection (const ON_3dVector &)
void SetCameraDirectionLock (bool bLockCameraDirection)
bool SetCameraLocation (const ON_3dPoint &)
void SetCameraLocationLock (bool bLockCameraLocation)
bool SetCameraUp (const ON_3dVector &)
void SetCameraUpLock (bool bLockCameraUp)
bool SetFrustum (double left, double right, double bottom, double top, double near_dist, double far_dist)
bool SetFrustumAspect (double)
void SetFrustumLeftRightSymmetry (bool bForceLeftRightSymmetry)
bool SetFrustumNearFar (const double *bboxmin, const double *bboxmax)
bool SetFrustumNearFar (const double *center, double radius)
bool SetFrustumNearFar (double near_dist, double far_dist)
bool SetFrustumNearFar (double near_dist, double far_dist, double min_near_dist, double min_near_over_far, double target_dist)
bool SetFrustumNearFar (double near_dist, double far_dist, double min_near_dist, double min_near_over_far, double target_dist, double relative_depth_bias)
void SetFrustumTopBottomSymmetry (bool bForceTopBottomSymmetry)
void SetPerspectiveClippingPlaneConstraints (unsigned int depth_buffer_bit_depth)
void SetPerspectiveMinNearDist (double min_near_dist)
void SetPerspectiveMinNearOverFar (double min_near_over_far)
bool SetProjection (ON::view_projection projection)
bool SetScreenPort (int port_left, int port_right, int port_bottom, int port_top, int port_near=0, int port_far=0)
bool SetTargetPoint (ON_3dPoint target_point)
bool SetViewportId (const ON_UUID &viewport_id)
bool SetViewScale (double x, double y)
double TargetDistance (bool bUseFrustumCenterFallback) const
ON_3dPoint TargetPoint () const
ON_BOOL32 Transform (const ON_Xform &)
void UnlockCamera ()
void UnlockFrustumSymmetry ()
ON_UUID ViewportId (void) const
ON_BOOL32 Write (ON_BinaryArchive &) const
bool ZoomToScreenRect (int screen_x0, int screen_y0, int screen_x1, int screen_y1)
 ~ON_Viewport ()

Static Public Member Functions

static void GetPerspectiveClippingPlaneConstraints (ON_3dPoint camera_location, unsigned int depth_buffer_bit_depth, double *min_near_dist, double *min_near_over_far)

Static Public Attributes

static const ON_3dVector Default3dCameraDirection
static const double DefaultFarDist = 1000.0
static const double DefaultMinNearDist = 0.0001
static const double DefaultMinNearOverFar = 0.0001
static const double DefaultNearDist = 0.005

Protected Attributes

bool m_bLockCamDir
bool m_bLockCamLoc
bool m_bLockCamUp
bool m_bValidCamera
bool m_bValidFrustum
bool m_bValidPort
ON_3dVector m_CamDir
ON_3dPoint m_CamLoc
ON_3dVector m_CamUp
ON_3dVector m_CamX
ON_3dVector m_CamY
ON_3dVector m_CamZ
double m_frus_bottom
double m_frus_far
double m_frus_left
double m_frus_near
double m_frus_right
double m_frus_top
unsigned char m_frustum_symmetry_flags
int m_port_bottom
int m_port_far
int m_port_left
int m_port_near
int m_port_right
int m_port_top
ON::view_projection m_projection
unsigned char m_reserved1
ON_3dPoint m_target_point

Private Member Functions

 ON_OBJECT_DECLARE (ON_Viewport)
bool SetCameraFrame ()
bool SetClipModXform (ON_Xform clip_mod_xform)

Private Attributes

double m__MIN_NEAR_DIST
double m__MIN_NEAR_OVER_FAR
ON_Xform m_clip_mods
ON_Xform m_clip_mods_inverse
ON_UUID m_viewport_id

Detailed Description

Definition at line 31 of file opennurbs_viewport.h.


Constructor & Destructor Documentation

Definition at line 319 of file opennurbs_viewport.cpp.

Definition at line 324 of file opennurbs_viewport.cpp.


Member Function Documentation

Definition at line 966 of file opennurbs_viewport.cpp.

Definition at line 981 of file opennurbs_viewport.cpp.

Definition at line 961 of file opennurbs_viewport.cpp.

Definition at line 976 of file opennurbs_viewport.cpp.

Definition at line 971 of file opennurbs_viewport.cpp.

Definition at line 986 of file opennurbs_viewport.cpp.

Definition at line 1148 of file opennurbs_viewport.cpp.

Definition at line 1153 of file opennurbs_viewport.cpp.

Definition at line 1158 of file opennurbs_viewport.cpp.

bool ON_Viewport::ChangeToParallelProjection ( bool  bSymmetricFrustum)

Definition at line 1310 of file opennurbs_viewport.cpp.

bool ON_Viewport::ChangeToPerspectiveProjection ( double  target_distance,
bool  bSymmetricFrustum,
double  lens_length 
)

Definition at line 1438 of file opennurbs_viewport.cpp.

bool ON_Viewport::ChangeToSymmetricFrustum ( bool  bLeftRightSymmetric,
bool  bTopBottomSymmetric,
double  target_distance 
)

Definition at line 2626 of file opennurbs_viewport.cpp.

bool ON_Viewport::ChangeToTwoPointPerspectiveProjection ( double  target_distance,
ON_3dVector  up,
double  lens_length 
)

Definition at line 1556 of file opennurbs_viewport.cpp.

void ON_Viewport::ChangeViewportId ( const ON_UUID viewport_id)

Definition at line 4234 of file opennurbs_viewport.cpp.

double ON_Viewport::ClipCoordDepthBias ( double  relative_depth_bias,
double  clip_z,
double  clip_w 
) const

Definition at line 3997 of file opennurbs_viewport.cpp.

Definition at line 4125 of file opennurbs_viewport.cpp.

Definition at line 4120 of file opennurbs_viewport.cpp.

Definition at line 4115 of file opennurbs_viewport.cpp.

int ON_Viewport::Dimension ( ) const [virtual]

Implements ON_Geometry.

Definition at line 577 of file opennurbs_viewport.cpp.

bool ON_Viewport::DollyCamera ( const ON_3dVector dolly_vector)

Definition at line 1078 of file opennurbs_viewport.cpp.

bool ON_Viewport::DollyFrustum ( double  dolly_distance)

Definition at line 1089 of file opennurbs_viewport.cpp.

void ON_Viewport::Dump ( ON_TextLog dump) const [virtual]

Reimplemented from ON_Object.

Definition at line 3033 of file opennurbs_viewport.cpp.

bool ON_Viewport::Extents ( double  half_view_angle,
const ON_BoundingBox world_bbox 
)

Definition at line 2963 of file opennurbs_viewport.cpp.

bool ON_Viewport::Extents ( double  half_view_angle,
const ON_3dPoint center,
double  radius 
)

Definition at line 3000 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumBottom ( ) const

Definition at line 1780 of file opennurbs_viewport.cpp.

ON_3dPoint ON_Viewport::FrustumCenterPoint ( double  target_distance) const

Definition at line 4138 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumFar ( ) const

Definition at line 1783 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumHeight ( ) const

Definition at line 1785 of file opennurbs_viewport.cpp.

Definition at line 991 of file opennurbs_viewport.cpp.

Definition at line 996 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumLeft ( ) const

Definition at line 1778 of file opennurbs_viewport.cpp.

Definition at line 1794 of file opennurbs_viewport.cpp.

Definition at line 1787 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumNear ( ) const

Definition at line 1782 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumRight ( ) const

Definition at line 1779 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumTop ( ) const

Definition at line 1781 of file opennurbs_viewport.cpp.

double ON_Viewport::FrustumWidth ( ) const

Definition at line 1784 of file opennurbs_viewport.cpp.

ON_BOOL32 ON_Viewport::GetBBox ( double *  boxmin,
double *  boxmax,
ON_BOOL32  bGrowBox = false 
) const [virtual]

Implements ON_Geometry.

Definition at line 746 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetBoundingBoxDepth ( ON_BoundingBox  bbox,
double *  near_dist,
double *  far_dist,
bool  bGrowNearFar = false 
) const

Definition at line 3138 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCamera35mmLenseLength ( double *  lens_length) const

Definition at line 2175 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCamera35mmLensLength ( double *  lens_length) const

Definition at line 2180 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCameraAngle ( double *  half_diagonal_angle,
double *  half_vertical_angle,
double *  half_horizontal_angle 
) const

Definition at line 2104 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCameraAngle ( double *  half_smallest_angle) const

Definition at line 2136 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCameraExtents ( int  count,
int  stride,
const double *  points,
ON_BoundingBox cambbox,
int  bGrowBox = false 
) const

Definition at line 1215 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCameraExtents ( const ON_BoundingBox wbox,
ON_BoundingBox cambbox,
int  bGrowBox = false 
) const

Definition at line 1241 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCameraExtents ( ON_3dPoint worldSphereCenter,
double  worldSphereRadius,
ON_BoundingBox cambox,
int  bGrowBox = false 
) const

Definition at line 1257 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCameraFrame ( double *  CameraLocation,
double *  CameraX,
double *  CameraY,
double *  CameraZ 
) const

Definition at line 1118 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetClipCoordDepthBiasXform ( double  relative_depth_bias,
ON_Xform clip_bias 
) const

Definition at line 4052 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetCoordinateSprite ( int  size,
int  scrx,
int  scry,
int  indx[3],
double  scr_coord[3][2] 
) const

Definition at line 2710 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetDollyCameraVector ( int  screen_x0,
int  screen_y0,
int  screen_x1,
int  screen_y1,
double  proj_plane_dist,
ON_3dVector dolly_vector 
) const

Definition at line 1047 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFarPlane ( ON_Plane far_plane) const

Definition at line 610 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFarPlaneEquation ( ON_PlaneEquation far_plane_equation) const

Definition at line 624 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFarRect ( ON_3dPoint left_bottom,
ON_3dPoint right_bottom,
ON_3dPoint left_top,
ON_3dPoint right_top 
) const

Definition at line 692 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustum ( double *  left,
double *  right,
double *  bottom,
double *  top,
double *  near_dist = NULL,
double *  far_dist = NULL 
) const

Definition at line 1754 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumAspect ( double &  frustum_aspect) const

Definition at line 1849 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumBottomPlane ( ON_Plane bottom_plane) const

Definition at line 3819 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumBottomPlaneEquation ( ON_PlaneEquation bottom_plane_equation) const

Definition at line 3848 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumCenter ( double *  frus_center) const

Definition at line 1867 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumLeftPlane ( ON_Plane left_plane) const

Definition at line 3709 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumLeftPlaneEquation ( ON_PlaneEquation left_plane_equation) const

Definition at line 3737 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumLine ( double  screenx,
double  screeny,
ON_Line world_line 
) const

Definition at line 2434 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumRightPlane ( ON_Plane right_plane) const

Definition at line 3764 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumRightPlaneEquation ( ON_PlaneEquation right_plane_equation) const

Definition at line 3792 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumTopPlane ( ON_Plane top_plane) const

Definition at line 3875 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetFrustumTopPlaneEquation ( ON_PlaneEquation top_plane_equation) const

Definition at line 3903 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetNearPlane ( ON_Plane near_plane) const

Definition at line 582 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetNearPlaneEquation ( ON_PlaneEquation near_plane_equation) const

Definition at line 596 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetNearRect ( ON_3dPoint left_bottom,
ON_3dPoint right_bottom,
ON_3dPoint left_top,
ON_3dPoint right_top 
) const

Definition at line 670 of file opennurbs_viewport.cpp.

void ON_Viewport::GetPerspectiveClippingPlaneConstraints ( ON_3dPoint  camera_location,
unsigned int  depth_buffer_bit_depth,
double *  min_near_dist,
double *  min_near_over_far 
) [static]

Definition at line 4403 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetPointDepth ( ON_3dPoint  point,
double *  near_dist,
double *  far_dist,
bool  bGrowNearFar = false 
) const

Definition at line 3102 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetPointDepth ( ON_3dPoint  point,
double *  view_plane_depth 
) const

Definition at line 3122 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetScreenPort ( int *  left,
int *  right,
int *  port_bottom,
int *  port_top,
int *  port_near = NULL,
int *  port_far = NULL 
) const

Definition at line 1909 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetScreenPortAspect ( double &  aspect) const

Definition at line 1945 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetSphereDepth ( ON_Sphere  sphere,
double *  near_dist,
double *  far_dist,
bool  bGrowNearFar = false 
) const

Definition at line 3366 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetViewPlane ( double  view_plane_depth,
ON_Plane view_plane 
) const

Definition at line 638 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetViewPlaneEquation ( double  view_plane_depth,
ON_PlaneEquation view_plane_equation 
) const

Definition at line 655 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetViewPlaneRect ( double  view_plane_depth,
ON_3dPoint left_bottom,
ON_3dPoint right_bottom,
ON_3dPoint left_top,
ON_3dPoint right_top 
) const

Definition at line 718 of file opennurbs_viewport.cpp.

void ON_Viewport::GetViewScale ( double *  x,
double *  y 
) const

Definition at line 3929 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetWorldToScreenScale ( const ON_3dPoint point_in_frustum,
double *  pixels_per_unit 
) const

Definition at line 2692 of file opennurbs_viewport.cpp.

bool ON_Viewport::GetXform ( ON::coordinate_system  srcCS,
ON::coordinate_system  destCS,
ON_Xform matrix 
) const

Definition at line 2244 of file opennurbs_viewport.cpp.

void ON_Viewport::Initialize ( void  )

Definition at line 275 of file opennurbs_viewport.cpp.

bool ON_Viewport::IsCameraFrameWorldPlan ( int *  xindex,
int *  yindex,
int *  zindex 
)

Definition at line 1163 of file opennurbs_viewport.cpp.

Definition at line 1670 of file opennurbs_viewport.cpp.

Definition at line 1675 of file opennurbs_viewport.cpp.

Definition at line 1680 of file opennurbs_viewport.cpp.

ON_BOOL32 ON_Viewport::IsValid ( ON_TextLog text_log = NULL) const [virtual]

Implements ON_Object.

Definition at line 547 of file opennurbs_viewport.cpp.

Definition at line 537 of file opennurbs_viewport.cpp.

Definition at line 542 of file opennurbs_viewport.cpp.

ON_Viewport & ON_Viewport::operator= ( const ON_Viewport src)

Definition at line 327 of file opennurbs_viewport.cpp.

Definition at line 248 of file opennurbs_viewport.cpp.

Definition at line 235 of file opennurbs_viewport.cpp.

ON::view_projection ON_Viewport::Projection ( ) const

Definition at line 1665 of file opennurbs_viewport.cpp.

Reimplemented from ON_Object.

Definition at line 379 of file opennurbs_viewport.cpp.

Definition at line 1939 of file opennurbs_viewport.cpp.

Definition at line 1933 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetCamera35mmLenseLength ( double  lens_length)

Definition at line 2207 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetCamera35mmLensLength ( double  lens_length)

Definition at line 2212 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetCameraAngle ( double  half_smallest_angle)

Definition at line 2149 of file opennurbs_viewport.cpp.

Definition at line 853 of file opennurbs_viewport.cpp.

void ON_Viewport::SetCameraDirectionLock ( bool  bLockCameraDirection)

Definition at line 1019 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetCameraFrame ( ) [private]

Definition at line 889 of file opennurbs_viewport.cpp.

Definition at line 836 of file opennurbs_viewport.cpp.

void ON_Viewport::SetCameraLocationLock ( bool  bLockCameraLocation)

Definition at line 1014 of file opennurbs_viewport.cpp.

Definition at line 868 of file opennurbs_viewport.cpp.

void ON_Viewport::SetCameraUpLock ( bool  bLockCameraUp)

Definition at line 1024 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetClipModXform ( ON_Xform  clip_mod_xform) [private]

Definition at line 4088 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustum ( double  left,
double  right,
double  bottom,
double  top,
double  near_dist,
double  far_dist 
)

Definition at line 1689 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustumAspect ( double  frustum_aspect)

Definition at line 1802 of file opennurbs_viewport.cpp.

void ON_Viewport::SetFrustumLeftRightSymmetry ( bool  bForceLeftRightSymmetry)

Definition at line 1029 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustumNearFar ( const double *  bboxmin,
const double *  bboxmax 
)

Definition at line 2465 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustumNearFar ( const double *  center,
double  radius 
)

Definition at line 2529 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustumNearFar ( double  near_dist,
double  far_dist 
)

Definition at line 2575 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustumNearFar ( double  near_dist,
double  far_dist,
double  min_near_dist,
double  min_near_over_far,
double  target_dist 
)

Definition at line 3384 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetFrustumNearFar ( double  near_dist,
double  far_dist,
double  min_near_dist,
double  min_near_over_far,
double  target_dist,
double  relative_depth_bias 
)

Definition at line 3403 of file opennurbs_viewport.cpp.

void ON_Viewport::SetFrustumTopBottomSymmetry ( bool  bForceTopBottomSymmetry)

Definition at line 1037 of file opennurbs_viewport.cpp.

void ON_Viewport::SetPerspectiveClippingPlaneConstraints ( unsigned int  depth_buffer_bit_depth)

Definition at line 212 of file opennurbs_viewport.cpp.

void ON_Viewport::SetPerspectiveMinNearDist ( double  min_near_dist)

Definition at line 240 of file opennurbs_viewport.cpp.

void ON_Viewport::SetPerspectiveMinNearOverFar ( double  min_near_over_far)

Definition at line 224 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetProjection ( ON::view_projection  projection)

Definition at line 1643 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetScreenPort ( int  port_left,
int  port_right,
int  port_bottom,
int  port_top,
int  port_near = 0,
int  port_far = 0 
)

Definition at line 1883 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetTargetPoint ( ON_3dPoint  target_point)

Definition at line 4130 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetViewportId ( const ON_UUID viewport_id)

Definition at line 4220 of file opennurbs_viewport.cpp.

bool ON_Viewport::SetViewScale ( double  x,
double  y 
)

Definition at line 3966 of file opennurbs_viewport.cpp.

double ON_Viewport::TargetDistance ( bool  bUseFrustumCenterFallback) const

Definition at line 4193 of file opennurbs_viewport.cpp.

Definition at line 4187 of file opennurbs_viewport.cpp.

ON_BOOL32 ON_Viewport::Transform ( const ON_Xform xform) [virtual]

Reimplemented from ON_Geometry.

Definition at line 768 of file opennurbs_viewport.cpp.

Definition at line 1001 of file opennurbs_viewport.cpp.

Definition at line 1008 of file opennurbs_viewport.cpp.

ON_UUID ON_Viewport::ViewportId ( void  ) const

Definition at line 4240 of file opennurbs_viewport.cpp.

ON_BOOL32 ON_Viewport::Write ( ON_BinaryArchive file) const [virtual]

Reimplemented from ON_Object.

Definition at line 475 of file opennurbs_viewport.cpp.

bool ON_Viewport::ZoomToScreenRect ( int  screen_x0,
int  screen_y0,
int  screen_x1,
int  screen_y1 
)

Definition at line 2811 of file opennurbs_viewport.cpp.


Member Data Documentation

Definition at line 37 of file opennurbs_viewport.h.

const double ON_Viewport::DefaultFarDist = 1000.0 [static]

Definition at line 1458 of file opennurbs_viewport.h.

const double ON_Viewport::DefaultMinNearDist = 0.0001 [static]

Definition at line 1459 of file opennurbs_viewport.h.

const double ON_Viewport::DefaultMinNearOverFar = 0.0001 [static]

Definition at line 1460 of file opennurbs_viewport.h.

const double ON_Viewport::DefaultNearDist = 0.005 [static]

Definition at line 1457 of file opennurbs_viewport.h.

Definition at line 1453 of file opennurbs_viewport.h.

Definition at line 1454 of file opennurbs_viewport.h.

bool ON_Viewport::m_bLockCamDir [protected]

Definition at line 1379 of file opennurbs_viewport.h.

bool ON_Viewport::m_bLockCamLoc [protected]

Definition at line 1380 of file opennurbs_viewport.h.

bool ON_Viewport::m_bLockCamUp [protected]

Definition at line 1378 of file opennurbs_viewport.h.

bool ON_Viewport::m_bValidCamera [protected]

Definition at line 1356 of file opennurbs_viewport.h.

bool ON_Viewport::m_bValidFrustum [protected]

Definition at line 1357 of file opennurbs_viewport.h.

bool ON_Viewport::m_bValidPort [protected]

Definition at line 1358 of file opennurbs_viewport.h.

Definition at line 1384 of file opennurbs_viewport.h.

Definition at line 1383 of file opennurbs_viewport.h.

Definition at line 1385 of file opennurbs_viewport.h.

Definition at line 1388 of file opennurbs_viewport.h.

Definition at line 1389 of file opennurbs_viewport.h.

Definition at line 1390 of file opennurbs_viewport.h.

Definition at line 1448 of file opennurbs_viewport.h.

Definition at line 1449 of file opennurbs_viewport.h.

double ON_Viewport::m_frus_bottom [protected]

Definition at line 1398 of file opennurbs_viewport.h.

double ON_Viewport::m_frus_far [protected]

Definition at line 1399 of file opennurbs_viewport.h.

double ON_Viewport::m_frus_left [protected]

Definition at line 1397 of file opennurbs_viewport.h.

double ON_Viewport::m_frus_near [protected]

Definition at line 1399 of file opennurbs_viewport.h.

double ON_Viewport::m_frus_right [protected]

Definition at line 1397 of file opennurbs_viewport.h.

double ON_Viewport::m_frus_top [protected]

Definition at line 1398 of file opennurbs_viewport.h.

unsigned char ON_Viewport::m_frustum_symmetry_flags [protected]

Definition at line 1381 of file opennurbs_viewport.h.

int ON_Viewport::m_port_bottom [protected]

Definition at line 1409 of file opennurbs_viewport.h.

int ON_Viewport::m_port_far [protected]

Definition at line 1415 of file opennurbs_viewport.h.

int ON_Viewport::m_port_left [protected]

Definition at line 1408 of file opennurbs_viewport.h.

int ON_Viewport::m_port_near [protected]

Definition at line 1415 of file opennurbs_viewport.h.

int ON_Viewport::m_port_right [protected]

Definition at line 1408 of file opennurbs_viewport.h.

int ON_Viewport::m_port_top [protected]

Definition at line 1409 of file opennurbs_viewport.h.

ON::view_projection ON_Viewport::m_projection [protected]

Definition at line 1364 of file opennurbs_viewport.h.

unsigned char ON_Viewport::m_reserved1 [protected]

Definition at line 1359 of file opennurbs_viewport.h.

Definition at line 1425 of file opennurbs_viewport.h.

Definition at line 1431 of file opennurbs_viewport.h.


The documentation for this class was generated from the following files:


pcl
Author(s): Open Perception
autogenerated on Wed Aug 26 2015 15:38:52