#include <client.h>
Public Member Functions | |
Client () | |
void | computeFromTopicStream () |
void | computeUsingQuickService () |
void | initAndSimulate () |
Private Attributes | |
ros::Publisher | camera_object_publisher_ |
ros::ServiceClient | compute_effector_camera_quick_service_ |
ros::ServiceClient | compute_effector_camera_service_ |
visp_hand2eye_calibration::compute_effector_camera | emc_comm |
visp_hand2eye_calibration::compute_effector_camera_quick | emc_quick_comm |
ros::NodeHandle | n_ |
visp_hand2eye_calibration::reset | reset_comm |
ros::ServiceClient | reset_service_ |
ros::Publisher | world_effector_publisher_ |
Definition at line 61 of file client.cpp.
Definition at line 167 of file client.cpp.
Definition at line 152 of file client.cpp.
Definition at line 78 of file client.cpp.
visp_hand2eye_calibration::compute_effector_camera visp_hand2eye_calibration::Client::emc_comm [private] |
visp_hand2eye_calibration::compute_effector_camera_quick visp_hand2eye_calibration::Client::emc_quick_comm [private] |
visp_hand2eye_calibration::reset visp_hand2eye_calibration::Client::reset_comm [private] |