Binaryify / OneDark-Pro

Atom's iconic One Dark theme for Visual Studio Code
https://marketplace.visualstudio.com/items?itemName=zhuangtongfa.Material-theme
MIT License
1.48k stars 291 forks source link

two different colors for the equal sign. #791

Closed Xinyu-Sheng closed 1 year ago

Xinyu-Sheng commented 1 year ago

Describe the bug In the display of a C++ file, there are two different colors for the equal sign.

Screenshots & Example Code image

Desktop (please complete the following information):

Binaryify commented 1 year ago

could you provide more code image

Xinyu-Sheng commented 1 year ago

the code comes from ROS2 Writing a simple publisher and subscriber (C++)Writing a simple publisher and subscriber (C++)

#include <chrono>
#include <functional>
#include <memory>
#include <string>

#include "rclcpp/rclcpp.hpp"
#include "std_msgs/msg/string.hpp"

using namespace std::chrono_literals;

/* This example creates a subclass of Node and uses std::bind() to register a
* member function as a callback from the timer. */

class MinimalPublisher : public rclcpp::Node
{
  public:
    MinimalPublisher()
    : Node("minimal_publisher"), count_(0)
    {
      publisher_ = this->create_publisher<std_msgs::msg::String>("topic", 10);
      timer_ = this->create_wall_timer(
      500ms, std::bind(&MinimalPublisher::timer_callback, this));
    }

  private:
    void timer_callback()
    {
      auto message = std_msgs::msg::String();
      message.data = "Hello, world! " + std::to_string(count_++);
      RCLCPP_INFO(this->get_logger(), "Publishing: '%s'", message.data.c_str());
      publisher_->publish(message);
    }
    rclcpp::TimerBase::SharedPtr timer_;
    rclcpp::Publisher<std_msgs::msg::String>::SharedPtr publisher_;
    size_t count_;
};

int main(int argc, char * argv[])
{
  rclcpp::init(argc, argv);
  rclcpp::spin(std::make_shared<MinimalPublisher>());
  rclcpp::shutdown();
  return 0;
}

image

Binaryify commented 1 year ago

can't reproduce in vscode 1.80.0 image

Xinyu-Sheng commented 1 year ago

Perhaps you should try using a computer with ROS2 installed, which includes the necessary header files that can be located. The following image is taken in vscode 1.80.0 image Perhaps the issue is related to the "inline" keyword: image

Binaryify commented 1 year ago

could you use this command to show the code's scope image image image

Xinyu-Sheng commented 1 year ago

image image

Binaryify commented 1 year ago

plz try v3.16.0

Xinyu-Sheng commented 1 year ago

Problem solved! Thanks for your effort!