$search
#include <ros/console.h>
#include <ros/ros.h>
#include <laser_cb_detector/laser_cb_detector.h>
#include <sstream>
Go to the source code of this file.
Defines | |
#define | ROS_INFO_CONFIG(name) |
Functions | |
laser_cb_detector::ConfigGoal | getParamConfig (ros::NodeHandle &n) |
int | main (int argc, char **argv) |
void | snapshotCallback (ros::Publisher *pub, ros::Publisher *image_pub, LaserCbDetector *detector, const calibration_msgs::DenseLaserSnapshotConstPtr &msg) |
#define ROS_INFO_CONFIG | ( | name | ) |
Definition at line 46 of file laser_cb_detector_node.cpp.
laser_cb_detector::ConfigGoal getParamConfig | ( | ros::NodeHandle & | n | ) |
Definition at line 55 of file laser_cb_detector_node.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 145 of file laser_cb_detector_node.cpp.
void snapshotCallback | ( | ros::Publisher * | pub, | |
ros::Publisher * | image_pub, | |||
LaserCbDetector * | detector, | |||
const calibration_msgs::DenseLaserSnapshotConstPtr & | msg | |||
) |
Definition at line 122 of file laser_cb_detector_node.cpp.