Functions | Variables
example_mobile_robot_node.cpp File Reference
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <nav_msgs/Odometry.h>
#include <std_srvs/Empty.h>
#include "sensor_msgs/JointState.h"
#include "hebiros/AddGroupFromNamesSrv.h"
Include dependency graph for example_mobile_robot_node.cpp:

Go to the source code of this file.

Functions

void cmd_vel_callback (geometry_msgs::Twist msg)
 
int main (int argc, char **argv)
 
void odometry_callback (nav_msgs::Odometry data)
 
bool reset_callback (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res)
 

Variables

geometry_msgs::Quaternion odom_quat
 
double th = 0.0
 
double vth = 0
 
double vx = 0
 
double vy = 0
 
double wheel_distance = 0.087
 
double wheel_radius = 0.1
 
double x = 0.0
 
double y = 0.0
 

Function Documentation

void cmd_vel_callback ( geometry_msgs::Twist  msg)

Definition at line 26 of file example_mobile_robot_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 48 of file example_mobile_robot_node.cpp.

void odometry_callback ( nav_msgs::Odometry  data)

Definition at line 41 of file example_mobile_robot_node.cpp.

bool reset_callback ( std_srvs::Empty::Request &  req,
std_srvs::Empty::Response &  res 
)

Definition at line 32 of file example_mobile_robot_node.cpp.

Variable Documentation

geometry_msgs::Quaternion odom_quat

Definition at line 14 of file example_mobile_robot_node.cpp.

double th = 0.0

Definition at line 13 of file example_mobile_robot_node.cpp.

double vth = 0

Definition at line 18 of file example_mobile_robot_node.cpp.

double vx = 0

Definition at line 16 of file example_mobile_robot_node.cpp.

double vy = 0

Definition at line 17 of file example_mobile_robot_node.cpp.

double wheel_distance = 0.087

Definition at line 23 of file example_mobile_robot_node.cpp.

double wheel_radius = 0.1

Definition at line 21 of file example_mobile_robot_node.cpp.

double x = 0.0

Definition at line 11 of file example_mobile_robot_node.cpp.

double y = 0.0

Definition at line 12 of file example_mobile_robot_node.cpp.



hebiros_advanced_examples
Author(s): Xavier Artache , Matthew Tesch
autogenerated on Thu Sep 3 2020 04:13:22