#include "ensenso_camera/point_cloud_utilities.h"#include "ensenso_camera/ros2/cv_bridge/cv_bridge.h"#include "ensenso_camera/ros2/core.h"#include "ensenso_camera/ros2/image_transport.h"#include "ensenso_camera/ros2/logging.h"#include "ensenso_camera/ros2/namespace.h"#include "ensenso_camera/ros2/node.h"#include "ensenso_camera/ros2/node_handle.h"#include "ensenso_camera/ros2/node_wrapper.h"#include "ensenso_camera/ros2/pcl.h"#include "ensenso_camera/ros2/sensor_msgs/image.h"#include <mutex>#include <string>
Go to the source code of this file.
| Macros | |
| #define | NODE_CLASS_NAME TexturePointCloudNode | 
| #define | NODE_NAME "texture_point_cloud" | 
| Functions | |
| int | main (int argc, char **argv) | 
| SINGLE_NODE_CLASS (NODE_CLASS_NAME) | |
| #define NODE_CLASS_NAME TexturePointCloudNode | 
Definition at line 21 of file texture_point_cloud.cpp.
| #define NODE_NAME "texture_point_cloud" | 
Definition at line 22 of file texture_point_cloud.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 144 of file texture_point_cloud.cpp.
| SINGLE_NODE_CLASS | ( | NODE_CLASS_NAME | ) | 
Definition at line 24 of file texture_point_cloud.cpp.