5 #define sqrt_2 1.41421356237 24 ROS_INFO(
"-----------------------------------------");
26 ROS_INFO(
"-----------------------------------------");
44 geometry_msgs::TransformStamped transformStamped;
47 transformStamped.header.frame_id =
"world";
48 transformStamped.child_frame_id =
"origin_link";
49 transformStamped.transform.translation.x = odom.pose.pose.position.x;
50 transformStamped.transform.translation.y = odom.pose.pose.position.y;
51 transformStamped.transform.translation.z = odom.pose.pose.position.z;
53 transformStamped.transform.rotation.x = odom.pose.pose.orientation.x;
54 transformStamped.transform.rotation.y = odom.pose.pose.orientation.y;
55 transformStamped.transform.rotation.z = odom.pose.pose.orientation.z;
56 transformStamped.transform.rotation.w = odom.pose.pose.orientation.w;
110 for (
int i = 0; i < 100; i++){
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
std_msgs::Float64 omega_2
ros::Publisher back_left_cmd_pub
ros::Subscriber odom_sub_
void publish(const boost::shared_ptr< M > &message) const
std_msgs::Float64 omega_4
std_msgs::Float64 omega_1
ros::Publisher back_right_cmd_pub
bool getParam(const std::string &key, std::string &s) const
ros::Publisher front_right_cmd_pub
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
bool hasParam(const std::string &key) const
ros::Publisher front_left_cmd_pub
void cmd_vel_cb(const geometry_msgs::Twist &vel)
void odom_cb(const nav_msgs::Odometry &)
std_msgs::Float64 omega_3
controller(ros::NodeHandle &nh, ros::NodeHandle &nh_private)