29 #ifndef OBJECT_TRACKER_PARAMETERS_H 30 #define OBJECT_TRACKER_PARAMETERS_H 34 #include <std_msgs/ColorRGBA.h> 55 extern std::map<std::string, std_msgs::ColorRGBA>
_marker_color;
64 namespace Parameters {
65 void load(
const std::string& class_id = std::string());
68 template <
typename T>
static inline T&
parameter(std::map<std::string, T>& p,
const std::string& class_id = std::string()) {
69 if (p.count(class_id))
return p.at(class_id);
70 return p[std::string()];
75 #endif // OBJECT_TRACKER_PARAMETERS_H std::map< std::string, double > _inactive_support
std::map< std::string, double > _pending_support
std::map< std::string, ros::ServiceClientPtr > _distance_to_obstacle_service
std::map< std::string, double > _inactive_time
std::map< std::string, double > _min_height
std::map< std::string, double > _active_time
std::map< std::string, double > _pending_time
std::vector< ServiceClientWithProperties > ServiceClientsWithProperties
std::map< std::string, double > _min_distance_between_objects
std::map< std::string, ros::ServiceClientPtr > _get_normal_service
std::map< std::string, std_msgs::ColorRGBA > _marker_color
std::pair< ros::ServiceClientPtr, XmlRpc::XmlRpcValue > ServiceClientWithProperties
std::map< std::string, bool > _with_orientation
std::map< std::string, double > _max_height
void load(const std::string &class_id)
std::map< std::string, bool > _project_objects
std::map< std::string, double > _default_distance
std::map< std::string, ServiceClientsWithProperties > _percept_verification_services
std::map< std::string, double > _active_support
std::map< std::string, double > _angle_variance
static T & parameter(std::map< std::string, T > &p, const std::string &class_id=std::string())
std::map< std::string, double > _distance_variance
std::map< std::string, ServiceClientsWithProperties > _object_verification_services