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 #include <sensor_msgs/CameraInfo.h>
9 
10 #include "nxLib.h"
11 
15 sensor_msgs::ImagePtr imageFromNxLibNode(NxLibItem const& node, std::string const& frame);
16 
26 std::vector<std::pair<sensor_msgs::ImagePtr, sensor_msgs::ImagePtr>> imagePairsFromNxLibNode(NxLibItem const& node,
27  std::string const& frame);
28 
29 std::vector<sensor_msgs::ImagePtr> imagesFromNxLibNode(NxLibItem const& node, std::string const& frame);
30 
34 ros::Time timestampFromNxLibNode(NxLibItem const& node);
35 
41 sensor_msgs::ImagePtr depthImageFromNxLibNode(NxLibItem const& node, std::string const& frame);
42 
46 void fillDistortionParamsFromNxLib(NxLibItem const& distortionItem, sensor_msgs::CameraInfoPtr const& info);
sensor_msgs::ImagePtr imageFromNxLibNode(NxLibItem const &node, std::string const &frame)
void fillDistortionParamsFromNxLib(NxLibItem const &distortionItem, sensor_msgs::CameraInfoPtr const &info)
ros::Time timestampFromNxLibNode(NxLibItem const &node)
sensor_msgs::ImagePtr depthImageFromNxLibNode(NxLibItem const &node, std::string const &frame)
std::vector< sensor_msgs::ImagePtr > imagesFromNxLibNode(NxLibItem const &node, std::string const &frame)
std::vector< std::pair< sensor_msgs::ImagePtr, sensor_msgs::ImagePtr > > imagePairsFromNxLibNode(NxLibItem const &node, std::string const &frame)


ensenso_camera
Author(s): Ensenso
autogenerated on Thu May 6 2021 02:50:06