#include "device_nodelet.h"
#include "publishers/camera_info_publisher.h"
#include "publishers/image_publisher.h"
#include "publishers/disparity_publisher.h"
#include "publishers/disparity_color_publisher.h"
#include "publishers/depth_publisher.h"
#include "publishers/confidence_publisher.h"
#include "publishers/error_disparity_publisher.h"
#include "publishers/error_depth_publisher.h"
#include "publishers/points2_publisher.h"
#include <rc_genicam_api/device.h>
#include <rc_genicam_api/stream.h>
#include <rc_genicam_api/buffer.h>
#include <rc_genicam_api/config.h>
#include <rc_genicam_api/pixel_formats.h>
#include <rc_dynamics_api/trajectory_time.h>
#include <pluginlib/class_list_macros.h>
#include <exception>
#include <sstream>
#include <stdexcept>
#include <ros/ros.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <tf/transform_broadcaster.h>
Go to the source code of this file.
Namespaces | |
rc | |
Macros | |
#define | ROS_HAS_STEADYTIME (ROS_VERSION_MINIMUM(1, 13, 1) || ((ROS_VERSION_MINOR == 12) && ROS_VERSION_PATCH >= 8)) |
Enumerations | |
enum | rc::@1::DynamicsCmd { rc::@1::DynamicsCmd::START = 0, rc::@1::DynamicsCmd::START_SLAM, rc::@1::DynamicsCmd::STOP, rc::@1::DynamicsCmd::STOP_SLAM, rc::@1::DynamicsCmd::RESTART, rc::@1::DynamicsCmd::RESTART_SLAM, rc::@1::DynamicsCmd::RESET_SLAM } |
Commands taken by handleDynamicsStateChangeRequest() More... | |
#define ROS_HAS_STEADYTIME (ROS_VERSION_MINIMUM(1, 13, 1) || ((ROS_VERSION_MINOR == 12) && ROS_VERSION_PATCH >= 8)) |
Definition at line 102 of file device_nodelet.cc.
|
strong |
Commands taken by handleDynamicsStateChangeRequest()
Definition at line 1484 of file device_nodelet.cc.