From 495a7e0d1a1aa658c70d55f461dff4a9d66ceddc Mon Sep 17 00:00:00 2001 From: Ryan Friedman Date: Sat, 27 Jan 2024 16:06:39 -0700 Subject: [PATCH] Camera: Remove accidental extra spaces Signed-off-by: Ryan Friedman --- src/CameraZoomPlugin.cc | 7 +++---- 1 file changed, 3 insertions(+), 4 deletions(-) diff --git a/src/CameraZoomPlugin.cc b/src/CameraZoomPlugin.cc index a2c79a4..944a8d1 100644 --- a/src/CameraZoomPlugin.cc +++ b/src/CameraZoomPlugin.cc @@ -235,7 +235,6 @@ void CameraZoomPlugin::Impl::InitialiseCamera() return; } } - // Todo compute camera sensor width here once rather than every PreUpdate() } ////////////////////////////////////////////////// @@ -424,7 +423,7 @@ void CameraZoomPlugin::PreUpdate( gzwarn << "Requested zoom command of " << requestedZoomCmd << " has been clamped to " << clampedZoomCmd << ".\n"; } - this->impl->goalHfov = this->impl->refHfov / clampedZoomCmd; + this->impl->goalHfov = this->impl->refHfov / clampedZoomCmd; this->impl->zoomChanged = false; } @@ -462,11 +461,11 @@ void CameraZoomPlugin::PreUpdate( double newFocalLength; if (goalFocalLength > curFocalLength) { - newFocalLength = curFocalLength + deltaFL; + newFocalLength = curFocalLength + deltaFL; } else { - newFocalLength = curFocalLength - deltaFL; + newFocalLength = curFocalLength - deltaFL; } const auto newHfov = CameraZoomPlugin::Impl::FocalLengthToFov(