Public Member Functions | |
| void | camerainfoCb (const sensor_msgs::CameraInfoConstPtr &info_msg) |
| bool | objectSrv (jsk_smart_gui::point2screenpoint::Request &req, jsk_smart_gui::point2screenpoint::Response &res) |
| TransformPixel () | |
Private Attributes | |
| image_geometry::PinholeCameraModel | cam_model_ |
| std::string | camera_topic |
| ros::Subscriber | camerainfosub_ |
| ros::NodeHandle | nh_ |
| ros::ServiceServer | srv_ |
| tf::TransformListener | tf_listener_ |
Definition at line 7 of file 3dtopixel.cpp.
| TransformPixel::TransformPixel | ( | ) | [inline] |
Definition at line 17 of file 3dtopixel.cpp.
| void TransformPixel::camerainfoCb | ( | const sensor_msgs::CameraInfoConstPtr & | info_msg | ) | [inline] |
Definition at line 38 of file 3dtopixel.cpp.
| bool TransformPixel::objectSrv | ( | jsk_smart_gui::point2screenpoint::Request & | req, |
| jsk_smart_gui::point2screenpoint::Response & | res | ||
| ) | [inline] |
Definition at line 23 of file 3dtopixel.cpp.
Definition at line 13 of file 3dtopixel.cpp.
std::string TransformPixel::camera_topic [private] |
Definition at line 14 of file 3dtopixel.cpp.
Definition at line 10 of file 3dtopixel.cpp.
ros::NodeHandle TransformPixel::nh_ [private] |
Definition at line 9 of file 3dtopixel.cpp.
ros::ServiceServer TransformPixel::srv_ [private] |
Definition at line 11 of file 3dtopixel.cpp.
Definition at line 12 of file 3dtopixel.cpp.