19 #include "psen_scan_v2/ZoneSetConfiguration.h" 36 "ConfigurationServer",
37 "The configuration server doesn't verfiy that the provided configuration file matches the one on the connected " 39 "Mismatching configurations can amongst other things lead to confusing errors in navigation and misleading " 42 std::string(config_file_path) +
"\" please make sure that is the one you intented to use.");
ros::Publisher zoneset_pub_
#define ROS_ERROR_STREAM_NAMED(name, args)
ConfigServerNode(ros::NodeHandle &nh, const char *config_file_path, const std::string &frame_id)
Contains the events needed to define and implement the scanner protocol.
void publish(const boost::shared_ptr< M > &message) const
Root namespace in which the software components to communicate with the scanner (firmware-version: 2)...
Root namespace for the ROS part.
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ZoneSetConfiguration parseFile(const char *filename)
static const std::string DEFAULT_ZONESET_TOPIC
psen_scan_v2::ZoneSet toRosMsg(const ZoneSetStandalone &zoneset, const std::string &frame_id, const ros::Time &stamp=ros::Time::now())
#define ROS_WARN_STREAM_NAMED(name, args)