7 #include <sensor_msgs/Image.h> 8 #include <sensor_msgs/CameraInfo.h> 15 sensor_msgs::ImagePtr
imageFromNxLibNode(NxLibItem
const& node, std::string
const& frame);
26 std::vector<std::pair<sensor_msgs::ImagePtr, sensor_msgs::ImagePtr>>
imagePairsFromNxLibNode(NxLibItem
const& node,
27 std::string
const& frame);
29 std::vector<sensor_msgs::ImagePtr>
imagesFromNxLibNode(NxLibItem
const& node, std::string
const& frame);
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)