Public Member Functions | |
void | cloud_callback (const sensor_msgs::PointCloud2 cloud_in) |
noise_gen () | |
double | random_number_kinect (double z) |
double | random_number_static (double sigma) |
~noise_gen () | |
Public Attributes | |
ros::NodeHandle | n |
ros::Publisher | pub_ |
ros::Subscriber | sub_ |
Definition at line 81 of file noise_gen.cpp.
noise_gen::noise_gen | ( | ) | [inline] |
Definition at line 109 of file noise_gen.cpp.
noise_gen::~noise_gen | ( | ) | [inline] |
Definition at line 122 of file noise_gen.cpp.
void noise_gen::cloud_callback | ( | const sensor_msgs::PointCloud2 | cloud_in | ) | [inline] |
Definition at line 193 of file noise_gen.cpp.
double noise_gen::random_number_kinect | ( | double | z | ) | [inline] |
Initiate Random Number generator with current time
Definition at line 126 of file noise_gen.cpp.
double noise_gen::random_number_static | ( | double | sigma | ) | [inline] |
Initiate Random Number generator with current time
Definition at line 163 of file noise_gen.cpp.
Definition at line 86 of file noise_gen.cpp.
Definition at line 89 of file noise_gen.cpp.
Definition at line 92 of file noise_gen.cpp.