16 #ifndef PSEN_SCAN_ROS_PARAMETER_HANDLER_H 17 #define PSEN_SCAN_ROS_PARAMETER_HANDLER_H 60 static std::string
decryptPassword(
const std::string& encrypted_password);
64 #endif // PSEN_SCAN_ROS_PARAMETER_HANDLER_H PSENscanInternalAngle getAngleEnd() const
Getter Method for angle_end_.
bool getOptionalParamFromParamServer(const std::string &key, T ¶m)
Gets one optional ROS-parameter from parameter server.
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val)
Class to model angles in degrees from user's perspective.
PSENscanInternalAngle angle_start_
Degree getXAxisRotation() const
Getter Method for x_axis_rotation_.
Class for getting ROS-Parameters from the parameter-server.
PSENscanInternalAngle angle_end_
PSENscanInternalAngle getAngleStart() const
Getter Method for angle_start_.
static std::string decryptPassword(const std::string &encrypted_password)
Decrypt password.
std::string getSensorIP() const
Getter Method for sensor_ip_.
uint16_t getSkip() const
Getter method for skip_.
void getRequiredParamFromParamServer(const std::string &key, T ¶m)
Gets one required ROS-parameter from parameter server.
uint32_t getHostUDPPort() const
Getter method for host_udp_port_.
uint32_t getHostIP() const
Getter method for host_ip_.
std::string getPassword() const
Getter method for password_.
std::string getFrameID() const
Getter method for frame_id_.
Class to model angles in PSENscan internal format (tenth of degrees)
RosParameterHandler(const ros::NodeHandle &nh)
Construct a new Ros Parameter Handler:: Ros Parameter Handler object.
void updateAllParamsFromParamServer()
Update all Parameters from ROS Parameter Server.
ros::NodeHandle const nh_