
Public Member Functions | |
| UndistortDepth () | |
| virtual | ~UndistortDepth () |
Private Member Functions | |
| void | callback (const sensor_msgs::ImageConstPtr &depth) |
| virtual void | onInit () |
Private Attributes | |
| clams::DiscreteDepthDistortionModel | model_ |
| image_transport::Publisher | pub_ |
| image_transport::Subscriber | sub_ |
Definition at line 48 of file undistort_depth.cpp.
| rtabmap_ros::UndistortDepth::UndistortDepth | ( | ) | [inline] |
Definition at line 51 of file undistort_depth.cpp.
| virtual rtabmap_ros::UndistortDepth::~UndistortDepth | ( | ) | [inline, virtual] |
Definition at line 54 of file undistort_depth.cpp.
| void rtabmap_ros::UndistortDepth::callback | ( | const sensor_msgs::ImageConstPtr & | depth | ) | [inline, private] |
Definition at line 85 of file undistort_depth.cpp.
| virtual void rtabmap_ros::UndistortDepth::onInit | ( | ) | [inline, private, virtual] |
Implements nodelet::Nodelet.
Definition at line 59 of file undistort_depth.cpp.
Definition at line 114 of file undistort_depth.cpp.
Definition at line 115 of file undistort_depth.cpp.
Definition at line 116 of file undistort_depth.cpp.