#include <orbit_camera.h>
Public Member Functions | |
OrbitCamera () | |
virtual | ~OrbitCamera () |
Private Member Functions | |
void | mouseCallback (const rve_msgs::MouseEventConstPtr &evt) |
void | move (float x, float y, float z) |
virtual void | onCameraSet () |
virtual void | onInit () |
virtual void | onPropertyChanged (const rve_properties::PropertyNodePtr &node, const std::string &path, rve_properties::PropertyChangeType type) |
void | pitch (float angle) |
void | setPoseCallback (const geometry_msgs::PoseConstPtr &new_pose) |
virtual void | updateRelativePose () |
void | yaw (float angle) |
void | zoom (float amount) |
Private Attributes | |
rve_render_client::PerspectiveProjectionFactoryPtr | camera_projection_ |
float | distance_ |
The camera's distance from the focal point. | |
Eigen::Vector3f | focal_point_ |
The camera's focal point. | |
int32_t | last_x_ |
int32_t | last_y_ |
Eigen::Quaternionf | pitch_quat_ |
Eigen::Quaternionf | yaw_quat_ |
Definition at line 53 of file orbit_camera.h.
Definition at line 51 of file orbit_camera.cpp.
virtual rve_common_transformers::OrbitCamera::~OrbitCamera | ( | ) | [inline, virtual] |
Definition at line 57 of file orbit_camera.h.
void rve_common_transformers::OrbitCamera::mouseCallback | ( | const rve_msgs::MouseEventConstPtr & | evt | ) | [private] |
Definition at line 86 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::move | ( | float | x, |
float | y, | ||
float | z | ||
) | [private] |
Definition at line 182 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::onCameraSet | ( | ) | [private, virtual] |
Set the position and orientation of the new camera.
Reimplemented from rve_common_transformers::FrameRelativeCameraController.
Definition at line 131 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::onInit | ( | ) | [private, virtual] |
This class doesn't have any initialization to do.
Reimplemented from rve_common_transformers::FrameRelativeCameraController.
Definition at line 63 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::onPropertyChanged | ( | const rve_properties::PropertyNodePtr & | node, |
const std::string & | path, | ||
rve_properties::PropertyChangeType | type | ||
) | [private, virtual] |
Definition at line 137 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::pitch | ( | float | angle | ) | [private] |
Definition at line 167 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::setPoseCallback | ( | const geometry_msgs::PoseConstPtr & | new_pose | ) | [private] |
Definition at line 74 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::updateRelativePose | ( | ) | [private, virtual] |
Compute relative pose based on current orbit values.
Reimplemented from rve_common_transformers::FrameRelativeCameraController.
Definition at line 150 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::yaw | ( | float | angle | ) | [private] |
Definition at line 162 of file orbit_camera.cpp.
void rve_common_transformers::OrbitCamera::zoom | ( | float | amount | ) | [private] |
Definition at line 172 of file orbit_camera.cpp.
rve_render_client::PerspectiveProjectionFactoryPtr rve_common_transformers::OrbitCamera::camera_projection_ [private] |
Definition at line 84 of file orbit_camera.h.
float rve_common_transformers::OrbitCamera::distance_ [private] |
The camera's distance from the focal point.
Definition at line 79 of file orbit_camera.h.
Eigen::Vector3f rve_common_transformers::OrbitCamera::focal_point_ [private] |
The camera's focal point.
Definition at line 76 of file orbit_camera.h.
int32_t rve_common_transformers::OrbitCamera::last_x_ [private] |
Definition at line 81 of file orbit_camera.h.
int32_t rve_common_transformers::OrbitCamera::last_y_ [private] |
Definition at line 82 of file orbit_camera.h.
Eigen::Quaternionf rve_common_transformers::OrbitCamera::pitch_quat_ [private] |
Definition at line 77 of file orbit_camera.h.
Eigen::Quaternionf rve_common_transformers::OrbitCamera::yaw_quat_ [private] |
Definition at line 78 of file orbit_camera.h.