Skip to content

Commit e800d54

Browse files
authored
refactor(pose2twist): apply static analysis (#7307)
* refactor based on linter Signed-off-by: a-maumau <maumaumaumaumaumaumaumaumaumau@gmail.com> * add cast double to float Signed-off-by: a-maumau <maumaumaumaumaumaumaumaumaumau@gmail.com> * remove default destructor Signed-off-by: a-maumau <maumaumaumaumaumaumaumaumaumau@gmail.com> --------- Signed-off-by: a-maumau <maumaumaumaumaumaumaumaumaumau@gmail.com>
1 parent 321e1c7 commit e800d54

File tree

2 files changed

+17
-18
lines changed

2 files changed

+17
-18
lines changed

localization/pose2twist/include/pose2twist/pose2twist_core.hpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -25,10 +25,9 @@ class Pose2Twist : public rclcpp::Node
2525
{
2626
public:
2727
explicit Pose2Twist(const rclcpp::NodeOptions & options);
28-
~Pose2Twist() = default;
2928

3029
private:
31-
void callbackPose(geometry_msgs::msg::PoseStamped::SharedPtr pose_msg_ptr);
30+
void callback_pose(geometry_msgs::msg::PoseStamped::SharedPtr pose_msg_ptr);
3231

3332
rclcpp::Subscription<geometry_msgs::msg::PoseStamped>::SharedPtr pose_sub_;
3433

localization/pose2twist/src/pose2twist_core.cpp

+16-16
Original file line numberDiff line numberDiff line change
@@ -38,10 +38,10 @@ Pose2Twist::Pose2Twist(const rclcpp::NodeOptions & options) : rclcpp::Node("pose
3838
create_publisher<tier4_debug_msgs::msg::Float32Stamped>("angular_z", durable_qos);
3939
// Note: this callback publishes topics above
4040
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));
4242
}
4343

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)
4545
{
4646
double diff_rad = lhs_rad - rhs_rad;
4747
if (diff_rad > M_PI) {
@@ -53,20 +53,20 @@ double calcDiffForRadian(const double lhs_rad, const double rhs_rad)
5353
}
5454

5555
// 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)
5757
{
5858
geometry_msgs::msg::Vector3 rpy;
5959
tf2::Quaternion q(pose.orientation.x, pose.orientation.y, pose.orientation.z, pose.orientation.w);
6060
tf2::Matrix3x3(q).getRPY(rpy.x, rpy.y, rpy.z);
6161
return rpy;
6262
}
6363

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)
6565
{
66-
return getRPY(pose->pose);
66+
return get_rpy(pose->pose);
6767
}
6868

69-
geometry_msgs::msg::TwistStamped calcTwist(
69+
geometry_msgs::msg::TwistStamped calc_twist(
7070
geometry_msgs::msg::PoseStamped::SharedPtr pose_a,
7171
geometry_msgs::msg::PoseStamped::SharedPtr pose_b)
7272
{
@@ -79,18 +79,18 @@ geometry_msgs::msg::TwistStamped calcTwist(
7979
return twist;
8080
}
8181

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);
8484

8585
geometry_msgs::msg::Vector3 diff_xyz;
8686
geometry_msgs::msg::Vector3 diff_rpy;
8787

8888
diff_xyz.x = pose_b->pose.position.x - pose_a->pose.position.x;
8989
diff_xyz.y = pose_b->pose.position.y - pose_a->pose.position.y;
9090
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);
9494

9595
geometry_msgs::msg::TwistStamped twist;
9696
twist.header = pose_b->header;
@@ -106,27 +106,27 @@ geometry_msgs::msg::TwistStamped calcTwist(
106106
return twist;
107107
}
108108

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)
110110
{
111111
// TODO(YamatoAndo) check time stamp diff
112112
// TODO(YamatoAndo) check suddenly move
113113
// TODO(YamatoAndo) apply low pass filter
114114

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;
116116
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);
118118
prev_pose_msg = current_pose_msg;
119119
twist_msg.header.frame_id = "base_link";
120120
twist_pub_->publish(twist_msg);
121121

122122
tier4_debug_msgs::msg::Float32Stamped linear_x_msg;
123123
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);
125125
linear_x_pub_->publish(linear_x_msg);
126126

127127
tier4_debug_msgs::msg::Float32Stamped angular_z_msg;
128128
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);
130130
angular_z_pub_->publish(angular_z_msg);
131131
}
132132

0 commit comments

Comments
 (0)