

Go to the source code of this file.
Namespaces | |
| namespace | mcl_3dl_compat |
Defines | |
| #define | STATIC_ASSERT(EXPR) static_assert(EXPR, #EXPR) |
Functions | |
| template<class M > | |
| ros::Publisher | mcl_3dl_compat::advertise (ros::NodeHandle &nh_new, const std::string &topic_new, ros::NodeHandle &nh_old, const std::string &topic_old, uint32_t queue_size, bool latch=false) |
| template<class T , class MReq , class MRes > | |
| ros::ServiceServer | mcl_3dl_compat::advertiseService (ros::NodeHandle &nh_new, const std::string &service_new, ros::NodeHandle &nh_old, const std::string &service_old, bool(T::*srv_func)(MReq &, MRes &), T *obj) |
| void | mcl_3dl_compat::checkCompatMode () |
| int | mcl_3dl_compat::getCompat () |
| std::string | mcl_3dl_compat::getSimplifiedNamespace (ros::NodeHandle &nh) |
| template<typename T > | |
| void | mcl_3dl_compat::paramRename (ros::NodeHandle &nh, const std::string ¶m_name_new, const std::string ¶m_name_old) |
| mcl_3dl_compat::STATIC_ASSERT (supported_level<=current_level &¤t_level<=supported_level+1) | |
| mcl_3dl_compat::STATIC_ASSERT (supported_level<=default_level &&default_level<=current_level) | |
| template<class M , class T > | |
| ros::Subscriber | mcl_3dl_compat::subscribe (ros::NodeHandle &nh_new, const std::string &topic_new, ros::NodeHandle &nh_old, const std::string &topic_old, uint32_t queue_size, void(T::*fp)(M) const, T *obj, const ros::TransportHints &transport_hints=ros::TransportHints()) |
Variables | |
| const int | mcl_3dl_compat::current_level = 1 |
| const int | mcl_3dl_compat::default_level = supported_level |
| const int | mcl_3dl_compat::supported_level = 0 |
| #define STATIC_ASSERT | ( | EXPR | ) | static_assert(EXPR, #EXPR) |
Definition at line 39 of file compatibility.h.