21 #ifndef ORBSLAM2_ROS_NODE_H_ 22 #define ORBSLAM2_ROS_NODE_H_ 29 #include <opencv2/core/core.hpp> 34 #include <tf2_geometry_msgs/tf2_geometry_msgs.h> 36 #include <dynamic_reconfigure/server.h> 37 #include <orb_slam2_ros/dynamic_reconfigureConfig.h> 39 #include "orb_slam2_ros/SaveMap.h" 45 #include <sensor_msgs/PointCloud2.h> 46 #include <geometry_msgs/PoseStamped.h> 47 #include <sensor_msgs/CameraInfo.h> 48 #include <std_msgs/Bool.h> 75 bool SaveMapSrv (orb_slam2_ros::SaveMap::Request &req, orb_slam2_ros::SaveMap::Response &res);
113 #endif //ORBSLAM2_ROS_NODE_H_ std::string camera_info_topic_
image_transport::Publisher rendered_image_publisher_
ros::Publisher status_gba_publisher_
std::string name_of_node_
std::string map_frame_id_param_
void ParamsChangedCallback(orb_slam2_ros::dynamic_reconfigureConfig &config, uint32_t level)
ros::Publisher map_points_publisher_
dynamic_reconfigure::Server< orb_slam2_ros::dynamic_reconfigureConfig > dynamic_param_server_
ros::NodeHandle node_handle_
ORB_SLAM2::System * orb_slam_
ros::ServiceServer service_server_
void PublishGBAStatus(bool gba_status)
void PublishPositionAsPoseStamped(cv::Mat position)
void LoadOrbParameters(ORB_SLAM2::ORBParameters ¶meters)
void PublishMapPoints(std::vector< ORB_SLAM2::MapPoint * > map_points)
std::string camera_frame_id_param_
std::string map_file_name_param_
ros::Time current_frame_time_
void PublishPositionAsTransform(cv::Mat position)
bool SaveMapSrv(orb_slam2_ros::SaveMap::Request &req, orb_slam2_ros::SaveMap::Response &res)
std::string voc_file_name_param_
sensor_msgs::PointCloud2 MapPointsToPointCloud(std::vector< ORB_SLAM2::MapPoint * > map_points)
Node(ORB_SLAM2::System::eSensor sensor, ros::NodeHandle &node_handle, image_transport::ImageTransport &image_transport)
tf2::Transform TransformToTarget(tf2::Transform tf_in, std::string frame_in, std::string frame_target)
void PublishRenderedImage(cv::Mat image)
std::string target_frame_id_param_
tf2::Transform TransformFromMat(cv::Mat position_mat)
bool publish_pointcloud_param_
int min_observations_per_point_
ros::Publisher pose_publisher_
boost::shared_ptr< tf2_ros::TransformListener > tfListener
boost::shared_ptr< tf2_ros::Buffer > tfBuffer
image_transport::ImageTransport image_transport_
ORB_SLAM2::System::eSensor sensor_