#include <CRLib.h>
Public Member Functions | |
bool | calcColor (sensor_msgs::PointCloud &pts, int srwidth, int srheight, cr_capture::PixelIndices *pidx=NULL) |
CRLib () | |
void | setLeftImg (const sensor_msgs::ImageConstPtr &img, const sensor_msgs::CameraInfoConstPtr &info) |
void | setRightImg (const sensor_msgs::ImageConstPtr &img, const sensor_msgs::CameraInfoConstPtr &info) |
Public Attributes | |
tf::StampedTransform | cam_trans |
bool | clear_uncolored_points |
Private Attributes | |
sensor_msgs::CameraInfo | info_left_ |
sensor_msgs::CameraInfo | info_right_ |
IplImage * | ipl_left_ |
IplImage * | ipl_right_ |
CRLib::CRLib | ( | ) |
bool CRLib::calcColor | ( | sensor_msgs::PointCloud & | pts, |
int | srwidth, | ||
int | srheight, | ||
cr_capture::PixelIndices * | pidx = NULL |
||
) |
void CRLib::setLeftImg | ( | const sensor_msgs::ImageConstPtr & | img, |
const sensor_msgs::CameraInfoConstPtr & | info | ||
) |
void CRLib::setRightImg | ( | const sensor_msgs::ImageConstPtr & | img, |
const sensor_msgs::CameraInfoConstPtr & | info | ||
) |
sensor_msgs::CameraInfo CRLib::info_left_ [private] |
sensor_msgs::CameraInfo CRLib::info_right_ [private] |
IplImage* CRLib::ipl_left_ [private] |
IplImage * CRLib::ipl_right_ [private] |