#include <ros/ros.h>
#include <string>
Go to the source code of this file.
|  | 
| template<class M > | 
| ros::Publisher | 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 | 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 | compat::checkCompatMode () | 
|  | 
| int | compat::getCompat () | 
|  | 
| std::string | compat::getSimplifiedNamespace (ros::NodeHandle &nh) | 
|  | 
|  | compat::STATIC_ASSERT (supported_level<=current_level &¤t_level<=supported_level+1) | 
|  | 
|  | compat::STATIC_ASSERT (supported_level<=default_level &&default_level<=current_level) | 
|  | 
| template<class M , class T > | 
| ros::Subscriber | 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()) | 
|  | 
| template<class M > | 
| ros::Subscriber | compat::subscribe (ros::NodeHandle &nh_new, const std::string &topic_new, ros::NodeHandle &nh_old, const std::string &topic_old, uint32_t queue_size, const boost::function< void(const boost::shared_ptr< M const  > &)> &callback, const ros::VoidConstPtr &tracked_object=ros::VoidConstPtr(), const ros::TransportHints &transport_hints=ros::TransportHints()) | 
|  | 
      
        
          | #define STATIC_ASSERT | ( |  | EXPR | ) | static_assert(EXPR, #EXPR) |