@@ -38,10 +38,10 @@ Pose2Twist::Pose2Twist(const rclcpp::NodeOptions & options) : rclcpp::Node("pose
38
38
create_publisher<tier4_debug_msgs::msg::Float32Stamped>(" angular_z" , durable_qos);
39
39
// Note: this callback publishes topics above
40
40
pose_sub_ = create_subscription<geometry_msgs::msg::PoseStamped>(
41
- " pose" , queue_size, std::bind (&Pose2Twist::callbackPose , this , _1));
41
+ " pose" , queue_size, std::bind (&Pose2Twist::callback_pose , this , _1));
42
42
}
43
43
44
- double calcDiffForRadian (const double lhs_rad, const double rhs_rad)
44
+ double calc_diff_for_radian (const double lhs_rad, const double rhs_rad)
45
45
{
46
46
double diff_rad = lhs_rad - rhs_rad;
47
47
if (diff_rad > M_PI) {
@@ -53,20 +53,20 @@ double calcDiffForRadian(const double lhs_rad, const double rhs_rad)
53
53
}
54
54
55
55
// x: roll, y: pitch, z: yaw
56
- geometry_msgs::msg::Vector3 getRPY (const geometry_msgs::msg::Pose & pose)
56
+ geometry_msgs::msg::Vector3 get_rpy (const geometry_msgs::msg::Pose & pose)
57
57
{
58
58
geometry_msgs::msg::Vector3 rpy;
59
59
tf2::Quaternion q (pose.orientation .x , pose.orientation .y , pose.orientation .z , pose.orientation .w );
60
60
tf2::Matrix3x3 (q).getRPY (rpy.x , rpy.y , rpy.z );
61
61
return rpy;
62
62
}
63
63
64
- geometry_msgs::msg::Vector3 getRPY (geometry_msgs::msg::PoseStamped::SharedPtr pose)
64
+ geometry_msgs::msg::Vector3 get_rpy (geometry_msgs::msg::PoseStamped::SharedPtr pose)
65
65
{
66
- return getRPY (pose->pose );
66
+ return get_rpy (pose->pose );
67
67
}
68
68
69
- geometry_msgs::msg::TwistStamped calcTwist (
69
+ geometry_msgs::msg::TwistStamped calc_twist (
70
70
geometry_msgs::msg::PoseStamped::SharedPtr pose_a,
71
71
geometry_msgs::msg::PoseStamped::SharedPtr pose_b)
72
72
{
@@ -79,18 +79,18 @@ geometry_msgs::msg::TwistStamped calcTwist(
79
79
return twist;
80
80
}
81
81
82
- const auto pose_a_rpy = getRPY (pose_a);
83
- const auto pose_b_rpy = getRPY (pose_b);
82
+ const auto pose_a_rpy = get_rpy (pose_a);
83
+ const auto pose_b_rpy = get_rpy (pose_b);
84
84
85
85
geometry_msgs::msg::Vector3 diff_xyz;
86
86
geometry_msgs::msg::Vector3 diff_rpy;
87
87
88
88
diff_xyz.x = pose_b->pose .position .x - pose_a->pose .position .x ;
89
89
diff_xyz.y = pose_b->pose .position .y - pose_a->pose .position .y ;
90
90
diff_xyz.z = pose_b->pose .position .z - pose_a->pose .position .z ;
91
- diff_rpy.x = calcDiffForRadian (pose_b_rpy.x , pose_a_rpy.x );
92
- diff_rpy.y = calcDiffForRadian (pose_b_rpy.y , pose_a_rpy.y );
93
- diff_rpy.z = calcDiffForRadian (pose_b_rpy.z , pose_a_rpy.z );
91
+ diff_rpy.x = calc_diff_for_radian (pose_b_rpy.x , pose_a_rpy.x );
92
+ diff_rpy.y = calc_diff_for_radian (pose_b_rpy.y , pose_a_rpy.y );
93
+ diff_rpy.z = calc_diff_for_radian (pose_b_rpy.z , pose_a_rpy.z );
94
94
95
95
geometry_msgs::msg::TwistStamped twist;
96
96
twist.header = pose_b->header ;
@@ -106,27 +106,27 @@ geometry_msgs::msg::TwistStamped calcTwist(
106
106
return twist;
107
107
}
108
108
109
- void Pose2Twist::callbackPose (geometry_msgs::msg::PoseStamped::SharedPtr pose_msg_ptr)
109
+ void Pose2Twist::callback_pose (geometry_msgs::msg::PoseStamped::SharedPtr pose_msg_ptr)
110
110
{
111
111
// TODO(YamatoAndo) check time stamp diff
112
112
// TODO(YamatoAndo) check suddenly move
113
113
// TODO(YamatoAndo) apply low pass filter
114
114
115
- geometry_msgs::msg::PoseStamped::SharedPtr current_pose_msg = pose_msg_ptr;
115
+ const geometry_msgs::msg::PoseStamped::SharedPtr & current_pose_msg = pose_msg_ptr;
116
116
static geometry_msgs::msg::PoseStamped::SharedPtr prev_pose_msg = current_pose_msg;
117
- geometry_msgs::msg::TwistStamped twist_msg = calcTwist (prev_pose_msg, current_pose_msg);
117
+ geometry_msgs::msg::TwistStamped twist_msg = calc_twist (prev_pose_msg, current_pose_msg);
118
118
prev_pose_msg = current_pose_msg;
119
119
twist_msg.header .frame_id = " base_link" ;
120
120
twist_pub_->publish (twist_msg);
121
121
122
122
tier4_debug_msgs::msg::Float32Stamped linear_x_msg;
123
123
linear_x_msg.stamp = this ->now ();
124
- linear_x_msg.data = twist_msg.twist .linear .x ;
124
+ linear_x_msg.data = static_cast < float >( twist_msg.twist .linear .x ) ;
125
125
linear_x_pub_->publish (linear_x_msg);
126
126
127
127
tier4_debug_msgs::msg::Float32Stamped angular_z_msg;
128
128
angular_z_msg.stamp = this ->now ();
129
- angular_z_msg.data = twist_msg.twist .angular .z ;
129
+ angular_z_msg.data = static_cast < float >( twist_msg.twist .angular .z ) ;
130
130
angular_z_pub_->publish (angular_z_msg);
131
131
}
132
132
0 commit comments