32 #ifndef REALSENSE_CAMERA_BASE_NODELET_H 33 #define REALSENSE_CAMERA_BASE_NODELET_H 36 #include <boost/thread.hpp> 37 #include <boost/algorithm/string/join.hpp> 51 #include <opencv2/core/core.hpp> 53 #include <opencv2/highgui/highgui.hpp> 57 #include <sensor_msgs/PointCloud2.h> 60 #include <std_msgs/String.h> 61 #include <std_msgs/Float32MultiArray.h> 69 #include <realsense_camera/CameraConfiguration.h> 70 #include <realsense_camera/IsPowered.h> 71 #include <realsense_camera/SetPower.h> 72 #include <realsense_camera/ForcePower.h> 85 realsense_camera::CameraConfiguration::Response &
res);
87 realsense_camera::SetPower::Response & res);
89 realsense_camera::ForcePower::Response & res);
91 realsense_camera::IsPowered::Response & res);
158 virtual std::vector<int>
listCameras(
int num_of_camera);
181 virtual void wrappedSystem(
const std::vector<std::string>& string_argv);
184 const std::string& current_fw,
185 const std::string& camera_name,
186 const std::string& camera_serial_number);
190 #endif // REALSENSE_CAMERA_BASE_NODELET_H boost::shared_ptr< boost::thread > transform_thread_
virtual void advertiseServices()
std::string optical_frame_id_[STREAM_COUNT]
tf::TransformBroadcaster dynamic_tf_broadcaster_
std::string nodelet_name_
virtual void getCameraExtrinsics()
virtual std::string stopCamera()
const uint16_t * image_depth16_
virtual void getParameters()
virtual void setDepthEnable(bool &enable_depth)
GLint GLint GLsizei GLsizei height
virtual std::string checkFirmwareValidation(const std::string &fw_type, const std::string ¤t_fw, const std::string &camera_name, const std::string &camera_serial_number)
std::function< void(rs::frame f)> ir_frame_handler_
virtual void getCameraOptions()
ros::Publisher pointcloud_publisher_
virtual std::string startCamera()
std::string base_frame_id_
virtual void publishTopic(rs_stream stream_index, rs::frame &frame)
virtual void publishStaticTransforms()
std::string encoding_[STREAM_COUNT]
virtual std::vector< std::string > setDynamicReconfServer()
int cv_type_[STREAM_COUNT]
virtual bool setPowerCameraService(realsense_camera::SetPower::Request &req, realsense_camera::SetPower::Response &res)
virtual void setFrameCallbacks()
virtual void setStreams()
bool start_stop_srv_called_
virtual void advertiseTopics()
virtual bool connectToCamera()
virtual void setStaticCameraOptions(std::vector< std::string > dynamic_params)
virtual void disableStream(rs_stream stream_index)
tf2_ros::StaticTransformBroadcaster static_tf_broadcaster_
bool enable_[STREAM_COUNT]
std::queue< pid_t > system_proc_groups_
virtual void enableStream(rs_stream stream_index, int width, int height, rs_format format, int fps)
sensor_msgs::CameraInfoPtr camera_info_ptr_[STREAM_COUNT]
virtual void publishDynamicTransforms()
virtual void prepareTransforms()
virtual void startDynamicReconfCallback()
std::mutex frame_mutex_[STREAM_COUNT]
virtual void setImageData(rs_stream stream_index, rs::frame &frame)
virtual std::vector< int > listCameras(int num_of_camera)
virtual ros::Time getTimestamp(rs_stream stream_index, double frame_ts)
std::string frame_id_[STREAM_COUNT]
rs_format format_[STREAM_COUNT]
ros::ServiceServer is_powered_service_
rs_extrinsics color2depth_extrinsic_
cv::Mat image_[STREAM_COUNT]
virtual bool forcePowerCameraService(realsense_camera::ForcePower::Request &req, realsense_camera::ForcePower::Response &res)
virtual void wrappedSystem(const std::vector< std::string > &string_argv)
rs_extrinsics color2ir_extrinsic_
virtual bool getCameraOptionValues(realsense_camera::CameraConfiguration::Request &req, realsense_camera::CameraConfiguration::Response &res)
image_transport::CameraPublisher camera_publisher_[STREAM_COUNT]
virtual bool isPoweredCameraService(realsense_camera::IsPowered::Request &req, realsense_camera::IsPowered::Response &res)
virtual void checkError()
std::function< void(rs::frame f)> depth_frame_handler_
int unit_step_size_[STREAM_COUNT]
GLint GLint GLsizei width
ros::ServiceServer force_power_service_
virtual void getStreamCalibData(rs_stream stream_index)
double tf_publication_rate_
virtual void publishPCTopic()
virtual bool checkForSubscriber()
std::vector< CameraOptions > camera_options_
ros::ServiceServer get_options_service_
ros::ServiceServer set_power_service_
int height_[STREAM_COUNT]
std::function< void(rs::frame f)> color_frame_handler_
ros::Time camera_start_ts_