File tree Expand file tree Collapse file tree 1 file changed +7
-7
lines changed
moveit_ros/visualization/motion_planning_rviz_plugin/src Expand file tree Collapse file tree 1 file changed +7
-7
lines changed Original file line number Diff line number Diff line change @@ -91,13 +91,13 @@ InteractiveMarkerDisplay::InteractiveMarkerDisplay()
91
91
92
92
void InteractiveMarkerDisplay::onInitialize ()
93
93
{
94
- // auto ros_node_abstraction = context_->getRosNodeAbstraction().lock();
95
- // if (!ros_node_abstraction) {
96
- // return;
97
- // }
98
- //
99
- // interactive_marker_namespace_property_->initialize(ros_node_abstraction);
100
- //
94
+ auto ros_node_abstraction = context_->getRosNodeAbstraction ().lock ();
95
+ if (!ros_node_abstraction)
96
+ {
97
+ return ;
98
+ }
99
+ interactive_marker_namespace_property_->initialize (ros_node_abstraction);
100
+
101
101
rclcpp::NodeOptions options;
102
102
options.arguments ({ " --ros-args" , " -r" ,
103
103
" __node:=" + std::string (" interactive_marker_display_" ) +
You can’t perform that action at this time.
0 commit comments