#include "evarobot_controller/evarobot_controller.h"
#include <dynamic_reconfigure/server.h>
#include <evarobot_controller/ParamsConfig.h>
Go to the source code of this file.
Functions | |
void | CallbackDesired (const geometry_msgs::Twist::ConstPtr &msg) |
void | CallbackMeasured (const im_msgs::WheelVel::ConstPtr &msg) |
void | CallbackReconfigure (evarobot_controller::ParamsConfig &config, uint32_t level) |
bool | CallbackResetController (std_srvs::Empty::Request &request, std_srvs::Empty::Response &response) |
int | main (int argc, char **argv) |
Variables | |
int | i_error_code = 0 |
void CallbackDesired | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) |
Definition at line 125 of file evarobot_controller.cpp.
void CallbackMeasured | ( | const im_msgs::WheelVel::ConstPtr & | msg | ) |
Definition at line 118 of file evarobot_controller.cpp.
void CallbackReconfigure | ( | evarobot_controller::ParamsConfig & | config, |
uint32_t | level | ||
) |
Definition at line 136 of file evarobot_controller.cpp.
bool CallbackResetController | ( | std_srvs::Empty::Request & | request, |
std_srvs::Empty::Response & | response | ||
) |
Definition at line 150 of file evarobot_controller.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 157 of file evarobot_controller.cpp.
int i_error_code = 0 |
Definition at line 6 of file evarobot_controller.cpp.