$search
#include <ros/ros.h>
#include <string>
#include <vector>
#include "rgbd_assembler/RgbdAssembly.h"
#include "rgbd_assembler/utils.h"
#include <visualization_msgs/Marker.h>
#include <image_transport/image_transport.h>
Go to the source code of this file.
Functions | |
void | fillRgbImage (sensor_msgs::Image &rgb_img, const sensor_msgs::PointCloud2 &point_cloud) |
visualization_msgs::Marker | getCloudMarker (const sensor_msgs::PointCloud2 &cloud) |
int | main (int argc, char **argv) |
void | publishClusterMarkers (const sensor_msgs::PointCloud2 &cloud, const ros::Publisher &marker_pub) |
void fillRgbImage | ( | sensor_msgs::Image & | rgb_img, | |
const sensor_msgs::PointCloud2 & | point_cloud | |||
) |
Definition at line 110 of file ping_rgbd_assembler_node.cpp.
visualization_msgs::Marker getCloudMarker | ( | const sensor_msgs::PointCloud2 & | cloud | ) |
Definition at line 49 of file ping_rgbd_assembler_node.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Simply pings the RGB-D Assembler and stores the images
Publisher for markers
Publisher for images
Definition at line 142 of file ping_rgbd_assembler_node.cpp.
void publishClusterMarkers | ( | const sensor_msgs::PointCloud2 & | cloud, | |
const ros::Publisher & | marker_pub | |||
) |
Definition at line 99 of file ping_rgbd_assembler_node.cpp.