11 #include <std_srvs/SetBool.h> 18 #include <realsense2_camera/Extrinsics.h> 19 #include <realsense2_camera/IMUInfo.h> 21 #include <eigen3/Eigen/Geometry> 24 #include <std_srvs/Empty.h> 68 virtual void onInit()
override;
72 bool handleReset(std_srvs::Empty::Request& request, std_srvs::Empty::Response& response);
73 static std::string parse_usb_port(std::string
line);
74 bool toggle_sensor_callback(std_srvs::SetBool::Request &req, std_srvs::SetBool::Response &
res);
std::thread _query_thread
const stream_index_pair FISHEYE1
const std::vector< stream_index_pair > IMAGE_STREAMS
GLenum GLuint GLenum severity
virtual ~InterfaceRealSenseNode()=default
virtual void registerDynamicReconfigCb(ros::NodeHandle &nh)=0
ROSCONSOLE_DECL void initialize()
const stream_index_pair INFRA0
const stream_index_pair INFRA2
ros::ServiceServer toggle_sensor_srv
virtual void publishTopics()=0
std::pair< rs2_stream, int > stream_index_pair
const stream_index_pair CONFIDENCE
const stream_index_pair GYRO
const stream_index_pair DEPTH
GLenum GLenum GLsizei const GLuint GLboolean enabled
std::shared_ptr< InterfaceRealSenseNode > _realSenseNode
const stream_index_pair FISHEYE2
virtual void toggleSensors(bool enabled)=0
ros::ServiceServer _reset_srv
const stream_index_pair ACCEL
const stream_index_pair POSE
ros::WallTimer _init_timer
const std::vector< stream_index_pair > HID_STREAMS
const stream_index_pair FISHEYE
const stream_index_pair COLOR
const stream_index_pair INFRA1