Skip to content

Commit

Permalink
fix typo
Browse files Browse the repository at this point in the history
Signed-off-by: Masaya Kataoka <[email protected]>
  • Loading branch information
hakuturu583 committed Feb 6, 2025
1 parent 71c3429 commit 1f546d1
Show file tree
Hide file tree
Showing 8 changed files with 18 additions and 13 deletions.
5 changes: 5 additions & 0 deletions .github/workflows/custom_spell.json
Original file line number Diff line number Diff line change
Expand Up @@ -23,6 +23,7 @@
"Kotaro",
"libunwind",
"linelint",
"localca",
"Manocha",
"Mersenne",
"Monic",
Expand All @@ -37,12 +38,14 @@
"Parapura",
"Petrich",
"piotr",
"PLANNE",
"pluggable",
"PREDEF",
"protos",
"pyproject",
"randomizer",
"randomizers",
"roadmaps",
"RVOSIMULATOR",
"Snape",
"sonarcloud",
Expand All @@ -54,6 +57,8 @@
"Tschirnhaus",
"VISUALIZEMARKER",
"walltime",
"whatsnew",
"xcodeproj",
"xerces",
"xercesc",
"Yoshimoto"
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef CONTEXT_GAMMA_PLANNER__PEDESTRIAN__FOLLW_POLYLINE_TRAJECTORY_ACTION_HPP_
#define CONTEXT_GAMMA_PLANNER__PEDESTRIAN__FOLLW_POLYLINE_TRAJECTORY_ACTION_HPP_
#ifndef CONTEXT_GAMMA_PLANNER__PEDESTRIAN__FOLLOW_POLYLINE_TRAJECTORY_ACTION_HPP_
#define CONTEXT_GAMMA_PLANNER__PEDESTRIAN__FOLLOW_POLYLINE_TRAJECTORY_ACTION_HPP_

#include <context_gamma_planner/behavior/pedestrian/action_node.hpp>
#include <context_gamma_planner/planner/pedestrian/follow_polyline_trajectory_planner.hpp>
Expand Down Expand Up @@ -67,4 +67,4 @@ class FollowPolylineTrajectoryAction : public context_gamma_planner::pedestrian:
} // namespace pedestrian
} // namespace context_gamma_planner

#endif // CONTEXT_GAMMA_PLANNER__PEDESTRIAN__FOLLW_POLYLINE_TRAJECTORY_ACTION_HPP_
#endif // CONTEXT_GAMMA_PLANNER__PEDESTRIAN__FOLLOW_POLYLINE_TRAJECTORY_ACTION_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -12,8 +12,8 @@
// See the License for the specific language governing permissions and
// limitations under the License.

#ifndef CONTEXT_GAMMA_PLANNER__VEHICLE__FOLLW_POLYLINE_TRAJECTORY_ACTION_HPP_
#define CONTEXT_GAMMA_PLANNER__VEHICLE__FOLLW_POLYLINE_TRAJECTORY_ACTION_HPP_
#ifndef CONTEXT_GAMMA_PLANNER__VEHICLE__FOLLOW_POLYLINE_TRAJECTORY_ACTION_HPP_
#define CONTEXT_GAMMA_PLANNER__VEHICLE__FOLLOW_POLYLINE_TRAJECTORY_ACTION_HPP_

#include <context_gamma_planner/behavior/vehicle/action_node.hpp>
#include <context_gamma_planner/planner/vehicle/follow_polyline_trajectory_planner.hpp>
Expand Down Expand Up @@ -67,4 +67,4 @@ class FollowPolylineTrajectoryAction : public context_gamma_planner::vehicle::Ac
} // namespace vehicle
} // namespace context_gamma_planner

#endif // CONTEXT_GAMMA_PLANNER__VEHICLE__FOLLW_POLYLINE_TRAJECTORY_ACTION_HPP_
#endif // CONTEXT_GAMMA_PLANNER__VEHICLE__FOLLOW_POLYLINE_TRAJECTORY_ACTION_HPP_
Original file line number Diff line number Diff line change
Expand Up @@ -94,7 +94,7 @@ class ConstraintActivatorBase

protected:
std::vector<RoadEdgeConstraint> queryRoadEdgeConstraint(
const geometry_msgs::msg::Point & p, double distance_threashold, const char subtype[]);
const geometry_msgs::msg::Point & p, double distance_threshold, const char subtype[]);
std::shared_ptr<hdmap_utils::HdMapUtils> hd_map_utils_ptr_;
std::shared_ptr<traffic_simulator::TrafficLightsBase> traffic_lights_ptr_;
std::vector<std::string> lanelet_subtypes_;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,7 @@ BT::NodeStatus FollowLaneAction::tick()
}
// update waypoints
planner_.setWaypoints(hdmap_utils, route_lanelets);
/// @todo Goal threashold should be defined by adaptive.
/// @todo Goal threshold should be defined by adaptive.
if (const auto next_goal = planner_.calculateNextGoalPoint()) {
setOutput("next_goal", next_goal.value());
} else {
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -77,10 +77,10 @@ const auto ConstraintActivatorBase::calculateRVOObstacles()
}

std::vector<RoadEdgeConstraint> ConstraintActivatorBase::queryRoadEdgeConstraint(
const geometry_msgs::msg::Point & p, double distance_threashold, const char subtype[])
const geometry_msgs::msg::Point & p, double distance_threshold, const char subtype[])
{
const auto ids = hd_map_utils_ptr_->filterLaneletIds(
hd_map_utils_ptr_->getNearbyLaneletIds(p, distance_threashold), subtype);
hd_map_utils_ptr_->getNearbyLaneletIds(p, distance_threshold), subtype);
deactivateAll(lane_constraints_);
setState(lane_constraints_, ids, State::ACTIVE);
return filter(lane_constraints_, State::ACTIVE);
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -114,7 +114,7 @@ std::vector<RVO::Line> ObstaclePlugin::calcOrcaLines(RVO::Agent::SharedPtr agent
continue;
} else if (s > 1.0f && distSq2 <= radiusSq) {
/* Collision with right vertex. Ignore if non-convex
* or if it will be taken care of by neighoring obstace */
* or if it will be taken care of by neighoring obstacle */

Check warning on line 117 in simulation/context_gamma_planner/customized_rvo2/src/Plugins/ObstaclePlugin.cpp

View workflow job for this annotation

GitHub Actions / spell-check

Unknown word (neighoring)
if (obstacle2->is_convex_ && det(relativePosition2, obstacle2->unit_dir_) >= 0.0f) {
line.point = Vector2(0.0f, 0.0f);
line.direction = normalize(Vector2(-relativePosition2.y(), relativePosition2.x()));
Expand All @@ -137,7 +137,7 @@ std::vector<RVO::Line> ObstaclePlugin::calcOrcaLines(RVO::Agent::SharedPtr agent
/*
* No collision.
* Compute legs. When obliquely viewed, both legs can come from a single
* vertex. Legs extend cut-off line when nonconvex vertex.
* vertex. Legs extend cut-off line when non-convex vertex.
*/

Vector2 leftLegDirection, rightLegDirection;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -407,7 +407,7 @@ TEST_F(Rvo2Test, critical_corner_case)
EXPECT_FALSE(has_collided);
}
/*
TEST_F(Rvo2Test, chenge_agent_speed)
TEST_F(Rvo2Test, change_agent_speed)
{
std::shared_ptr<RVO::Agent> agent = std::make_shared<RVO::Agent>("agent", RVO::Vector2(0, 0));
simulator_->addAgent(agent);
Expand Down

0 comments on commit 1f546d1

Please sign in to comment.