Public Member Functions | |
void | motorParamGet (const dlut_pc_odom::motor &motor_msg) |
void | motorRotateStart (const std_msgs::Bool &is_run) |
void | odomGet (const nav_msgs::Odometry &odom) |
PointCloudOdom () | |
geometry_msgs::Vector3 | rpyGet (const tf::Quaternion &qua) |
geometry_msgs::Vector3 | rpyGet (const geometry_msgs::Quaternion &qua) |
void | scanCallBack (const sensor_msgs::LaserScan &ls) |
~PointCloudOdom () | |
Public Attributes | |
ros::NodeHandle | nh_ |
Private Attributes | |
double | alpha_ |
double | angle_rotated_ |
double | beta_ |
double | gamma_ |
double | h2p_a_ |
double | h2p_b_ |
double | h2p_c_ |
double | h2p_d_ |
double | h2p_e_ |
double | h2p_f_ |
double | h2p_g_ |
double | h2p_h_ |
double | h2p_i_ |
bool | is_first_circle_ |
bool | is_first_flag_ |
std_msgs::Bool | is_rotate_ |
std::ofstream | laser_range_data_ |
ros::Subscriber | laser_scan_sub_ |
unsigned int | laser_seq_ |
double | length_ |
dlut_pc_odom::motor | motor_param_ |
ros::Subscriber | motor_param_sub_ |
unsigned int | num_per_cloud_ |
unsigned int | num_points_ |
sensor_msgs::PointCloud | odom_cloud_ |
std::ofstream | odom_data_ |
ros::Subscriber | odom_sub_ |
tf::TransformListener | odom_tf_listener_ |
double | p2r_a_ |
double | p2r_b_ |
double | p2r_c_ |
double | p2r_d_ |
double | p2r_e_ |
double | p2r_f_ |
double | p2r_g_ |
double | p2r_h_ |
double | p2r_i_ |
std::ofstream | pc_data_ |
PointType | point2_ |
ros::Publisher | point_cloud2_pub_ |
unsigned int | points_per_scan_ |
ros::Subscriber | rotate_start_sub_ |
double | t_h2p_a_ |
double | t_h2p_b_ |
double | t_h2p_c_ |
ros::Time | time_begin_rotate_ |
ros::Time | time_end_rotate_ |
geometry_msgs::Vector3 | ypr_ |
Definition at line 59 of file odom_pc.cpp.
Definition at line 110 of file odom_pc.cpp.
Definition at line 168 of file odom_pc.cpp.
void PointCloudOdom::motorParamGet | ( | const dlut_pc_odom::motor & | motor_msg | ) |
Definition at line 351 of file odom_pc.cpp.
void PointCloudOdom::motorRotateStart | ( | const std_msgs::Bool & | is_run | ) |
Definition at line 338 of file odom_pc.cpp.
void PointCloudOdom::odomGet | ( | const nav_msgs::Odometry & | odom | ) |
Definition at line 325 of file odom_pc.cpp.
geometry_msgs::Vector3 PointCloudOdom::rpyGet | ( | const tf::Quaternion & | qua | ) |
Definition at line 359 of file odom_pc.cpp.
geometry_msgs::Vector3 PointCloudOdom::rpyGet | ( | const geometry_msgs::Quaternion & | qua | ) |
Definition at line 374 of file odom_pc.cpp.
void PointCloudOdom::scanCallBack | ( | const sensor_msgs::LaserScan & | ls | ) |
Definition at line 177 of file odom_pc.cpp.
double PointCloudOdom::alpha_ [private] |
Definition at line 100 of file odom_pc.cpp.
double PointCloudOdom::angle_rotated_ [private] |
Definition at line 86 of file odom_pc.cpp.
double PointCloudOdom::beta_ [private] |
Definition at line 100 of file odom_pc.cpp.
double PointCloudOdom::gamma_ [private] |
Definition at line 100 of file odom_pc.cpp.
double PointCloudOdom::h2p_a_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_b_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_c_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_d_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_e_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_f_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_g_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_h_ [private] |
Definition at line 101 of file odom_pc.cpp.
double PointCloudOdom::h2p_i_ [private] |
Definition at line 101 of file odom_pc.cpp.
bool PointCloudOdom::is_first_circle_ [private] |
Definition at line 105 of file odom_pc.cpp.
bool PointCloudOdom::is_first_flag_ [private] |
Definition at line 87 of file odom_pc.cpp.
std_msgs::Bool PointCloudOdom::is_rotate_ [private] |
Definition at line 80 of file odom_pc.cpp.
std::ofstream PointCloudOdom::laser_range_data_ [private] |
Definition at line 94 of file odom_pc.cpp.
ros::Subscriber PointCloudOdom::laser_scan_sub_ [private] |
Definition at line 78 of file odom_pc.cpp.
unsigned int PointCloudOdom::laser_seq_ [private] |
Definition at line 90 of file odom_pc.cpp.
double PointCloudOdom::length_ [private] |
Definition at line 100 of file odom_pc.cpp.
dlut_pc_odom::motor PointCloudOdom::motor_param_ [private] |
Definition at line 81 of file odom_pc.cpp.
ros::Subscriber PointCloudOdom::motor_param_sub_ [private] |
Definition at line 78 of file odom_pc.cpp.
ros::NodeHandle PointCloudOdom::nh_ |
Definition at line 73 of file odom_pc.cpp.
unsigned int PointCloudOdom::num_per_cloud_ [private] |
Definition at line 91 of file odom_pc.cpp.
unsigned int PointCloudOdom::num_points_ [private] |
Definition at line 88 of file odom_pc.cpp.
sensor_msgs::PointCloud PointCloudOdom::odom_cloud_ [private] |
Definition at line 82 of file odom_pc.cpp.
std::ofstream PointCloudOdom::odom_data_ [private] |
Definition at line 96 of file odom_pc.cpp.
ros::Subscriber PointCloudOdom::odom_sub_ [private] |
Definition at line 78 of file odom_pc.cpp.
tf::TransformListener PointCloudOdom::odom_tf_listener_ [private] |
Definition at line 95 of file odom_pc.cpp.
double PointCloudOdom::p2r_a_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_b_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_c_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_d_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_e_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_f_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_g_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_h_ [private] |
Definition at line 102 of file odom_pc.cpp.
double PointCloudOdom::p2r_i_ [private] |
Definition at line 102 of file odom_pc.cpp.
std::ofstream PointCloudOdom::pc_data_ [private] |
Definition at line 94 of file odom_pc.cpp.
PointType PointCloudOdom::point2_ [private] |
Definition at line 107 of file odom_pc.cpp.
ros::Publisher PointCloudOdom::point_cloud2_pub_ [private] |
Definition at line 76 of file odom_pc.cpp.
unsigned int PointCloudOdom::points_per_scan_ [private] |
Definition at line 92 of file odom_pc.cpp.
ros::Subscriber PointCloudOdom::rotate_start_sub_ [private] |
Definition at line 78 of file odom_pc.cpp.
double PointCloudOdom::t_h2p_a_ [private] |
Definition at line 103 of file odom_pc.cpp.
double PointCloudOdom::t_h2p_b_ [private] |
Definition at line 103 of file odom_pc.cpp.
double PointCloudOdom::t_h2p_c_ [private] |
Definition at line 103 of file odom_pc.cpp.
ros::Time PointCloudOdom::time_begin_rotate_ [private] |
Definition at line 84 of file odom_pc.cpp.
ros::Time PointCloudOdom::time_end_rotate_ [private] |
Definition at line 84 of file odom_pc.cpp.
geometry_msgs::Vector3 PointCloudOdom::ypr_ [private] |
Definition at line 98 of file odom_pc.cpp.