14 : nodeHandle_(nodeHandle),
32 ROS_ERROR(
"A filter configuration must be a map with fields name, type, and params.");
44 ROS_DEBUG(
"Loading param %s\n", it->first.c_str());
58 value = std::string(it->second);
69 (int) (it->second) : (double) (it->second);
76 bool isSuccess =
getParam(name, valueDouble);
77 if (isSuccess) value =
static_cast<float>(valueDouble);
virtual ~VisualizationBase()
ValueStruct::iterator iterator
Type const & getType() const
bool getParam(const std::string &name, std::string &value)
bool hasMember(const std::string &name) const
StringMap parameters_
Storage of the parsed XML parameters.
uint32_t getNumSubscribers() const
ros::Publisher publisher_
ROS publisher of the occupancy grid.
virtual bool readParameters(XmlRpc::XmlRpcValue &config)
VisualizationBase(ros::NodeHandle &nodeHandle, const std::string &name)