Public Member Functions | |
void | laserGetDataCallBack (const sensor_msgs::LaserScan::ConstPtr &laser) |
void | laserGetDataCallBack (const sensor_msgs::LaserScan::ConstPtr &laser) |
void | laserGetMotorMoveTime (double f_time) |
void | laserGetMotorMoveTime (double f_time) |
void | laserGetScanDegree (float f_degree) |
void | laserGetScanDegree (float f_degree) |
bool | laserIsSaveDataAsPCD (char *p_is_save) |
bool | laserIsSaveDataAsPCD (char *c_is_save) |
SickLaser () | |
SickLaser () | |
~SickLaser () | |
~SickLaser () | |
Public Attributes | |
CameraCapture | m_camera_ |
Private Attributes | |
bool | b_is_save_as_pcd_ |
vector< vector< double > > | data_vec_ |
float | first_scan_degree_ |
bool | is_captured_ |
bool | is_save_as_PCD_ |
double | motor_move_time_ |
int | n_image_count_ |
ros::NodeHandle | nh_ |
vector< double > | one_frame_vec_ |
ros::Subscriber | sub_ |
ros::Time | time_start_ |
vector< double > | timestamp_vec_ |
Static Private Attributes | |
static float | f_count_ = 0.0 |
static float | n_count_ = 0.0 |
Definition at line 53 of file get_cloud_and_image.cpp.
Definition at line 84 of file get_cloud_and_image.cpp.
Definition at line 102 of file get_cloud_and_image.cpp.
void SickLaser::laserGetDataCallBack | ( | const sensor_msgs::LaserScan::ConstPtr & | laser | ) |
Definition at line 129 of file get_cloud_and_image.cpp.
void SickLaser::laserGetDataCallBack | ( | const sensor_msgs::LaserScan::ConstPtr & | laser | ) |
void SickLaser::laserGetMotorMoveTime | ( | double | f_time | ) |
Definition at line 118 of file get_cloud_and_image.cpp.
void SickLaser::laserGetMotorMoveTime | ( | double | f_time | ) |
void SickLaser::laserGetScanDegree | ( | float | f_degree | ) |
Definition at line 124 of file get_cloud_and_image.cpp.
void SickLaser::laserGetScanDegree | ( | float | f_degree | ) |
bool SickLaser::laserIsSaveDataAsPCD | ( | char * | p_is_save | ) |
Definition at line 106 of file get_cloud_and_image.cpp.
bool SickLaser::laserIsSaveDataAsPCD | ( | char * | c_is_save | ) |
bool SickLaser::b_is_save_as_pcd_ [private] |
Definition at line 73 of file get_cloud_and_image.cpp.
vector< vector< double > > SickLaser::data_vec_ [private] |
Definition at line 70 of file get_cloud_and_image.cpp.
float SickLaser::f_count_ = 0.0 [static, private] |
Definition at line 76 of file get_point_cloud.cpp.
float SickLaser::first_scan_degree_ [private] |
Definition at line 76 of file get_cloud_and_image.cpp.
bool SickLaser::is_captured_ [private] |
Definition at line 79 of file get_cloud_and_image.cpp.
bool SickLaser::is_save_as_PCD_ [private] |
Definition at line 74 of file get_point_cloud.cpp.
Definition at line 64 of file get_cloud_and_image.cpp.
double SickLaser::motor_move_time_ [private] |
Definition at line 77 of file get_cloud_and_image.cpp.
float SickLaser::n_count_ = 0.0 [static, private] |
Definition at line 75 of file get_cloud_and_image.cpp.
int SickLaser::n_image_count_ [private] |
Definition at line 78 of file get_cloud_and_image.cpp.
ros::NodeHandle SickLaser::nh_ [private] |
Definition at line 66 of file get_cloud_and_image.cpp.
vector< double > SickLaser::one_frame_vec_ [private] |
Definition at line 69 of file get_cloud_and_image.cpp.
ros::Subscriber SickLaser::sub_ [private] |
Definition at line 67 of file get_cloud_and_image.cpp.
ros::Time SickLaser::time_start_ [private] |
Definition at line 74 of file get_cloud_and_image.cpp.
vector< double > SickLaser::timestamp_vec_ [private] |
Definition at line 71 of file get_cloud_and_image.cpp.