Main Page
Namespaces
Namespace List
Namespace Members
All
Functions
Typedefs
Enumerations
Enumerator
Classes
Class List
Class Hierarchy
Class Members
All
_
a
c
d
e
f
g
h
i
l
m
n
o
p
s
t
u
v
~
Functions
a
c
d
e
g
h
i
l
o
p
s
u
~
Variables
_
a
c
d
e
f
h
i
l
m
n
p
s
t
v
Typedefs
Files
File List
File Members
All
Functions
Macros
include
floam
lidar_imager_node.hpp
Go to the documentation of this file.
1
3
4
// Original Author of FLOAM: Wang Han
5
// Email wh200720041@gmail.com
6
// Homepage https://wanghan.pro
7
#ifndef FLOAM__LIDAR_IMAGER_NODE_HPP_
8
#define FLOAM__LIDAR_IMAGER_NODE_HPP_
9
10
#include <
ros/ros.h
>
11
#include <
nodelet/nodelet.h
>
12
#include <sensor_msgs/PointCloud2.h>
13
14
#include <
pcl_conversions/pcl_conversions.h
>
15
#include <pcl/point_cloud.h>
16
#include <pcl/point_types.h>
17
18
#include "
floam/lidar.hpp
"
19
#include "
floam/lidar_utils.hpp
"
20
21
22
namespace
floam
23
{
24
namespace
lidar
25
{
26
27
28
class
ImagingLidarNode
:
public
nodelet::Nodelet
29
{
30
public
:
31
ImagingLidarNode
();
32
~ImagingLidarNode
();
33
34
void
onInit
();
35
36
void
handlePoints
(
const
sensor_msgs::PointCloud2ConstPtr &lidarCloudMsg);
37
38
Lidar<floam::lidar::Imager>
m_lidar
;
39
40
private
:
41
ros::NodeHandle
m_nodeHandle
;
42
43
ros::Subscriber
m_subPoints
;
44
45
ros::Publisher
m_pubEdgePoints
;
46
ros::Publisher
m_pubSurfacePoints
;
47
ros::Publisher
m_pubPointsFiltered
;
48
49
std::queue<sensor_msgs::PointCloud2ConstPtr>
m_points
;
50
51
};
52
53
}
// namespace lidar
54
}
// namespace floam
55
56
#endif // FLOAM__LIDAR_IMAGER_NODE_HPP_
floam::lidar::ImagingLidarNode::ImagingLidarNode
ImagingLidarNode()
Definition:
lidar_imager_node.cpp:39
ros::Publisher
ros.h
floam::lidar::ImagingLidarNode::m_points
std::queue< sensor_msgs::PointCloud2ConstPtr > m_points
Definition:
lidar_imager_node.hpp:49
lidar.hpp
floam::lidar::ImagingLidarNode::handlePoints
void handlePoints(const sensor_msgs::PointCloud2ConstPtr &lidarCloudMsg)
Definition:
lidar_imager_node.cpp:84
floam::lidar::ImagingLidarNode::m_subPoints
ros::Subscriber m_subPoints
Definition:
lidar_imager_node.hpp:43
floam::lidar::ImagingLidarNode::m_nodeHandle
ros::NodeHandle m_nodeHandle
Definition:
lidar_imager_node.hpp:41
floam::lidar::Lidar< floam::lidar::Imager >
floam::lidar::ImagingLidarNode::m_pubSurfacePoints
ros::Publisher m_pubSurfacePoints
Definition:
lidar_imager_node.hpp:46
floam::lidar::ImagingLidarNode::onInit
void onInit()
Definition:
lidar_imager_node.cpp:49
lidar_utils.hpp
nodelet::Nodelet
floam::lidar::ImagingLidarNode::m_pubPointsFiltered
ros::Publisher m_pubPointsFiltered
Definition:
lidar_imager_node.hpp:47
floam::lidar::ImagingLidarNode
Definition:
lidar_imager_node.hpp:28
nodelet.h
floam::lidar::ImagingLidarNode::~ImagingLidarNode
~ImagingLidarNode()
Definition:
lidar_imager_node.cpp:44
floam::lidar::ImagingLidarNode::m_lidar
Lidar< floam::lidar::Imager > m_lidar
Definition:
lidar_imager_node.hpp:38
floam
Major rewrite Author: Evan Flynn.
Definition:
lidar.hpp:15
floam::lidar::ImagingLidarNode::m_pubEdgePoints
ros::Publisher m_pubEdgePoints
Definition:
lidar_imager_node.hpp:45
ros::NodeHandle
ros::Subscriber
pcl_conversions.h
floam
Author(s): Han Wang
autogenerated on Wed Mar 2 2022 00:23:09