#include "ros/ros.h"
#include <ric_robot/ric_raw.h>
#include <ric_robot/ric_gps.h>
#include <ric_robot/ric_pan_tilt.h>
#include <ric_robot/ric_command.h>
#include <ric_robot/set_odom.h>
#include "sensor_msgs/Imu.h"
#include "sensor_msgs/Range.h"
#include "sensor_msgs/NavSatFix.h"
#include "sensor_msgs/NavSatStatus.h"
#include <sensor_msgs/JointState.h>
#include "geometry_msgs/Twist.h"
#include "geometry_msgs/Quaternion.h"
#include "geometry_msgs/Vector3Stamped.h"
#include "nav_msgs/Odometry.h"
#include "tf/transform_datatypes.h"
#include <tf/transform_broadcaster.h>
#include <math.h>
Go to the source code of this file.
Functions | |
void | cmd_velCallback (const geometry_msgs::Twist::ConstPtr &msg) |
void | encodersCallback (int32_t left_ticks, int32_t right_ticks) |
void | gpsCallback (const ric_robot::ric_gps::ConstPtr &msg) |
void | imuCallback (const ric_robot::ric_raw::ConstPtr &msg) |
int | main (int argc, char **argv) |
void | pan_tiltCallback (const ric_robot::ric_pan_tilt::ConstPtr &msg) |
void | rawCallback (const ric_robot::ric_raw::ConstPtr &msg) |
bool | set_odom (ric_robot::set_odom::Request &req, ric_robot::set_odom::Response &res) |
void | urfCallback (float left_urf, float rear_urf, float right_urf) |
double | wrapToPi (double angle) |
Variables | |
std::string | base_frame_id |
std::string | cmd_vel_topic |
ros::Publisher | command_pub |
double | encoder_cpr |
bool | first_enc_read = true |
std::string | FL_joint_id |
std::string | FR_joint_id |
bool | fuse_imu_roll_pitch |
bool | fuse_imu_yaw |
ros::Publisher | gps_pub |
std::string | gps_pub_topic |
bool | have_pan_tilt |
tf::TransformBroadcaster * | imu_broadcaster |
std::string | imu_frame_id |
ros::Publisher | imu_pub |
std::string | joint_states_topic |
sensor_msgs::JointState | jointstate_msg |
int | l_encoder = 0 |
std::string | left_urf_frame_id |
sensor_msgs::Range | left_urf_msg |
ros::Publisher | left_urf_pub |
std::string | map_frame_id |
tf::TransformBroadcaster * | odom_broadcaster |
std::string | odom_frame_id |
ros::Publisher | odom_pub |
std::string | odom_topic |
double | pan = 0 |
std::string | pan_joint_id |
ros::Publisher | pan_tilt_pub |
std::string | pan_tilt_topic |
double | pos_cov = 0.0 |
int | pre_l_encoder = 0 |
int | pre_r_encoder = 0 |
ros::Time | prev_time |
geometry_msgs::Quaternion | q_imu |
int | r_encoder = 0 |
std::string | rear_urf_frame_id |
sensor_msgs::Range | rear_urf_msg |
ros::Publisher | rear_urf_pub |
std::string | ric_command_topic |
std::string | ric_gps_topic |
std::string | ric_raw_topic |
std::string | right_urf_frame_id |
sensor_msgs::Range | right_urf_msg |
ros::Publisher | right_urf_pub |
std::string | RL_joint_id |
double | rot_cov = 0.0 |
std::string | RR_joint_id |
std::string | set_odom_srv |
double | slip_factor |
double | tilt = 0 |
std::string | tilt_joint_id |
double | tt = 0 |
bool | wd_on = false |
ros::Time | wd_time |
double | wheel_base_length |
double | wheel_diameter |
ros::Publisher | wheels_pub |
double | xx = 0 |
double | yy = 0 |
void cmd_velCallback | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) |
Definition at line 94 of file ric_node.cpp.
void encodersCallback | ( | int32_t | left_ticks, |
int32_t | right_ticks | ||
) |
Definition at line 124 of file ric_node.cpp.
void gpsCallback | ( | const ric_robot::ric_gps::ConstPtr & | msg | ) |
Definition at line 254 of file ric_node.cpp.
void imuCallback | ( | const ric_robot::ric_raw::ConstPtr & | msg | ) |
Definition at line 319 of file ric_node.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 424 of file ric_node.cpp.
void pan_tiltCallback | ( | const ric_robot::ric_pan_tilt::ConstPtr & | msg | ) |
Definition at line 410 of file ric_node.cpp.
void rawCallback | ( | const ric_robot::ric_raw::ConstPtr & | msg | ) |
Definition at line 382 of file ric_node.cpp.
bool set_odom | ( | ric_robot::set_odom::Request & | req, |
ric_robot::set_odom::Response & | res | ||
) |
Definition at line 398 of file ric_node.cpp.
void urfCallback | ( | float | left_urf, |
float | rear_urf, | ||
float | right_urf | ||
) |
Definition at line 296 of file ric_node.cpp.
double wrapToPi | ( | double | angle | ) |
Definition at line 113 of file ric_node.cpp.
std::string base_frame_id |
Definition at line 39 of file ric_node.cpp.
std::string cmd_vel_topic |
Definition at line 41 of file ric_node.cpp.
Definition at line 28 of file ric_node.cpp.
double encoder_cpr |
Definition at line 69 of file ric_node.cpp.
bool first_enc_read = true |
Definition at line 75 of file ric_node.cpp.
std::string FL_joint_id |
Definition at line 55 of file ric_node.cpp.
std::string FR_joint_id |
Definition at line 54 of file ric_node.cpp.
bool fuse_imu_roll_pitch |
Definition at line 77 of file ric_node.cpp.
bool fuse_imu_yaw |
Definition at line 78 of file ric_node.cpp.
Definition at line 26 of file ric_node.cpp.
std::string gps_pub_topic |
Definition at line 44 of file ric_node.cpp.
bool have_pan_tilt |
Definition at line 91 of file ric_node.cpp.
Definition at line 63 of file ric_node.cpp.
std::string imu_frame_id |
Definition at line 40 of file ric_node.cpp.
Definition at line 27 of file ric_node.cpp.
std::string joint_states_topic |
Definition at line 59 of file ric_node.cpp.
sensor_msgs::JointState jointstate_msg |
Definition at line 61 of file ric_node.cpp.
int l_encoder = 0 |
Definition at line 71 of file ric_node.cpp.
std::string left_urf_frame_id |
Definition at line 49 of file ric_node.cpp.
sensor_msgs::Range left_urf_msg |
Definition at line 32 of file ric_node.cpp.
Definition at line 21 of file ric_node.cpp.
std::string map_frame_id |
Definition at line 37 of file ric_node.cpp.
Definition at line 64 of file ric_node.cpp.
std::string odom_frame_id |
Definition at line 38 of file ric_node.cpp.
Definition at line 25 of file ric_node.cpp.
std::string odom_topic |
Definition at line 46 of file ric_node.cpp.
double pan = 0 |
Definition at line 88 of file ric_node.cpp.
std::string pan_joint_id |
Definition at line 52 of file ric_node.cpp.
Definition at line 29 of file ric_node.cpp.
std::string pan_tilt_topic |
Definition at line 42 of file ric_node.cpp.
double pos_cov = 0.0 |
Definition at line 82 of file ric_node.cpp.
int pre_l_encoder = 0 |
Definition at line 71 of file ric_node.cpp.
int pre_r_encoder = 0 |
Definition at line 72 of file ric_node.cpp.
Definition at line 83 of file ric_node.cpp.
geometry_msgs::Quaternion q_imu |
Definition at line 73 of file ric_node.cpp.
int r_encoder = 0 |
Definition at line 72 of file ric_node.cpp.
std::string rear_urf_frame_id |
Definition at line 50 of file ric_node.cpp.
sensor_msgs::Range rear_urf_msg |
Definition at line 33 of file ric_node.cpp.
Definition at line 22 of file ric_node.cpp.
std::string ric_command_topic |
Definition at line 43 of file ric_node.cpp.
std::string ric_gps_topic |
Definition at line 48 of file ric_node.cpp.
std::string ric_raw_topic |
Definition at line 47 of file ric_node.cpp.
std::string right_urf_frame_id |
Definition at line 51 of file ric_node.cpp.
sensor_msgs::Range right_urf_msg |
Definition at line 34 of file ric_node.cpp.
Definition at line 23 of file ric_node.cpp.
std::string RL_joint_id |
Definition at line 57 of file ric_node.cpp.
double rot_cov = 0.0 |
Definition at line 81 of file ric_node.cpp.
std::string RR_joint_id |
Definition at line 56 of file ric_node.cpp.
std::string set_odom_srv |
Definition at line 45 of file ric_node.cpp.
double slip_factor |
Definition at line 79 of file ric_node.cpp.
double tilt = 0 |
Definition at line 89 of file ric_node.cpp.
std::string tilt_joint_id |
Definition at line 53 of file ric_node.cpp.
double tt = 0 |
Definition at line 74 of file ric_node.cpp.
bool wd_on = false |
Definition at line 85 of file ric_node.cpp.
Definition at line 86 of file ric_node.cpp.
double wheel_base_length |
Definition at line 67 of file ric_node.cpp.
double wheel_diameter |
Definition at line 68 of file ric_node.cpp.
Definition at line 30 of file ric_node.cpp.
double xx = 0 |
Definition at line 74 of file ric_node.cpp.
double yy = 0 |
Definition at line 74 of file ric_node.cpp.