Public Types | |
typedef sensor_msgs::PointCloud | PointCloud |
Public Member Functions | |
FixGazeboPointcloud () | |
void | input_callback (const PointCloud::Ptr &cloud) |
Public Attributes | |
ros::NodeHandle | nh_ |
ros::Publisher | pub_ |
ros::Subscriber | sub_ |
Definition at line 58 of file fix_gazebo_pointcloud.cpp.
typedef sensor_msgs::PointCloud FixGazeboPointcloud::PointCloud |
Definition at line 58 of file fix_gazebo_pointcloud.cpp.
FixGazeboPointcloud::FixGazeboPointcloud | ( | ) | [inline] |
Definition at line 60 of file fix_gazebo_pointcloud.cpp.
void FixGazeboPointcloud::input_callback | ( | const PointCloud::Ptr & | cloud | ) | [inline] |
Definition at line 66 of file fix_gazebo_pointcloud.cpp.
ros::NodeHandle FixGazeboPointcloud::nh_ |
Definition at line 78 of file fix_gazebo_pointcloud.cpp.
ros::Publisher FixGazeboPointcloud::pub_ |
Definition at line 80 of file fix_gazebo_pointcloud.cpp.
ros::Subscriber FixGazeboPointcloud::sub_ |
Definition at line 79 of file fix_gazebo_pointcloud.cpp.