RosInterface.hpp 1.78 KB
Newer Older
oscar's avatar
oscar committed
1 2 3 4 5 6 7 8 9 10 11 12 13 14 15 16 17 18 19 20 21 22 23 24 25 26 27 28 29 30 31 32 33 34 35 36 37 38 39 40 41 42 43 44 45 46 47 48 49 50 51 52 53 54 55 56 57 58 59 60 61 62 63 64 65
// #ifndef _JFX_ROS_INTERFACE_H_
// #define _JFX_ROS_INTERFACE_H_

// #include <ros/ros.h>

// #include "MapMatching.hpp"
// #include "eyeq4_msgs/MeData.h"
// #include "gnss_imu_msgs/GNSS.h"
// #include "map_msgs/AheadMap.h"
// #include "map_msgs/GnssFootLocation.h"
// #include "map_msgs/GnssLocationData.h"
// #include "map_msgs/RtkData.h"
// #include "map_msgs/VisionMap.h"
// // #include "roadsim/GNSS.h"

// #include "sensor_msgs/CompressedImage.h"

// namespace zone {

// namespace fusion_localization {

// namespace map {

// class RosInterface {
//    public:
//     RosInterface(ros::NodeHandle& phpriv_nh, const std::string& prj_dir, const std::string& cfg_dir);
//     ~RosInterface();

//    public:
//     void ReceivePic(const sensor_msgs::CompressedImage::ConstPtr& msg);

//     void ReceiveGnss(const gnss_imu_msgs::GNSS::ConstPtr& msg);
//     void ReceiveEyeQ4Data(const eyeq4_msgs::MeData::ConstPtr& msg);
//     void ReceiveRtk(const map_msgs::RtkData::ConstPtr& msg);

//     void PublishGnssFootLoc(const IGnssFootLocation& msg);
//     void PublishAheadMap(const IAheadMap& msg);

//    private:
//     bool ConvertLanePos(int src, LaneMarkingSide& dst);
//     bool ConvertLaneColor(int src, HMC::LaneMarkingColor& dst);
//     bool ConvertLaneCross(int src_double, int src_single, HMC::LaneMarkingType& dst);
//     bool ConvertLinkPos(int src, LinkMarkingSide& dst);

//    private:
//     MapMatching mm_;

//     ros::Subscriber pic_sub_;

//     ros::Subscriber gps_sub_;

//     ros::Subscriber gnss_sub_;
//     ros::Subscriber eyeq4_data_sub_;
//     ros::Subscriber rtk_sub_;

//     ros::Publisher ahead_map_pub_;
//     ros::Publisher gnss_foot_pub_;
// };

// }  // namespace map

// }  // namespace fusion_localization

// }  // namespace zone
// #endif  // _JFX_ROS_INTERFACE_H_