image_utilities.h
Go to the documentation of this file.
1 #pragma once
2 
3 #include <utility>
4 #include <string>
5 #include <vector>
6 
7 #include <sensor_msgs/Image.h>
8 
9 #include "nxLib.h"
10 
14 sensor_msgs::ImagePtr imageFromNxLibNode(NxLibItem const& node, std::string const& frame);
15 
25 std::vector<std::pair<sensor_msgs::ImagePtr, sensor_msgs::ImagePtr>> imagesFromNxLibNode(NxLibItem const& node,
26  std::string const& frame);
27 
31 ros::Time timestampFromNxLibNode(NxLibItem const& node);
32 
38 sensor_msgs::ImagePtr depthImageFromNxLibNode(NxLibItem const& node, std::string const& frame);
sensor_msgs::ImagePtr imageFromNxLibNode(NxLibItem const &node, std::string const &frame)
std::vector< std::pair< sensor_msgs::ImagePtr, sensor_msgs::ImagePtr > > imagesFromNxLibNode(NxLibItem const &node, std::string const &frame)
ros::Time timestampFromNxLibNode(NxLibItem const &node)
sensor_msgs::ImagePtr depthImageFromNxLibNode(NxLibItem const &node, std::string const &frame)


ensenso_camera
Author(s): Ensenso
autogenerated on Thu May 16 2019 02:44:23