#include <camera_configurations.h>
Public Member Functions | |
CameraConfigurations () | |
bool | get_camera_placement (const std::string &position_name, geometry_msgs::PointStamped &eye, geometry_msgs::PointStamped &focus, geometry_msgs::Vector3Stamped &up) |
std::vector< double > | get_camera_pose (const std::string &position_name) |
Definition at line 49 of file camera_configurations.h.
Definition at line 54 of file camera_configurations.h.
bool object_manipulator::CameraConfigurations::get_camera_placement | ( | const std::string & | position_name, |
geometry_msgs::PointStamped & | eye, | ||
geometry_msgs::PointStamped & | focus, | ||
geometry_msgs::Vector3Stamped & | up | ||
) | [inline] |
Definition at line 65 of file camera_configurations.h.
std::vector< double > object_manipulator::CameraConfigurations::get_camera_pose | ( | const std::string & | position_name | ) | [inline] |
Definition at line 56 of file camera_configurations.h.