#include <ros/ros.h>#include <ros/console.h>#include <vector>#include <map>#include <regex>#include <algorithm>#include <chrono>#include <thread>#include <sync_params/ParameterMsg.h>
Go to the source code of this file.
Functions | |
| bool | isOnBlackList (string key) |
| bool | isOnWhiteList (string key) |
| void | loadParams (ros::NodeHandle n_priv) |
| void | loadPubs (ros::NodeHandle n) |
| void | loadSubs (ros::NodeHandle n) |
| int | main (int argc, char **argv) |
| void | publishParam (ParameterMsg param) |
| string | replaceAll (string const &original, string const &from, string const &to) |
| void | subscribeParam (const ParameterMsg::ConstPtr &msg) |
Variables | |
| vector< string > | blacklist |
| double | death_timer |
| bool | debug |
| ros::NodeHandle * | n_ptr |
| map< string, string > | param_map |
| ros::Publisher | param_pub |
| ros::Subscriber | param_sub |
| double | rate |
| bool | use_death_timer |
| bool | use_wall_time |
| vector< string > | whitelist |
| bool isOnBlackList | ( | string | key | ) |
Definition at line 66 of file sync_params.cpp.
| bool isOnWhiteList | ( | string | key | ) |
Definition at line 79 of file sync_params.cpp.
| void loadParams | ( | ros::NodeHandle | n_priv | ) |
Definition at line 133 of file sync_params.cpp.
| void loadPubs | ( | ros::NodeHandle | n | ) |
Definition at line 129 of file sync_params.cpp.
| void loadSubs | ( | ros::NodeHandle | n | ) |
Definition at line 125 of file sync_params.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 168 of file sync_params.cpp.
| void publishParam | ( | ParameterMsg | param | ) |
Definition at line 96 of file sync_params.cpp.
| string replaceAll | ( | string const & | original, |
| string const & | from, | ||
| string const & | to | ||
| ) |
Definition at line 47 of file sync_params.cpp.
| void subscribeParam | ( | const ParameterMsg::ConstPtr & | msg | ) |
Definition at line 106 of file sync_params.cpp.
| vector<string> blacklist |
Definition at line 35 of file sync_params.cpp.
| double death_timer |
Definition at line 30 of file sync_params.cpp.
| bool debug |
Definition at line 27 of file sync_params.cpp.
| ros::NodeHandle* n_ptr |
Definition at line 32 of file sync_params.cpp.
| map<string, string> param_map |
Definition at line 33 of file sync_params.cpp.
| ros::Publisher param_pub |
Definition at line 38 of file sync_params.cpp.
| ros::Subscriber param_sub |
Definition at line 39 of file sync_params.cpp.
| double rate |
Definition at line 31 of file sync_params.cpp.
| bool use_death_timer |
Definition at line 29 of file sync_params.cpp.
| bool use_wall_time |
Definition at line 28 of file sync_params.cpp.
| vector<string> whitelist |
Definition at line 36 of file sync_params.cpp.