Public Member Functions | |
void | MyCallback (const camera_pose_calibration::CameraCalibration::ConstPtr &msg) |
Public Attributes | |
std::string | avg_res_file |
std::vector< KDL::Frame > | best_prev_frames |
std::vector< KDL::Twist > | best_prev_twists |
std::vector< KDL::Twist > | best_prev_twists_rel1 |
int | callback_count |
std::string | f_log_file |
bool | is_1st_time |
std::vector< KDL::Twist >::iterator | it |
tf::TransformListener | listener |
ros::ServiceClient | monitor_client |
std::string | mounting_frame |
ros::NodeHandle | n |
std::string | new_cam_id |
std::string | new_cam_ns |
KDL::Frame | prev_frame |
std::string | prev_mounting_frame |
std::string | prev_new_cam_id |
double | prev_p [3] |
double | prev_rpy [3] |
tf::StampedTransform | prev_s_transform |
ros::Time | prev_stamp0 |
KDL::Twist | prev_twist |
std::string | prev_urdf_cam_id |
int | prev_weight |
std::vector< int > | prev_weights |
int | printOnce_a |
int | printOnce_f |
int | printOnce_t |
ros::Publisher | pub |
bool | reset_flag |
std::string | t_log_file |
std::string | urdf_cam_id |
std::string | urdf_cam_ns |
Definition at line 35 of file transform_finder.cpp.
void T_Finder::MyCallback | ( | const camera_pose_calibration::CameraCalibration::ConstPtr & | msg | ) | [inline] |
Definition at line 87 of file transform_finder.cpp.
std::string T_Finder::avg_res_file |
Definition at line 62 of file transform_finder.cpp.
std::vector<KDL::Frame> T_Finder::best_prev_frames |
Definition at line 69 of file transform_finder.cpp.
std::vector<KDL::Twist> T_Finder::best_prev_twists |
Definition at line 68 of file transform_finder.cpp.
std::vector<KDL::Twist> T_Finder::best_prev_twists_rel1 |
Definition at line 72 of file transform_finder.cpp.
Definition at line 79 of file transform_finder.cpp.
std::string T_Finder::f_log_file |
Definition at line 60 of file transform_finder.cpp.
Definition at line 66 of file transform_finder.cpp.
std::vector<KDL::Twist>::iterator T_Finder::it |
Definition at line 71 of file transform_finder.cpp.
Definition at line 41 of file transform_finder.cpp.
Definition at line 45 of file transform_finder.cpp.
std::string T_Finder::mounting_frame |
Definition at line 54 of file transform_finder.cpp.
Definition at line 40 of file transform_finder.cpp.
std::string T_Finder::new_cam_id |
Definition at line 49 of file transform_finder.cpp.
std::string T_Finder::new_cam_ns |
Definition at line 47 of file transform_finder.cpp.
Definition at line 75 of file transform_finder.cpp.
std::string T_Finder::prev_mounting_frame |
Definition at line 84 of file transform_finder.cpp.
std::string T_Finder::prev_new_cam_id |
Definition at line 82 of file transform_finder.cpp.
double T_Finder::prev_p[3] |
Definition at line 77 of file transform_finder.cpp.
double T_Finder::prev_rpy[3] |
Definition at line 78 of file transform_finder.cpp.
Definition at line 55 of file transform_finder.cpp.
Definition at line 65 of file transform_finder.cpp.
Definition at line 74 of file transform_finder.cpp.
std::string T_Finder::prev_urdf_cam_id |
Definition at line 83 of file transform_finder.cpp.
Definition at line 76 of file transform_finder.cpp.
std::vector<int> T_Finder::prev_weights |
Definition at line 70 of file transform_finder.cpp.
Definition at line 59 of file transform_finder.cpp.
Definition at line 57 of file transform_finder.cpp.
Definition at line 58 of file transform_finder.cpp.
Definition at line 42 of file transform_finder.cpp.
bool T_Finder::reset_flag |
Definition at line 67 of file transform_finder.cpp.
std::string T_Finder::t_log_file |
Definition at line 61 of file transform_finder.cpp.
std::string T_Finder::urdf_cam_id |
Definition at line 50 of file transform_finder.cpp.
std::string T_Finder::urdf_cam_ns |
Definition at line 48 of file transform_finder.cpp.